Class ControllerHandler

Class Documentation

class ControllerHandler

Public Functions

ControllerHandler(std::shared_ptr<as2_controller_plugin_base::ControllerBase> controller, as2::Node *node)
rcl_interfaces::msg::SetParametersResult parametersCallback(const std::vector<rclcpp::Parameter> &parameters)
inline void getMode(as2_msgs::msg::ControlMode &mode_in, as2_msgs::msg::ControlMode &mode_out)
inline void setInputControlModesAvailables(const std::vector<uint8_t> &available_modes)
inline void setOutputControlModesAvailables(const std::vector<uint8_t> &available_modes)
inline virtual ~ControllerHandler()

Public Members

bool use_bypass_ = false
bool bypass_controller_ = false

Protected Attributes

as2::Node *node_ptr_