qb_hand_gazebo_hardware_interface.h
Go to the documentation of this file.
1 /***
2  * Software License Agreement: BSD 3-Clause License
3  *
4  * Copyright (c) 2016-2018, qbrobotics®
5  * All rights reserved.
6  *
7  * Redistribution and use in source and binary forms, with or without modification, are permitted provided that the
8  * following conditions are met:
9  *
10  * * Redistributions of source code must retain the above copyright notice, this list of conditions and the
11  * following disclaimer.
12  *
13  * * Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the
14  * following disclaimer in the documentation and/or other materials provided with the distribution.
15  *
16  * * Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote
17  * products derived from this software without specific prior written permission.
18  *
19  * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES,
20  * INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE
21  * DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL,
22  * SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR
23  * SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY,
24  * WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE
25  * USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
26  */
27 
28 #ifndef QB_HAND_GAZEBO_HARDWARE_INTERFACE_H
29 #define QB_HAND_GAZEBO_HARDWARE_INTERFACE_H
30 
31 // ROS libraries
32 #include <ros/ros.h>
33 #include <angles/angles.h>
44 #include <urdf/model.h>
45 
46 // internal libraries
51 
53 
54 template <typename T>
55 T clamp(const T &value, const T &absolute) {
56  return std::max(std::min(value, std::abs(absolute)), -std::abs(absolute));
57  // it is worth noticing that:
58  // std::min(NaN, const_value) = NaN
59  // std::min(const_value, NaN) = const_value
60 }
61 template <typename T>
62 T clamp(const T &value, const T &lower, const T &upper) {
63  return std::max(std::min(value, upper), lower);
64  // it is worth noticing that:
65  // std::min(NaN, const_value) = NaN
66  // std::min(const_value, NaN) = const_value
67 }
68 bool startsWith(const std::string &string, const std::string &prefix) {
69  return string.size() >= prefix.size() && string.compare(0, prefix.size(), prefix) == 0;
70 }
71 std::string trailNamespace(const std::string &string) {
72  auto pos = string.find_last_of('/');
73  if (pos == std::string::npos) {
74  return string;
75  }
76  return string.substr(pos+1);
77 }
78 
80  public:
81  qbHandHWSim() = default;
82  ~qbHandHWSim() override = default;
83 
84  bool initSim(const std::string &robot_namespace, ros::NodeHandle model_nh, gazebo::physics::ModelPtr parent_model, const urdf::Model *const urdf_model, std::vector<transmission_interface::TransmissionInfo> transmissions) override;
85  void readSim(ros::Time time, ros::Duration period) override;
86  void writeSim(ros::Time time, ros::Duration period) override;
87 
88  private:
94  std::vector<gazebo::physics::JointPtr> sim_joints_;
95 };
96 typedef std::shared_ptr<qbHandHWSim> qbHandHWSimPtr;
97 } // namespace qb_hand_gazebo_hardware_interface
98 
99 #endif // QB_HAND_GAZEBO_HARDWARE_INTERFACE_H
qb_hand_gazebo_hardware_interface::qbHandHWSim::joint_limits_
qb_device_joint_limits_interface::qbDeviceJointLimitsResources joint_limits_
Definition: qb_hand_gazebo_hardware_interface.h:118
ros.h
joint_limits_interface.h
qb_hand_gazebo_hardware_interface::qbHandHWSim::initSim
bool initSim(const std::string &robot_namespace, ros::NodeHandle model_nh, gazebo::physics::ModelPtr parent_model, const urdf::Model *const urdf_model, std::vector< transmission_interface::TransmissionInfo > transmissions) override
Definition: qb_hand_gazebo_hardware_interface.cpp:32
qb_hand_gazebo_hardware_interface
Definition: qb_hand_gazebo_hardware_interface.h:52
qb_hand_gazebo_hardware_interface::qbHandHWSim::qbHandHWSim
qbHandHWSim()=default
qb_hand_gazebo_hardware_interface::qbHandHWSim::urdf_model_
urdf::Model urdf_model_
Definition: qb_hand_gazebo_hardware_interface.h:115
urdf::Model
gazebo_ros_control::RobotHWSim
joint_limits.h
qb_device_transmission_resources.h
qb_device_joint_limits_interface.h
class_list_macros.h
robot_hw_sim.h
qb_hand_gazebo_hardware_interface::qbHandHWSim::readSim
void readSim(ros::Time time, ros::Duration period) override
Definition: qb_hand_gazebo_hardware_interface.cpp:67
joint_command_interface.h
qb_hand_gazebo_hardware_interface::qbHandHWSim::model_nh_
ros::NodeHandle model_nh_
Definition: qb_hand_gazebo_hardware_interface.h:114
model.h
joint_limits_rosparam.h
qb_hand_gazebo_hardware_interface::startsWith
bool startsWith(const std::string &string, const std::string &prefix)
Definition: qb_hand_gazebo_hardware_interface.h:93
transmission_interface.h
qb_hand_gazebo_hardware_interface::qbHandHWSim::sim_joints_
std::vector< gazebo::physics::JointPtr > sim_joints_
Definition: qb_hand_gazebo_hardware_interface.h:119
qb_hand_gazebo_hardware_interface::trailNamespace
std::string trailNamespace(const std::string &string)
Definition: qb_hand_gazebo_hardware_interface.h:96
joint_state_interface.h
qb_hand_gazebo_hardware_interface::qbHandHWSim::writeSim
void writeSim(ros::Time time, ros::Duration period) override
Definition: qb_hand_gazebo_hardware_interface.cpp:81
qb_device_hardware_resources.h
ros::Time
joint_limits_urdf.h
qb_hand_gazebo_hardware_interface::qbHandHWSimPtr
std::shared_ptr< qbHandHWSim > qbHandHWSimPtr
Definition: qb_hand_gazebo_hardware_interface.h:121
qb_hand_gazebo_hardware_interface::qbHandHWSim::~qbHandHWSim
~qbHandHWSim() override=default
robot_hw.h
qb_device_joint_limits_interface::qbDeviceJointLimitsResources
qb_hand_gazebo_hardware_interface::qbHandHWSim::interfaces_
qb_device_hardware_interface::qbDeviceHWInterfaces interfaces_
Definition: qb_hand_gazebo_hardware_interface.h:117
qb_device_hardware_interface::qbDeviceHWResources
qb_hand_gazebo_hardware_interface::clamp
T clamp(const T &value, const T &absolute)
Definition: qb_hand_gazebo_hardware_interface.h:80
qb_device_hardware_interface::qbDeviceHWInterfaces
qb_hand_gazebo_hardware_interface::qbHandHWSim
Definition: qb_hand_gazebo_hardware_interface.h:104
qb_device_joint_limits_resources.h
ros::Duration
ros::NodeHandle
angles.h
qb_hand_gazebo_hardware_interface::qbHandHWSim::joints_
qb_device_hardware_interface::qbDeviceHWResources joints_
Definition: qb_hand_gazebo_hardware_interface.h:116


qb_hand_gazebo
Author(s): qbrobotics®
autogenerated on Fri Jul 26 2024 02:22:08