Create occupancy grid message
The OccupancyGrid
object is an implementation of the
nav_msgs/OccupancyGrid
message type in ROS. The object contains
meta-information about the message and the occupancy grid data. To create a binaryOccupancyMap
(Robotics System Toolbox) object from a ROS message, use readBinaryOccupancyGrid
(Robotics System Toolbox).
msg = rosmessage('nav_msgs/OccupancyGrid');
creates
an empty OccupancyGrid
object. To specify map information
and data, use the map.Info
and
msg.Data
properties. You can also get the occupancy
grid messages off the ROS network using rossubscriber
.
readBinaryOccupancyGrid (Robotics System Toolbox) | Read binary occupancy grid |
writeBinaryOccupancyGrid (Robotics System Toolbox) | Write values from grid to ROS message |
rosmessage
| rossubscriber
| binaryOccupancyMap
(Robotics System Toolbox) | readBinaryOccupancyGrid
(Robotics System Toolbox) | writeBinaryOccupancyGrid
(Robotics System Toolbox)