Public Member Functions | Protected Member Functions | Protected Attributes
cop::SensorNetworkRelay< SensorType, MessageType > Class Template Reference

#include <Sensor.h>

List of all members.

Public Member Functions

virtual MessageType ConvertData (Reading *img)=0
virtual std::string GetName () const
 SensorNetworkRelay ()
virtual ~SensorNetworkRelay ()

Protected Member Functions

virtual void PushBack (Reading *img)
virtual void PushBackAsync ()

Protected Attributes

bool m_bCameraInfo
sensor_msgs::CameraInfo m_cameraInfoMessage
Readingm_curPubReading
ros::Publisher m_pub
ros::Publisher m_pubCamInfo
int m_rate
int m_rateCounter
bool m_readyToPub
std::string m_stTopic

Detailed Description

template<class SensorType, class MessageType>
class cop::SensorNetworkRelay< SensorType, MessageType >

Definition at line 220 of file Sensor.h.


Constructor & Destructor Documentation

template<class SensorType , class MessageType >
cop::SensorNetworkRelay< SensorType, MessageType >::SensorNetworkRelay ( ) [inline]

Definition at line 226 of file Sensor.h.

template<class SensorType , class MessageType >
virtual cop::SensorNetworkRelay< SensorType, MessageType >::~SensorNetworkRelay ( ) [inline, virtual]

The destructor is virtual

Definition at line 236 of file Sensor.h.


Member Function Documentation

template<class SensorType , class MessageType >
virtual MessageType cop::SensorNetworkRelay< SensorType, MessageType >::ConvertData ( Reading img) [pure virtual]
template<class SensorType , class MessageType >
virtual std::string cop::SensorNetworkRelay< SensorType, MessageType >::GetName ( ) const [inline, virtual]

Get Type of the camera by its Name

Definition at line 248 of file Sensor.h.

template<class SensorType , class MessageType >
virtual void cop::SensorNetworkRelay< SensorType, MessageType >::PushBack ( Reading img) [inline, protected, virtual]

Definition at line 279 of file Sensor.h.

template<class SensorType , class MessageType >
virtual void cop::SensorNetworkRelay< SensorType, MessageType >::PushBackAsync ( ) [inline, protected, virtual]

Definition at line 252 of file Sensor.h.


Member Data Documentation

template<class SensorType , class MessageType >
bool cop::SensorNetworkRelay< SensorType, MessageType >::m_bCameraInfo [protected]

Definition at line 293 of file Sensor.h.

template<class SensorType , class MessageType >
sensor_msgs::CameraInfo cop::SensorNetworkRelay< SensorType, MessageType >::m_cameraInfoMessage [protected]

Definition at line 297 of file Sensor.h.

template<class SensorType , class MessageType >
Reading* cop::SensorNetworkRelay< SensorType, MessageType >::m_curPubReading [protected]

Definition at line 295 of file Sensor.h.

template<class SensorType , class MessageType >
ros::Publisher cop::SensorNetworkRelay< SensorType, MessageType >::m_pub [protected]

Definition at line 292 of file Sensor.h.

template<class SensorType , class MessageType >
ros::Publisher cop::SensorNetworkRelay< SensorType, MessageType >::m_pubCamInfo [protected]

Definition at line 296 of file Sensor.h.

template<class SensorType , class MessageType >
int cop::SensorNetworkRelay< SensorType, MessageType >::m_rate [protected]

Definition at line 298 of file Sensor.h.

template<class SensorType , class MessageType >
int cop::SensorNetworkRelay< SensorType, MessageType >::m_rateCounter [protected]

Definition at line 299 of file Sensor.h.

template<class SensorType , class MessageType >
bool cop::SensorNetworkRelay< SensorType, MessageType >::m_readyToPub [protected]

Definition at line 294 of file Sensor.h.

template<class SensorType , class MessageType >
std::string cop::SensorNetworkRelay< SensorType, MessageType >::m_stTopic [protected]

Definition at line 291 of file Sensor.h.


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


cognitive_perception
Author(s): Ulrich F Klank
autogenerated on Mon Oct 6 2014 10:48:46