Only released in EOL distros:
starmac_sensors: starmac_kinect
Package Summary
Documented
State estimation and obstacle detection using 3D sensor output. NOTE: Hasn't been maintained in awhile and would need some modifications to get working again. For this reason, building this package is suppressed with ROS_NOBUILD.
- Author: bouffard
- License: BSD
- Source: hg https://bitbucket.org/bouffard/starmac-ros-pkg (branch: default)
Nodes
kinect_estimation
Node to do (partial) state estimation using data from a KinectSubscribed Topics
~input (sensor_msgs/PointCloud2)- Point cloud from sensor
- Indices of point cloud that are inliers of the planar model
- Coefficients of the planar model
- Backup estimation source (i.e. Vicon). Only subscribed if ~use_backup_estimator_alt parameter is set.
Published Topics
~output (nav_msgs/Odometry)- Output state estimate
- Detected obstacle information
- Testing/debugging information
- Visualization markers
- Indices of full point cloud that the kinect node is requested to publish
Parameters
~use_backup_estimator_alt (bool, default: true)- Whether to use a backup source of altitude state estimate (i.e. Vicon)
- Vertical distance in meters from IMU to Kinect (positive means Kinect is above IMU)
- Tolerance in meters on distance between Kinect-derived altitude and backup source of altitude data
- Points more than this distance in meters above the ground plane will be considered potential obstacles
- For debugging purposes. Rate in Hz to limit the main callback by. Zero means to disable throttling.
- Altitude velocity determination filter parameter.
- Altitude velocity determination filter parameter.