Class Display

Class Documentation

class Display

Public Functions

explicit Display(std::vector<Turtlebot4MenuEntry> entries, std::shared_ptr<rclcpp::Node> &nh)
inline virtual ~Display()
void set_battery(const sensor_msgs::msg::BatteryState::SharedPtr &battery_state_msg)
void set_ip(std::string ip)
void scroll_up()
void scroll_down()
void select()
void back()
void show_message(std::vector<std::string> message)
void show_message(std::string message)
void spin_once()
void request_update()