PKG - navigation
Last updated
Was this helpful?
Last updated
Was this helpful?
input = odometry, sensor(avoid obstacles), and a goal pose
output = safe velocity commands
tf = determine the robot's location in the world and relate sensor data to a static map. (no velocity data)
odometry = publish both a transform and a nav_msgs/Odometry message that contains velocity information.
for both differential drive and holonomic wheeled robots only. command = Vel_x, Vel_y, Vel_theta.
planar laser mounted, for map building and localization.
This uses 2 costmaps to store information about obstacles in the world, and in total 3 maps
global = long-term plans
local = local planning and obstacle avoidance
common = global & local
The robot will only update its map with info about obstacles that are within 2.5 meters of the base.
The robot will attempt to clear out space in front of it up to 3.0 meters away given a sensor reading.
center of the robot is assumed to be at (0.0, 0.0)
the robot will treat all paths that stay 0.55 meters or more away from obstacles as having equal obstacle cost.
defines what coordinate frame the costmap should run in
defines the coordinate frame the costmap should reference for the base of the robot.
If you aren't using an existing map or map server, set the static_map parameter to false.
true means that the costmap will remain centered around the robot as the robot moves through the world.
dimension of the costmap
given a high-level plan, compute velocity commands and send to the robot.