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

#include <vehiclebasemeasurementwriter.h>

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

Public Member Functions

 VehicleBaseMeasurementWriter (ros::NodeHandle *n, const std::string steering_topic, const std::string wheel_speed_topic, const std::string yawrate_esp_topic, const std::string ax_esp_topic, const std::string ay_esp_topic, int qsize)
 
virtual bool canWriteMore () const override
 canWriteMore indicates whether more data can be written More...
 
virtual void write (const adore::fun::VehicleBaseMeasurement &value) override
 write sends out data value More...
 
- Public Member Functions inherited from adore::mad::AWriter< adore::fun::VehicleBaseMeasurement >
virtual std::string getDesc ()
 
virtual uint32_t getNumberOfSubscribers () const
 

Private Attributes

ros::Publisher steering_angle_pub_
 
ros::Publisher wheel_speed_pub_
 
ros::Publisher yawrate_esp_pub_
 
ros::Publisher ax_esp_pub_
 
ros::Publisher ay_esp_pub_
 

Detailed Description

ROS specific implementation of AWriter for adore::fun::VehicleBaseMeasurement. Transmits adore::fun::VehicleBaseMeasurement by sending the following ROS messages: measured steering wheel angle in rad:

std_msgs::Float32 /vehicleXY/VEH/steering_angle_measured

wheel speeds (speed above ground in m/s), FL,RL,RR,FR (TODO)

std_msgs::Float32MultiArray /vehicleXY/VEH/wheel_speed yaw-rate measured by ESP (rad/s) (TODO)

std_msgs::Float32 /vehicleXY/VEH/yaw_rate

acceleration measured by ESP (m/s², ax, ay TODO, az TODO)

std_msgs::Float32 /vehicleXY/VEH/ax

Constructor & Destructor Documentation

◆ VehicleBaseMeasurementWriter()

adore::if_ROS::VehicleBaseMeasurementWriter::VehicleBaseMeasurementWriter ( ros::NodeHandle *  n,
const std::string  steering_topic,
const std::string  wheel_speed_topic,
const std::string  yawrate_esp_topic,
const std::string  ax_esp_topic,
const std::string  ay_esp_topic,
int  qsize 
)
inline

Member Function Documentation

◆ canWriteMore()

virtual bool adore::if_ROS::VehicleBaseMeasurementWriter::canWriteMore ( ) const
inlineoverridevirtual

canWriteMore indicates whether more data can be written

Implements adore::mad::AWriter< adore::fun::VehicleBaseMeasurement >.

◆ write()

virtual void adore::if_ROS::VehicleBaseMeasurementWriter::write ( const adore::fun::VehicleBaseMeasurement value)
inlineoverridevirtual

write sends out data value

Implements adore::mad::AWriter< adore::fun::VehicleBaseMeasurement >.

Here is the call graph for this function:

Member Data Documentation

◆ ax_esp_pub_

ros::Publisher adore::if_ROS::VehicleBaseMeasurementWriter::ax_esp_pub_
private

◆ ay_esp_pub_

ros::Publisher adore::if_ROS::VehicleBaseMeasurementWriter::ay_esp_pub_
private

◆ steering_angle_pub_

ros::Publisher adore::if_ROS::VehicleBaseMeasurementWriter::steering_angle_pub_
private

◆ wheel_speed_pub_

ros::Publisher adore::if_ROS::VehicleBaseMeasurementWriter::wheel_speed_pub_
private

◆ yawrate_esp_pub_

ros::Publisher adore::if_ROS::VehicleBaseMeasurementWriter::yawrate_esp_pub_
private

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