qb_hand_gazebo_hardware_interface.cpp
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 
29 
30 using namespace qb_hand_gazebo_hardware_interface;
31 
32 bool qbHandHWSim::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) {
33  model_nh_ = ros::NodeHandle(robot_namespace);
34  urdf_model_ = *urdf_model;
35 
36  std::vector<std::string> joint_names;
37  for (auto const &transmission : transmissions) {
38  if (!startsWith(transmission.name_, trailNamespace(model_nh.getNamespace()))) {
39  continue; // select only joints of the specific qb SoftHand
40  }
41 
42  ROS_INFO_STREAM_NAMED("qb_hand_gazebo_hardware_interface","Initializing qbHandHWSim of '" << model_nh.getNamespace() << "'...");
43  for (auto const &joint : transmission.joints_) {
44  gazebo::physics::JointPtr sim_joint = parent_model->GetJoint(joint.name_);
45  if (!sim_joint) {
46  ROS_ERROR_STREAM_NAMED("qb_hand_gazebo_hardware_interface","This robot has a joint named '" << joint.name_ << "' which is not in the gazebo model.");
47  return false;
48  }
49  sim_joints_.push_back(sim_joint);
50  joint_names.push_back(joint.name_);
51  ROS_INFO_STREAM_NAMED("qb_hand_gazebo_hardware_interface"," * Added joint '" << joint.name_ << "'.");
52  }
53  }
54  joints_.setJoints(joint_names);
55 
56  //TODO: add a check on the number on transmission and check if multiple qb SoftHands can be spawned
57  if (joints_.names.size() != 34 && joints_.names.size() != 35) { // considering also the virtual transmissions (34 joints for SoftHand and 35 joints for SoftHand 2 Motors)
58  ROS_ERROR_STREAM_NAMED("qb_hand_gazebo_hardware_interface","Wrong number of joints [" << joints_.names.size() << "]");
59  return false;
60  }
61 
64  return true;
65 }
66 
68  for (int i=0; i<sim_joints_.size(); i++) {
69 #if GAZEBO_MAJOR_VERSION >= 8
70  double position = sim_joints_.at(i)->Position(0);
71 #else
72  double position = sim_joints_.at(i)->GetAngle(0).Radian();
73 #endif
74  // read joints data from Gazebo
76  joints_.velocities.at(i) = sim_joints_.at(i)->GetVelocity(0);
77  joints_.efforts.at(i) = sim_joints_.at(i)->GetForce(0);
78  }
79 }
80 
82  // enforce joint limits for all registered interfaces
84 
85  // send joint commands to Gazebo
86  if (joints_.names.size() == 34) { // SoftHand
87  for (int i = 0; i < sim_joints_.size(); i++) {
88  sim_joints_.at(i)->SetForce(0, 0); //FIXME: use real dynamics
89  }
90  } else { // SoftHand 2 Motors
91  for (int i = 0; i < sim_joints_.size(); i++) {
92  sim_joints_.at(i)->SetForce(0, 0); //FIXME: use real dynamics
93  }
94  }
95 }
96 
PLUGINLIB_EXPORT_CLASS
PLUGINLIB_EXPORT_CLASS(qb_hand_gazebo_hardware_interface::qbHandHWSim, gazebo_ros_control::RobotHWSim)
angles::shortest_angular_distance
static double shortest_angular_distance(double from, double to)
qb_device_hardware_interface::qbDeviceHWResources::names
std::vector< std::string > names
qb_hand_gazebo_hardware_interface::qbHandHWSim::joint_limits_
qb_device_joint_limits_interface::qbDeviceJointLimitsResources joint_limits_
Definition: qb_hand_gazebo_hardware_interface.h:118
qb_device_hardware_interface::qbDeviceHWInterfaces::initialize
void initialize(hardware_interface::RobotHW *robot, qbDeviceHWResources &joints)
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::urdf_model_
urdf::Model urdf_model_
Definition: qb_hand_gazebo_hardware_interface.h:115
urdf::Model
gazebo_ros_control::RobotHWSim
qb_device_hardware_interface::qbDeviceHWResources::positions
std::vector< double > positions
qb_device_joint_limits_interface::qbDeviceJointLimitsResources::enforceLimits
void enforceLimits(const ros::Duration &period)
qb_hand_gazebo_hardware_interface::qbHandHWSim::readSim
void readSim(ros::Time time, ros::Duration period) override
Definition: qb_hand_gazebo_hardware_interface.cpp:67
qb_hand_gazebo_hardware_interface::qbHandHWSim::model_nh_
ros::NodeHandle model_nh_
Definition: qb_hand_gazebo_hardware_interface.h:114
ROS_ERROR_STREAM_NAMED
#define ROS_ERROR_STREAM_NAMED(name, args)
qb_device_hardware_interface::qbDeviceHWResources::velocities
std::vector< double > velocities
qb_device_hardware_interface::qbDeviceHWResources::efforts
std::vector< double > efforts
qb_device_hardware_interface::qbDeviceHWInterfaces::joint_position
hardware_interface::PositionJointInterface joint_position
qb_hand_gazebo_hardware_interface::startsWith
bool startsWith(const std::string &string, const std::string &prefix)
Definition: qb_hand_gazebo_hardware_interface.h:93
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
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_joint_limits_interface::qbDeviceJointLimitsResources::initialize
void initialize(ros::NodeHandle &robot_hw_nh, qb_device_hardware_interface::qbDeviceHWResources &joints, const urdf::Model &urdf_model, hardware_interface::PositionJointInterface &joint_position)
ros::Time
qb_hand_gazebo_hardware_interface.h
ROS_INFO_STREAM_NAMED
#define ROS_INFO_STREAM_NAMED(name, args)
qb_hand_gazebo_hardware_interface::qbHandHWSim::interfaces_
qb_device_hardware_interface::qbDeviceHWInterfaces interfaces_
Definition: qb_hand_gazebo_hardware_interface.h:117
ros::NodeHandle::getNamespace
const std::string & getNamespace() const
qb_hand_gazebo_hardware_interface::qbHandHWSim
Definition: qb_hand_gazebo_hardware_interface.h:104
ros::Duration
ros::NodeHandle
qb_device_hardware_interface::qbDeviceHWResources::setJoints
void setJoints(const std::vector< std::string > &joints)
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