nav2_msgs
1.2
  • Message Definitions
    • BehaviorTreeLog
    • BehaviorTreeStatusChange
    • CollisionDetectorState
    • CollisionMonitorState
    • Costmap
    • CostmapFilterInfo
    • CostmapMetaData
    • MissedWaypoint
    • Particle
    • ParticleCloud
    • SpeedLimit
    • VoxelGrid
  • Service Definitions
    • ClearCostmapAroundRobot
    • ClearCostmapExceptRegion
    • ClearEntireCostmap
    • GetCostmap
    • IsPathValid
    • LoadMap
    • ManageLifecycleNodes
    • SaveMap
    • SetInitialPose
  • Action Definitions
    • AssistedTeleop
    • BackUp
    • ComputePathThroughPoses
    • ComputePathToPose
    • DriveOnHeading
    • DummyBehavior
    • FollowGPSWaypoints
    • FollowPath
    • FollowWaypoints
    • NavigateThroughPoses
    • NavigateToPose
    • SmoothPath
    • Spin
    • Wait
  • Standard Documents
    • CHANGELOG
    • PACKAGE
    • README
      • nav2_msgs
  • Index
nav2_msgs
  • Action Definitions
  • NavigateThroughPoses
  • View page source

NavigateThroughPoses

This is a ROS action definition.

Source

# Error codes
# Note: The expected priority order of the errors should match the message order
uint16 NONE=0

#goal definition
geometry_msgs/PoseStamped[] poses
string behavior_tree
---
#result definition
uint16 error_code
---
#feedback definition
geometry_msgs/PoseStamped current_pose
builtin_interfaces/Duration navigation_time
builtin_interfaces/Duration estimated_time_remaining
int16 number_of_recoveries
float32 distance_remaining
int16 number_of_poses_remaining
Previous Next

© Copyright The <nav2_msgs> Contributors. License: Apache-2.0.

Built with Sphinx using a theme provided by Read the Docs.