qb_hand_gazebo_plugin.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_plugin;
31 
33  update_connection_.reset();
34 }
35 
36 void qbHandGazeboPlugin::Load(gazebo::physics::ModelPtr parent, sdf::ElementPtr sdf) {
37  ROS_INFO_STREAM_NAMED("qb_hand_gazebo_plugin","Loading qb SoftHand Gazebo plugin...");
38  parent_model_ = parent;
39  sdf_ = sdf;
40 
41  if (!parent_model_) {
42  ROS_ERROR_STREAM_NAMED("qb_hand_gazebo_plugin","Parent model is null.");
43  return;
44  }
45  if(!ros::isInitialized()) {
46  ROS_FATAL_STREAM_NAMED("qb_hand_gazebo_plugin","Unable to load qb SoftHand Gazebo plugin: a ROS node for Gazebo has not been initialized yet.");
47  return;
48  }
49 
50 #if GAZEBO_MAJOR_VERSION >= 8
51  ros::Duration gazebo_period(parent_model_->GetWorld()->Physics()->GetMaxStepSize());
52 #else
53  ros::Duration gazebo_period(parent_model_->GetWorld()->GetPhysicsEngine()->GetMaxStepSize());
54 #endif
55  model_nh_ = ros::NodeHandle(sdf_->HasElement("robotName") ? sdf_->Get<std::string>("robotName") : parent_model_->GetName());
57  robot_description_ = sdf_->HasElement("robotDescription") ? sdf_->Get<std::string>("robotDescription") : "robot_description";
58  control_period_ = sdf_->HasElement("controlPeriod") ? ros::Duration(sdf_->Get<double>("controlPeriod")) : gazebo_period;
59  if (control_period_ < gazebo_period) {
60  ROS_WARN_STREAM_NAMED("qb_hand_gazebo_plugin","Desired controller update period (" << control_period_ << " s) is faster than the Gazebo simulation period (" << gazebo_period << " s).");
61  }
62  ROS_INFO_STREAM_NAMED("qb_hand_gazebo_plugin", "Starting qb SoftHand Gazebo plugin in namespace: " << model_nh_.getNamespace());
63 
64  const std::string urdf_string = getURDF(robot_description_);
65  if (!parseTransmissionsFromURDF(urdf_string)) {
66  ROS_ERROR_STREAM_NAMED("qb_hand_gazebo_plugin", "Error while parsing transmissions in the URDF for the qb SoftHand Gazebo plugin.");
67  return;
68  }
69  urdf::Model urdf_model;
70  const urdf::Model *const urdf_model_ptr = urdf_model.initString(urdf_string) ? &urdf_model : nullptr;
71  if (!urdf_model_ptr){
72  ROS_FATAL_STREAM_NAMED("qb_hand_gazebo_plugin", "Error while initializing the URDF pointer.");
73  return;
74  }
75  robot_hw_sim_ = std::make_shared<gazebo_ros_control::CombinedRobotHWSim>();
76  if (!robot_hw_sim_->initSim(model_nh_.getNamespace(), model_nh_, parent_model_, urdf_model_ptr, transmissions_)) {
77  ROS_FATAL_STREAM_NAMED("qb_hand_gazebo_plugin", "Error while initializing the robot simulation interface");
78  return;
79  }
80 
82  update_connection_ = gazebo::event::Events::ConnectWorldUpdateBegin(std::bind(&qbHandGazeboPlugin::Update, this, std::placeholders::_1));
83  ROS_INFO_NAMED("qb_hand_gazebo_plugin", "qb SoftHand Gazebo plugin successfully loaded.");
84 }
85 
86 void qbHandGazeboPlugin::Update(const gazebo::common::UpdateInfo &info) {
87  ros::Time sim_time_ros(info.simTime.sec, info.simTime.nsec);
88  ros::Duration sim_period_ros = sim_time_ros - last_sim_time_ros_;
89  if (sim_period_ros < control_period_) {
90  return;
91  }
92 
93  robot_hw_sim_->readSim(sim_time_ros, sim_period_ros);
94  controller_manager_->update(sim_time_ros, sim_period_ros);
95  robot_hw_sim_->writeSim(sim_time_ros, sim_period_ros);
96  last_sim_time_ros_ = sim_time_ros;
97 }
98 
99 std::string qbHandGazeboPlugin::getURDF(const std::string &param_name) {
100  std::string urdf_string;
101 
102  while (urdf_string.empty()) {
103  std::string search_param_name;
104  if (model_nh_.searchParam(param_name, search_param_name)) {
105  ROS_INFO_STREAM_ONCE_NAMED("qb_hand_gazebo_plugin", "qb SoftHand Gazebo plugin is waiting for model URDF in parameter [" << search_param_name << "] on the ROS param server.");
106  model_nh_.getParam(search_param_name, urdf_string);
107  } else {
108  ROS_INFO_STREAM_ONCE_NAMED("qb_hand_gazebo_plugin", "qb SoftHand Gazebo plugin is waiting for model URDF in parameter [" << robot_description_ << "] on the ROS param server.");
109  model_nh_.getParam(param_name, urdf_string);
110  }
111 
112  usleep(100000);
113  }
114  ROS_INFO_STREAM_NAMED("qb_hand_gazebo_plugin", "Received URDF from param server, parsing...");
115  return urdf_string;
116 }
117 
118 bool qbHandGazeboPlugin::parseTransmissionsFromURDF(const std::string &urdf_string) {
120 }
121 
controller_manager::ControllerManager
transmission_interface::TransmissionParser::parse
static bool parse(const std::string &urdf_string, std::vector< TransmissionInfo > &transmissions)
qb_hand_gazebo_plugin::qbHandGazeboPlugin::Load
void Load(gazebo::physics::ModelPtr parent, sdf::ElementPtr sdf) override
Definition: qb_hand_gazebo_plugin.cpp:36
qb_hand_gazebo_plugin::qbHandGazeboPlugin::robot_hw_sim_
std::shared_ptr< gazebo_ros_control::CombinedRobotHWSim > robot_hw_sim_
Definition: qb_hand_gazebo_plugin.h:115
qb_hand_gazebo_plugin::qbHandGazeboPlugin::Update
void Update(const gazebo::common::UpdateInfo &info)
Definition: qb_hand_gazebo_plugin.cpp:86
ros::NodeHandle::getParam
bool getParam(const std::string &key, bool &b) const
urdf::Model
ROS_INFO_STREAM_ONCE_NAMED
#define ROS_INFO_STREAM_ONCE_NAMED(name, args)
qb_hand_gazebo_plugin::qbHandGazeboPlugin::model_nh_control_
ros::NodeHandle model_nh_control_
Definition: qb_hand_gazebo_plugin.h:111
qb_hand_gazebo_plugin::qbHandGazeboPlugin::update_connection_
gazebo::event::ConnectionPtr update_connection_
Definition: qb_hand_gazebo_plugin.h:107
qb_hand_gazebo_plugin::qbHandGazeboPlugin
Definition: qb_hand_gazebo_plugin.h:70
qb_hand_gazebo_plugin::qbHandGazeboPlugin::sdf_
sdf::ElementPtr sdf_
Definition: qb_hand_gazebo_plugin.h:109
qb_hand_gazebo_plugin::qbHandGazeboPlugin::robot_description_
std::string robot_description_
Definition: qb_hand_gazebo_plugin.h:117
ROS_INFO_NAMED
#define ROS_INFO_NAMED(name,...)
ROS_FATAL_STREAM_NAMED
#define ROS_FATAL_STREAM_NAMED(name, args)
ROS_ERROR_STREAM_NAMED
#define ROS_ERROR_STREAM_NAMED(name, args)
ros::NodeHandle::searchParam
bool searchParam(const std::string &key, std::string &result) const
ros::isInitialized
ROSCPP_DECL bool isInitialized()
qb_hand_gazebo_plugin.h
qb_hand_gazebo_plugin::qbHandGazeboPlugin::transmissions_
std::vector< transmission_interface::TransmissionInfo > transmissions_
Definition: qb_hand_gazebo_plugin.h:114
urdf::Model::initString
URDF_EXPORT bool initString(const std::string &xmlstring)
qb_hand_gazebo_plugin::qbHandGazeboPlugin::control_period_
ros::Duration control_period_
Definition: qb_hand_gazebo_plugin.h:112
ROS_WARN_STREAM_NAMED
#define ROS_WARN_STREAM_NAMED(name, args)
qb_hand_gazebo_plugin::qbHandGazeboPlugin::getURDF
std::string getURDF(const std::string &param_name)
Definition: qb_hand_gazebo_plugin.cpp:99
qb_hand_gazebo_plugin
Definition: qb_hand_gazebo_plugin.h:44
qb_hand_gazebo_plugin::qbHandGazeboPlugin::parseTransmissionsFromURDF
bool parseTransmissionsFromURDF(const std::string &urdf_string)
Definition: qb_hand_gazebo_plugin.cpp:118
GZ_REGISTER_MODEL_PLUGIN
GZ_REGISTER_MODEL_PLUGIN(qbHandGazeboPlugin)
qb_hand_gazebo_plugin::qbHandGazeboPlugin::parent_model_
gazebo::physics::ModelPtr parent_model_
Definition: qb_hand_gazebo_plugin.h:108
ros::Time
qb_hand_gazebo_plugin::qbHandGazeboPlugin::last_sim_time_ros_
ros::Time last_sim_time_ros_
Definition: qb_hand_gazebo_plugin.h:113
qb_hand_gazebo_plugin::qbHandGazeboPlugin::model_nh_
ros::NodeHandle model_nh_
Definition: qb_hand_gazebo_plugin.h:110
qb_hand_gazebo_plugin::qbHandGazeboPlugin::controller_manager_
std::shared_ptr< controller_manager::ControllerManager > controller_manager_
Definition: qb_hand_gazebo_plugin.h:116
ROS_INFO_STREAM_NAMED
#define ROS_INFO_STREAM_NAMED(name, args)
ros::NodeHandle::getNamespace
const std::string & getNamespace() const
ros::Duration
qb_hand_gazebo_plugin::qbHandGazeboPlugin::~qbHandGazeboPlugin
~qbHandGazeboPlugin() override
Definition: qb_hand_gazebo_plugin.cpp:32
ros::NodeHandle


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