HEBI C++ API  3.12.2
All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Friends Macros Pages
arm.hpp
Go to the documentation of this file.
1 #pragma once
2 
3 #include <set>
4 
5 // HEBI C++ API components
6 #include "group.hpp"
7 #include "group_command.hpp"
8 #include "group_feedback.hpp"
9 #include "robot_config.hpp"
10 #include "robot_model.hpp"
11 #include "trajectory.hpp"
12 
13 // Arm API components
14 #include "arm/end_effector.hpp"
15 #include "arm/goal.hpp"
17 
18 namespace hebi {
19 
20 // Transition code for arm::experimental -> arm
21 namespace experimental {
22  namespace arm = hebi::arm;
23 }
24 
25 namespace arm {
26 
27 // Forward declare for usage in plugin.
28 class Arm;
29 
30 namespace plugin {
31 
48 class Plugin {
49 public:
50  Plugin(const std::string& name) : name_(name) {}
51  virtual ~Plugin() = default;
52 
53  // The name of this plugin
54  std::string name() const { return name_; }
55 
56  // Determines if the plugin's effects are enabled. Note that every
57  // plugin is always invoked by Arm::update, and the plugin itself is
58  // responsible for using this state (and the current ramped "enabled ratio")
59  // to moderate its effect.
60  bool enabled() const { return enabled_; }
61  // Sets enabled state. If "ramp time" > 0, the "enabled" state is immediately
62  // set to the new value, but "enabled_ratio" will change gradually.
63  void setEnabled(bool enabled) { enabled_ = enabled; }
64  // Float value between 0 and 1 of "how enabled" we are as we are
65  // ramping between disabled/enabled state.
66  float enabledRatio() { return enabled_ratio_; }
67  // Set how fast we ramp between enabled and disabled states; returns "false"
68  // if value given is invalid.
69  bool setRampTime(float ramp_time);
70  // How fast we ramp between enabled and disabled states
71  float rampTime() { return ramp_time_; }
72 
73  // Callback which updates state on the arm. Invoked by Arm::update.
74  // Returns `true` on success and `false` otherwise.
75  bool update(Arm&, double dt);
76 
77  // Can be overridden by plugin implementations if necessary; called by `Arm::send`
78  virtual bool send() { return true; }
79 
80  // Override to update any state based on the associated arm.
81  // Invoked when the instance is added to an arm via `Arm::addPlugin`. Returns
82  // "false" if there was an error when attempting to add.
83  virtual bool onAssociated(const Arm&) { return true; }
84 
85 protected:
86  // When the object is created through the "create" factory method,
87  // parameters should be applied in turn. Each parameter should be
88  // validated, and an error returned if they cannot be applied.
89  //
90  // Implementations should override the "applyParameterImpl" functions for parameters of types
91  // they have. The main "applyParameters" function is called to iterate through the config
92  // structure, and should be called by each implementing class' "create" method
93  bool applyParameters(const PluginConfig& config, std::set<std::string> required_parameters);
94  virtual bool applyParameterImpl(const std::string& /*name*/, bool /*value*/) { return false; }
95  virtual bool applyParameterImpl(const std::string& /*name*/, const std::vector<bool>& /*value*/) { return false; }
96  virtual bool applyParameterImpl(const std::string& /*name*/, double /*value*/) { return false; }
97  virtual bool applyParameterImpl(const std::string& /*name*/, const std::vector<double>& /*value*/) { return false; }
98  virtual bool applyParameterImpl(const std::string& /*name*/, const std::string& /*value*/) { return false; }
99  virtual bool applyParameterImpl(const std::string& /*name*/, const std::vector<std::string>& /*value*/) { return false; }
100 
101  // Overridden by plugin implementations, and called by `Plugin::update`
102  virtual bool updateImpl(Arm&, double dt) = 0;
103 
104 private:
105  virtual bool applyParameter(const std::string& name, bool value); // we implement for "enabled"
106  virtual bool applyParameter(const std::string& name, const std::vector<bool>& value) {
107  return applyParameterImpl(name, value);
108  }
109  virtual bool applyParameter(const std::string& name, double value); // we implement for "ramp_time"
110  virtual bool applyParameter(const std::string& name, const std::vector<double>& value) {
111  return applyParameterImpl(name, value);
112  }
113  virtual bool applyParameter(const std::string& name, const std::string& value) {
114  return applyParameterImpl(name, value);
115  }
116  virtual bool applyParameter(const std::string& name, const std::vector<std::string>& value) {
117  return applyParameterImpl(name, value);
118  }
119 
120  // Name of the plugin
121  const std::string name_{};
122  // How long it takes to fully transition enabled state.
123  float ramp_time_{};
124  // Whether the plugin is enabled
125  bool enabled_{true};
126  // Current linear level between off (0) and on (1); updated during `update`
127  float enabled_ratio_{1.f};
128 };
129 
130 using Factory = std::function<std::unique_ptr<Plugin>(const PluginConfig&)>;
131 
143 public:
144  static std::unique_ptr<GravityCompensationEffort> create(const PluginConfig&);
145  static std::string pluginTypeName() { return "GravityCompensationEffort"; };
146  bool onAssociated(const Arm& arm) override;
147 
148 protected:
149  // For "imu_feedback_index" and "imu_frame_index"
150  bool applyParameterImpl(const std::string& name, double value) override;
151  // For "imu_rotation_offset"
152  bool applyParameterImpl(const std::string& name, const std::vector<double>& value) override;
153  bool updateImpl(Arm& arm, double dt) override;
154 
155 private:
156  GravityCompensationEffort(const std::string& name) : Plugin(name) {}
157  // Cached helper var
158  Eigen::VectorXd grav_efforts_;
159  // Parameters
160  size_t imu_feedback_index_{};
161  size_t imu_frame_index_{};
162  Eigen::Matrix3d imu_local_transform_{Eigen::Matrix3d::Identity()};
163 };
164 
166 public:
167  static std::unique_ptr<DynamicsCompensationEffort> create(const PluginConfig&);
168  static std::string pluginTypeName() { return "DynamicsCompensationEffort"; };
169  bool onAssociated(const Arm& arm) override;
170 
171 protected:
172  bool updateImpl(Arm& arm, double dt) override;
173 
174 private:
175  DynamicsCompensationEffort(const std::string& name) : Plugin(name) {}
176  // Cached helper var
177  Eigen::VectorXd dyn_efforts_;
178 };
179 
180 class ImpedanceController : public Plugin {
181 public:
182  static std::unique_ptr<ImpedanceController> create(const PluginConfig&);
183  static std::string pluginTypeName() { return "ImpedanceController"; };
184  bool onAssociated(const Arm& arm) override;
185  // Set frame in which gains are defined in to be the end-effector frame, which is otherwise the base frame
186  void setGainsInEndEffectorFrame(bool gains_in_end_effector_frame);
187  // Returns true when gains are in the end-effector frame, and false when they are in the base frame
188  bool gainsInEndEffectorFrame() const { return gains_in_end_effector_frame_; }
189  // Set proportional gains (stiffness) of impedance controller.
190  // Returns "false" if values or size given are invalid.
191  bool setKp(const Eigen::VectorXd& kp);
192  // Returns proportional gains
193  Eigen::VectorXd kp() const { return kp_; }
194  // Set derivative gains (damping) of impedance controller.
195  // Returns "false" if values or size given are invalid.
196  bool setKd(const Eigen::VectorXd& kd);
197  // Returns derivative gains
198  Eigen::VectorXd kd() const { return kd_; }
199  // Set integral gains of impedance controller.
200  // Returns "false" if values or size given are invalid.
201  bool setKi(const Eigen::VectorXd& ki);
202  // Return integral gains
203  Eigen::VectorXd ki() const { return ki_; }
204  // Set caps for integral errors
205  // Returns "false" if values or size given are invalid.
206  bool setIClamp(const Eigen::VectorXd& i_clamp);
207  // Return caps for integral errors, and an empty vector when there are no caps.
208  Eigen::VectorXd iClamp() const { return i_clamp_; }
209 
210 protected:
211  // For "kp", "kd", "ki", and "i_clamp", accessed by set_kp, set_kd, set_ki, and set_i_clamp
212  bool setParam(const std::string& name, const Eigen::VectorXd& value_vector);
213  // For "gains_in_end_effector_frame"
214  bool applyParameterImpl(const std::string& name, bool value) override;
215  // For "kp", "kd", "ki", and "i_clamp"
216  bool applyParameterImpl(const std::string& name, const std::vector<double>& value) override;
217  bool updateImpl(Arm& arm, double dt) override;
218 
219 private:
220  ImpedanceController(const std::string& name) : Plugin(name) {}
221 
222  // Cached helper vars
223 
224  // Current integral error term
225  Eigen::VectorXd i_error_{Eigen::VectorXd::Zero(6)};
226 
227  // Parameters
228 
229  // Translations and Rotations can be specified in the
230  // base frame or in the end effector frame.
231  bool gains_in_end_effector_frame_{}; // Initialized as false (gains are in the base frame)
232  // Impedance Control Gains
233  // NOTE: The gains correspond to:
234  // [ trans_x trans_y trans_z rot_x rot_y rot_z ]
235  Eigen::VectorXd kp_{Eigen::VectorXd::Zero(6)}; // (N/m) or (Nm/rad)
236  Eigen::VectorXd kd_{Eigen::VectorXd::Zero(6)}; // (N/(m/sec)) or (Nm/(rad/sec))
237  Eigen::VectorXd ki_{Eigen::VectorXd::Zero(6)}; // (N/(m*sec)) or (Nm/(rad*sec))
238  Eigen::VectorXd i_clamp_;
239 };
240 
241 class EffortOffset : public Plugin {
242 public:
243  static std::unique_ptr<EffortOffset> create(const PluginConfig&);
244  static std::string pluginTypeName() { return "EffortOffset"; };
245  bool onAssociated(const Arm& arm) override;
246 
247 protected:
248  // For "offset"
249  bool applyParameterImpl(const std::string& name, const std::vector<double>& value) override;
250  bool updateImpl(Arm& arm, double dt) override;
251 
252 private:
253  EffortOffset(const std::string& name) : Plugin(name) {}
254  // Parameters
255  Eigen::VectorXd effort_offsets_{};
256 };
257 
258 class DoubledJoint : public Plugin {
259 public:
260  static std::unique_ptr<DoubledJoint> create(const PluginConfig&);
261  static std::string pluginTypeName() { return "DoubledJoint"; };
262  bool onAssociated(const Arm& arm) override;
263 
264 protected:
265  bool applyParameterImpl(const std::string& name, bool value) override;
266  bool applyParameterImpl(const std::string& name, double value) override;
267  bool applyParameterImpl(const std::string& name, const std::string& value) override;
268  bool updateImpl(Arm& arm, double dt) override;
269 
270 private:
271  DoubledJoint(const std::string& name) : Plugin(name) {}
272  size_t index_{};
273  bool mirror_{};
274  std::string name_;
275  std::string family_;
276  std::shared_ptr<hebi::Group> group_;
277  hebi::GroupCommand cmd_{1};
278 };
279 
280 } // namespace plugin
281 
282 static std::map<std::string, plugin::Factory> ArmPluginMap = {
288 };
289 
290 // A high-level abstraction of a robot arm, coordinating kinematics, control,
291 // and basic motion planning.
292 //
293 // Typical usage is as follows; the robot.cfg file includes information such as
294 // module family and names, HRDFs, gains, etc.
295 //
296 // std::vector<std::string> errors;
297 // auto cfg = RobotConfig::loadConfig("robot.cfg", errors);
298 // if (!cfg)
299 // return; // see contents of "errors"
300 // auto arm = Arm::create(*cfg);
301 // if (!arm)
302 // return; // are modules on network?
303 //
304 // arm->loadGains(cfg->getGains("default"));
305 //
306 // while(true) {
307 // arm->update();
308 // arm->send();
309 // if (some_condition)
310 // arm->setGoal(target_goal);
311 // }
312 //
313 // (Note -- in an actual application, you would want to verify the return
314 // values of many of the functions above to ensure proper operation!)
315 class Arm {
316 public:
318  // Setup functions
320 
321  // Parameters for creating an arm
322  struct Params {
323  // The family and names passed to the "lookup" function to find modules
324  // Both are required.
325  std::vector<std::string> families_;
326  std::vector<std::string> names_;
327  // How long a command takes effect for on the robot before expiring.
328  int command_lifetime_ = 100;
329  // Loop rate, in Hz. This is how fast the arm update loop will nominally
330  // run.
331  double control_frequency_ = 200.f;
332 
333  // The robot description. Either supply the hrdf_file _or_ the robot_model.
334  std::string hrdf_file_;
335  std::shared_ptr<robot_model::RobotModel> robot_model_;
336 
337  // Optionally, supply an end effector to be controlled by the "aux" state of
338  // provided goals.
339  std::shared_ptr<EndEffectorBase> end_effector_;
340 
341  // A function pointer that returns a double representing the current time in
342  // seconds. (Can be overloaded to use, e.g., simulator time)
343  //
344  // The default value uses the steady clock wall time.
345  std::function<double()> get_current_time_s_ = []() {
346  using clock = std::chrono::steady_clock;
347  static const clock::time_point start_time = clock::now();
348  return (std::chrono::duration<double>(clock::now() - start_time)).count();
349  };
350  };
351 
352  // Creates an "Arm" object; uses the RobotConfig file for information about the robot.
353  static std::unique_ptr<Arm> create(const RobotConfig& config);
354  // Creates an "Arm" object; uses the RobotConfig file for information about the robot
355  // and an existing "Lookup" object
356  static std::unique_ptr<Arm> create(const RobotConfig& config, const Lookup& lookup);
357 
358  // Creates an "Arm" object, and puts it into a "weightless" no-goal control
359  // mode.
360  static std::unique_ptr<Arm> create(const Params& params);
361  // Creates an "Arm" object using an existing "Lookup" object, and puts it into a
362  // "weightless" no-goal control mode.
363  static std::unique_ptr<Arm> create(const Params& config, const Lookup& lookup);
364 
365  // Adds the plugin to the arm object, taking ownership of the plugin.
366  bool addPlugin(std::unique_ptr<plugin::Plugin> plugin);
367 
368  // Returns a weak pointer to the first plugin found of the given type, or nullopt
369  // if nothing is found.
370  template<class T>
371  std::weak_ptr<plugin::Plugin> getPluginByType() {
372  for (auto& p : plugins_) {
373  if (dynamic_cast<T*>(p.get()) != nullptr)
374  return p;
375  }
376  return {};
377  }
378 
379  std::weak_ptr<plugin::Plugin> getPluginByName(const std::string& name);
380 
381  // Loads gains from the given .xml file, and sends them to the module. Returns
382  // false if the gains file could not be found, if these is a mismatch in
383  // number of modules, or the modules do not acknowledge receipt of the gains.
384  bool loadGains(const std::string& gains_file);
385 
387  // Accessors
389 
390  // Returns the number of modules / DoF in the arm
391  size_t size() const { return group_->size(); }
392 
393  // Returns the internal group. Not necessary for most use cases.
394  const Group& group() const { return *group_; }
395 
396  // Returns the internal robot model. Not necessary for most use cases.
397  const robot_model::RobotModel& robotModel() const { return *robot_model_; }
398  // Returns the (non-const) internal robot model. Not necessary for most use cases.
399  // Use with care, as modifying the properties of the underlying robot model while
400  // using the arm may result in undefined behavior.
401  robot_model::RobotModel& robotModel() { return *robot_model_; }
402 
403  // Returns the currently active internal trajectory. Not necessary for most
404  // use cases.
405  // Returns 'nullptr' if there is no active trajectory.
406  const trajectory::Trajectory* trajectory() const { return trajectory_.get(); }
407 
408  // Returns the end effector object, if given. Not necessary for most use
409  // cases.
410  // Returns 'nullptr' if there is no end effector.
411  const EndEffectorBase* endEffector() const { return end_effector_.get(); }
412 
413  // Returns the command last computed by update, or an empty command object
414  // if "update" has never successfully run. The returned command can be
415  // modified as desired before it is sent to the robot with the send function.
416  GroupCommand& pendingCommand() { return command_; }
417  const GroupCommand& pendingCommand() const { return command_; }
418 
419  // Returns the last feedback obtained by update, or an empty feedback object
420  // if "update" has never successfully run.
421  const GroupFeedback& lastFeedback() const { return feedback_; }
422 
424  // Main loop functions
425  //
426  // Typical usage:
427  //
428  // while(true) {
429  // arm->update();
430  // arm->send();
431  // }
433 
434  // Updates feedback and generates the basic command for this timestep.
435  // To retrieve the feedback, call `getLastFeedback()` after this call.
436  // You can modify the command object after calling this.
437  //
438  // Returns 'false' on a connection problem; true on success.
439  bool update();
440 
441  // Sends the command last computed by "update" to the robot arm. Any user
442  // modifications to the command are included.
443  bool send();
444 
446  // Goals
447  //
448  // A goal is a desired (joint angle) position that the arm should reach, and
449  // optionally information about the time it should reach that goal at and the
450  // path (position, velocity, and acceleration waypoints) it should take to
451  // get there.
452  //
453  // The default behavior when a goal is set is for the arm to plan and begin
454  // executing a smooth motion from its current state to this goal, with an
455  // internal heuristic that defines the time at which it will reach the goal.
456  // This immediately overrides any previous goal that was set.
457  //
458  // If there is no "active" goal the arm is set into a mode where it is
459  // actively controlled to be approximately weightless, and can be moved around
460  // by hand easily. This is the default state when the arm is created.
461  //
462  // After reaching the goal, the arm continues to be commanded with the final
463  // joint state of the set goal, and is _not_ implicitly returned to a
464  // "weightless" mode.
465  //
466  // A goal may also define "aux" states to be sent to an end effector
467  // associated with the arm. In this case, the end effector states are
468  // treated as "step functions", immediately being commanded at the timestamp
469  // of the waypoint they are associated with. An empty "aux" goal or "NaN"
470  // defines a "no transition" at the given waypoint.
472 
473  // Set the current goal waypoint(s), immediately replanning to these
474  // location(s) and optionally end effector states.
475  // Goal is a commanded position / velocity.
476  void setGoal(const Goal& goal);
477 
478  // Set the state of aux, if added (e.g., end effector). Overrides any
479  // future aux waypoints.
480  template<typename T>
481  void setAuxState(const T& aux_state) {
482  auto aux_size = aux_state.size();
483  if (aux_state.size() > 0) {
484  aux_times_.resize(1);
485  aux_times_[0] = get_current_time_s_();
486  aux_.resize(aux_size, 1);
487  // Replaces 'aux_.leftCols(1) = aux_state;'
488  for (size_t i = 0; i < aux_size; i++) {
489  aux_(i, 0) = aux_state[i];
490  }
491  } else {
492  // Reset aux states
493  aux_.resize(0, 0);
494  aux_times_.resize(0);
495  }
496  }
497 
498  // Returns the progress (from 0 to 1) of the current goal, per the last
499  // update call.
500  //
501  // If we have reached the goal, progress is "1". If there is no active goal,
502  // or we have just begun, progress is "0".
503  double goalProgress() const;
504 
505  // Have we reached the goal? If there is no goal, returns 'false'
506  bool atGoal() const { return goalProgress() >= 1.0; }
507 
508  // Cancels any active goal, returning to a "weightless" state which does not
509  // actively command position or velocity.
510  void cancelGoal();
511 
513  // Helper functions for forward and inverse kinematics.
515 
516  // Use the following joint limits when computing IK
517  // Affects future calls to solveIK**.
518  void setJointLimits(const Eigen::VectorXd& min_positions, const Eigen::VectorXd& max_positions) {
519  kinematics_helper_.setJointLimits(*robot_model_, min_positions, max_positions);
520  }
521 
522  // Do not use joint limits when computing IK
523  // Affects future calls to solveIK**.
525  kinematics_helper_.clearJointLimits();
526  }
527 
528  // Get the end effector (x,y,z) location
529  Eigen::Vector3d FK(const Eigen::VectorXd& positions) const {
530  return kinematics_helper_.FK3Dof(*robot_model_, positions);
531  }
532 
533  // Get the end effector (x,y,z) location and direction, represented by a unit-length vector
534  void FK(const Eigen::VectorXd& positions, Eigen::Vector3d& xyz_out, Eigen::Vector3d& tip_axis) const {
535  kinematics_helper_.FK5Dof(*robot_model_, positions, xyz_out, tip_axis);
536  }
537 
538  // Get the end effector (x,y,z) location and orientation (represented by a rotation matrix)
539  void FK(const Eigen::VectorXd& positions, Eigen::Vector3d& xyz_out, Eigen::Matrix3d& orientation) const {
540  kinematics_helper_.FK6Dof(*robot_model_, positions, xyz_out, orientation);
541  }
542 
543  // Return the joint angles to move to a given xyz location
544  Eigen::VectorXd solveIK(const Eigen::VectorXd& initial_positions, const Eigen::Vector3d& target_xyz) const {
545  return kinematics_helper_.solveIK3Dof(*robot_model_, initial_positions, target_xyz);
546  }
547 
548  // Return the joint angles to move to a given xyz location while
549  // pointing a certain direction
550  Eigen::VectorXd solveIK(const Eigen::VectorXd& initial_positions, const Eigen::Vector3d& target_xyz,
551  const Eigen::Vector3d& end_tip) const {
552  return kinematics_helper_.solveIK5Dof(*robot_model_, initial_positions, target_xyz, end_tip);
553  }
554 
555  // Return the joint angles to move to a given xyz location while
556  // pointing a certain direction
557  Eigen::VectorXd solveIK(const Eigen::VectorXd& initial_positions, const Eigen::Vector3d& target_xyz,
558  const Eigen::Matrix3d& orientation) const {
559  return kinematics_helper_.solveIK6Dof(*robot_model_, initial_positions, target_xyz, orientation);
560  }
561 
562 private:
563  // Private arm constructor
564  Arm(std::function<double()> get_current_time_s, std::shared_ptr<Group> group,
565  std::shared_ptr<robot_model::RobotModel> robot_model, std::shared_ptr<EndEffectorBase> end_effector = nullptr)
566  : get_current_time_s_(get_current_time_s),
567  last_time_(get_current_time_s()),
568  group_(std::move(group)),
569  robot_model_(std::move(robot_model)),
570  end_effector_(std::move(end_effector)),
571  pos_(Eigen::VectorXd::Zero(group_->size())),
572  vel_(Eigen::VectorXd::Zero(group_->size())),
573  accel_(Eigen::VectorXd::Zero(group_->size())),
574  feedback_(group_->size()),
575  command_(group_->size()) {}
576 
577  // Optionally uses lookup object internally
578  static std::unique_ptr<Arm> create(const RobotConfig& config, const Lookup* lookup);
579  // Optionally uses lookup object internally
580  static std::unique_ptr<Arm> create(const Params& config, const Lookup* lookup);
581 
582  // Returns the aux state at this point in the trajectory
583  Eigen::VectorXd getAux(double t) const;
584 
585  std::function<double()> get_current_time_s_;
586  double last_time_;
587  std::shared_ptr<Group> group_;
588  std::shared_ptr<robot_model::RobotModel> robot_model_;
589  std::shared_ptr<EndEffectorBase> end_effector_;
590 
591  // The joint angle trajectory for reaching the current goal.
592  std::shared_ptr<trajectory::Trajectory> trajectory_;
593  double trajectory_start_time_{std::numeric_limits<double>::quiet_NaN()};
594  // These are just temporary variables to cache output from
595  // Trajectory::getState.
596  Eigen::VectorXd pos_;
597  Eigen::VectorXd vel_;
598  Eigen::VectorXd accel_;
599 
600  // Along with a trajectory, aux states may be set. These are the last aux
601  // state for each timestep in the trajectory:
602  Eigen::VectorXd aux_times_;
603  Eigen::MatrixXd aux_;
604 
605  // Robot model helpers for FK + IK
606  internal::KinematicsHelper kinematics_helper_;
607 
608  hebi::GroupFeedback feedback_;
609  hebi::GroupCommand command_;
610 
611  // Current arm plugins
612  std::vector<std::shared_ptr<plugin::Plugin>> plugins_;
613 
614  friend plugin::DynamicsCompensationEffort;
615 };
616 
617 } // namespace arm
618 } // namespace hebi
void setJointLimits(const Eigen::VectorXd &min_positions, const Eigen::VectorXd &max_positions)
Definition: arm.hpp:518
bool updateImpl(Arm &arm, double dt) override
Definition: arm.cpp:281
std::function< std::unique_ptr< Plugin >(const PluginConfig &)> Factory
Definition: arm.hpp:130
std::function< double()> get_current_time_s_
Definition: arm.hpp:345
bool loadGains(const std::string &gains_file)
Definition: arm.cpp:664
Definition: plugin_config.hpp:11
virtual bool updateImpl(Arm &, double dt)=0
virtual bool send()
Definition: arm.hpp:78
A list of Feedback objects that can be received from a Group of modules; the size() must match the nu...
Definition: group_feedback.hpp:18
static std::unique_ptr< DynamicsCompensationEffort > create(const PluginConfig &)
Definition: arm.cpp:183
static std::string pluginTypeName()
Definition: arm.hpp:145
static std::unique_ptr< GravityCompensationEffort > create(const PluginConfig &)
Definition: arm.cpp:103
Represents a group of physical HEBI modules, and allows Command, Feedback, and Info objects to be sen...
Definition: group.hpp:42
bool atGoal() const
Definition: arm.hpp:506
static std::string pluginTypeName()
Definition: arm.hpp:261
bool onAssociated(const Arm &arm) override
Definition: arm.cpp:213
void setJointLimits(const robot_model::RobotModel &robot_model, const Eigen::VectorXd &min_positions, const Eigen::VectorXd &max_positions)
Definition: kinematics_helper.cpp:7
static std::unique_ptr< DoubledJoint > create(const PluginConfig &)
Definition: arm.cpp:384
static std::string pluginTypeName()
Definition: arm.hpp:168
Eigen::VectorXd solveIK3Dof(const robot_model::RobotModel &robot_model, const Eigen::VectorXd &initial_positions, const Eigen::Vector3d &target_xyz) const
Definition: kinematics_helper.cpp:44
float rampTime()
Definition: arm.hpp:71
GroupCommand & pendingCommand()
Definition: arm.hpp:416
bool update(Arm &, double dt)
Definition: arm.cpp:87
Eigen::VectorXd ki() const
Definition: arm.hpp:203
virtual bool applyParameterImpl(const std::string &, const std::vector< double > &)
Definition: arm.hpp:97
bool applyParameterImpl(const std::string &name, bool value) override
Definition: arm.cpp:410
Eigen::VectorXd solveIK6Dof(const robot_model::RobotModel &robot_model, const Eigen::VectorXd &initial_positions, const Eigen::Vector3d &target_xyz, const Eigen::Matrix3d &orientation) const
Definition: kinematics_helper.cpp:97
void setEnabled(bool enabled)
Definition: arm.hpp:63
bool onAssociated(const Arm &arm) override
Definition: arm.cpp:110
std::vector< std::string > names_
Definition: arm.hpp:326
bool updateImpl(Arm &arm, double dt) override
Definition: arm.cpp:379
bool setKi(const Eigen::VectorXd &ki)
Definition: arm.cpp:229
Definition: arm.cpp:10
virtual bool applyParameterImpl(const std::string &, double)
Definition: arm.hpp:96
size_t size() const
Definition: arm.hpp:391
robot_model::RobotModel & robotModel()
Definition: arm.hpp:401
virtual bool onAssociated(const Arm &)
Definition: arm.hpp:83
virtual ~Plugin()=default
virtual bool applyParameterImpl(const std::string &, const std::vector< std::string > &)
Definition: arm.hpp:99
std::weak_ptr< plugin::Plugin > getPluginByType()
Definition: arm.hpp:371
Represents a chain or tree of robot elements (rigid bodies and joints).
Definition: robot_model.hpp:412
bool updateImpl(Arm &arm, double dt) override
Definition: arm.cpp:442
Definition: arm.hpp:48
Definition: arm.hpp:322
Eigen::VectorXd kd() const
Definition: arm.hpp:198
static std::unique_ptr< Arm > create(const RobotConfig &config)
Definition: arm.cpp:475
Eigen::VectorXd kp() const
Definition: arm.hpp:193
void FK5Dof(const robot_model::RobotModel &robot_model, const Eigen::VectorXd &positions, Eigen::Vector3d &xyz_out, Eigen::Vector3d &tip_axis) const
Definition: kinematics_helper.cpp:134
Eigen::VectorXd solveIK(const Eigen::VectorXd &initial_positions, const Eigen::Vector3d &target_xyz, const Eigen::Matrix3d &orientation) const
Definition: arm.hpp:557
Definition: arm.cpp:11
std::shared_ptr< robot_model::RobotModel > robot_model_
Definition: arm.hpp:335
Eigen::VectorXd solveIK5Dof(const robot_model::RobotModel &robot_model, const Eigen::VectorXd &initial_positions, const Eigen::Vector3d &target_xyz, const Eigen::Vector3d &end_tip) const
Definition: kinematics_helper.cpp:69
std::string name() const
Definition: arm.hpp:54
std::vector< std::string > families_
Definition: arm.hpp:325
bool applyParameterImpl(const std::string &name, double value) override
Definition: arm.cpp:120
void setAuxState(const T &aux_state)
Definition: arm.hpp:481
Definition: arm.hpp:258
bool gainsInEndEffectorFrame() const
Definition: arm.hpp:188
bool update()
Definition: arm.cpp:672
bool updateImpl(Arm &arm, double dt) override
Definition: arm.cpp:196
Eigen::Vector3d FK(const Eigen::VectorXd &positions) const
Definition: arm.hpp:529
Plugin for providing gravity compensating torques for the arm.
Definition: arm.hpp:142
void clearJointLimits()
Definition: arm.hpp:524
bool applyParameters(const PluginConfig &config, std::set< std::string > required_parameters)
Definition: arm.cpp:22
bool enabled() const
Definition: arm.hpp:60
bool setParam(const std::string &name, const Eigen::VectorXd &value_vector)
Definition: arm.cpp:237
const Group & group() const
Definition: arm.hpp:394
const trajectory::Trajectory * trajectory() const
Definition: arm.hpp:406
Eigen::VectorXd solveIK(const Eigen::VectorXd &initial_positions, const Eigen::Vector3d &target_xyz) const
Definition: arm.hpp:544
int command_lifetime_
Definition: arm.hpp:328
bool setKp(const Eigen::VectorXd &kp)
Definition: arm.cpp:221
bool applyParameterImpl(const std::string &name, bool value) override
Definition: arm.cpp:242
std::weak_ptr< plugin::Plugin > getPluginByName(const std::string &name)
Definition: arm.cpp:656
Definition: arm.hpp:241
static std::string pluginTypeName()
Definition: arm.hpp:244
void FK(const Eigen::VectorXd &positions, Eigen::Vector3d &xyz_out, Eigen::Matrix3d &orientation) const
Definition: arm.hpp:539
bool setKd(const Eigen::VectorXd &kd)
Definition: arm.cpp:225
A list of Command objects appropriate for sending to a Group of modules; the size() must match the nu...
Definition: group_command.hpp:19
bool updateImpl(Arm &arm, double dt) override
Definition: arm.cpp:157
double control_frequency_
Definition: arm.hpp:331
void setGainsInEndEffectorFrame(bool gains_in_end_effector_frame)
Definition: arm.cpp:217
static std::string pluginTypeName()
Definition: arm.hpp:183
bool addPlugin(std::unique_ptr< plugin::Plugin > plugin)
Definition: arm.cpp:643
void cancelGoal()
Definition: arm.cpp:815
const EndEffectorBase * endEffector() const
Definition: arm.hpp:411
bool applyParameterImpl(const std::string &name, const std::vector< double > &value) override
Definition: arm.cpp:368
bool onAssociated(const Arm &arm) override
Definition: arm.cpp:361
const GroupCommand & pendingCommand() const
Definition: arm.hpp:417
Eigen::Vector3d FK3Dof(const robot_model::RobotModel &robot_model, const Eigen::VectorXd &positions) const
Definition: kinematics_helper.cpp:125
double goalProgress() const
Definition: arm.cpp:803
static std::unique_ptr< EffortOffset > create(const PluginConfig &)
Definition: arm.cpp:354
Definition: arm.hpp:315
const GroupFeedback & lastFeedback() const
Definition: arm.hpp:421
Maintains a registry of network-connected modules and returns Group objects to the user.
Definition: lookup.hpp:24
bool setIClamp(const Eigen::VectorXd &i_clamp)
Definition: arm.cpp:233
static std::unique_ptr< ImpedanceController > create(const PluginConfig &)
Definition: arm.cpp:206
Represents a smooth trajectory through a set of waypoints.
Definition: trajectory.hpp:17
Definition: robot_config.hpp:13
void clearJointLimits()
Definition: kinematics_helper.cpp:37
bool onAssociated(const Arm &arm) override
Definition: arm.cpp:391
Plugin(const std::string &name)
Definition: arm.hpp:50
virtual bool applyParameterImpl(const std::string &, bool)
Definition: arm.hpp:94
Eigen::VectorXd solveIK(const Eigen::VectorXd &initial_positions, const Eigen::Vector3d &target_xyz, const Eigen::Vector3d &end_tip) const
Definition: arm.hpp:550
Definition: end_effector.hpp:11
virtual bool applyParameterImpl(const std::string &, const std::string &)
Definition: arm.hpp:98
Definition: goal.hpp:15
std::string hrdf_file_
Definition: arm.hpp:334
Eigen::VectorXd iClamp() const
Definition: arm.hpp:208
static std::map< std::string, plugin::Factory > ArmPluginMap
Definition: arm.hpp:282
float enabledRatio()
Definition: arm.hpp:66
bool onAssociated(const Arm &arm) override
Definition: arm.cpp:190
virtual bool applyParameterImpl(const std::string &, const std::vector< bool > &)
Definition: arm.hpp:95
void setGoal(const Goal &goal)
Definition: arm.cpp:739
std::shared_ptr< EndEffectorBase > end_effector_
Definition: arm.hpp:339
bool send()
Definition: arm.cpp:722
bool setRampTime(float ramp_time)
Definition: arm.cpp:15
const robot_model::RobotModel & robotModel() const
Definition: arm.hpp:397
void FK(const Eigen::VectorXd &positions, Eigen::Vector3d &xyz_out, Eigen::Vector3d &tip_axis) const
Definition: arm.hpp:534
void FK6Dof(const robot_model::RobotModel &robot_model, const Eigen::VectorXd &positions, Eigen::Vector3d &xyz_out, Eigen::Matrix3d &orientation) const
Definition: kinematics_helper.cpp:146