This is a generic parent class for the tactile sensors used in the Shadow Robot Dextrous Hand. It implements virtual tactile sensors and is extended in sr_real_tactile_sensor.hpp to implement the connection to real sensors. More...
#include <ros/ros.h>#include <boost/smart_ptr.hpp>#include <string>#include <vector>#include <std_msgs/Float64.h>#include <XmlRpcValue.h>#include <sr_robot_msgs/is_hand_occupied.h>#include <sr_robot_msgs/which_fingers_are_touching.h>

Go to the source code of this file.
Classes | |
| class | shadowrobot::SrGenericTactileSensor |
| class | shadowrobot::SrTactileSensorManager |
Namespaces | |
| shadowrobot | |
This is a generic parent class for the tactile sensors used in the Shadow Robot Dextrous Hand. It implements virtual tactile sensors and is extended in sr_real_tactile_sensor.hpp to implement the connection to real sensors.
Definition in file sr_generic_tactile_sensor.hpp.