Class A200Status
Defined in File status.hpp
Inheritance Relationships
Base Type
public rclcpp::Node
Class Documentation
-
class A200Status : public rclcpp::Node
Public Functions
-
explicit A200Status()
-
void publish_power(const clearpath_platform_msgs::msg::Power &power_msg)
-
void publish_status(const clearpath_platform_msgs::msg::Status &status_msg)
-
void publish_stop_status(const clearpath_platform_msgs::msg::StopStatus &stop_status_msg)
-
void publish_stop_state(const std_msgs::msg::Bool &stop_msg)
-
void publish_temps(const std_msgs::msg::Float32 &driver_left_msg, const std_msgs::msg::Float32 &driver_right_msg, const std_msgs::msg::Float32 &motor_left_msg, const std_msgs::msg::Float32 &motor_right_msg)
-
explicit A200Status()