Only released in EOL distros:
Package Summary
Navigation nodes for controlling the ART autonomous vehicle. This is a port to ROS of some of the Player 2D navigation code used on the vehicle for the 2007 DARPA Urban Challenge competition.
- Author: Austin Robot Technology, Jack O'Quin
- License: BSD
- Repository: utexas-ros-pkg
- Source: svn https://utexas-art-ros-pkg.googlecode.com/svn/tags/stacks/art_vehicle/art_vehicle-0.4.0
Package Summary
Navigation nodes for controlling the ART autonomous vehicle. This is a port to ROS of some of the Player 2D navigation code used on the vehicle for the 2007 DARPA Urban Challenge competition.
- Author: Austin Robot Technology, Jack O'Quin
- License: BSD
- Source: svn https://utexas-art-ros-pkg.googlecode.com/svn/trunk/stacks/art_vehicle
Package Summary
Navigation nodes for controlling the ART autonomous vehicle. This is a port to ROS of some of the Player 2D navigation code used on the vehicle for the 2007 DARPA Urban Challenge competition.
- Author: Austin Robot Technology, Jack O'Quin
- License: BSD
- Source: svn https://utexas-art-ros-pkg.googlecode.com/svn/trunk/stacks/art_vehicle
Package Summary
Navigation nodes for controlling the ART autonomous vehicle. This is a port to ROS of some of the Player 2D navigation code used on the vehicle for the 2007 DARPA Urban Challenge competition.
- Author: Austin Robot Technology, Jack O'Quin
- License: BSD
- Source: svn https://utexas-art-ros-pkg.googlecode.com/svn/trunk/stacks/art_vehicle
Contents
ROS Nodes
This package contains ROS nodes for navigating the ART autonomous vehicle.
commander
Global path planning for the ART vehicle.Subscribed Topics
navigator/state (art_msgs/NavigatorState)- current navigator state information
Published Topics
navigator/cmd (art_msgs/NavigatorCommand)- way-point orders for navigator
Parameters
Initial Parameters
- Frame of reference for road map.
- Mission Definition File name (required).
- Mission state save file name (default: none).
- Route Network Definition File name. Required, but can be defined anywhere within the enclosing namespace.
Examples
Run the ART commander, sending navigator/cmd messages.
rosrun art_nav commander _rndf:=road_map.rndf _mdf:=mission_ckpts.mdf
navigator
Local path control for the ART vehicle.Subscribed Topics
navigator/cmd (art_msgs/NavigatorCommand)- way-point orders from the commander node
Published Topics
navigator/state (art_msgs/NavigatorState)- current navigator state
- velocity and steering angle for the pilot node
Parameters
Dynamically Reconfigurable Parameters
See the dynamic_reconfigure package for details on dynamically reconfigurable parameters.- Blockage timeout (s) Range: 0.0 to 20.0
- Distance to stop from an obstacle (m) Range: 5.0 to 20.0
- Desired following time (s) Range: 0.0 to 10.0
- Heading change ratio Range: 0.0 to 1.0
- Initialize look ahead distance (m) Range: 0.0 to 30.0
- Initialize minimum angle (radians) Range: 0.0 to 3.14159265359
- Lane change target (seconds ahead) Range: 0.0 to 8.0
- Lane width ration (fraction) Range: 0.01 to 1.0
- Turn lookahead distance (m) Range: 0.0 to 200.0
- Speed when lost (m/s) Range: 1.0 to 5.0
- Distance for which to creep (m) Range: 0.0 to 5.0
- turn max deceleration (m/s^2) Range: 0.1 to 4.0
- Maximum speed ever to request (m/s) Range: 0.0 to 25.0
- Maximum speed for sharpest possible turn (m/s) Range: 1.0 to 8.0
- turn max yaw rate (radians/s) Range: 0.01 to 2.0
- Minimum approach speed considered dangerous (m/s) Range: 0.0 to 5.0
- Minimum curve length for turn (m) Range: 1.0 to 5.0
- Minimum following time (s) Range: 0.0 to 10.0
- Minimum lane steering distance (m) Range: 0.0 to 16.0
- Minimum speed when slowing for curves (m/s) Range: 1.0 to 5.0
- Minimum distance to begin stopping (m) Range: 0.0 to 25.0
- Drive aggressively (defensively if false)
- Wait time before passing (s) Range: 0.0 to 10.0
- Wait time for intersection precedence (s) Range: 0.0 to 30.0
- Real maximum yaw rate (radians/s) Range: 0.1 to 2.0
- Wait time for road blockage (s) Range: 0.0 to 10.0
- Spot waypoint radius (m) Range: 0.1 to 4.0
- Spring lookahead distance (m) Range: 0.0 to 8.0
- Stop line approach speed (m/s) Range: 1.0 to 5.0
- Speed while creeping to stop (m/s) Range: 0.5 to 3.0
- Desired stopping deceleration (m/s^2) Range: 0.05 to 4.0
- Desired stopping distance (m) Range: 0.0 to 4.0
- Brake latency for stopping (s) Range: 0.0 to 4.0
- Delay when stop line reached (s) Range: 0.0 to 10.0
- yaw tuning parameter (heading) Range: 0.0 to 1.0
- yaw tuning parameter (integral) Range: 0.0 to 4.0
- Turning latency time (s) Range: 0.0 to 4.0
- Yaw tuning parameter (offset) Range: 0.0 to 1.0
- U-turn speed (m/s) Range: 1.0 to 4.0
- U-turn stop heading (radians) Range: 0.0 to 3.14159265359
- U-turn threshold (m) Range: 0.0 to 4.0
- U-turn yaw rate (radians/s) Range: 0.5 to 3.0
- Zone waypoint radius (m) Range: 0.1 to 4.0
Examples
Run the ART navigator, accepting navigator/cmd messages.
rosrun art_nav navigator
estop
Graphical client for navigator E-stop control.Subscribed Topics
navigator/state (art_msgs/NavigatorState)- current navigator state
Published Topics
navigator/cmd (art_msgs/NavigatorCommand)- navigator orders
Examples
Run GUI for sending Run and Pause orders to the navigator.
rosrun art_nav estop.py