[Documentation] [TitleIndex] [WordIndex

New in Diamondback

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_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

A package for user-aided grasp planning, where the user provides some sort of information based on sensor data from the robot. Examples include the user clicking somewhere in an image to tell the robot where to grasp from.

Launching the Gripper Click tools

The Gripper Click tools are implemented as rviz displays. Usually, they are started and used as part of the pr2_interactive_manipulation package. See that package documentation for details on how to start the entire interactive manipulation pipeline.

Using Gripper Click

The Gripper Click rviz displays will normally not display anything unless called. Once called by the interactive manipulation pipeline, they will pop up a window requesting user input.

In general, the pop-up window will show an image from the narrow angle robot camera. Masked in light red will be the image points for which we have no associated depth information, those are generally not usable for grasp and place selection.

Even though the pop up tools display a monocular image, we also use the associated depth information for two purposes: to choose 3D points for grasping and placing, and to render the correct occlusions when superimposing meshes on top of the image. This generally helps a lot with position and orientation selection.

Grasping

The grasp selection pop-up window will also offer two options for selecting grasps, 3D Gripper and Line selection. You can choose between them using the drop-down list in the bottom right corner of the window.

Line selection

This method assumes the gripper will approach the object coming from the viewpoint of the camera. You just need to select a location and a gripper roll angle:

gripper_click_line.png

3D Gripper

This method allows you to completely specify the grasp point in 6D:

gripper_click_1.png

gripper_click_2.png

Placing

This method allows you to select where an object should be placed:

place_click.png

Where exactly the gripper goes based on your chosen place location depends on the grasp that you have executed. In most cases, the manipulation pipeline will attempt to choose a gripper orientation that maintains the same orientation of the object relative to the world that it had when you grasped it. If that information is not available, a pre-specified gripper orientation will be used.


2023-10-28 12:53