Class UnknownErrorController

Inheritance Relationships

Base Type

  • public nav2_core::Controller

Derived Types

Class Documentation

class UnknownErrorController : public nav2_core::Controller

Subclassed by nav2_system_tests::FailedToMakeProgressErrorController, nav2_system_tests::InvalidPathErrorController, nav2_system_tests::NoValidControlErrorController, nav2_system_tests::PatienceExceededErrorController, nav2_system_tests::TFErrorController

Public Functions

UnknownErrorController() = default
~UnknownErrorController() = 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()
inline void activate()
inline void deactivate()
inline void setPlan(const nav_msgs::msg::Path&)
inline virtual geometry_msgs::msg::TwistStamped computeVelocityCommands(const geometry_msgs::msg::PoseStamped&, const geometry_msgs::msg::Twist&, nav2_core::GoalChecker*)
inline void setSpeedLimit(const double&, const bool&)