object_manipulation_msgs/FindClusterBoundingBox Service

File: object_manipulation_msgs/FindClusterBoundingBox.srv

Raw Message Definition

sensor_msgs/PointCloud cluster

---

#the pose of the box frame
geometry_msgs/PoseStamped pose

#the dimensions of the box
geometry_msgs/Vector3 box_dims

#whether there was an error
int32 SUCCESS=0
int32 TF_ERROR=1
int32 error_code

Compact Message Definition

sensor_msgs/PointCloud cluster

int32 SUCCESS=0
int32 TF_ERROR=1
geometry_msgs/PoseStamped pose
geometry_msgs/Vector3 box_dims
int32 error_code