kinect: freenect | kinect_calibration | kinect_camera | kinect_pcl
Package Summary
No API documentation
A general purpose ROS driver for the Microsoft XBOX 360 Kinect sensor. The driver publishes:
- RGB/IR image data
- depth data as PointCloud and PointCloud2
- ...
- Author: Ivan Dryanovski, William Morris, Stéphane Magnenat, Radu Bogdan Rusu, Patrick Mihelich
- License: BSD
- Repository: ros-pkg
- Source: git https://github.com/ros-pkg-git/kinect.git
Contents
ROS API
Kinect Node
The Kinect node and nodelet implement the following ROS API:Published Topics
camera/points (sensor_msgs/PointCloud)- The 3D pointcloud acquired by the Kinect stereo, as pointcloud version 1
- The 3D pointcloud acquired by the Kinect stereo, as pointcloud version 2
- Metadata (camera matrix, distortion, rectification, projection) for the color camera
- The raw uncompressed images of the color camera
- Metadata (camera matrix, distortion, rectification, projection) for the infrared depth camera
- The raw uncompressed images of the infrared depth camera
Parameters
kinect_node/depth/camera_info_url (namespace on parameter server)- Metadata (camera matrix, distortion, rectification, projection) for the infrared depth camera.