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::ControlCommand2Carla Class Reference
Collaboration diagram for adore::adore_if_carla::ControlCommand2Carla:
Collaboration graph

Public Member Functions

 ControlCommand2Carla ()
 
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 receiveVehicleInfo (const carla_msgs::CarlaEgoVehicleInfoConstPtr &in_msg)
 
void receiveVehicleStatus (const carla_msgs::CarlaEgoVehicleStatusConstPtr &in_msg)
 
void transmitControlCommand (const ros::TimerEvent &te)
 
double getSteeringGain ()
 
double getAccelerationErrorIGain ()
 

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::Publisher publisher_control_command_
 
double acceleration_command_
 
double steering_command_
 
double current_acceleration_
 
double current_steeringAngle_
 
double integrator_error_ax_
 
double integrator_error_delta_
 
double last_error_ax_
 
double last_error_delta_
 
double last_throttle_
 
double current_vx_
 
carla_msgs::CarlaEgoVehicleInfo carla_ego_vehicle_info_
 
carla_msgs::CarlaEgoVehicleStatus carla_ego_vehicle_status_
 
double carla_ego_vehicle_max_steer_angle_
 
ros::NodeHandle * n_
 
ros::Timer transmitControlCommandTimer_
 

Constructor & Destructor Documentation

◆ ControlCommand2Carla()

adore::adore_if_carla::ControlCommand2Carla::ControlCommand2Carla ( )
inline

Member Function Documentation

◆ getAccelerationErrorIGain()

double adore::adore_if_carla::ControlCommand2Carla::getAccelerationErrorIGain ( )
inlineprivate
Here is the caller graph for this function:

◆ getRosNodeHandle()

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

◆ getSteeringGain()

double adore::adore_if_carla::ControlCommand2Carla::getSteeringGain ( )
inlineprivate
Here is the caller graph for this function:

◆ init()

void adore::adore_if_carla::ControlCommand2Carla::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::ControlCommand2Carla::initROSConnections ( )
inlineprivate
Here is the call graph for this function:
Here is the caller graph for this function:

◆ initSim()

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

◆ receiveAccelerationCommand()

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

◆ receiveAx()

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

◆ receiveDelta()

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

◆ receiveOdom()

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

◆ receiveSteeringCommand()

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

◆ receiveVehicleInfo()

void adore::adore_if_carla::ControlCommand2Carla::receiveVehicleInfo ( const carla_msgs::CarlaEgoVehicleInfoConstPtr &  in_msg)
inlineprivate
Here is the caller graph for this function:

◆ receiveVehicleStatus()

void adore::adore_if_carla::ControlCommand2Carla::receiveVehicleStatus ( const carla_msgs::CarlaEgoVehicleStatusConstPtr &  in_msg)
inlineprivate
Here is the caller graph for this function:

◆ run()

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

◆ transmitControlCommand()

void adore::adore_if_carla::ControlCommand2Carla::transmitControlCommand ( const ros::TimerEvent &  te)
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::ControlCommand2Carla::acceleration_command_
private

◆ carla_ego_vehicle_info_

carla_msgs::CarlaEgoVehicleInfo adore::adore_if_carla::ControlCommand2Carla::carla_ego_vehicle_info_
private

◆ carla_ego_vehicle_max_steer_angle_

double adore::adore_if_carla::ControlCommand2Carla::carla_ego_vehicle_max_steer_angle_
private

◆ carla_ego_vehicle_status_

carla_msgs::CarlaEgoVehicleStatus adore::adore_if_carla::ControlCommand2Carla::carla_ego_vehicle_status_
private

◆ current_acceleration_

double adore::adore_if_carla::ControlCommand2Carla::current_acceleration_
private

◆ current_steeringAngle_

double adore::adore_if_carla::ControlCommand2Carla::current_steeringAngle_
private

◆ current_vx_

double adore::adore_if_carla::ControlCommand2Carla::current_vx_
private

◆ integrator_error_ax_

double adore::adore_if_carla::ControlCommand2Carla::integrator_error_ax_
private

◆ integrator_error_delta_

double adore::adore_if_carla::ControlCommand2Carla::integrator_error_delta_
private

◆ last_error_ax_

double adore::adore_if_carla::ControlCommand2Carla::last_error_ax_
private

◆ last_error_delta_

double adore::adore_if_carla::ControlCommand2Carla::last_error_delta_
private

◆ last_throttle_

double adore::adore_if_carla::ControlCommand2Carla::last_throttle_
private

◆ n_

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

◆ namespace_carla_

std::string adore::adore_if_carla::ControlCommand2Carla::namespace_carla_
private

◆ publisher_control_command_

ros::Publisher adore::adore_if_carla::ControlCommand2Carla::publisher_control_command_
private

◆ steering_command_

double adore::adore_if_carla::ControlCommand2Carla::steering_command_
private

◆ subscriber_acceleration_command_

ros::Subscriber adore::adore_if_carla::ControlCommand2Carla::subscriber_acceleration_command_
private

◆ subscriber_current_acceleration_

ros::Subscriber adore::adore_if_carla::ControlCommand2Carla::subscriber_current_acceleration_
private

◆ subscriber_current_steeringAngle_

ros::Subscriber adore::adore_if_carla::ControlCommand2Carla::subscriber_current_steeringAngle_
private

◆ subscriber_odom_

ros::Subscriber adore::adore_if_carla::ControlCommand2Carla::subscriber_odom_
private

◆ subscriber_steering_command_

ros::Subscriber adore::adore_if_carla::ControlCommand2Carla::subscriber_steering_command_
private

◆ subscriber_vehicle_info_

ros::Subscriber adore::adore_if_carla::ControlCommand2Carla::subscriber_vehicle_info_
private

◆ subscriber_vehicle_status_

ros::Subscriber adore::adore_if_carla::ControlCommand2Carla::subscriber_vehicle_status_
private

◆ transmitControlCommandTimer_

ros::Timer adore::adore_if_carla::ControlCommand2Carla::transmitControlCommandTimer_
private

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