LaserScan
Create laser scan message
Description
The LaserScan
object is an implementation of the
sensor_msgs/LaserScan
message type in ROS. The object contains
meta-information about the message and the laser scan data. You can extract the ranges
and angles using the Ranges
property and the readScanAngles
function. To access points in Cartesian coordinates, use
readCartesian
.
You can also convert this object to a lidarScan
(Navigation Toolbox)
object to use with other robotics algorithms such as matchScans
(Navigation Toolbox), controllerVFH
(Navigation Toolbox), or monteCarloLocalization
(Navigation Toolbox).
Creation
Description
scan = rosmessage('sensor_msgs/LaserScan')
creates an
empty LaserScan
object. You can specify scan info and
data using the properties, or you can get these messages off a ROS network
using rossubscriber
.
Properties
Object Functions
lidarScan (Navigation Toolbox) | Create object for storing 2-D lidar scan |
plot | Display laser or lidar scan readings |
readCartesian | Read laser scan ranges in Cartesian coordinates |
readScanAngles | Return scan angles for laser scan range readings |
Examples
Version History
See Also
lidarScan
(Robotics System Toolbox) | plot
| readCartesian
| readScanAngles
| showdetails
| rosmessage
| rossubscriber