object_recognition_gui/ModelHypothesisList Message

File: object_recognition_gui/ModelHypothesisList.msg

ModelHypothesis[] hypotheses

#initial guess if this can be a correct recognition result at all
bool accept

Expanded Definition

ModelHypothesis[] hypotheses
    geometric_shapes_msgs/Shape mesh
        byte SPHERE=0
        byte BOX=1
        byte CYLINDER=2
        byte MESH=3
        byte type
        float64[] dimensions
        int32[] triangles
        geometry_msgs/Point[] vertices
            float64 x
            float64 y
            float64 z
    geometry_msgs/PoseStamped pose
        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
bool accept