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

Public Member Functions

void receive_position (nav_msgs::OdometryConstPtr msg)
 
void init (int argc, char **argv, double rate, std::string nodename)
 
bool isInArea (int &connection_id, int &intersection_id)
 
void send_srem ()
 
void run ()
 
double getTime ()
 
double getSecondOfYearFromUTC ()
 
int getDSecond ()
 
void setDebugMode (DEBUGMODE input)
 
DEBUGMODE getDebugMode ()
 

Private Attributes

ros::Publisher srem_publisher_
 
ros::Subscriber state_subscriber_
 
ros::NodeHandle * nh_
 
dsrc_v2_srem_pdu_descriptions::SREM srem_
 
std::vector< std::vector< double > > srem_zones_
 
int request_counter_
 
DEBUGMODE debug_mode_
 
DEBUGMODE last_debug_mode_
 
double rate_
 
double x_
 
double y_
 
double z_
 
double t_
 
bool position_initialized_
 

Member Function Documentation

◆ getDebugMode()

DEBUGMODE adore::if_ROS::SREMGenerator::getDebugMode ( )
inline
Here is the caller graph for this function:

◆ getDSecond()

int adore::if_ROS::SREMGenerator::getDSecond ( )
inline
Here is the call graph for this function:
Here is the caller graph for this function:

◆ getSecondOfYearFromUTC()

double adore::if_ROS::SREMGenerator::getSecondOfYearFromUTC ( )
inline
Here is the caller graph for this function:

◆ getTime()

double adore::if_ROS::SREMGenerator::getTime ( )
inline
Here is the caller graph for this function:

◆ init()

void adore::if_ROS::SREMGenerator::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:

◆ isInArea()

bool adore::if_ROS::SREMGenerator::isInArea ( int &  connection_id,
int &  intersection_id 
)
inline
Here is the caller graph for this function:

◆ receive_position()

void adore::if_ROS::SREMGenerator::receive_position ( nav_msgs::OdometryConstPtr  msg)
inline
Here is the caller graph for this function:

◆ run()

void adore::if_ROS::SREMGenerator::run ( )
inline
Here is the call graph for this function:
Here is the caller graph for this function:

◆ send_srem()

void adore::if_ROS::SREMGenerator::send_srem ( )
inline
Here is the call graph for this function:
Here is the caller graph for this function:

◆ setDebugMode()

void adore::if_ROS::SREMGenerator::setDebugMode ( DEBUGMODE  input)
inline
Here is the caller graph for this function:

Member Data Documentation

◆ debug_mode_

DEBUGMODE adore::if_ROS::SREMGenerator::debug_mode_
private

◆ last_debug_mode_

DEBUGMODE adore::if_ROS::SREMGenerator::last_debug_mode_
private

◆ nh_

ros::NodeHandle* adore::if_ROS::SREMGenerator::nh_
private

◆ position_initialized_

bool adore::if_ROS::SREMGenerator::position_initialized_
private

◆ rate_

double adore::if_ROS::SREMGenerator::rate_
private

◆ request_counter_

int adore::if_ROS::SREMGenerator::request_counter_
private

◆ srem_

dsrc_v2_srem_pdu_descriptions::SREM adore::if_ROS::SREMGenerator::srem_
private

◆ srem_publisher_

ros::Publisher adore::if_ROS::SREMGenerator::srem_publisher_
private

◆ srem_zones_

std::vector<std::vector<double> > adore::if_ROS::SREMGenerator::srem_zones_
private

◆ state_subscriber_

ros::Subscriber adore::if_ROS::SREMGenerator::state_subscriber_
private

◆ t_

double adore::if_ROS::SREMGenerator::t_
private

◆ x_

double adore::if_ROS::SREMGenerator::x_
private

◆ y_

double adore::if_ROS::SREMGenerator::y_
private

◆ z_

double adore::if_ROS::SREMGenerator::z_
private

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