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

#include <indicatorcommandconverter.h>

Inheritance diagram for adore::if_ROS::IndicatorCommandReader:
Inheritance graph
Collaboration diagram for adore::if_ROS::IndicatorCommandReader:
Collaboration graph

Public Member Functions

 IndicatorCommandReader (ros::NodeHandle *n, const std::string &topic_leftIndicator, const std::string &topic_rightIndicator, int qsize)
 
virtual bool hasData () const override
 
bool hasUpdate () const override
 
virtual void getData (adore::fun::IndicatorCommand &value) override
 
- Public Member Functions inherited from adore::mad::AReader< adore::fun::IndicatorCommand >
virtual std::string getDesc ()
 

Private Member Functions

void receive_left (std_msgs::BoolConstPtr msg)
 
void receive_right (std_msgs::BoolConstPtr msg)
 

Private Attributes

adore::fun::IndicatorCommand data_
 
ros::Subscriber leftIndicatorSubscriber_
 
ros::Subscriber rightIndicatorSubscriber_
 
bool changed_
 

Detailed Description

ROS specific implementation of AReader for adore::fun::IndicatorCommand. Receives ROS std_msgs::Bool and creates adore::fun::IndicatorCommand.

Constructor & Destructor Documentation

◆ IndicatorCommandReader()

adore::if_ROS::IndicatorCommandReader::IndicatorCommandReader ( ros::NodeHandle *  n,
const std::string &  topic_leftIndicator,
const std::string &  topic_rightIndicator,
int  qsize 
)
inline
Here is the call graph for this function:

Member Function Documentation

◆ getData()

virtual void adore::if_ROS::IndicatorCommandReader::getData ( adore::fun::IndicatorCommand value)
inlineoverridevirtual

getData returns the latest data item

Implements adore::mad::AReader< adore::fun::IndicatorCommand >.

◆ hasData()

virtual bool adore::if_ROS::IndicatorCommandReader::hasData ( ) const
inlineoverridevirtual

hasData indicates whether the data has been initialized with a first data item

Implements adore::mad::AReader< adore::fun::IndicatorCommand >.

Here is the caller graph for this function:

◆ hasUpdate()

bool adore::if_ROS::IndicatorCommandReader::hasUpdate ( ) const
inlineoverridevirtual

hasUpdate indicates whether the data item was updated since last getdata

Implements adore::mad::AReader< adore::fun::IndicatorCommand >.

Here is the call graph for this function:

◆ receive_left()

void adore::if_ROS::IndicatorCommandReader::receive_left ( std_msgs::BoolConstPtr  msg)
inlineprivate
Here is the call graph for this function:
Here is the caller graph for this function:

◆ receive_right()

void adore::if_ROS::IndicatorCommandReader::receive_right ( std_msgs::BoolConstPtr  msg)
inlineprivate
Here is the call graph for this function:
Here is the caller graph for this function:

Member Data Documentation

◆ changed_

bool adore::if_ROS::IndicatorCommandReader::changed_
private

◆ data_

adore::fun::IndicatorCommand adore::if_ROS::IndicatorCommandReader::data_
private

◆ leftIndicatorSubscriber_

ros::Subscriber adore::if_ROS::IndicatorCommandReader::leftIndicatorSubscriber_
private

◆ rightIndicatorSubscriber_

ros::Subscriber adore::if_ROS::IndicatorCommandReader::rightIndicatorSubscriber_
private

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