Only released in EOL distros:
Package Summary
Documented
riskrrt is a risk-based rapidly exploring random tree algorithm for human aware navigation
- Maintainer status: maintained
- Maintainer: Procopio Silveira <procopio.silveira-stein AT inria DOT fr>
- Author: Gregoire Vignon <gregoire.vignon AT inria DOT fr>
- License: BSD
- Source: git https://github.com/spalanza/riskrrt_ros.git (branch: master)
Contents
Example scenarios
Some example scenarios can be run using:
roslaunch riskrrt scenario_name.launch
Available scenarios:
- corridor
- D_corridor
- airport
- empty_airport
- back_forth
- crossing
- frontal
- inria_hall
- test
Nodes
controller
a path following node for differential drive robotsSubscribed Topics
traj (riskrrt/Trajectory)- robot trajectory
- robot pose
Published Topics
controller_feedback (std_msgs/Bool)- controller feedback, true as long as robot is on trajectory
- velocity commands
goal_pub
an automatic goal publisherPublished Topics
goal (geometry_msgs/PoseStamped)- robot final goal
og_builder*
some occupancy grid array publishers examplesSubscribed Topics
map (nav_msgs/OccupancyGrid)- static map
- mobile obstacles poses
Published Topics
robot_*/cmd_vel (geometry_msgs/Twist)- mobile obstacles velocities
- occupancy grid array
planner
the riskrrt plannerSubscribed Topics
ogarray (riskrrt/OccupancyGridArray)- occupancy grid array
- robot final goal
- controller feedback
- robot pose
- robot odometry
Published Topics
traj (riskrrt/Trajectory)- robot trajectory
Parameters
~timeStep (double)
- time step between each node (s), should be used as the time gap between each grid if using a custom OccupancyGridArray publisher
- maximum depth a node can have, should be used to set the occupancy grid array size if using a custom OccupancyGridArray publisher
- discretization of the robot's linear speed, used to create the set of possible controls from a node
- discretization of the robot's angular speed, used to create the set of possible controls from a node
- maximum risk value a node can have to be considered free
- weight of the risk component in the computation of the node's score
- weight of the node's orientation toward the goal (compared to the distance)
- time allocated to the tree growth between map updates (s)
- percentage of the time the final goal is chosen as random goal
- size of the window from which to pick a random goal (m)
- maximum distance the robot can be from the final goal to consider the goal reached (m)
- robot lenght (m)
- robot width (m)
- minimum robot linear speed (m/s), set it to 0 or a negative value to allow reverse
- maximum robot linear speed (m/s)
- maximum linear acceleration (m/s²)
- maximum angular speed (rad/s)
- maximum angular acceleration (rad/s²)