Class Devices

Inheritance Relationships

Derived Types

Class Documentation

class Devices

Subclassed by robotis::turtlebot3::devices::MotorPower, robotis::turtlebot3::devices::Reset, robotis::turtlebot3::devices::Sound

Public Functions

inline explicit Devices(std::shared_ptr<rclcpp::Node> &nh, std::shared_ptr<DynamixelSDKWrapper> &dxl_sdk_wrapper)
virtual void command(const void *request, void *response) = 0

Protected Attributes

std::shared_ptr<rclcpp::Node> nh_
std::shared_ptr<DynamixelSDKWrapper> dxl_sdk_wrapper_
rclcpp::QoS qos_ = rclcpp::QoS(rclcpp::ServicesQoS())