Franky 0.12.0
A High-Level Motion API for Franka
Loading...
Searching...
No Matches
robot.hpp
Go to the documentation of this file.
1#pragma once
2
3#include <franka/control_types.h>
4#include <franka/duration.h>
5#include <franka/exception.h>
6#include <franka/model.h>
7#include <franka/robot.h>
8#include <franka/robot_state.h>
9
10#include <exception>
11#include <future>
12#include <optional>
13#include <stdexcept>
14#include <variant>
15
20#include "franky/model.hpp"
24#include "franky/robot_pose.hpp"
27#include "franky/types.hpp"
28#include "franky/util.hpp"
29
30namespace franky {
31
38struct InvalidMotionTypeException : std::runtime_error {
39 using std::runtime_error::runtime_error;
40};
41
47class Robot : public franka::Robot {
48 public:
52 struct Params {
59
64
69
75 franka::ControllerMode controller_mode{franka::ControllerMode::kJointImpedance};
76
82 franka::RealtimeConfig realtime_config{franka::RealtimeConfig::kEnforce};
83
92 };
93
94 // clang-format off
99 "translational velocity", 1.7, 0.7, control_mutex_, [this] { return is_in_control_unsafe(); }};
100
105 "rotational velocity", 2.5, 2.5, control_mutex_, [this] { return is_in_control_unsafe(); }};
106
111 "elbow velocity", 2.175, 2.175, control_mutex_, [this] { return is_in_control_unsafe(); }};
112
117 "translational acceleration", 13.0, 2.0, control_mutex_, [this] { return is_in_control_unsafe(); }};
118
123 "rotational acceleration", 25.0, 10.0, control_mutex_, [this] { return is_in_control_unsafe(); }};
124
129 "elbow acceleration", 10.0, 4.0, control_mutex_, [this] { return is_in_control_unsafe(); }};
130
135 "translational jerk", 6500.0, 500.0, control_mutex_, [this] { return is_in_control_unsafe(); }};
136
141 "rotational jerk", 12500.0, 2000.0, control_mutex_, [this] { return is_in_control_unsafe(); }};
142
147 "elbow jerk", 5000.0, 800.0, control_mutex_, [this] { return is_in_control_unsafe(); }};
148
152#define MAX_JOINT_VEL toEigenD<7>({2.175, 2.175, 2.175, 2.175, 2.610, 2.610, 2.610})
154 "joint_velocity", MAX_JOINT_VEL, MAX_JOINT_VEL, control_mutex_,
155 [this] { return is_in_control_unsafe(); }
156 };
157
161#define MAX_JOINT_ACC toEigenD<7>({15.0, 7.5, 10.0, 12.5, 15.0, 20.0, 20.0})
163 "joint_acceleration", MAX_JOINT_ACC, MAX_JOINT_ACC * 0.3, control_mutex_,
164 [this] { return is_in_control_unsafe(); }
165 };
166
170#define MAX_JOINT_JERK toEigenD<7>({7500.0, 3750.0, 5000.0, 6250.0, 7500.0, 10000.0, 10000.0})
172 "joint_jerk", MAX_JOINT_JERK, MAX_JOINT_JERK * 0.3, control_mutex_,
173 [this] { return is_in_control_unsafe(); }
174 };
175
176 // clang-format on
177
179 static constexpr size_t degrees_of_freedoms{7};
180
182 static constexpr double control_rate{0.001};
183
187 explicit Robot(const std::string &fci_hostname);
188
193 explicit Robot(const std::string &fci_hostname, const Params &params);
194
195 using franka::Robot::setCollisionBehavior;
196
204
216
244
249 bool recoverFromErrors();
250
255 [[nodiscard]] bool hasErrors();
256
262
268
274 auto s = state();
275 return {
276 {Affine(Eigen::Matrix4d::Map(s.O_T_EE.data())), ElbowState{s.elbow}}, RobotVelocity(s.O_dP_EE_c, s.delbow_c)};
277 }
278
284 auto s = state();
285 return {s.q, s.dq};
286 }
287
293
299
305
311
317
321 [[nodiscard]] bool is_in_control();
322
326 [[nodiscard]] std::string fci_hostname() const;
327
331 [[nodiscard]] std::optional<ControlSignalType> current_control_signal_type();
332
338 [[nodiscard]] std::shared_ptr<const Model> model() const { return model_; }
339
340#ifdef FRANKA_0_15
345 [[nodiscard]] std::string model_urdf() const { return model_urdf_; }
346#endif
347
351 bool joinMotion() {
352 std::unique_lock lock(*control_mutex_);
353 return joinMotionUnsafe(lock);
354 }
355
363 template <class Rep, class Period>
364 bool joinMotion(const std::chrono::duration<Rep, Period> &timeout) {
365 std::unique_lock lock(*control_mutex_);
367 }
368
374 [[nodiscard]]
375 bool pollMotion() {
376 return joinMotion(std::chrono::milliseconds(0));
377 }
378
379 // These helper functions are needed as the implicit template deduction does not work on subclasses of Motion
380
386 void move(const std::shared_ptr<Motion<franka::CartesianPose>> &motion, bool async = false) {
388 motion, [this](const ControlFunc<franka::CartesianPose> &m) { control(m, params_.controller_mode); }, async);
389 }
390
396 void move(const std::shared_ptr<Motion<franka::CartesianVelocities>> &motion, bool async = false) {
398 motion,
399 [this](const ControlFunc<franka::CartesianVelocities> &m) { control(m, params_.controller_mode); },
400 async);
401 }
402
408 void move(const std::shared_ptr<Motion<franka::JointPositions>> &motion, bool async = false) {
410 motion, [this](const ControlFunc<franka::JointPositions> &m) { control(m, params_.controller_mode); }, async);
411 }
412
418 void move(const std::shared_ptr<Motion<franka::JointVelocities>> &motion, bool async = false) {
420 motion, [this](const ControlFunc<franka::JointVelocities> &m) { control(m, params_.controller_mode); }, async);
421 }
422
428 void move(const std::shared_ptr<Motion<franka::Torques>> &motion, bool async = false) {
429 moveInternal<franka::Torques>(motion, [this](const ControlFunc<franka::Torques> &m) { control(m); }, async);
430 }
431
432 private:
433 std::shared_ptr<const Model> model_;
434#ifdef FRANKA_0_15
435 std::string model_urdf_;
436#endif
437
438 template <typename ControlSignalType>
439 using ControlFunc = std::function<ControlSignalType(const franka::RobotState &, franka::Duration)>;
440 using MotionGeneratorVariant = std::variant<
444
446 std::string fci_hostname_;
447 Params params_;
448 RobotState current_state_;
449 std::mutex state_mutex_;
450 std::shared_ptr<std::mutex> control_mutex_;
451 std::condition_variable control_finished_condition_;
452 std::exception_ptr control_exception_;
453 std::thread control_thread_;
454 MotionGeneratorVariant motion_generator_{std::nullopt};
455 bool motion_generator_running_{false};
456
457 RobotState convertState(const franka::RobotState &franka_robot_state, Vector7d ddq_est) const;
458
459 RobotState initState(const franka::RobotState &franka_robot_state) const;
460
461 RobotState updateState(const RobotState &robot_state, const franka::RobotState &franka_robot_state) const;
462
463 [[nodiscard]] bool is_in_control_unsafe() const;
464
465 template <class Rep = long, class Period = std::ratio<1>>
466 bool joinMotionUnsafe(
467 std::unique_lock<std::mutex> &lock,
468 const std::optional<std::chrono::duration<Rep, Period>> &timeout = std::nullopt) {
469 while (motion_generator_running_) {
470 if (timeout.has_value()) {
471 if (control_finished_condition_.wait_for(lock, timeout.value()) == std::cv_status::timeout) {
472 return false;
473 }
474 } else {
475 control_finished_condition_.wait(lock);
476 }
477 }
478 if (control_thread_.joinable()) control_thread_.join();
479 if (control_exception_ != nullptr) {
480 auto control_exception = control_exception_;
481 control_exception_ = nullptr;
482 std::rethrow_exception(control_exception);
483 }
484 return true;
485 }
486
487 template <typename ControlSignalType>
488 void moveInternal(
489 const std::shared_ptr<Motion<ControlSignalType>> &motion,
490 const std::function<void(const ControlFunc<ControlSignalType> &)> &control_func_executor, bool async) {
491 if (motion == nullptr) {
492 throw std::invalid_argument("The motion must not be null.");
493 }
494 { // Do not remove brace, it is needed to scope the lock
495 std::unique_lock lock(*control_mutex_);
496 if (is_in_control_unsafe() && motion_generator_running_) {
497 if (!std::holds_alternative<MotionGenerator<ControlSignalType>>(motion_generator_)) {
498 throw InvalidMotionTypeException(
499 "The type of motion cannot change during runtime. Please ensure that the "
500 "previous motion finished before using a new type of motion.");
501 }
502 std::get<MotionGenerator<ControlSignalType>>(motion_generator_).updateMotion(motion);
503 } else {
504 joinMotionUnsafe(lock);
505
506 motion_generator_.emplace<MotionGenerator<ControlSignalType>>(this, motion);
507 auto motion_generator = &std::get<MotionGenerator<ControlSignalType>>(motion_generator_);
508 motion_generator->registerUpdateCallback(
509 [this](const RobotState &robot_state, franka::Duration duration, franka::Duration time) {
510 std::lock_guard lock(state_mutex_);
511 current_state_ = robot_state;
512 });
513 motion_generator_running_ = true;
514 control_thread_ = std::thread([this, control_func_executor, motion_generator]() {
515 try {
516 bool done = false;
517 std::optional<RobotState> robot_state;
518 while (!done) {
520 [this, motion_generator, &robot_state](const franka::RobotState &rs, franka::Duration d) {
521 if (!robot_state.has_value())
522 robot_state = initState(rs);
523 else
524 robot_state = updateState(robot_state.value(), rs);
525 return (*motion_generator)(robot_state.value(), d);
526 });
527 std::unique_lock lock(*control_mutex_);
528
529 // This code is just for the case that a new motion is set just after the old one terminates. If this
530 // happens, we need to continue with this motion, unless an exception occurs.
531 done = !motion_generator->has_new_motion();
532 if (motion_generator->has_new_motion()) {
533 motion_generator->resetTimeUnsafe();
534 } else {
535 done = true;
536 motion_generator_running_ = false;
537 control_finished_condition_.notify_all();
538 }
539 }
540 } catch (...) {
541 std::unique_lock lock(*control_mutex_);
542 control_exception_ = std::current_exception();
543 motion_generator_running_ = false;
544 control_finished_condition_.notify_all();
545 }
546 });
547 }
548 }
549 if (!async) joinMotion();
550 }
551};
552
553} // namespace franky
Definition cartesian_state.hpp:17
RobotPose pose() const
Definition cartesian_state.hpp:60
RobotVelocity velocity() const
Definition cartesian_state.hpp:67
A template class representing a dynamics limit with a maximum value.
Definition dynamics_limit.hpp:21
Elbow state of the robot.
Definition elbow_state.hpp:27
Joint state of a robot.
Definition joint_state.hpp:15
Vector7d velocity() const
The velocity component of the state.
Definition joint_state.hpp:49
Vector7d position() const
The position component of the state.
Definition joint_state.hpp:42
Helper class for handling motions and reactions.
Definition motion_generator.hpp:31
Base class for motions.
Definition motion.hpp:23
Relative dynamics factors.
Definition relative_dynamics_factor.hpp:13
A class representing a Franka robot.
Definition robot.hpp:47
DynamicsLimit< Vector7d > joint_acceleration_limit
Definition robot.hpp:162
void move(const std::shared_ptr< Motion< franka::JointPositions > > &motion, bool async=false)
Execute the given motion.
Definition robot.hpp:408
bool joinMotion(const std::chrono::duration< Rep, Period > &timeout)
Wait for the current motion to finish with a timeout. Throw any exceptions that occurred during the m...
Definition robot.hpp:364
std::optional< ControlSignalType > current_control_signal_type()
The type of the current control signal.
Definition robot.cpp:117
void move(const std::shared_ptr< Motion< franka::CartesianPose > > &motion, bool async=false)
Execute the given motion.
Definition robot.hpp:386
std::string fci_hostname() const
The hostname of the robot.
Definition robot.cpp:113
Vector7d currentJointVelocities()
Returns the current joint velocities of the robot.
Definition robot.hpp:298
bool joinMotion()
Wait for the current motion to finish. Throw any exceptions that occurred during the motion.
Definition robot.hpp:351
static constexpr double control_rate
Definition robot.hpp:182
DynamicsLimit< double > elbow_acceleration_limit
Elbow acceleration limit [rad/s²].
Definition robot.hpp:128
RelativeDynamicsFactor relative_dynamics_factor()
Returns the current global relative dynamics factor of the robot.
Definition robot.cpp:132
Vector7d currentJointPositions()
Returns the current joint positions of the robot.
Definition robot.hpp:292
void move(const std::shared_ptr< Motion< franka::Torques > > &motion, bool async=false)
Execute the given motion.
Definition robot.hpp:428
CartesianState currentCartesianState()
Returns the current cartesian state of the robot.
Definition robot.hpp:273
DynamicsLimit< Vector7d > joint_velocity_limit
Definition robot.hpp:153
RobotState state()
Returns the current state of the robot.
Definition robot.cpp:56
DynamicsLimit< double > translation_jerk_limit
Translational jerk limit [m/s³].
Definition robot.hpp:134
DynamicsLimit< double > translation_velocity_limit
Translational velocity limit [m/s].
Definition robot.hpp:98
bool recoverFromErrors()
Calls the automatic error recovery of the robot and returns whether the recovery was successful.
Definition robot.cpp:51
DynamicsLimit< double > elbow_velocity_limit
Elbow velocity limit [rad/s].
Definition robot.hpp:110
DynamicsLimit< double > rotation_velocity_limit
Rotational velocity limit [rad/s].
Definition robot.hpp:104
DynamicsLimit< double > elbow_jerk_limit
Elbow jerk limit [rad/s³].
Definition robot.hpp:146
bool is_in_control()
Whether the robot is currently in control, i.e. a motion is being executed.
Definition robot.cpp:108
void move(const std::shared_ptr< Motion< franka::JointVelocities > > &motion, bool async=false)
Execute the given motion.
Definition robot.hpp:418
DynamicsLimit< Vector7d > joint_jerk_limit
Definition robot.hpp:171
JointState currentJointState()
Returns the current joint state of the robot.
Definition robot.hpp:283
void setCollisionBehavior(const ScalarOrArray< 7 > &torque_threshold, const ScalarOrArray< 6 > &force_threshold)
Set the collision behavior of the robot.
Definition robot.cpp:67
static constexpr size_t degrees_of_freedoms
Definition robot.hpp:179
RobotVelocity currentCartesianVelocity()
Returns the current cartesian velocity of the robot.
Definition robot.hpp:267
DynamicsLimit< double > rotation_jerk_limit
Rotational jerk limit [rad/s³].
Definition robot.hpp:140
void move(const std::shared_ptr< Motion< franka::CartesianVelocities > > &motion, bool async=false)
Execute the given motion.
Definition robot.hpp:396
void setRelativeDynamicsFactor(const RelativeDynamicsFactor &relative_dynamics_factor)
Sets the global relative dynamics factor of the robot.
Definition robot.cpp:137
std::shared_ptr< const Model > model() const
The model of the robot.
Definition robot.hpp:338
DynamicsLimit< double > translation_acceleration_limit
Translational acceleration limit [m/s²].
Definition robot.hpp:116
bool hasErrors()
Returns whether the robot has errors.
Definition robot.cpp:47
RobotPose currentPose()
Returns the current pose of the robot.
Definition robot.hpp:261
DynamicsLimit< double > rotation_acceleration_limit
Rotational acceleration limit [rad/s²].
Definition robot.hpp:122
bool pollMotion()
Check whether the robot is still in motion. This function is non-blocking and returns immediately....
Definition robot.hpp:375
Cartesian pose of a robot.
Definition robot_pose.hpp:17
Cartesian velocity of a robot.
Definition robot_velocity.hpp:19
Definition dynamics_limit.cpp:8
std::array< double, dims > toStdD(const Eigen::Matrix< double, dims, 1 > &vector)
Definition util.hpp:18
Eigen::Vector< double, 7 > Vector7d
Definition types.hpp:12
ControlSignalType
Type of control signal.
Definition control_signal_type.hpp:8
std::variant< double, Array< dims > > ScalarOrArray
Definition types.hpp:22
Eigen::Affine3d Affine
Definition types.hpp:16
#define MAX_JOINT_JERK
Joint jerk limit [rad/s³].
Definition robot.hpp:170
#define MAX_JOINT_ACC
Joint acceleration limit [rad/s²].
Definition robot.hpp:161
#define MAX_JOINT_VEL
Joint velocity limit [rad/s].
Definition robot.hpp:152
Exception thrown when an invalid motion type is used.
Definition robot.hpp:38
Global parameters for the robot.
Definition robot.hpp:52
RelativeDynamicsFactor relative_dynamics_factor
Relative dynamics factor for the robot.
Definition robot.hpp:58
double default_force_threshold
Default force threshold for collision behavior.
Definition robot.hpp:68
franka::ControllerMode controller_mode
Default controller mode for the robot.
Definition robot.hpp:75
double joint_acceleration_estimator_decay
Joint acceleration estimator decay.
Definition robot.hpp:91
franka::RealtimeConfig realtime_config
Default realtime configuration for the robot.
Definition robot.hpp:82
double default_torque_threshold
Default torque threshold for collision behavior.
Definition robot.hpp:63
Full state of the robot.
Definition robot_state.hpp:20