32 #include <sr_robot_msgs/UBI0All.h> 33 #include <sr_robot_msgs/UBI0.h> 34 #include <sr_robot_msgs/AuxSpiData.h> 35 #include <sr_robot_msgs/MidProxDataAll.h> 36 #include <sr_robot_msgs/MidProxData.h> 44 template<
class StatusType,
class CommandType>
49 UBI0(
ros::NodeHandle nh, std::string device_id, std::vector<generic_updater::UpdateConfig> update_configs_vector,
52 UBI0(
ros::NodeHandle nh, std::string device_id, std::vector<generic_updater::UpdateConfig> update_configs_vector,
59 void init(std::vector<generic_updater::UpdateConfig> update_configs_vector,
69 virtual void update(StatusType *status_data);
81 virtual void add_diagnostics(std::vector<diagnostic_msgs::DiagnosticStatus> &vec,
107 class UBI0<ETHERCAT_DATA_STRUCTURE_0200_PALM_EDC_STATUS, ETHERCAT_DATA_STRUCTURE_0200_PALM_EDC_COMMAND> :
109 ETHERCAT_DATA_STRUCTURE_0200_PALM_EDC_COMMAND>
112 UBI0(
ros::NodeHandle nh, std::string device_id, std::vector<generic_updater::UpdateConfig> update_configs_vector,
115 ETHERCAT_DATA_STRUCTURE_0200_PALM_EDC_COMMAND>(nh, device_id, update_configs_vector, update_state)
117 ROS_WARN(
"This UBI0 tactile object should not have been instantiated for this type of ETHERCAT_DATA_STRUCTURE. " 118 "Ignore this message if you are using a mockup tactile device.");
121 UBI0(
ros::NodeHandle nh, std::string device_id, std::vector<generic_updater::UpdateConfig> update_configs_vector,
125 ETHERCAT_DATA_STRUCTURE_0200_PALM_EDC_COMMAND>(nh, device_id, update_configs_vector, update_state)
127 ROS_WARN(
"This UBI0 tactile object should not have been instantiated for this type of ETHERCAT_DATA_STRUCTURE. " 128 "Ignore this message if you are using a mockup tactile device.");
137 class UBI0<ETHERCAT_DATA_STRUCTURE_0300_PALM_EDC_STATUS, ETHERCAT_DATA_STRUCTURE_0300_PALM_EDC_COMMAND> :
139 ETHERCAT_DATA_STRUCTURE_0300_PALM_EDC_COMMAND>
142 UBI0(
ros::NodeHandle nh, std::string device_id, std::vector<generic_updater::UpdateConfig> update_configs_vector,
145 ETHERCAT_DATA_STRUCTURE_0300_PALM_EDC_COMMAND>(nh, device_id, update_configs_vector, update_state)
147 ROS_WARN(
"This UBI0 tactile object should not have been instantiated for this type of ETHERCAT_DATA_STRUCTURE. " 148 "Ignore this message if you are using a mockup tactile device.");
151 UBI0(
ros::NodeHandle nh, std::string device_id, std::vector<generic_updater::UpdateConfig> update_configs_vector,
155 ETHERCAT_DATA_STRUCTURE_0300_PALM_EDC_COMMAND>(nh, device_id, update_configs_vector, update_state)
157 ROS_WARN(
"This UBI0 tactile object should not have been instantiated for this type of ETHERCAT_DATA_STRUCTURE. " 158 "Ignore this message if you are using a mockup tactile device.");
167 class UBI0<ETHERCAT_DATA_STRUCTURE_0240_PALM_EDC_STATUS, ETHERCAT_DATA_STRUCTURE_0240_PALM_EDC_COMMAND> :
169 ETHERCAT_DATA_STRUCTURE_0240_PALM_EDC_COMMAND>
172 UBI0(
ros::NodeHandle nh, std::string device_id, std::vector<generic_updater::UpdateConfig> update_configs_vector,
175 ETHERCAT_DATA_STRUCTURE_0240_PALM_EDC_COMMAND>(nh, device_id, update_configs_vector, update_state)
177 ROS_WARN(
"This UBI0 tactile object should not have been instantiated for this type of ETHERCAT_DATA_STRUCTURE. " 178 "Ignore this message if you are using a mockup tactile device.");
181 UBI0(
ros::NodeHandle nh, std::string device_id, std::vector<generic_updater::UpdateConfig> update_configs_vector,
185 ETHERCAT_DATA_STRUCTURE_0240_PALM_EDC_COMMAND>(nh, device_id, update_configs_vector, update_state)
187 ROS_WARN(
"This UBI0 tactile object should not have been instantiated for this type of ETHERCAT_DATA_STRUCTURE. " 188 "Ignore this message if you are using a mockup tactile device.");
UBI0(ros::NodeHandle nh, std::string device_id, std::vector< generic_updater::UpdateConfig > update_configs_vector, operation_mode::device_update_state::DeviceUpdateState update_state, boost::shared_ptr< std::vector< GenericTactileData > > init_tactiles_vector)
UBI0(ros::NodeHandle nh, std::string device_id, std::vector< generic_updater::UpdateConfig > update_configs_vector, operation_mode::device_update_state::DeviceUpdateState update_state)
virtual std::vector< AllTactileData > * get_tactile_data()
UBI0(ros::NodeHandle nh, std::string device_id, std::vector< generic_updater::UpdateConfig > update_configs_vector, operation_mode::device_update_state::DeviceUpdateState update_state)
virtual void update(StatusType *status_data)
void init(std::vector< generic_updater::UpdateConfig > update_configs_vector, operation_mode::device_update_state::DeviceUpdateState update_state)
boost::shared_ptr< UBI0PalmData > palm_tactiles
the object containing the data from the palm sensors
UBI0(ros::NodeHandle nh, std::string device_id, std::vector< generic_updater::UpdateConfig > update_configs_vector, operation_mode::device_update_state::DeviceUpdateState update_state)
UBI0(ros::NodeHandle nh, std::string device_id, std::vector< generic_updater::UpdateConfig > update_configs_vector, operation_mode::device_update_state::DeviceUpdateState update_state)
boost::shared_ptr< realtime_tools::RealtimePublisher< sr_robot_msgs::AuxSpiData > > aux_spi_publisher
boost::shared_ptr< std::vector< UBI0Data > > tactiles_vector
the vector containing the data for the tactiles.
UBI0(ros::NodeHandle nh, std::string device_id, std::vector< generic_updater::UpdateConfig > update_configs_vector, operation_mode::device_update_state::DeviceUpdateState update_state, boost::shared_ptr< std::vector< GenericTactileData > > init_tactiles_vector)
virtual void add_diagnostics(std::vector< diagnostic_msgs::DiagnosticStatus > &vec, diagnostic_updater::DiagnosticStatusWrapper &d)
UBI0(ros::NodeHandle nh, std::string device_id, std::vector< generic_updater::UpdateConfig > update_configs_vector, operation_mode::device_update_state::DeviceUpdateState update_state, boost::shared_ptr< std::vector< GenericTactileData > > init_tactiles_vector)