[Documentation] [TitleIndex] [WordIndex

Only released in EOL distros:  

shadow_robot: sr_description | sr_example | sr_gazebo_plugins | sr_hand | sr_hardware_interface | sr_kinematics | sr_mechanism_controllers | sr_mechanism_model | sr_move_arm | sr_movements | sr_robot_msgs | sr_tactile_sensors | sr_utilities

Package Summary

A specific shadowhand package derived from arm_kinematics, for computing both forward and backward kinematics for the fingers except thumb. Solution is analytic. Developed as an alternative to arm_kinematics that cannot solve coupled joints.

shadow_robot: sr_description | sr_example | sr_gazebo_plugins | sr_hand | sr_hardware_interface | sr_kinematics | sr_mechanism_controllers | sr_mechanism_model | sr_move_arm | sr_movements | sr_robot_msgs | sr_tactile_sensors | sr_utilities

Package Summary

A specific shadowhand package derived from arm_kinematics, for computing both forward and backward kinematics for the fingers except thumb. Solution is analytic. Developed as an alternative to arm_kinematics that cannot solve coupled joints.

shadow_robot: sr_description | sr_example | sr_gazebo_plugins | sr_hand | sr_hardware_interface | sr_mechanism_controllers | sr_mechanism_model | sr_move_arm | sr_movements | sr_robot_msgs | sr_self_test | sr_tactile_sensors | sr_utilities

Package Summary

A specific shadowhand package derived from arm_kinematics, for computing both forward and backward kinematics for the fingers except thumb. Solution is analytic. Developed as an alternative to arm_kinematics that cannot solve coupled joints.

Package Summary

A specific shadowhand package derived from arm_kinematics, for computing both forward and backward kinematics for the fingers except thumb. Solution is analytic. Developed as an alternative to arm_kinematics that cannot solve coupled joints.

Overview

sr_kinematics currently contains a specific analytical inverse kinematics for the shadow_robot hand. Currently, only the 4 fingers have an IK solution, the thumb will come later. The solution takes care of the coupled joint J1/J2 (assuming it is 1:1) and accepts 3D requests (instead of 6D). There is an approximation in this solution.

Detail of the solution

Approximation

The developed IK uses an approximation of the fingertip center to create a virtually simplified 2 links (3 dof) kinematic chain. The method considers the isoceles triangle formed by the coupled joint to solve the inverse kinematics.

Limits

ROS API

Services

The node proposes the same services and parameters as the arm_kinematics

NOTE that epsilon parameter is used to detect singularities for J4 joint.


2022-05-28 13:03