Class GoToBehavior

Inheritance Relationships

Base Type

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

Class Documentation

class GoToBehavior : public as2_behavior::BehaviorServer<as2_msgs::action::GoToWaypoint>

Public Types

using GoalHandleGoTo = rclcpp_action::ServerGoalHandle<as2_msgs::action::GoToWaypoint>

Public Functions

GoToBehavior(const rclcpp::NodeOptions &options = rclcpp::NodeOptions())
~GoToBehavior()
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::GoToWaypoint::Goal> goal, as2_msgs::action::GoToWaypoint::Goal &new_goal)
bool on_activate(std::shared_ptr<const as2_msgs::action::GoToWaypoint::Goal> goal) override
bool on_modify(std::shared_ptr<const as2_msgs::action::GoToWaypoint::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::GoToWaypoint::Goal> &goal, std::shared_ptr<as2_msgs::action::GoToWaypoint::Feedback> &feedback_msg, std::shared_ptr<as2_msgs::action::GoToWaypoint::Result> &result_msg) override
virtual void on_execution_end(const as2_behavior::ExecutionStatus &state) override