Class UnknownErrorPlanner

Inheritance Relationships

Base Type

  • public nav2_core::GlobalPlanner

Derived Types

Class Documentation

class UnknownErrorPlanner : public nav2_core::GlobalPlanner

Subclassed by nav2_system_tests::CancelledPlanner, nav2_system_tests::GoalOccupiedErrorPlanner, nav2_system_tests::GoalOutsideMapErrorPlanner, nav2_system_tests::NoValidPathErrorPlanner, nav2_system_tests::NoViapointsGivenErrorPlanner, nav2_system_tests::StartOccupiedErrorPlanner, nav2_system_tests::StartOutsideMapErrorPlanner, nav2_system_tests::TFErrorPlanner, nav2_system_tests::TimedOutErrorPlanner

Public Functions

UnknownErrorPlanner() = default
~UnknownErrorPlanner() = default
inline void configure(const rclcpp_lifecycle::LifecycleNode::WeakPtr&, std::string, std::shared_ptr<tf2_ros::Buffer>, std::shared_ptr<nav2_costmap_2d::Costmap2DROS>) override
inline void cleanup() override
inline void activate() override
inline void deactivate() override
inline nav_msgs::msg::Path createPlan(const geometry_msgs::msg::PoseStamped&, const geometry_msgs::msg::PoseStamped&, std::function<bool()>) override