sr_biotac_tactile_sensor_publisher.hpp
Go to the documentation of this file.
1 /*
2 * @file sr_biotac_tactile_sensor_publisher.hpp
3 * @author Ugo Cupcic <ugo@shadowrobot.com>
4 *
5 * Copyright 2015 Shadow Robot Company Ltd.
6 *
7 * This program is free software: you can redistribute it and/or modify it
8 * under the terms of the GNU General Public License as published by the Free
9 * Software Foundation version 2 of the License.
10 *
11 * This program is distributed in the hope that it will be useful, but WITHOUT
12 * ANY WARRANTY; without even the implied warranty of MERCHANTABILITY or
13 * FITNESS FOR A PARTICULAR PURPOSE. See the GNU General Public License for
14 * more details.
15 *
16 * You should have received a copy of the GNU General Public License along
17 * with this program. If not, see <http://www.gnu.org/licenses/>.
18 *
19 * @brief Publishes Biotac tactile state
20 *
21 */
22 
24 
25 #pragma once
26 
29 #include <sr_robot_msgs/BiotacAll.h>
30 #include <vector>
31 #include <string>
32 
33 namespace controller
34 {
35 
37 {
38 public:
39  SrBiotacTactileSensorPublisher(std::vector<tactiles::AllTactileData>* sensors,
40  double publish_rate, ros::NodeHandle nh_prefix, std::string prefix)
41  : SrTactileSensorPublisher(sensors, publish_rate, nh_prefix, prefix) {}
42  virtual void init(const ros::Time& time);
43  virtual void update(const ros::Time& time, const ros::Duration& period);
44 
45 private:
48  BiotacPublisherPtr biotac_realtime_pub_;
49 };
50 
51 } // namespace controller
52 
53 /* For the emacs weenies in the crowd.
54 Local Variables:
55  c-basic-offset: 2
56 End:
57 */
realtime_tools::RealtimePublisher< sr_robot_msgs::BiotacAll > BiotacPublisher
virtual void update(const ros::Time &time, const ros::Duration &period)
SrBiotacTactileSensorPublisher(std::vector< tactiles::AllTactileData > *sensors, double publish_rate, ros::NodeHandle nh_prefix, std::string prefix)
Publishes PST tactile state.
derived from ImuSensorController author: Adolfo Rodriguez Tsouroukdissian


sr_tactile_sensor_controller
Author(s): Guillaume Walck
autogenerated on Tue Oct 13 2020 04:02:07