Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
fastrack::sensor::Sensor< E, M, P > Class Template Referenceabstract

#include <sensor.h>

Public Member Functions

bool Initialize (const ros::NodeHandle &n)
 
virtual ~Sensor ()
 

Protected Member Functions

virtual bool LoadParameters (const ros::NodeHandle &n)
 
bool RegisterCallbacks (const ros::NodeHandle &n)
 
 Sensor ()
 
void TimerCallback (const ros::TimerEvent &e)
 
virtual void UpdateParameters ()=0
 
virtual void Visualize () const =0
 

Protected Attributes

env_
 
std::string fixed_frame_
 
bool initialized_
 
std::string name_
 
params_
 
std::string sensor_frame_
 
ros::Publisher sensor_pub_
 
std::string sensor_topic_
 
tf2_ros::Buffer tf_buffer_
 
tf2_ros::TransformListener tf_listener_
 
double time_step_
 
ros::Timer timer_
 
ros::Publisher vis_pub_
 
std::string vis_topic_
 

Detailed Description

template<typename E, typename M, typename P>
class fastrack::sensor::Sensor< E, M, P >

Definition at line 62 of file sensor.h.

Constructor & Destructor Documentation

template<typename E, typename M, typename P>
virtual fastrack::sensor::Sensor< E, M, P >::~Sensor ( )
inlinevirtual

Definition at line 64 of file sensor.h.

template<typename E, typename M, typename P>
fastrack::sensor::Sensor< E, M, P >::Sensor ( )
inlineexplicitprotected

Definition at line 70 of file sensor.h.

Member Function Documentation

template<typename E , typename M , typename P >
bool fastrack::sensor::Sensor< E, M, P >::Initialize ( const ros::NodeHandle &  n)

Definition at line 124 of file sensor.h.

template<typename E , typename M , typename P >
bool fastrack::sensor::Sensor< E, M, P >::LoadParameters ( const ros::NodeHandle &  n)
protectedvirtual

Reimplemented in fastrack::sensor::SphereSensor< E >.

Definition at line 150 of file sensor.h.

template<typename E , typename M , typename P >
bool fastrack::sensor::Sensor< E, M, P >::RegisterCallbacks ( const ros::NodeHandle &  n)
protected

Definition at line 169 of file sensor.h.

template<typename E , typename M , typename P >
void fastrack::sensor::Sensor< E, M, P >::TimerCallback ( const ros::TimerEvent &  e)
protected

Definition at line 188 of file sensor.h.

template<typename E, typename M, typename P>
virtual void fastrack::sensor::Sensor< E, M, P >::UpdateParameters ( )
protectedpure virtual
template<typename E, typename M, typename P>
virtual void fastrack::sensor::Sensor< E, M, P >::Visualize ( ) const
protectedpure virtual

Member Data Documentation

template<typename E, typename M, typename P>
E fastrack::sensor::Sensor< E, M, P >::env_
protected

Definition at line 91 of file sensor.h.

template<typename E, typename M, typename P>
std::string fastrack::sensor::Sensor< E, M, P >::fixed_frame_
protected

Definition at line 105 of file sensor.h.

template<typename E, typename M, typename P>
bool fastrack::sensor::Sensor< E, M, P >::initialized_
protected

Definition at line 117 of file sensor.h.

template<typename E, typename M, typename P>
std::string fastrack::sensor::Sensor< E, M, P >::name_
protected

Definition at line 116 of file sensor.h.

template<typename E, typename M, typename P>
P fastrack::sensor::Sensor< E, M, P >::params_
protected

Definition at line 94 of file sensor.h.

template<typename E, typename M, typename P>
std::string fastrack::sensor::Sensor< E, M, P >::sensor_frame_
protected

Definition at line 104 of file sensor.h.

template<typename E, typename M, typename P>
ros::Publisher fastrack::sensor::Sensor< E, M, P >::sensor_pub_
protected

Definition at line 98 of file sensor.h.

template<typename E, typename M, typename P>
std::string fastrack::sensor::Sensor< E, M, P >::sensor_topic_
protected

Definition at line 101 of file sensor.h.

template<typename E, typename M, typename P>
tf2_ros::Buffer fastrack::sensor::Sensor< E, M, P >::tf_buffer_
protected

Definition at line 108 of file sensor.h.

template<typename E, typename M, typename P>
tf2_ros::TransformListener fastrack::sensor::Sensor< E, M, P >::tf_listener_
protected

Definition at line 109 of file sensor.h.

template<typename E, typename M, typename P>
double fastrack::sensor::Sensor< E, M, P >::time_step_
protected

Definition at line 113 of file sensor.h.

template<typename E, typename M, typename P>
ros::Timer fastrack::sensor::Sensor< E, M, P >::timer_
protected

Definition at line 112 of file sensor.h.

template<typename E, typename M, typename P>
ros::Publisher fastrack::sensor::Sensor< E, M, P >::vis_pub_
protected

Definition at line 97 of file sensor.h.

template<typename E, typename M, typename P>
std::string fastrack::sensor::Sensor< E, M, P >::vis_topic_
protected

Definition at line 100 of file sensor.h.


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


fastrack
Author(s): David Fridovich-Keil
autogenerated on Mon Aug 3 2020 21:28:37