ADORe
ADORe is a modular open source software library and toolkit for decision making, planning, control and simulation of automated vehicles
PlotLongControlInfo Class Reference
Collaboration diagram for PlotLongControlInfo:
Collaboration graph

Public Member Functions

 PlotLongControlInfo ()
 
void run ()
 

Private Member Functions

void receive_ax_ackermann_control_in (ackermann_msgs::AckermannDriveConstPtr msg)
 
void receive_ax_command (std_msgs::Float32ConstPtr msg)
 
void receive_ax_actual (std_msgs::Float32ConstPtr msg)
 
void receive_throttle_command (carla_msgs::CarlaEgoVehicleControlConstPtr msg)
 
void receive_odom (nav_msgs::OdometryConstPtr msg)
 
void do_plot ()
 

Private Attributes

double ax_ackermann_control_in_
 
std::string style_ax_ackermann_control_in_
 
double ax_command_
 
std::string style_ax_command_
 
double ax_actual_
 
std::string style_ax_actual_
 
double throttle_command_
 
std::string style_throttle_command_
 
double t_
 
double t0_
 
bool t0_set_
 
std::string namespace_carla_
 
ros::NodeHandle * n_
 
ros::Subscriber subscriber_ax_ackermann_control_in_
 
ros::Subscriber subscriber_ax_command_
 
ros::Subscriber subscriber_ax_actual_
 
ros::Subscriber subscriber_throttle_command_
 
ros::Subscriber subscriber_odom_
 
DLR_TS::PlotLab::AFigureStubfigure_
 

Constructor & Destructor Documentation

◆ PlotLongControlInfo()

PlotLongControlInfo::PlotLongControlInfo ( )
inline
Here is the call graph for this function:

Member Function Documentation

◆ do_plot()

void PlotLongControlInfo::do_plot ( )
inlineprivate
Here is the call graph for this function:
Here is the caller graph for this function:

◆ receive_ax_ackermann_control_in()

void PlotLongControlInfo::receive_ax_ackermann_control_in ( ackermann_msgs::AckermannDriveConstPtr  msg)
inlineprivate
Here is the caller graph for this function:

◆ receive_ax_actual()

void PlotLongControlInfo::receive_ax_actual ( std_msgs::Float32ConstPtr  msg)
inlineprivate
Here is the caller graph for this function:

◆ receive_ax_command()

void PlotLongControlInfo::receive_ax_command ( std_msgs::Float32ConstPtr  msg)
inlineprivate
Here is the caller graph for this function:

◆ receive_odom()

void PlotLongControlInfo::receive_odom ( nav_msgs::OdometryConstPtr  msg)
inlineprivate
Here is the call graph for this function:
Here is the caller graph for this function:

◆ receive_throttle_command()

void PlotLongControlInfo::receive_throttle_command ( carla_msgs::CarlaEgoVehicleControlConstPtr  msg)
inlineprivate
Here is the caller graph for this function:

◆ run()

void PlotLongControlInfo::run ( )
inline
Here is the caller graph for this function:

Member Data Documentation

◆ ax_ackermann_control_in_

double PlotLongControlInfo::ax_ackermann_control_in_
private

◆ ax_actual_

double PlotLongControlInfo::ax_actual_
private

◆ ax_command_

double PlotLongControlInfo::ax_command_
private

◆ figure_

DLR_TS::PlotLab::AFigureStub* PlotLongControlInfo::figure_
private

◆ n_

ros::NodeHandle* PlotLongControlInfo::n_
private

◆ namespace_carla_

std::string PlotLongControlInfo::namespace_carla_
private

◆ style_ax_ackermann_control_in_

std::string PlotLongControlInfo::style_ax_ackermann_control_in_
private

◆ style_ax_actual_

std::string PlotLongControlInfo::style_ax_actual_
private

◆ style_ax_command_

std::string PlotLongControlInfo::style_ax_command_
private

◆ style_throttle_command_

std::string PlotLongControlInfo::style_throttle_command_
private

◆ subscriber_ax_ackermann_control_in_

ros::Subscriber PlotLongControlInfo::subscriber_ax_ackermann_control_in_
private

◆ subscriber_ax_actual_

ros::Subscriber PlotLongControlInfo::subscriber_ax_actual_
private

◆ subscriber_ax_command_

ros::Subscriber PlotLongControlInfo::subscriber_ax_command_
private

◆ subscriber_odom_

ros::Subscriber PlotLongControlInfo::subscriber_odom_
private

◆ subscriber_throttle_command_

ros::Subscriber PlotLongControlInfo::subscriber_throttle_command_
private

◆ t0_

double PlotLongControlInfo::t0_
private

◆ t0_set_

bool PlotLongControlInfo::t0_set_
private

◆ t_

double PlotLongControlInfo::t_
private

◆ throttle_command_

double PlotLongControlInfo::throttle_command_
private

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