#include <sr_virtual_tactile_sensor.hpp>
Public Member Functions | |
SrVirtualTactileSensorManager () | |
~SrVirtualTactileSensorManager () | |
Public Member Functions inherited from shadowrobot::SrTactileSensorManager | |
void | publish_all () |
SrTactileSensorManager () | |
~SrTactileSensorManager () | |
Additional Inherited Members | |
Protected Member Functions inherited from shadowrobot::SrTactileSensorManager | |
std::vector< std::vector< std::string > > | get_all_names () |
bool | is_hand_occupied_cb (sr_robot_msgs::is_hand_occupied::Request &req, sr_robot_msgs::is_hand_occupied::Response &res) |
bool | which_fingers_are_touching_cb (sr_robot_msgs::which_fingers_are_touching::Request &req, sr_robot_msgs::which_fingers_are_touching::Response &res) |
Protected Attributes inherited from shadowrobot::SrTactileSensorManager | |
ros::ServiceServer | is_hand_occupied_server |
std::vector< double > | is_hand_occupied_thresholds |
ros::NodeHandle | n_tilde |
ros::Rate | publish_rate |
std::vector< boost::shared_ptr< SrGenericTactileSensor > > | tactile_sensors |
ros::ServiceServer | which_fingers_are_touching_server |
Definition at line 97 of file sr_virtual_tactile_sensor.hpp.
shadowrobot::SrVirtualTactileSensorManager::SrVirtualTactileSensorManager | ( | ) |
Definition at line 109 of file sr_virtual_tactile_sensor.cpp.
shadowrobot::SrVirtualTactileSensorManager::~SrVirtualTactileSensorManager | ( | ) |
Definition at line 123 of file sr_virtual_tactile_sensor.cpp.