Class UnknownErrorSmoother

Inheritance Relationships

Base Type

  • public nav2_core::Smoother

Derived Types

Class Documentation

class UnknownErrorSmoother : public nav2_core::Smoother

Subclassed by nav2_system_tests::FailedToSmoothPath, nav2_system_tests::InvalidPath, nav2_system_tests::SmoothedPathInCollision, nav2_system_tests::TimeOutErrorSmoother

Public Functions

inline void configure(const rclcpp_lifecycle::LifecycleNode::WeakPtr&, std::string, std::shared_ptr<tf2_ros::Buffer>, std::shared_ptr<nav2_costmap_2d::CostmapSubscriber>, std::shared_ptr<nav2_costmap_2d::FootprintSubscriber>) override
inline void cleanup() override
inline void activate() override
inline void deactivate() override
inline bool smooth(nav_msgs::msg::Path&, const rclcpp::Duration&) override