Public Member Functions | Private Member Functions | Private Attributes | List of all members
rm_referee::DroneTowardsTimeChangeGroupUi Class Reference

#include <time_change_ui.h>

Inheritance diagram for rm_referee::DroneTowardsTimeChangeGroupUi:
Inheritance graph
[legend]

Public Member Functions

 DroneTowardsTimeChangeGroupUi (XmlRpc::XmlRpcValue &rpc_value, Base &base, std::deque< Graph > *graph_queue, std::deque< Graph > *character_queue)
 
void updateTowardsData (const geometry_msgs::PoseStampedConstPtr &data)
 
- Public Member Functions inherited from rm_referee::TimeChangeGroupUi
 TimeChangeGroupUi (XmlRpc::XmlRpcValue &rpc_value, Base &base, const std::string &graph_name, std::deque< Graph > *graph_queue, std::deque< Graph > *character_queue)
 
void update () override
 
void updateForQueue () override
 
- Public Member Functions inherited from rm_referee::GroupUiBase
void add () override
 
void addForQueue (int add_times=1) override
 
void display (bool check_repeat=true) override
 
void display (const ros::Time &time) override
 
void displayTwice (bool check_repeat=true) override
 
void erasure () override
 
 GroupUiBase (XmlRpc::XmlRpcValue &rpc_value, Base &base, std::deque< Graph > *graph_queue=nullptr, std::deque< Graph > *character_queue=nullptr)
 
void sendDoubleGraph (const ros::Time &time, Graph *graph0, Graph *graph1)
 
void sendFiveGraph (const ros::Time &time, Graph *graph0, Graph *graph1, Graph *graph2, Graph *graph3, Graph *graph4)
 
void sendSevenGraph (const ros::Time &time, Graph *graph0, Graph *graph1, Graph *graph2, Graph *graph3, Graph *graph4, Graph *graph5, Graph *graph6)
 
void sendUi (const ros::Time &time) override
 
void update () override
 
void updateForQueue () override
 
 ~GroupUiBase ()=default
 
- Public Member Functions inherited from rm_referee::UiBase
void clearTxBuffer ()
 
void display (const ros::Time &time, bool state, bool once=false)
 
void pack (uint8_t *tx_buffer, uint8_t *data, int cmd_id, int len) const
 
void sendCharacter (const ros::Time &time, Graph *graph)
 
void sendSerial (const ros::Time &time, int data_len)
 
void sendSingleGraph (const ros::Time &time, Graph *graph)
 
 UiBase (XmlRpc::XmlRpcValue &rpc_value, Base &base, std::deque< Graph > *graph_queue=nullptr, std::deque< Graph > *character_queue=nullptr)
 
virtual void updateManualCmdData (const rm_msgs::ManualToReferee::ConstPtr data)
 
virtual void updateManualCmdData (const rm_msgs::ManualToReferee::ConstPtr data, const ros::Time &last_get_data_time)
 
 ~UiBase ()=default
 

Private Member Functions

void updateConfig () override
 

Private Attributes

double angle_
 
int left_line_x2_
 
int left_line_y2_
 
int mid_line_x1_
 
int mid_line_x2_
 
int mid_line_y1_
 
int mid_line_y2_
 
int ori_x_
 
int ori_y_
 
int right_line_x2_
 
int right_line_y2_
 

Additional Inherited Members

- Public Attributes inherited from rm_referee::UiBase
uint8_t tx_buffer_ [127]
 
int tx_len_
 
- Protected Attributes inherited from rm_referee::TimeChangeGroupUi
std::string graph_name_
 
- Protected Attributes inherited from rm_referee::GroupUiBase
std::map< std::string, Graph * > character_vector_
 
std::map< std::string, Graph * > graph_vector_
 
- Protected Attributes inherited from rm_referee::UiBase
Basebase_
 
std::deque< Graph > * character_queue_
 
ros::Duration delay_ = ros::Duration(0.)
 
Graphgraph_
 
std::deque< Graph > * graph_queue_
 
const int k_cmd_id_length_ = 2
 
const int k_frame_length_ = 128
 
const int k_header_length_ = 5
 
const int k_tail_length_ = 2
 
ros::Time last_send_
 
tf2_ros::Buffer tf_buffer_
 
tf2_ros::TransformListener tf_listener_
 
- Static Protected Attributes inherited from rm_referee::UiBase
static int id_
 

Detailed Description

Definition at line 319 of file time_change_ui.h.

Constructor & Destructor Documentation

◆ DroneTowardsTimeChangeGroupUi()

rm_referee::DroneTowardsTimeChangeGroupUi::DroneTowardsTimeChangeGroupUi ( XmlRpc::XmlRpcValue rpc_value,
Base base,
std::deque< Graph > *  graph_queue,
std::deque< Graph > *  character_queue 
)
inlineexplicit

Definition at line 322 of file time_change_ui.h.

Member Function Documentation

◆ updateConfig()

void rm_referee::DroneTowardsTimeChangeGroupUi::updateConfig ( )
overrideprivatevirtual

Reimplemented from rm_referee::TimeChangeGroupUi.

Definition at line 444 of file time_change_ui.cpp.

◆ updateTowardsData()

void rm_referee::DroneTowardsTimeChangeGroupUi::updateTowardsData ( const geometry_msgs::PoseStampedConstPtr &  data)

Definition at line 430 of file time_change_ui.cpp.

Member Data Documentation

◆ angle_

double rm_referee::DroneTowardsTimeChangeGroupUi::angle_
private

Definition at line 347 of file time_change_ui.h.

◆ left_line_x2_

int rm_referee::DroneTowardsTimeChangeGroupUi::left_line_x2_
private

Definition at line 348 of file time_change_ui.h.

◆ left_line_y2_

int rm_referee::DroneTowardsTimeChangeGroupUi::left_line_y2_
private

Definition at line 348 of file time_change_ui.h.

◆ mid_line_x1_

int rm_referee::DroneTowardsTimeChangeGroupUi::mid_line_x1_
private

Definition at line 348 of file time_change_ui.h.

◆ mid_line_x2_

int rm_referee::DroneTowardsTimeChangeGroupUi::mid_line_x2_
private

Definition at line 348 of file time_change_ui.h.

◆ mid_line_y1_

int rm_referee::DroneTowardsTimeChangeGroupUi::mid_line_y1_
private

Definition at line 348 of file time_change_ui.h.

◆ mid_line_y2_

int rm_referee::DroneTowardsTimeChangeGroupUi::mid_line_y2_
private

Definition at line 348 of file time_change_ui.h.

◆ ori_x_

int rm_referee::DroneTowardsTimeChangeGroupUi::ori_x_
private

Definition at line 346 of file time_change_ui.h.

◆ ori_y_

int rm_referee::DroneTowardsTimeChangeGroupUi::ori_y_
private

Definition at line 346 of file time_change_ui.h.

◆ right_line_x2_

int rm_referee::DroneTowardsTimeChangeGroupUi::right_line_x2_
private

Definition at line 348 of file time_change_ui.h.

◆ right_line_y2_

int rm_referee::DroneTowardsTimeChangeGroupUi::right_line_y2_
private

Definition at line 349 of file time_change_ui.h.


The documentation for this class was generated from the following files:


rm_referee
Author(s): Qiayuan Liao
autogenerated on Tue May 6 2025 02:23:49