#include <sr_generic_tactile_sensor.hpp>
Public Member Functions | |
void | publish_current_values () |
SrGenericTactileSensor (std::string name, std::string touch_name) | |
~SrGenericTactileSensor () | |
Protected Member Functions | |
virtual double | get_touch_data ()=0 |
Private Attributes | |
std_msgs::Float64 | msg_touch |
ros::NodeHandle | n_tilde |
ros::Publisher | touch_pub |
std::string | touch_sensor_name |
Definition at line 40 of file sr_generic_tactile_sensor.hpp.
shadowrobot::SrGenericTactileSensor::SrGenericTactileSensor | ( | std::string | name, | |
std::string | touch_name | |||
) |
Definition at line 35 of file sr_generic_tactile_sensor.cpp.
shadowrobot::SrGenericTactileSensor::~SrGenericTactileSensor | ( | ) |
Definition at line 44 of file sr_generic_tactile_sensor.cpp.
virtual double shadowrobot::SrGenericTactileSensor::get_touch_data | ( | ) | [protected, pure virtual] |
Needs to be implemented in the inheriting class
Implemented in shadowrobot::SrGazeboVirtualTactileSensor, shadowrobot::SrRealTactileSensor, and shadowrobot::SrVirtualTactileSensor.
void shadowrobot::SrGenericTactileSensor::publish_current_values | ( | ) |
publish the current values to the correct ros topics
Definition at line 47 of file sr_generic_tactile_sensor.cpp.
std_msgs::Float64 shadowrobot::SrGenericTactileSensor::msg_touch [private] |
Definition at line 64 of file sr_generic_tactile_sensor.hpp.
ros::NodeHandle shadowrobot::SrGenericTactileSensor::n_tilde [private] |
Definition at line 62 of file sr_generic_tactile_sensor.hpp.
ros::Publisher shadowrobot::SrGenericTactileSensor::touch_pub [private] |
Definition at line 61 of file sr_generic_tactile_sensor.hpp.
std::string shadowrobot::SrGenericTactileSensor::touch_sensor_name [private] |
Definition at line 63 of file sr_generic_tactile_sensor.hpp.