Class FollowPathBehavior

Inheritance Relationships

Base Type

  • public as2_behavior::BehaviorServer< as2_msgs::action::FollowPath >

Class Documentation

class FollowPathBehavior : public as2_behavior::BehaviorServer<as2_msgs::action::FollowPath>

Public Types

using GoalHandleFollowPath = rclcpp_action::ServerGoalHandle<as2_msgs::action::FollowPath>

Public Functions

FollowPathBehavior(const rclcpp::NodeOptions &options = rclcpp::NodeOptions())
~FollowPathBehavior()
void state_callback(const geometry_msgs::msg::TwistStamped::SharedPtr _twist_msg)
void platform_info_callback(const as2_msgs::msg::PlatformInfo::SharedPtr msg)
bool process_goal(std::shared_ptr<const as2_msgs::action::FollowPath::Goal> goal, as2_msgs::action::FollowPath::Goal &new_goal)
bool on_activate(std::shared_ptr<const as2_msgs::action::FollowPath::Goal> goal) override
bool on_modify(std::shared_ptr<const as2_msgs::action::FollowPath::Goal> goal) override
virtual bool on_deactivate(const std::shared_ptr<std::string> &message) override
virtual bool on_pause(const std::shared_ptr<std::string> &message) override
virtual bool on_resume(const std::shared_ptr<std::string> &message) override
as2_behavior::ExecutionStatus on_run(const std::shared_ptr<const as2_msgs::action::FollowPath::Goal> &goal, std::shared_ptr<as2_msgs::action::FollowPath::Feedback> &feedback_msg, std::shared_ptr<as2_msgs::action::FollowPath::Result> &result_msg) override
virtual void on_execution_end(const as2_behavior::ExecutionStatus &state) override