#include <sr_generic_tactile_sensor.hpp>
Public Member Functions | |
void | publish_all () |
SrTactileSensorManager () | |
~SrTactileSensorManager () | |
Protected Member Functions | |
std::vector< std::vector < std::string > > | get_all_names () |
Protected Attributes | |
ros::NodeHandle | n_tilde |
ros::Rate | publish_rate |
std::vector< boost::shared_ptr < SrGenericTactileSensor > > | tactile_sensors |
Definition at line 67 of file sr_generic_tactile_sensor.hpp.
shadowrobot::SrTactileSensorManager::SrTactileSensorManager | ( | ) |
Definition at line 57 of file sr_generic_tactile_sensor.cpp.
shadowrobot::SrTactileSensorManager::~SrTactileSensorManager | ( | ) |
Definition at line 65 of file sr_generic_tactile_sensor.cpp.
std::vector< std::vector< std::string > > shadowrobot::SrTactileSensorManager::get_all_names | ( | ) | [protected] |
Get all the necessary names for the tactile sensors: the display names, the touch sensor name (for the robot).
Those names are read from the parameter server. They are stored in params/sensor_names.yaml
Definition at line 68 of file sr_generic_tactile_sensor.cpp.
void shadowrobot::SrTactileSensorManager::publish_all | ( | ) |
Calls the publish_current_values for each of the tactile sensors.
Definition at line 127 of file sr_generic_tactile_sensor.cpp.
ros::NodeHandle shadowrobot::SrTactileSensorManager::n_tilde [protected] |
Definition at line 81 of file sr_generic_tactile_sensor.hpp.
ros::Rate shadowrobot::SrTactileSensorManager::publish_rate [protected] |
Definition at line 82 of file sr_generic_tactile_sensor.hpp.
std::vector<boost::shared_ptr<SrGenericTactileSensor> > shadowrobot::SrTactileSensorManager::tactile_sensors [protected] |
Definition at line 80 of file sr_generic_tactile_sensor.hpp.