motion_planning_msgs/AllowedContactSpecification Message

File: motion_planning_msgs/AllowedContactSpecification.msg

# The names of the regions
string name

# The shape of the region in the environment
geometric_shapes_msgs/Shape shape

# The pose of the space defining the region
geometry_msgs/PoseStamped pose_stamped

# The set of links that will be allowed to have penetration contact within this region
string[] link_names

# The maximum penetration depth allowed for every link
float64 penetration_depth

Expanded Definition

string name
geometric_shapes_msgs/Shape shape
    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_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
string[] link_names
float64 penetration_depth