Public Member Functions | Private Attributes
Sensor Class Reference

List of all members.

Public Member Functions

int getId () const
 operator sensor_msgs::Range () const
void publish ()
 Sensor (const std::string &fr_id, const int id, const int filter_size=10)
void update (const int v)

Private Attributes

int filter_size_
std::string frame_id_
int id_
ros::NodeHandle n_
ros::Publisher pub_range_
std::list< int > vals_

Detailed Description

Definition at line 12 of file phidgets_range_sensors.cpp.


Constructor & Destructor Documentation

Sensor::Sensor ( const std::string &  fr_id,
const int  id,
const int  filter_size = 10 
) [inline]

Definition at line 21 of file phidgets_range_sensors.cpp.


Member Function Documentation

int Sensor::getId ( ) const [inline]

Definition at line 56 of file phidgets_range_sensors.cpp.

Sensor::operator sensor_msgs::Range ( ) const [inline]

Definition at line 34 of file phidgets_range_sensors.cpp.

void Sensor::publish ( ) [inline]

Definition at line 29 of file phidgets_range_sensors.cpp.

void Sensor::update ( const int  v) [inline]

Definition at line 61 of file phidgets_range_sensors.cpp.


Member Data Documentation

int Sensor::filter_size_ [private]

Definition at line 16 of file phidgets_range_sensors.cpp.

std::string Sensor::frame_id_ [private]

Definition at line 18 of file phidgets_range_sensors.cpp.

int Sensor::id_ [private]

Definition at line 16 of file phidgets_range_sensors.cpp.

Definition at line 14 of file phidgets_range_sensors.cpp.

Definition at line 15 of file phidgets_range_sensors.cpp.

std::list<int> Sensor::vals_ [private]

Definition at line 17 of file phidgets_range_sensors.cpp.


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


cob_phidgets
Author(s): Florian Weisshardt, Benjamin Maidel
autogenerated on Sun Oct 5 2014 23:10:20