pr2_grasp_adjust/GraspAdjust Action

File: pr2_grasp_adjust/GraspAdjust.action

Action Definition

#goal definition

sensor_msgs/PointCloud2 cloud
geometry_msgs/PoseStamped pose_stamped
bool use_orientation
int32 seed_index
uint8 search_mode

int32 GLOBAL_SEARCH = 0
int32 LOCAL_SEARCH = 1
int32 SINGLE_POSE = 2

---
#result definition

object_manipulation_msgs/Grasp[] grasps
object_manipulation_msgs/GraspPlanningErrorCode result

---
#feedback