joint_velocity_controller.cpp
Go to the documentation of this file.
1 /*********************************************************************
2  * Software License Agreement (BSD License)
3  *
4  * Copyright (c) 2008, Willow Garage, Inc.
5  * Copyright (c) 2012, hiDOF, Inc.
6  * All rights reserved.
7  *
8  * Redistribution and use in source and binary forms, with or without
9  * modification, are permitted provided that the following conditions
10  * are met:
11  *
12  * * Redistributions of source code must retain the above copyright
13  * notice, this list of conditions and the following disclaimer.
14  * * Redistributions in binary form must reproduce the above
15  * copyright notice, this list of conditions and the following
16  * disclaimer in the documentation and/or other materials provided
17  * with the distribution.
18  * * Neither the name of the Willow Garage nor the names of its
19  * contributors may be used to endorse or promote products derived
20  * from this software without specific prior written permission.
21  *
22  * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
23  * "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
24  * LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
25  * FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
26  * COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
27  * INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
28  * BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
29  * LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
30  * CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
31  * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
32  * ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
33  * POSSIBILITY OF SUCH DAMAGE.
34  *********************************************************************/
35 
38 
39 
40 namespace effort_controllers {
41 
43 : command_(0), loop_count_(0)
44 {}
45 
47 {
49 }
50 
52  const std::string &joint_name, const control_toolbox::Pid &pid)
53 {
54  pid_controller_ = pid;
55 
56  // Get joint handle from hardware interface
57  joint_ = robot->getHandle(joint_name);
58 
59  return true;
60 }
61 
63 {
64  // Get joint name from parameter server
65  std::string joint_name;
66  if (!n.getParam("joint", joint_name)) {
67  ROS_ERROR("No joint given (namespace: %s)", n.getNamespace().c_str());
68  return false;
69  }
70 
71  // Get joint handle from hardware interface
72  joint_ = robot->getHandle(joint_name);
73 
74  // Load PID Controller using gains set on parameter server
75  if (!pid_controller_.init(ros::NodeHandle(n, "pid")))
76  return false;
77 
78  // Start realtime state publisher
81  (n, "state", 1));
82 
83  // Start command subscriber
84  sub_command_ = n.subscribe<std_msgs::Float64>("command", 1, &JointVelocityController::setCommandCB, this);
85 
86  return true;
87 }
88 
89 void JointVelocityController::setGains(const double &p, const double &i, const double &d, const double &i_max, const double &i_min, const bool &antiwindup)
90 {
91  pid_controller_.setGains(p,i,d,i_max,i_min,antiwindup);
92 }
93 
94 void JointVelocityController::getGains(double &p, double &i, double &d, double &i_max, double &i_min, bool &antiwindup)
95 {
96  pid_controller_.getGains(p,i,d,i_max,i_min,antiwindup);
97 }
98 
99 void JointVelocityController::getGains(double &p, double &i, double &d, double &i_max, double &i_min)
100 {
101  bool dummy;
102  pid_controller_.getGains(p,i,d,i_max,i_min,dummy);
103 }
104 
106 {
108 }
109 
111 {
112  return joint_.getName();
113 }
114 
115 // Set the joint velocity command
117 {
118  command_ = cmd;
119 }
120 
121 // Return the current velocity command
123 {
124  cmd = command_;
125 }
126 
128 {
129  command_ = 0.0;
131 }
132 
134 {
135  double error = command_ - joint_.getVelocity();
136 
137  // Set the PID error and compute the PID command with nonuniform time
138  // step size. The derivative error is computed from the change in the error
139  // and the timestep dt.
140  double commanded_effort = pid_controller_.computeCommand(error, period);
141 
142  joint_.setCommand(commanded_effort);
143 
144  if(loop_count_ % 10 == 0)
145  {
147  {
148  controller_state_publisher_->msg_.header.stamp = time;
149  controller_state_publisher_->msg_.set_point = command_;
150  controller_state_publisher_->msg_.process_value = joint_.getVelocity();
151  controller_state_publisher_->msg_.error = error;
152  controller_state_publisher_->msg_.time_step = period.toSec();
153  controller_state_publisher_->msg_.command = commanded_effort;
154 
155  double dummy;
156  bool antiwindup;
160  controller_state_publisher_->msg_.i_clamp,
161  dummy,
162  antiwindup);
163  controller_state_publisher_->msg_.antiwindup = static_cast<char>(antiwindup);
164  controller_state_publisher_->unlockAndPublish();
165  }
166  }
167  loop_count_++;
168 }
169 
170 void JointVelocityController::setCommandCB(const std_msgs::Float64ConstPtr& msg)
171 {
172  command_ = msg->data;
173 }
174 
175 } // namespace
176 
std::unique_ptr< realtime_tools::RealtimePublisher< control_msgs::JointControllerState > > controller_state_publisher_
void setGains(const double &p, const double &i, const double &d, const double &i_max, const double &i_min, const bool &antiwindup=false)
Set the PID parameters.
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
void getGains(double &p, double &i, double &d, double &i_max, double &i_min)
void setGains(double p, double i, double d, double i_max, double i_min, bool antiwindup=false)
void starting(const ros::Time &time)
This is called from within the realtime thread just before the first call to update.
bool init(const ros::NodeHandle &n, const bool quiet=false)
void setCommand(double cmd)
Give set velocity of the joint for next update: revolute (angle) and prismatic (velocity) ...
double computeCommand(double error, ros::Duration dt)
bool getParam(const std::string &key, std::string &s) const
void update(const ros::Time &time, const ros::Duration &period)
Issues commands to the joint. Should be called at regular intervals.
void setCommandCB(const std_msgs::Float64ConstPtr &msg)
Callback from /command subscriber for setpoint.
JointHandle getHandle(const std::string &name)
void setCommand(double command)
const std::string & getNamespace() const
std::string getJointName()
Get the name of the joint this controller uses.
bool init(hardware_interface::EffortJointInterface *robot, const std::string &joint_name, const control_toolbox::Pid &pid)
void getGains(double &p, double &i, double &d, double &i_max, double &i_min)
Get the PID parameters.
#define PLUGINLIB_EXPORT_CLASS(class_type, base_class_type)
#define ROS_ERROR(...)
void getCommand(double &cmd)
Get latest velocity command to the joint: revolute (angle) and prismatic (velocity).


effort_controllers
Author(s): Vijay Pradeep
autogenerated on Fri Feb 3 2023 03:19:08