Inverse Kinematics for two HyQ legs attached to a brick (base). More...
#include <inverse_kinematics_hyq2.h>
Public Member Functions | |
Joints | GetAllJointAngles (const EndeffectorsPos &pos_B) const override |
Returns joint angles to reach for a specific foot position. More... | |
int | GetEECount () const override |
Number of endeffectors (feet, hands) this implementation expects. More... | |
InverseKinematicsHyq2 ()=default | |
virtual | ~InverseKinematicsHyq2 ()=default |
Public Member Functions inherited from xpp::InverseKinematics | |
InverseKinematics ()=default | |
virtual | ~InverseKinematics ()=default |
Private Attributes | |
HyqlegInverseKinematics | leg |
Additional Inherited Members | |
Public Types inherited from xpp::InverseKinematics | |
typedef std::shared_ptr< InverseKinematics > | Ptr |
typedef Eigen::Vector3d | Vector3d |
Inverse Kinematics for two HyQ legs attached to a brick (base).
Definition at line 42 of file inverse_kinematics_hyq2.h.
|
default |
|
virtualdefault |
|
overridevirtual |
Returns joint angles to reach for a specific foot position.
pos_B | 3D-position of the foot expressed in the base frame (B). |
Implements xpp::InverseKinematics.
Definition at line 41 of file inverse_kinematics_hyq2.cc.
|
inlineoverridevirtual |
Number of endeffectors (feet, hands) this implementation expects.
Implements xpp::InverseKinematics.
Definition at line 56 of file inverse_kinematics_hyq2.h.
|
private |
Definition at line 56 of file inverse_kinematics_hyq2.h.