[Documentation] [TitleIndex] [WordIndex

Only released in EOL distros:  

pr2_object_manipulation: active_realtime_segmentation | fast_plane_detection | manipulation_worlds | object_recognition_gui | object_segmentation_gui | pick_and_place_demo_app | pr2_create_object_model | pr2_grasp_adjust | pr2_gripper_grasp_controller | pr2_gripper_grasp_planner_cluster | pr2_gripper_reactive_approach | pr2_gripper_sensor_action | pr2_gripper_sensor_controller | pr2_gripper_sensor_msgs | pr2_handy_tools | pr2_interactive_gripper_pose_action | pr2_interactive_manipulation | pr2_interactive_object_detection | pr2_manipulation_controllers | pr2_marker_control | pr2_navigation_controllers | pr2_object_manipulation_launch | pr2_object_manipulation_msgs | pr2_pick_and_place_demos | pr2_tabletop_manipulation_launch | pr2_wrappers | rgbd_assembler | robot_self_filter_color | segmented_clutter_grasp_planner | simple_Jtranspose_controller | tabletop_collision_map_processing | tabletop_object_detector | tabletop_vfh_cluster_detector | vfh_recognition | vfh_recognizer_db | vfh_recognizer_fs

Package Summary

Contains launch and configuration files for starting the manipulation pipeline, along with all needed controllers, planners, etc., on the PR2 robot.

pr2_object_manipulation: active_realtime_segmentation | fast_plane_detection | manipulation_worlds | object_recognition_gui | object_segmentation_gui | pick_and_place_demo_app | pr2_create_object_model | pr2_grasp_adjust | pr2_gripper_grasp_controller | pr2_gripper_grasp_planner_cluster | pr2_gripper_reactive_approach | pr2_gripper_sensor_action | pr2_gripper_sensor_controller | pr2_gripper_sensor_msgs | pr2_handy_tools | pr2_interactive_gripper_pose_action | pr2_interactive_manipulation | pr2_interactive_object_detection | pr2_manipulation_controllers | pr2_marker_control | pr2_navigation_controllers | pr2_object_manipulation_launch | pr2_object_manipulation_msgs | pr2_pick_and_place_demos | pr2_pick_and_place_tutorial | pr2_tabletop_manipulation_launch | pr2_wrappers | rgbd_assembler | robot_self_filter_color | segmented_clutter_grasp_planner | tabletop_collision_map_processing | tabletop_object_detector | tf_throttle

Package Summary

Contains launch and configuration files for starting the manipulation pipeline, along with all needed controllers, planners, etc., on the PR2 robot.

pr2_object_manipulation: interactive_perception_msgs | manipulation_worlds | object_recognition_gui | pr2_create_object_model | pr2_gripper_grasp_controller | pr2_gripper_grasp_planner_cluster | pr2_gripper_reactive_approach | pr2_gripper_sensor_action | pr2_gripper_sensor_controller | pr2_gripper_sensor_msgs | pr2_interactive_gripper_pose_action | pr2_interactive_manipulation | pr2_interactive_manipulation_frontend | pr2_interactive_object_detection | pr2_interactive_object_detection_frontend | pr2_manipulation_controllers | pr2_marker_control | pr2_navigation_controllers | pr2_object_manipulation_launch | pr2_object_manipulation_msgs | pr2_pick_and_place_demos | pr2_tabletop_manipulation_launch | pr2_wrappers | rgbd_assembler | robot_self_filter_color | segmented_clutter_grasp_planner | tabletop_collision_map_processing | tabletop_object_detector | tf_throttle

Package Summary

Contains launch and configuration files for starting the manipulation pipeline, along with all needed controllers, planners, etc., on the PR2 robot.

Note that these launch files do not include sensor data processing, an implementation of which can be found in tabletop_object_perception. Launch files combining manipulation (as contained here) and perception can be found in pr2_tabletop_manipulation_launch. Once started, the manipulation pipeline is ready to serve requests for tasks such as object pickup and placing.

PR2 Gripper Hand Description

This package also contains configuration files with the description of a PR2 arm equipped with a gripper as needed by the manipulation pipeline. The format of an arm/hand description is documented in the object_manipulator page. Here is an example of such a configuration file:

hand_description:
  right_arm:
    hand_frame: r_wrist_roll_link
    robot_frame: base_link
    attached_objects_name: attached
    attach_link: r_gripper_r_finger_tip_link
    hand_group_name: r_end_effector
    arm_group_name: right_arm
    hand_database_name: WILLOW_GRIPPER_2010
    hand_joints: [r_gripper_l_finger_joint,r_gripper_r_finger_joint,r_gripper_r_finger_tip_joint,r_gripper_l_finger_tip_joint]
    hand_touch_links: [r_gripper_palm_link,r_gripper_r_finger_tip_link,r_gripper_l_finger_tip_link,r_gripper_l_finger_link,r_gripper_r_finger_link]
    hand_fingertip_links: [r_gripper_r_finger_tip_link,r_gripper_l_finger_tip_link]
    hand_approach_direction: [1.0,0.0,0.0]
  left_arm:
    hand_frame: l_wrist_roll_link
    robot_frame: base_link
    attached_objects_name: attached
    attach_link: l_gripper_r_finger_tip_link
    hand_group_name: l_end_effector
    arm_group_name: left_arm
    hand_database_name: WILLOW_GRIPPER_2010
    hand_joints: [l_gripper_l_finger_joint,l_gripper_r_finger_joint,l_gripper_r_finger_tip_joint,l_gripper_l_finger_tip_joint]
    hand_touch_links: [l_gripper_palm_link,l_gripper_r_finger_tip_link,l_gripper_l_finger_tip_link,l_gripper_l_finger_link,l_gripper_r_finger_link]
    hand_fingertip_links: [l_gripper_r_finger_tip_link,l_gripper_l_finger_tip_link]
    hand_approach_direction: [1.0,0.0,0.0]

Running the Manipulation Pipeline

To launch the manipulation pipeline and execute pickup and place tasks using the PR2 robot, tutorials and launch files are provided in pr2_tabletop_manipulation_apps.


2025-10-25 12:38