Contenuto principale

readOccupancyGrid

(To be removed) Read occupancy grid message

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

Description

map = readOccupancyGrid(msg) returns an occupancyMap (Navigation Toolbox) object by reading the data inside a ROS message, msg, which must be a 'nav_msgs/OccupancyGrid' message. All message data values are converted to probabilities from 0 to 1. The unknown values (-1) in the message are set as 0.5 in the map.

Input Arguments

collapse all

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

Output Arguments

collapse all

Occupancy map, returned as an occupancyMap (Navigation Toolbox) object handle.

Version History

Introduced in R2016b

collapse all