diff --git a/_sources/commander_api/index.rst.txt b/_sources/commander_api/index.rst.txt index 0398a2638..a403154a9 100644 --- a/_sources/commander_api/index.rst.txt +++ b/_sources/commander_api/index.rst.txt @@ -102,9 +102,6 @@ New as of September 2023: the simple navigator constructor will accept a `namesp | getPathThroughPoses(start, goals, | Gets a path through a starting to a set of goals, a list | | planner_id='', use_start=False) | of ``PoseStamped``, ``nav_msgs/Path``. | +---------------------------------------+----------------------------------------------------------------------------+ -| getRoute(start, goal, | Gets a sparse route and dense path from start to goal, where start and | -| use_start=False) | goal may be of type ``PoseStamped`` or ``int`` for known NodeIDs. | -+---------------------------------------+----------------------------------------------------------------------------+ | dockRobot(dock_pose, dock_type) | Attempts to dock the robot at a given docking pose and type, without using | | | docking database of known docks. | +---------------------------------------+----------------------------------------------------------------------------+ diff --git a/commander_api/index.html b/commander_api/index.html index 9580e741c..0bc07bbe7 100644 --- a/commander_api/index.html +++ b/commander_api/index.html @@ -1198,67 +1198,62 @@
nav_msgs/Path
.
-getRoute(start, goal, -use_start=False)
Gets a sparse route and dense path from start to goal, where start and
-goal may be of type PoseStamped
or int
for known NodeIDs.
dockRobot(dock_pose, dock_type)
dockRobot(dock_pose, dock_type)
Attempts to dock the robot at a given docking pose and type, without using docking database of known docks.
dockRobot(dock_id)
dockRobot(dock_id)
Attempts to dock the robot at a given dock ID in the database of known docks.
undockRobot(dock_type=”“)
undockRobot(dock_type=”“)
Undocks robot. If docking server instance was used to dock, type is not required.
getandTrackRoute(start, goal, +
getandTrackRoute(start, goal, use_start=False)
Gets and tracks a sparse route and dense path from start to goal, where
start & goal may be of type PoseStamped
or int
for known NodeIDs.
smoothPath(path, smoother_id=’‘, +
smoothPath(path, smoother_id=’‘, max_duration=2.0, check_for_collision=False)
Smooths a given path of type nav_msgs/Path
.
changeMap(map_filepath)
changeMap(map_filepath)
Requests a change from the current map to map_filepath’s yaml.
clearAllCostmaps()
clearAllCostmaps()
Clears both the global and local costmaps.
clearLocalCostmap()
clearLocalCostmap()
Clears the local costmap.
clearGlobalCostmap()
clearGlobalCostmap()
Clears the global costmap.
getGlobalCostmap()
getGlobalCostmap()
Returns the global costmap, nav2_msgs/Costmap
.
getLocalCostmap()
getLocalCostmap()
Returns the local costmap, nav2_msgs/Costmap
.
waitUntilNav2Active( +
waitUntilNav2Active( navigator=’bt_navigator’, localizer=’amcl’)
Blocks until Nav2 is completely online and lifecycle nodes are in the active state. To be used in conjunction with autostart or external lifecycle bringup. Custom navigator and localizer nodes can be specified
lifecycleStartup()
lifecycleStartup()
Sends a request to all lifecycle management servers to bring them into
the active state, to be used if autostart is False
and you want this
program to control Nav2’s lifecycle.
lifecycleShutdown()
lifecycleShutdown()
Sends a request to all lifecycle management servers to shut them down.
destroyNode()
destroyNode()
Releases the resources used by the object.