object_manipulation_msgs/ClusterBoundingBox Message

File: object_manipulation_msgs/ClusterBoundingBox.msg

# contains a bounding box, which is essentially a box somewhere in space
# used here ususally for the outlier-invariant bounding box of a cluster of points

#the pose of the box frame
geometry_msgs/PoseStamped pose_stamped

#the dimensions of the box
geometry_msgs/Vector3 dimensions

Expanded Definition

geometry_msgs/PoseStamped pose_stamped
    Header header
        uint32 seq
        time stamp
        string frame_id
    geometry_msgs/Pose pose
        geometry_msgs/Point position
            float64 x
            float64 y
            float64 z
        geometry_msgs/Quaternion orientation
            float64 x
            float64 y
            float64 z
            float64 w
geometry_msgs/Vector3 dimensions
    float64 x
    float64 y
    float64 z