LaserScan
(To be removed) Create laser scan message
LaserScan object will be removed in a future release. Use message structure format
when you create ROS messages using the rosmessage
function, by specifying the Dataformat
name-value argument as "struct"
. You can use rosReadLidarScan
, rosReadCartesian
, and rosReadScanAngles
functions to read laser scan data from ROS messages.
For more information, see ROS Message Structure Functions.
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 | (To be removed) Read laser scan ranges in Cartesian coordinates |
readScanAngles | (To be removed) Return scan angles for laser scan range readings |
Examples
Version History
Introduced in R2019bSee Also
rosReadLidarScan
| lidarScan
(Robotics System Toolbox) | plot
| rosReadCartesian
| rosReadScanAngles
| rosShowDetails
| rosmessage
| rossubscriber