Converts Cartesian endeffector positions into joint angles. More...
#include <inverse_kinematics.h>
Public Member Functions | |
virtual Joints | GetAllJointAngles (const EndeffectorsPos &pos_b) const =0 |
Calculates the joint angles to reach a position @ pos_b. | |
virtual int | GetEECount () const =0 |
Number of endeffectors (feet, hands) this implementation expects. | |
InverseKinematics () | |
virtual | ~InverseKinematics () |
Converts Cartesian endeffector positions into joint angles.
This class is responsible for calculating the joint angles of a robot given an endeffector position (=inverse kinematics). Base class that every inverse dynamics class must conform with.
Definition at line 48 of file inverse_kinematics.h.
virtual xpp::InverseKinematics::~InverseKinematics | ( | ) | [virtual] |
virtual Joints xpp::InverseKinematics::GetAllJointAngles | ( | const EndeffectorsPos & | pos_b | ) | const [pure virtual] |
Calculates the joint angles to reach a position @ pos_b.
pos_b | 3D-position of the endeffector expressed in base frame. |
virtual int xpp::InverseKinematics::GetEECount | ( | ) | const [pure virtual] |
Number of endeffectors (feet, hands) this implementation expects.