grid_map_msgs/GridMapInfo Message

File: grid_map_msgs/GridMapInfo.msg

Raw Message Definition

# Header (time and frame)
Header header

# Resolution of the grid [m/cell].
float64 resolution

# Length in x-direction [m].
float64 length_x

# Length in y-direction [m].
float64 length_y

# Pose of the grid map center in the frame defined in `header` [m].
geometry_msgs/Pose pose

Compact Message Definition

std_msgs/Header header
float64 resolution
float64 length_x
float64 length_y
geometry_msgs/Pose pose