Skip to main content
Version: ROS 2 Humble

ROS 2 Sensors API

note

The '#' in the topic represents the index of the sensor. Indexing begins at 0 and will increment for each new sensor of that type that is added. Internal sensors such as IMU's will be indexed first.

2D Lidar topics

TopicMessage typeDescriptionQoS
sensors/lidar2d_#/scansensor_msgs/LaserScanLidar scan dataSystem Default

3D Lidar topics

TopicMessage typeDescriptionQoS
sensors/lidar3d_#/pointssensor_msgs/PointCloud2Lidar pointcloud dataSystem Default
sensors/lidar3d_#/scansensor_msgs/LaserScanLidar scan dataSystem Default

Camera topics

TopicMessage typeDescriptionQoS
sensors/camera_#/color/imagesensor_msgs/ImageRaw RGB imageSystem Default
sensors/camera_#/color/camera_infosensor_msgs/CameraInfoCamera InfoSystem Default
sensors/camera_#/depth/imagesensor_msgs/ImageRaw depth imageSystem Default
sensors/camera_#/depth/camera_infosensor_msgs/CameraInfoCamera InfoSystem Default
sensors/camera_#/pointssensor_msgs/PointCloud2Pointcloud dataSystem Default
sensors/camera_#/imusensor_msgs/ImuIMU dataSystem Default

IMU topics

TopicMessage typeDescriptionQoS
sensors/imu_#/data_rawsensor_msgs/ImuRaw IMU orientation, angular velocity, and linear acceleration dataSensor Data
sensors/imu_#/datasensor_msgs/ImuFiltered IMU orientation, angular velocity, and linear acceleration dataSystem Default
sensors/imu_#/magsensor_msgs/MagneticFieldIMU magnetic field dataSystem Default

GPS topics

TopicMessage typeDescriptionQoS
sensors/gps_#/fixsensor_msgs/NavSatFixNavsat Fix informationSystem Default