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

Public Member Functions

 AckermannCommand2Carla ()
 
void init (int argc, char **argv, double rate, std::string nodename)
 
void run ()
 

Private Member Functions

void initSim ()
 
ros::NodeHandle * getRosNodeHandle ()
 
void initROSConnections ()
 
void receiveAccelerationCommand (const std_msgs::Float32ConstPtr &in_msg)
 
void receiveSteeringCommand (const std_msgs::Float32ConstPtr &in_msg)
 
void receiveAx (const std_msgs::Float32ConstPtr &in_msg)
 
void receiveDelta (const std_msgs::Float32ConstPtr &in_msg)
 
void receiveOdom (const nav_msgs::OdometryConstPtr &in_msg)
 
void receiveSPR (const adore_if_ros_msg::SetPointRequestConstPtr &in_msg)
 
void transmitControlCommand ()
 

Private Attributes

std::string namespace_carla_
 
ros::Subscriber subscriber_acceleration_command_
 
ros::Subscriber subscriber_steering_command_
 
ros::Subscriber subscriber_current_acceleration_
 
ros::Subscriber subscriber_current_steeringAngle_
 
ros::Subscriber subscriber_odom_
 
ros::Subscriber subscriber_vehicle_info_
 
ros::Subscriber subscriber_vehicle_status_
 
ros::Subscriber subscriber_spr_
 
ros::Publisher publisher_ackermann_command_
 
double acceleration_command_
 
double steering_command_
 
double current_acceleration_
 
double current_steeringAngle_
 
double current_vx_
 
double current_time_
 
bool b_received_acc_
 
bool b_received_steer_
 
adore_if_ros_msg::SetPointRequest last_spr_
 
ros::NodeHandle * n_
 

Constructor & Destructor Documentation

◆ AckermannCommand2Carla()

adore::adore_if_carla::AckermannCommand2Carla::AckermannCommand2Carla ( )
inline

Member Function Documentation

◆ getRosNodeHandle()

ros::NodeHandle* adore::adore_if_carla::AckermannCommand2Carla::getRosNodeHandle ( )
inlineprivate
Here is the caller graph for this function:

◆ init()

void adore::adore_if_carla::AckermannCommand2Carla::init ( int  argc,
char **  argv,
double  rate,
std::string  nodename 
)
inline
Here is the call graph for this function:
Here is the caller graph for this function:

◆ initROSConnections()

void adore::adore_if_carla::AckermannCommand2Carla::initROSConnections ( )
inlineprivate
Here is the call graph for this function:
Here is the caller graph for this function:

◆ initSim()

void adore::adore_if_carla::AckermannCommand2Carla::initSim ( )
inlineprivate
Here is the caller graph for this function:

◆ receiveAccelerationCommand()

void adore::adore_if_carla::AckermannCommand2Carla::receiveAccelerationCommand ( const std_msgs::Float32ConstPtr &  in_msg)
inlineprivate
Here is the call graph for this function:
Here is the caller graph for this function:

◆ receiveAx()

void adore::adore_if_carla::AckermannCommand2Carla::receiveAx ( const std_msgs::Float32ConstPtr &  in_msg)
inlineprivate
Here is the caller graph for this function:

◆ receiveDelta()

void adore::adore_if_carla::AckermannCommand2Carla::receiveDelta ( const std_msgs::Float32ConstPtr &  in_msg)
inlineprivate
Here is the caller graph for this function:

◆ receiveOdom()

void adore::adore_if_carla::AckermannCommand2Carla::receiveOdom ( const nav_msgs::OdometryConstPtr &  in_msg)
inlineprivate
Here is the caller graph for this function:

◆ receiveSPR()

void adore::adore_if_carla::AckermannCommand2Carla::receiveSPR ( const adore_if_ros_msg::SetPointRequestConstPtr &  in_msg)
inlineprivate
Here is the caller graph for this function:

◆ receiveSteeringCommand()

void adore::adore_if_carla::AckermannCommand2Carla::receiveSteeringCommand ( const std_msgs::Float32ConstPtr &  in_msg)
inlineprivate
Here is the call graph for this function:
Here is the caller graph for this function:

◆ run()

void adore::adore_if_carla::AckermannCommand2Carla::run ( )
inline
Here is the caller graph for this function:

◆ transmitControlCommand()

void adore::adore_if_carla::AckermannCommand2Carla::transmitControlCommand ( )
inlineprivate
Here is the call graph for this function:
Here is the caller graph for this function:

Member Data Documentation

◆ acceleration_command_

double adore::adore_if_carla::AckermannCommand2Carla::acceleration_command_
private

◆ b_received_acc_

bool adore::adore_if_carla::AckermannCommand2Carla::b_received_acc_
private

◆ b_received_steer_

bool adore::adore_if_carla::AckermannCommand2Carla::b_received_steer_
private

◆ current_acceleration_

double adore::adore_if_carla::AckermannCommand2Carla::current_acceleration_
private

◆ current_steeringAngle_

double adore::adore_if_carla::AckermannCommand2Carla::current_steeringAngle_
private

◆ current_time_

double adore::adore_if_carla::AckermannCommand2Carla::current_time_
private

◆ current_vx_

double adore::adore_if_carla::AckermannCommand2Carla::current_vx_
private

◆ last_spr_

adore_if_ros_msg::SetPointRequest adore::adore_if_carla::AckermannCommand2Carla::last_spr_
private

◆ n_

ros::NodeHandle* adore::adore_if_carla::AckermannCommand2Carla::n_
private

◆ namespace_carla_

std::string adore::adore_if_carla::AckermannCommand2Carla::namespace_carla_
private

◆ publisher_ackermann_command_

ros::Publisher adore::adore_if_carla::AckermannCommand2Carla::publisher_ackermann_command_
private

◆ steering_command_

double adore::adore_if_carla::AckermannCommand2Carla::steering_command_
private

◆ subscriber_acceleration_command_

ros::Subscriber adore::adore_if_carla::AckermannCommand2Carla::subscriber_acceleration_command_
private

◆ subscriber_current_acceleration_

ros::Subscriber adore::adore_if_carla::AckermannCommand2Carla::subscriber_current_acceleration_
private

◆ subscriber_current_steeringAngle_

ros::Subscriber adore::adore_if_carla::AckermannCommand2Carla::subscriber_current_steeringAngle_
private

◆ subscriber_odom_

ros::Subscriber adore::adore_if_carla::AckermannCommand2Carla::subscriber_odom_
private

◆ subscriber_spr_

ros::Subscriber adore::adore_if_carla::AckermannCommand2Carla::subscriber_spr_
private

◆ subscriber_steering_command_

ros::Subscriber adore::adore_if_carla::AckermannCommand2Carla::subscriber_steering_command_
private

◆ subscriber_vehicle_info_

ros::Subscriber adore::adore_if_carla::AckermannCommand2Carla::subscriber_vehicle_info_
private

◆ subscriber_vehicle_status_

ros::Subscriber adore::adore_if_carla::AckermannCommand2Carla::subscriber_vehicle_status_
private

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