|
1 | 1 | # Admittance parameters. |
2 | | -# These are the parameters of a mass-spring-damper model that determines |
3 | | -# the admittance behavior on each of the Cartesian axes. |
| 2 | +# These are the parameters of a mass-spring-damper model that determine |
| 3 | +# the admittance behavior on each of the Cartesian axes of each tip. |
| 4 | +# Each of the individual mass, spring, and damper vectors have 6 elements, one for each Cartesian axis. |
| 5 | +# They are given in the order: [X, Y, Z, RX, RY, RZ]. |
4 | 6 | # Use carefully. Certain choices may lead to unstable behavior. |
5 | | -float64[] mass |
6 | | -float64[] stiffness |
7 | | -float64[] damping |
| 7 | +float64[6] mass |
| 8 | +float64[6] stiffness |
| 9 | +float64[6] damping |
| 10 | +bool[6] selected_axes # Axes in the control frame to control with admittance. |
| 11 | +# Joint space damping. If there are multiple tips and corresponding chains in the Admittance problem, and the chains |
| 12 | +# share joints, then the joint_damping must match in the AdmittanceParameters that correspond to the overlapping joints. |
8 | 13 | float64 joint_damping |
9 | 14 |
|
10 | | -geometry_msgs/Pose ee_pose_control # Control frame w.r.t. end-effector frame. |
11 | | -bool[] selected_axes # Axes in the control frame to control with admittance. |
| 15 | +# End-effector frame, mass, and center of gravity (CoG) position. |
| 16 | +string end_effector_frame |
| 17 | +float64 end_effector_mass |
| 18 | +float64 end_effector_cog[] # X,Y,Z center of gravity in the end-effector frame. If empty, will default to [0.0, 0.0, 0.0]. |
| 19 | +geometry_msgs/Pose ee_pose_control # Control frame w.r.t. end-effector frame. If empty, will default to identity pose. |
| 20 | + |
| 21 | +# The absolute force or torque threshold value for each Cartesian axis at which |
| 22 | +# the controller will stop executing if exceeded. |
| 23 | +# If the absolute value of an axis of the measured FTS wrench exceeds the corresponding |
| 24 | +# threshold, the trajectory goal is aborted with 'error_code' set to |
| 25 | +# FORCE_TORQUE_THRESHOLD_EXCEEDED. |
| 26 | +# If empty, default threshold values from configs will be used. |
| 27 | +float64[] absolute_force_torque_threshold |
0 commit comments