rosPlot
Display lidar scan or point cloud from ROS or ROS 2 message structures
Since R2021a
Description
rosPlot(
plots the laser scan
readings specified in the input ROS or ROS 2
scanMsg
)sensor_msgs/LaserScan
message structure. Axes are
automatically scaled to the maximum range of the sensor.
rosPlot(
plots the point
cloud readings specified in the input ptcloudMsg
)sensor_msgs/PointCloud2
message structure.
rosPlot(___,Name,Value)
provides additional
options specified by one or more Name,Value
pair
arguments.
returns
a column vector of line series handles, using any of the arguments
from previous syntaxes. Use linehandle
= plot(___)linehandle
to modify
properties of the line series after it is created.
When plotting ROS laser scan messages, MATLAB® follows the standard ROS convention for axis orientation. This convention states that positive x is forward, positive y is left, and positive z is up. For more information, see Axis Orientation on the ROS Wiki.
Input Arguments
Outputs
Version History
Introduced in R2021a