marker_msgs/MarkerDetection Message

File: marker_msgs/MarkerDetection.msg

Raw Message Definition

# This expresses a marker/fiducial detection
Header header                  # timestamp in the header is the acquisition time and frame

float32 distance_min           # distance minimum range value [m]
float32 distance_max           # distance maximum range value [m]
float32 distance_max_id        # distance maximum range value to detect id [m]

geometry_msgs/Quaternion view_direction       # view direction
float32 fov_horizontal                        # field of view horizontal [rad]
float32 fov_vertical                          # field of view vertical [rad]

string   type                  # marker type used (bch, artag, mip_36h12, stage, ...)
Marker[] markers               # detected markers

Compact Message Definition

std_msgs/Header header
float32 distance_min
float32 distance_max
float32 distance_max_id
geometry_msgs/Quaternion view_direction
float32 fov_horizontal
float32 fov_vertical
string type
marker_msgs/Marker[] markers