ADORe
ADORe is a modular open source software library and toolkit for decision making, planning, control and simulation of automated vehicles
adore_v2x_sim::Station Class Reference

#include <station.h>

Collaboration diagram for adore_v2x_sim::Station:
Collaboration graph

Public Member Functions

 Station (ros::NodeHandle n, std::string odom_topic)
 
void setPosition (double X, double Y, double Z)
 
void setTime (double t)
 
double getX () const
 
double getY () const
 
double getZ () const
 
double getT () const
 

Private Member Functions

void odom_receive (nav_msgs::OdometryConstPtr msg)
 

Private Attributes

double X_
 
double Y_
 
double Z_
 
double t_
 
ros::Subscriber odom_subscriber_
 

Detailed Description

Station tracks position and time of a v2x sender/receiver.

Constructor & Destructor Documentation

◆ Station()

adore_v2x_sim::Station::Station ( ros::NodeHandle  n,
std::string  odom_topic 
)
inline
Here is the call graph for this function:

Member Function Documentation

◆ getT()

double adore_v2x_sim::Station::getT ( ) const
inline
Here is the caller graph for this function:

◆ getX()

double adore_v2x_sim::Station::getX ( ) const
inline
Here is the caller graph for this function:

◆ getY()

double adore_v2x_sim::Station::getY ( ) const
inline
Here is the caller graph for this function:

◆ getZ()

double adore_v2x_sim::Station::getZ ( ) const
inline
Here is the caller graph for this function:

◆ odom_receive()

void adore_v2x_sim::Station::odom_receive ( nav_msgs::OdometryConstPtr  msg)
inlineprivate
Here is the caller graph for this function:

◆ setPosition()

void adore_v2x_sim::Station::setPosition ( double  X,
double  Y,
double  Z 
)
inline

◆ setTime()

void adore_v2x_sim::Station::setTime ( double  t)
inline

Member Data Documentation

◆ odom_subscriber_

ros::Subscriber adore_v2x_sim::Station::odom_subscriber_
private

◆ t_

double adore_v2x_sim::Station::t_
private

◆ X_

double adore_v2x_sim::Station::X_
private

◆ Y_

double adore_v2x_sim::Station::Y_
private

◆ Z_

double adore_v2x_sim::Station::Z_
private

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