Class ControllerBase

Class Documentation

class ControllerBase

Public Functions

inline ControllerBase()
inline void initialize(as2::Node *node_ptr)
inline virtual void ownInitialize()
virtual void updateState(const geometry_msgs::msg::PoseStamped &pose_msg, const geometry_msgs::msg::TwistStamped &twist_msg) = 0
inline virtual void updateReference(const geometry_msgs::msg::PoseStamped &ref)
inline virtual void updateReference(const geometry_msgs::msg::TwistStamped &ref)
inline virtual void updateReference(const as2_msgs::msg::TrajectoryPoint &ref)
virtual bool computeOutput(double dt, geometry_msgs::msg::PoseStamped &pose, geometry_msgs::msg::TwistStamped &twist, as2_msgs::msg::Thrust &thrust) = 0
virtual bool setMode(const as2_msgs::msg::ControlMode &mode_in, const as2_msgs::msg::ControlMode &mode_out) = 0
virtual bool updateParams(const std::vector<std::string> &_params_list) = 0
virtual void reset() = 0
inline virtual std::string getDesiredPoseFrameId()
inline virtual std::string getDesiredTwistFrameId()
inline virtual ~ControllerBase()

Protected Functions

inline as2::Node *getNodePtr()

Protected Attributes

as2::Node *node_ptr_