Wiki

rgbd_image_proc is an application available in ccny_rgbd. The application subscribes to the output of RGB-D cameras as produces by the openni_camera (or compatible) driver and performs image rectification, depth-to-rgb registration, depth unwarping, and point cloud generation.

rgbd_image_proc.png

Two drivers are available: rgbd_image_proc_nodelet and rgbd_image_proc_node. Their parameters and topics are identical.

ROS API

Subscribed topics

/camera/rgb/image_color (sensor_msgs/Image)

/camera/depth/image_raw (sensor_msgs/Image) /camera/rgb/camera_info (sensor_msgs/CameraInfo) /camera/depth/camera_info (sensor_msgs/CameraInfo)

Published topics

/rgbd/rgb (sensor_msgs/Image)

/rgbd/depth (sensor_msgs/Image) /rgbd/info (sensor_msgs/CameraInfo) /rgbd/cloud (sensor_msgs/PointCloud2)

Parameters

~queue_size (int, default: 5)

~calib_path (string, default: "$HOME/.ros/rgbd_calibration") ~scale (double, default: 1.0) ~unwarp (bool, default: true) ~publish_cloud (bool, default: true)

Wiki: ccny_rgbd/rgbd_image_proc (last edited 2013-02-05 20:33:13 by IvanDryanovski)