readBinaryOccupancyGrid
(To be removed) Read binary occupancy grid
readBinaryOccupancyGrid will be removed in a future release. Use rosReadBinaryOccupancyGrid instead. For more information, see ROS Message Structure Functions.
Syntax
Description
returns a object by reading the data inside
a ROS message, map = readBinaryOccupancyGrid(msg)msg, which must be a
'nav_msgs/OccupancyGrid' message. All message data values
greater than or equal to the occupancy threshold are set to occupied,
1, in the map. All other values, including unknown values
(-1) are set to unoccupied, 0, in the
map.