Contenuto principale

writeBinaryOccupancyGrid

(To be removed) Write values from grid to ROS message

writeBinaryOccupancyGrid will be removed in a future release. Use rosWriteBinaryOccupancyGrid instead. For more information, see ROS Message Structure Functions.

Description

writeBinaryOccupancyGrid(msg,map) writes occupancy values and other information to the ROS message, msg, from the binary occupancy grid, map.

Input Arguments

collapse all

Binary occupancy grid, specified as a object handle. map is converted to a 'nav_msgs/OccupancyGrid' message on the ROS network. map is an object with a grid of binary values, where 1 indicates an occupied location and 0 indications an unoccupied location.

'nav_msgs/OccupancyGrid' ROS message, specified as a OccupancyGrid object handle.

Version History

Introduced in R2015a

collapse all