Class GoToBase
Defined in File go_to_base.hpp
Inheritance Relationships
Derived Types
public go_to_plugin_position::Plugin
(Class Plugin)public go_to_plugin_trajectory::Plugin
(Class Plugin)
Class Documentation
-
class GoToBase
Subclassed by go_to_plugin_position::Plugin, go_to_plugin_trajectory::Plugin
Public Types
-
using GoalHandleGoTo = rclcpp_action::ServerGoalHandle<as2_msgs::action::GoToWaypoint>
Public Functions
-
inline GoToBase()
-
inline virtual ~GoToBase()
-
inline void state_callback(geometry_msgs::msg::PoseStamped &pose_msg, geometry_msgs::msg::TwistStamped &twist_msg)
-
inline void on_execution_end(const as2_behavior::ExecutionStatus &state)
Protected Functions
-
inline virtual void ownInit()
-
virtual bool own_activate(as2_msgs::action::GoToWaypoint::Goal &goal) = 0
-
inline virtual bool own_modify(as2_msgs::action::GoToWaypoint::Goal &goal)
-
virtual void own_execution_end(const as2_behavior::ExecutionStatus &state) = 0
-
virtual as2_behavior::ExecutionStatus own_run() = 0
-
inline void sendHover()
-
using GoalHandleGoTo = rclcpp_action::ServerGoalHandle<as2_msgs::action::GoToWaypoint>