Class W200HardwareInterface

Inheritance Relationships

Base Type

  • public rclcpp::Node

Class Documentation

class W200HardwareInterface : public rclcpp::Node

Public Functions

explicit W200HardwareInterface(std::string node_name)
void feedback_left_callback(const std_msgs::msg::Float64::SharedPtr msg)
void feedback_right_callback(const std_msgs::msg::Float64::SharedPtr msg)
void drive_command(const float &left_wheel, const float &right_wheel)
bool has_new_feedback()
std_msgs::msg::Float64 get_left_feedback()
std_msgs::msg::Float64 get_right_feedback()