- main topics:
/object_manipulator/grasp_execution_markers: shows the grasps being tested for execution by the object_manipulator
planning_scene_markers: shows the last planning scene used for motion planning/collision avoidance
occupied_cells: shows the current occupancy grid for the Octomap
/point_cluster_grasp_planner_markers: shows the behavior of the grasp planner for unrecognized point clouds (enable in Electric by changing 'self.draw_gripper = 0' to 'self.draw_gripper = 1' in point_cluster_grasp_planner.py in pr2_gripper_grasp_planner_cluster/src/pr2_gripper_grasp_planner_cluster)
- advanced topics:
/kinematics_collisions: shows the collisions reported by IK queries; very useful for understanding why certain grasps or place locations have been rejected by the manipulation pipeline
/tabletop_segmentation_markers and /tabletop_object_recognition_markers: shows the markers from the tabletop_object_detector
/attached_objects: shows objects that have been attached to the grippers for collision avoidance purposes (Electric only)