Public Member Functions | Private Attributes | List of all members
stdr_robot::Sonar Class Reference

A class that provides co2 sensor implementation. \ Inherits publicly Sensor. More...

#include <sonar.h>

Inheritance diagram for stdr_robot::Sonar:
Inheritance graph
[legend]

Public Member Functions

 Sonar (const nav_msgs::OccupancyGrid &map, const stdr_msgs::SonarSensorMsg &msg, const std::string &name, ros::NodeHandle &n)
 Default constructor. More...
 
virtual void updateSensorCallback ()
 Updates the sensor measurements. More...
 
 ~Sonar (void)
 Default destructor. More...
 
- Public Member Functions inherited from stdr_robot::Sensor
std::string getFrameId (void) const
 Getter function for returning the sensor frame id. More...
 
geometry_msgs::Pose2D getSensorPose (void) const
 Getter function for returning the sensor pose relatively to robot. More...
 
virtual ~Sensor (void)
 Default destructor. More...
 

Private Attributes

stdr_msgs::SonarSensorMsg _description
 < Sonar sensor description More...
 

Additional Inherited Members

- Protected Member Functions inherited from stdr_robot::Sensor
void checkAndUpdateSensor (const ros::TimerEvent &ev)
 Checks if transform is available and calls updateSensorCallback() More...
 
 Sensor (const nav_msgs::OccupancyGrid &map, const std::string &name, ros::NodeHandle &n, const geometry_msgs::Pose2D &sensorPose, const std::string &sensorFrameId, float updateFrequency)
 Default constructor. More...
 
void updateTransform (const ros::TimerEvent &ev)
 Function for updating the sensor tf transform. More...
 
- Protected Attributes inherited from stdr_robot::Sensor
bool _gotTransform
 
const nav_msgs::OccupancyGrid & _map
 Sensor pose relative to robot. More...
 
const std::string & _namespace
 < The base for the sensor frame_id More...
 
ros::Publisher _publisher
 ROS tf listener. More...
 
const std::string _sensorFrameId
 A ROS timer for updating the sensor values. More...
 
const geometry_msgs::Pose2D _sensorPose
 Update frequency of _timer. More...
 
tf::StampedTransform _sensorTransform
 True if sensor got the _sensorTransform. More...
 
tf::TransformListener _tfListener
 ROS transform from sensor to map. More...
 
ros::Timer _tfTimer
 ROS publisher for posting the sensor measurements. More...
 
ros::Timer _timer
 A ROS timer for updating the sensor tf. More...
 
const float _updateFrequency
 Sensor frame id. More...
 

Detailed Description

A class that provides co2 sensor implementation. \ Inherits publicly Sensor.

A class that provides thermal sensor implementation. \ Inherits publicly Sensor.

A class that provides sonar implementation. Inherits publicly Sensor.

A class that provides sound sensor implementation. \ Inherits publicly Sensor.

Definition at line 39 of file sonar.h.

Constructor & Destructor Documentation

stdr_robot::Sonar::Sonar ( const nav_msgs::OccupancyGrid &  map,
const stdr_msgs::SonarSensorMsg &  msg,
const std::string &  name,
ros::NodeHandle n 
)

Default constructor.

Parameters
map[const nav_msgs::OccupancyGrid&] An occupancy grid map
msg[const stdr_msgs::SonarSensorMsg&] The sonar description message
name[const std::string&] The sensor frame id without the base
n[ros::NodeHandle&] The ROS node handle
Returns
void

Definition at line 34 of file sonar.cpp.

stdr_robot::Sonar::~Sonar ( void  )

Default destructor.

Returns
void

Definition at line 51 of file sonar.cpp.

Member Function Documentation

void stdr_robot::Sonar::updateSensorCallback ( void  )
virtual

Updates the sensor measurements.

Returns
void

Implements stdr_robot::Sensor.

Definition at line 60 of file sonar.cpp.

Member Data Documentation

stdr_msgs::SonarSensorMsg stdr_robot::Sonar::_description
private

< Sonar sensor description

Definition at line 70 of file sonar.h.


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


stdr_robot
Author(s): Manos Tsardoulias, Chris Zalidis, Aris Thallas
autogenerated on Mon Jun 10 2019 15:15:10