Wiki

Nodelets

rtabmap_sync/rgbd_sync

Synchronize RGB, depth and camera_info messages into a single message. You can then use subscribe_rgbd to make rtabmap or odometry nodes subscribing to this message instead. This is useful when, for example, rtabmap is subscribed also to a laser scan or odometry topic published at different rate than the image topics. We can then make sure that images are correctly synchronized together. If you have camera publishing on the network, this can be also a good format to synchronize images before sending them on the network, to avoid synchronization issues when the network is lagging.

Subscribed Topics

rgb/image (sensor_msgs/Image) depth/image (sensor_msgs/Image) rgb/camera_info (sensor_msgs/CameraInfo)

Published Topics

rgbd_image (rtabmap_msgs/RGBDImage) rgbd_image/compressed (rtabmap_msgs/RGBDImage)

Parameters

~queue_size (int, default: 10) ~approx_sync (bool, default: 0) ~approx_sync_max_interval (double, default: "True") ~compressed_rate (double, default: 0) ~depth_scale (double, default: 1.0) ~decimation (int, default: 1)

rtabmap_sync/rgb_sync

Synchronize RGB and camera_info messages into a single message. You can then use subscribe_rgbd to make rtabmap or odometry nodes subscribing to this message instead. This is useful when, for example, rtabmap is subscribed also to a laser scan or odometry topic published at different rate than the image topics. We can then make sure that images are correctly synchronized together. If you have camera publishing on the network, this can be also a good format to synchronize images before sending them on the network, to avoid synchronization issues when the network is lagging.

Subscribed Topics

rgb/image (sensor_msgs/Image) rgb/camera_info (sensor_msgs/CameraInfo)

Published Topics

rgbd_image (rtabmap_msgs/RGBDImage) rgbd_image/compressed (rtabmap_msgs/RGBDImage)

Parameters

~queue_size (int, default: 10) ~approx_sync (bool, default: "False") ~compressed_rate (double, default: 0)

rtabmap_sync/stereo_sync

Synchronize left image, right image and camera_info messages into a single message. You can then use subscribe_rgbd to make rtabmap or odometry nodes subscribing to this message instead. This is useful when, for example, rtabmap is subscribed also to a laser scan or odometry topic published at different rate than the image topics. We can then make sure that images are correctly synchronized together. If you have camera publishing on the network, this can be also a good format to synchronize images before sending them on the network, to avoid synchronization issues when the network is lagging.

Subscribed Topics

left/image_rect (sensor_msgs/Image) right/image_rect (sensor_msgs/Image) left/camera_info (sensor_msgs/CameraInfo) right/camera_info (sensor_msgs/CameraInfo)

Published Topics

rgbd_image (rtabmap_msgs/RGBDImage) rgbd_image/compressed (rtabmap_msgs/RGBDImage)

Parameters

~queue_size (int, default: 10) ~approx_sync (bool, default: "False") ~compressed_rate (double, default: 0)

rtabmap_sync/rgbdx_sync

Synchronize up to 8 rtabmap_msgs/RGBDImage into a single message rtabmap_msgs/RGBDImages. You can then use subscribe_rgbd with rgbd_cameras=0 to make rtabmap or odometry nodes subscribing to this message instead. Input topics should be all RGB-D or all stereo, we cannot mix RGB-D + stereo cameras, and they should have all the same resolution.

Subscribed Topics

rgbd_image0 (rtabmap_msgs/RGBDImage) rgbd_image1 (rtabmap_msgs/RGBDImage) rgbd_image2 (rtabmap_msgs/RGBDImage) rgbd_image3 (rtabmap_msgs/RGBDImage) rgbd_image4 (rtabmap_msgs/RGBDImage) rgbd_image5 (rtabmap_msgs/RGBDImage) rgbd_image6 (rtabmap_msgs/RGBDImage) rgbd_image7 (rtabmap_msgs/RGBDImage)

Published Topics

rgbd_images (rtabmap_msgs/RGBDImages)

Parameters

~queue_size (int, default: 10) ~approx_sync (bool, default: "True") ~approx_sync_max_interval (double, default: 0.0) ~rgbd_cameras (int, default: 2)

Wiki: rtabmap_sync (last edited 2024-04-07 21:59:23 by MathieuLabbe)