Only released in EOL distros:
Package Summary
This node implements a simple "freespace" (obstacle avoidance) behavior. It subscribes to a 2D laser scan and always tries to steer towards the largest open space.
It was tested on the Kurt robot platform, but should work on any robot that has a 2D laser scanner and accepts Twist messages.
- Author: Jochen Sprickerhof
- License: BSD
- Source: git http://kos.informatik.uni-osnabrueck.de/kurt_apps.git (branch: master)
Package Summary
This node implements a simple "freespace" (obstacle avoidance) behavior. It subscribes to a 2D laser scan and always tries to steer towards the largest open space.
It was tested on the Kurt robot platform, but should work on any robot that has a 2D laser scanner and accepts Twist messages.
- Author: Jochen Sprickerhof
- License: BSD
- Source: git https://github.com/uos/kurt_apps.git (branch: fuerte)
Package Summary
This node implements a simple "freespace" (obstacle avoidance) behavior. It subscribes to a 2D laser scan and always tries to steer towards the largest open space.
It was tested on the Kurt robot platform, but should work on any robot that has a 2D laser scanner and accepts Twist messages.
- Author: Jochen Sprickerhof
- License: BSD
- Source: git https://github.com/uos/kurt_apps.git (branch: groovy)
Package Summary
This node implements a simple "freespace" (obstacle avoidance) behavior. It subscribes to a 2D laser scan and always tries to steer towards the largest open space.
It was tested on the Kurt robot platform, but should work on any robot that has a 2D laser scanner and accepts Twist messages.
- Author: Jochen Sprickerhof
- License: BSD
- Source: git https://github.com/uos/kurt_apps.git (branch: hydro)
ROS API
kurt_freespace
Subscribed Topics
scan (sensor_msgs/LaserScan)Published Topics
cmd_vel (geometry_msgs/Twist)Parameters
max_vel_x (double, default: 0.9)- The maximum x velocity [m/s].
- The maximum yaw velocity [rad/s].