Class Sensors

Inheritance Relationships

Derived Types

Class Documentation

class Sensors

Subclassed by robotis::turtlebot3::sensors::BatteryState, robotis::turtlebot3::sensors::Imu, robotis::turtlebot3::sensors::JointState, robotis::turtlebot3::sensors::SensorState

Public Functions

inline explicit Sensors(std::shared_ptr<rclcpp::Node> &nh, const std::string &frame_id = "")
virtual void publish(const rclcpp::Time &now, std::shared_ptr<DynamixelSDKWrapper> &dxl_sdk_wrapper) = 0

Protected Attributes

std::shared_ptr<rclcpp::Node> nh_
std::string frame_id_
rclcpp::QoS qos_ = rclcpp::QoS(rclcpp::KeepLast(10))