Only released in EOL distros:
Package Summary
The clearpath_kinect_demo package provides a set of basic demos that can be used with almost any robot and a Kinect. Launch files can be found in clearpath_husky and clearpath_turtlebot with robot specific parameters.
- Author: Sean Anderson
- License: BSD
- Repository: clearpath-ros-pkg
- Source: svn https://clearpath-ros-pkg.googlecode.com/svn/tags/stacks/clearpath_kinect/clearpath_kinect-0.1.0
Package Summary
The clearpath_kinect_demo package provides a set of basic demos that can be used with almost any robot and a Kinect. Launch files can be found in clearpath_husky and clearpath_turtlebot with robot specific parameters.
- Author: Sean Anderson
- License: BSD
- Source: git https://github.com/clearpathrobotics/clearpath_kinect.git (branch: master)
Package Summary
The clearpath_kinect_demo package provides a set of basic demos that can be used with almost any robot and a Kinect. Launch files can be found in clearpath_husky and clearpath_turtlebot with robot specific parameters.
- Author: Sean Anderson
- License: BSD
- Source: git https://github.com/clearpathrobotics/clearpath_kinect.git (branch: master)
Package Summary
The clearpath_kinect_demo package provides a set of basic demos that can be used with almost any robot and a Kinect. Launch files can be found in clearpath_husky and clearpath_turtlebot with robot specific parameters.
- Author: Sean Anderson
- License: BSD
- Source: svn https://clearpath-ros-pkg.googlecode.com/svn/trunk/clearpath_kinect
Contents
Nodes
ClearpathDemoExplore
ClearpathDemoExplore is a ROS node that reads a frame from the Kinect PointCloud and generates a motion output that drives it towards empty space.
Subscribed Topics
idfloor_in(~in) (sensor_msgs/PointCloud2)- Get the Kinect Point cloud as a pcl::PointCloud<pcl::PointXYZRGB>.
Published Topics
idfloor_out(~out) (sensor_msgs/PointCloud2)- A pcl::PointCloud<pcl::PointXYZRGB> that can be used for visualization.
- Publish the commanded velocity.
Parameters
~in (string, default: "idfloor_in")- Name of the topic your XYZRGB Point Cloud is on.
- Name of the topic your display XYZRGB Point Cloud is put out on.
- Name of the topic your cmd_vel should go out on.
- A gain applied to the commanded angular velocity during turns.
- The linear speed in m/s the robot should move during operation.
- The angular speed that the robot should moving during turns, rad/s.
- The height of the Kinect from the ground
- Displacement of the camera from the center of the robot.
- Amount of "buffer" to add to obstacles (treating the robot as a point)
- A flag to turn on/off visualization publishing on the 'out' channel
ClearpathDemoTrack
ClearpathDemoTrack is a ROS node that reads a frame from the Kinect PointCloud and generates a motion output that drives it towards a tracked object (person).
Subscribed Topics
idfloor_in(~in) (sensor_msgs/PointCloud2)- Get the Kinect Point cloud as a pcl::PointCloud<pcl::PointXYZRGB>.
Published Topics
idfloor_out(~out) (sensor_msgs/PointCloud2)- A pcl::PointCloud<pcl::PointXYZRGB> that can be used for visualization.
- Publish the commanded velocity.
Parameters
~in (string, default: "idfloor_in")- Name of the topic your XYZRGB Point Cloud is on.
- Name of the topic your display XYZRGB Point Cloud is put out on.
- Name of the topic your cmd_vel should go out on.
- A gain applied to the commanded angular velocity during turns.
- The linear speed in m/s the robot should move during operation.
- The angular speed that the robot should moving during turns, rad/s.
- The height of the Kinect from the ground
- Displacement of the camera from the center of the robot.
- Distance in meters that is searched from the previous object location.
- A flag to turn on/off visualization publishing on the 'out' channel