tabletop_object_detector/TabletopObjectRecognition Service

File: tabletop_object_detector/TabletopObjectRecognition.srv

# The information for the plane that has been detected
Table table

# The raw clusters detected in the scan 
sensor_msgs/PointCloud[] clusters

# How many models should be returned for each recognition
int32 num_models

# Whether to perform a merge step based on model fit results
bool perform_fit_merge

---

# The list of models that have been detected along with confidence levels
household_objects_database_msgs/DatabaseModelPoseList[] models

# For each cluster, the index of the list of models that was fit to that cluster
# keep in mind that multiple raw clusters can correspond to a single fit
int32[] cluster_model_indices

Expanded Definition

Table table
    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
    float32 x_min
    float32 x_max
    float32 y_min
    float32 y_max
sensor_msgs/PointCloud[] clusters
    Header header
        uint32 seq
        time stamp
        string frame_id
    geometry_msgs/Point32[] points
        float32 x
        float32 y
        float32 z
    sensor_msgs/ChannelFloat32[] channels
        string name
        float32[] values
int32 num_models
bool perform_fit_merge

household_objects_database_msgs/DatabaseModelPoseList[] models
    household_objects_database_msgs/DatabaseModelPose[] model_list
        int32 model_id
        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
        float32 confidence
int32[] cluster_model_indices