|
class | ArticulatedBodyInertia |
| 6D Inertia of a articulated body More...
|
|
class | Chain |
| This class encapsulates a serial kinematic interconnection structure. More...
|
|
class | ChainDynParam |
| Implementation of a method to calculate the matrices H (inertia),C(coriolis) and G(gravitation) for the calculation torques out of the pose and derivatives. More...
|
|
class | ChainFkSolverAcc |
| This abstract class encapsulates a solver for the forward acceleration kinematics for a KDL::Chain. More...
|
|
class | ChainFkSolverPos |
| This abstract class encapsulates a solver for the forward position kinematics for a KDL::Chain. More...
|
|
class | ChainFkSolverPos_recursive |
| Implementation of a recursive forward position kinematics algorithm to calculate the position transformation from joint space to Cartesian space of a general kinematic chain (KDL::Chain). More...
|
|
class | ChainFkSolverVel |
| This abstract class encapsulates a solver for the forward velocity kinematics for a KDL::Chain. More...
|
|
class | ChainFkSolverVel_recursive |
| Implementation of a recursive forward position and velocity kinematics algorithm to calculate the position and velocity transformation from joint space to Cartesian space of a general kinematic chain (KDL::Chain). More...
|
|
class | ChainIdSolver |
| This abstract class encapsulates the inverse dynamics solver for a KDL::Chain. More...
|
|
class | ChainIdSolver_RNE |
| Recursive newton euler inverse dynamics solver. More...
|
|
class | ChainIdSolver_Vereshchagin |
| Dynamics calculations by constraints based on Vereshchagin 1989. More...
|
|
class | ChainIkSolverAcc |
| This abstract class encapsulates the inverse acceleration solver for a KDL::Chain. More...
|
|
class | ChainIkSolverPos |
| This abstract class encapsulates the inverse position solver for a KDL::Chain. More...
|
|
class | ChainIkSolverPos_LMA |
| Solver for the inverse position kinematics that uses Levenberg-Marquardt. More...
|
|
class | ChainIkSolverPos_NR |
| Implementation of a general inverse position kinematics algorithm based on Newton-Raphson iterations to calculate the position transformation from Cartesian to joint space of a general KDL::Chain. More...
|
|
class | ChainIkSolverPos_NR_JL |
| Implementation of a general inverse position kinematics algorithm based on Newton-Raphson iterations to calculate the position transformation from Cartesian to joint space of a general KDL::Chain. More...
|
|
class | ChainIkSolverVel |
| This abstract class encapsulates the inverse velocity solver for a KDL::Chain. More...
|
|
class | ChainIkSolverVel_pinv |
| Implementation of a inverse velocity kinematics algorithm based on the generalize pseudo inverse to calculate the velocity transformation from Cartesian to joint space of a general KDL::Chain. More...
|
|
class | ChainIkSolverVel_pinv_givens |
| Implementation of a inverse velocity kinematics algorithm based on the generalize pseudo inverse to calculate the velocity transformation from Cartesian to joint space of a general KDL::Chain. More...
|
|
class | ChainIkSolverVel_pinv_nso |
| Implementation of a inverse velocity kinematics algorithm based on the generalize pseudo inverse to calculate the velocity transformation from Cartesian to joint space of a general KDL::Chain. More...
|
|
class | ChainIkSolverVel_wdls |
| Implementation of a inverse velocity kinematics algorithm based on the weighted pseudo inverse with damped least-square to calculate the velocity transformation from Cartesian to joint space of a general KDL::Chain. More...
|
|
class | ChainJntToJacDotSolver |
| Computes the Jacobian time derivative (Jdot) by calculating the partial derivatives regarding to a joint angle, in the Hybrid, Body-fixed or Inertial representation. More...
|
|
class | ChainJntToJacSolver |
| Class to calculate the jacobian of a general KDL::Chain, it is used by other solvers. More...
|
|
class | Frame |
| represents a frame transformation in 3D space (rotation + translation) More...
|
|
class | Frame2 |
| A 2D frame class, for further documentation see the Frames class for methods with unchanged semantics. More...
|
|
class | FrameAcc |
|
class | FrameVel |
|
class | Jacobian |
|
class | JntArray |
| This class represents an fixed size array containing joint values of a KDL::Chain. More...
|
|
class | JntArrayAcc |
|
class | JntArrayVel |
|
class | Joint |
| This class encapsulates a simple joint, that is with one parameterized degree of freedom and with scalar dynamic properties. More...
|
|
class | Path |
| The specification of the path of a trajectory. More...
|
|
class | Path_Circle |
| A circular Path with 'open ends'. More...
|
|
class | Path_Composite |
| A Path being the composition of other Path objects. More...
|
|
class | Path_Cyclic_Closed |
| A Path representing a closed circular movement, which is traversed a number of times. More...
|
|
class | Path_Line |
| A path representing a line from A to B. More...
|
|
class | Path_Point |
| A Path consisting only of a point in space. More...
|
|
class | Path_RoundedComposite |
| The specification of a path, composed of way-points with rounded corners. More...
|
|
class | RigidBodyInertia |
| 6D Inertia of a rigid body More...
|
|
class | Rotation |
| represents rotations in 3 dimensional space. More...
|
|
class | Rotation2 |
| A 2D Rotation class, for conventions see Rotation. More...
|
|
class | RotationAcc |
|
class | RotationalInertia |
|
class | RotationalInterpolation |
| RotationalInterpolation specifies the rotational part of a geometric trajectory. More...
|
|
class | RotationalInterpolation_SingleAxis |
| An interpolation algorithm which rotates a frame over the existing single rotation axis formed by start and end rotation. More...
|
|
class | RotationVel |
|
class | Segment |
| This class encapsulates a simple segment, that is a "rigid
body" (i.e., a frame and a rigid body inertia) with a joint and with "handles", root and tip to connect to other segments. More...
|
|
class | SolverI |
| Solver interface supporting storage and description of the latest error. More...
|
|
class | Stiffness |
| Preliminary class to implement Stiffness, only diagonal stiffness is implemented no transformations provided... More...
|
|
class | Trajectory |
| An abstract class that implements a trajectory contains a cartesian space trajectory and an underlying velocity profile. More...
|
|
class | Trajectory_Composite |
| Trajectory_Composite implements a trajectory that is composed of underlying trajectoria. More...
|
|
class | Trajectory_Segment |
| Trajectory_Segment combines a VelocityProfile and a Path into a trajectory. More...
|
|
class | Trajectory_Stationary |
| Implements a "trajectory" of a stationary position for an amount of time. More...
|
|
class | Tree |
| This class encapsulates a tree kinematic interconnection structure. More...
|
|
class | TreeElement |
|
class | TreeFkSolverPos |
| This abstract class encapsulates a solver for the forward position kinematics for a KDL::Tree. More...
|
|
class | TreeFkSolverPos_recursive |
| Implementation of a recursive forward position kinematics algorithm to calculate the position transformation from joint space to Cartesian space of a general kinematic tree (KDL::Tree). More...
|
|
class | TreeIkSolverPos |
| This abstract class encapsulates the inverse position solver for a KDL::Chain. More...
|
|
class | TreeIkSolverPos_NR_JL |
| Implementation of a general inverse position kinematics algorithm based on Newton-Raphson iterations to calculate the position transformation from Cartesian to joint space of a general KDL::Tree. More...
|
|
class | TreeIkSolverPos_Online |
| Implementation of a general inverse position kinematics algorithm to calculate the position transformation from Cartesian to joint space of a general KDL::Tree. More...
|
|
class | TreeIkSolverVel |
| This abstract class encapsulates the inverse velocity solver for a KDL::Tree. More...
|
|
class | TreeIkSolverVel_wdls |
|
class | TreeJntToJacSolver |
|
class | Twist |
| represents both translational and rotational velocities. More...
|
|
class | TwistAcc |
|
class | TwistVel |
|
class | Vector |
| A concrete implementation of a 3 dimensional vector class. More...
|
|
class | Vector2 |
| 2D version of Vector More...
|
|
class | VectorAcc |
|
class | VectorVel |
|
class | VelocityProfile |
| A VelocityProfile stores the velocity profile that is used within a trajectory. More...
|
|
class | VelocityProfile_Dirac |
| A Dirac VelocityProfile generates an infinite velocity so that the position jumps from A to B in in infinite short time. More...
|
|
class | VelocityProfile_Rectangular |
| A rectangular VelocityProfile generates a constant velocity for moving from A to B. More...
|
|
class | VelocityProfile_Spline |
| A spline VelocityProfile trajectory interpolation. More...
|
|
class | VelocityProfile_Trap |
| A Trapezoidal VelocityProfile implementation. More...
|
|
class | VelocityProfile_TrapHalf |
| A 'Half' Trapezoidal VelocityProfile. More...
|
|
class | Wrench |
| represents both translational and rotational acceleration. More...
|
|
|
ArticulatedBodyInertia | operator* (double a, const ArticulatedBodyInertia &I) |
| Scalar product: I_new = double * I_old. More...
|
|
ArticulatedBodyInertia | operator+ (const ArticulatedBodyInertia &Ia, const ArticulatedBodyInertia &Ib) |
| addition I: I_new = I_old1 + I_old2, make sure that I_old1 and I_old2 are expressed in the same reference frame/point, otherwise the result is worth nothing More...
|
|
ArticulatedBodyInertia | operator+ (const RigidBodyInertia &Ia, const ArticulatedBodyInertia &Ib) |
|
ArticulatedBodyInertia | operator- (const ArticulatedBodyInertia &Ia, const ArticulatedBodyInertia &Ib) |
|
ArticulatedBodyInertia | operator- (const RigidBodyInertia &Ia, const ArticulatedBodyInertia &Ib) |
|
Wrench | operator* (const ArticulatedBodyInertia &I, const Twist &t) |
| calculate spatial momentum: h = I*v make sure that the twist v and the inertia are expressed in the same reference frame/point More...
|
|
ArticulatedBodyInertia | operator* (const Frame &T, const ArticulatedBodyInertia &I) |
| Coordinate system transform Ia = T_a_b*Ib with T_a_b the frame from a to b. More...
|
|
ArticulatedBodyInertia | operator* (const Rotation &R, const ArticulatedBodyInertia &I) |
| Reference frame orientation change Ia = R_a_b*Ib with R_a_b the rotation of b expressed in a. More...
|
|
ArticulatedBodyInertia | operator+ (const ArticulatedBodyInertia &Ia, const RigidBodyInertia &Ib) |
|
ArticulatedBodyInertia | operator- (const ArticulatedBodyInertia &Ia, const RigidBodyInertia &Ib) |
|
template<typename Derived > |
void | Twist_to_Eigen (const KDL::Twist &t, Eigen::MatrixBase< Derived > &e) |
|
IMETHOD bool | Equal (const FrameAcc &r1, const FrameAcc &r2, double eps=epsilon) |
|
IMETHOD bool | Equal (const Frame &r1, const FrameAcc &r2, double eps=epsilon) |
|
IMETHOD bool | Equal (const FrameAcc &r1, const Frame &r2, double eps=epsilon) |
|
IMETHOD bool | Equal (const RotationAcc &r1, const RotationAcc &r2, double eps=epsilon) |
|
IMETHOD bool | Equal (const Rotation &r1, const RotationAcc &r2, double eps=epsilon) |
|
IMETHOD bool | Equal (const RotationAcc &r1, const Rotation &r2, double eps=epsilon) |
|
IMETHOD bool | Equal (const TwistAcc &a, const TwistAcc &b, double eps=epsilon) |
|
IMETHOD bool | Equal (const Twist &a, const TwistAcc &b, double eps=epsilon) |
|
IMETHOD bool | Equal (const TwistAcc &a, const Twist &b, double eps=epsilon) |
|
IMETHOD bool | Equal (const VectorAcc &r1, const VectorAcc &r2, double eps=epsilon) |
|
IMETHOD bool | Equal (const Vector &r1, const VectorAcc &r2, double eps=epsilon) |
|
IMETHOD bool | Equal (const VectorAcc &r1, const Vector &r2, double eps=epsilon) |
|
VectorAcc | operator+ (const VectorAcc &r1, const VectorAcc &r2) |
|
VectorAcc | operator- (const VectorAcc &r1, const VectorAcc &r2) |
|
VectorAcc | operator+ (const Vector &r1, const VectorAcc &r2) |
|
VectorAcc | operator- (const Vector &r1, const VectorAcc &r2) |
|
VectorAcc | operator+ (const VectorAcc &r1, const Vector &r2) |
|
VectorAcc | operator- (const VectorAcc &r1, const Vector &r2) |
|
VectorAcc | operator- (const VectorAcc &r) |
|
VectorAcc | operator* (const VectorAcc &r1, const VectorAcc &r2) |
|
VectorAcc | operator* (const VectorAcc &r1, const Vector &r2) |
|
VectorAcc | operator* (const Vector &r1, const VectorAcc &r2) |
|
VectorAcc | operator* (double r1, const VectorAcc &r2) |
|
VectorAcc | operator* (const VectorAcc &r1, double r2) |
|
VectorAcc | operator* (const doubleAcc &r1, const VectorAcc &r2) |
|
VectorAcc | operator* (const VectorAcc &r2, const doubleAcc &r1) |
|
doubleAcc | dot (const VectorAcc &lhs, const VectorAcc &rhs) |
|
doubleAcc | dot (const VectorAcc &lhs, const Vector &rhs) |
|
doubleAcc | dot (const Vector &lhs, const VectorAcc &rhs) |
|
VectorAcc | operator/ (const VectorAcc &r1, double r2) |
|
VectorAcc | operator/ (const VectorAcc &r2, const doubleAcc &r1) |
|
RotationAcc | operator* (const RotationAcc &r1, const RotationAcc &r2) |
|
RotationAcc | operator* (const Rotation &r1, const RotationAcc &r2) |
|
RotationAcc | operator* (const RotationAcc &r1, const Rotation &r2) |
|
VectorAcc | operator* (const Rotation &R, const VectorAcc &x) |
|
FrameAcc | operator* (const FrameAcc &lhs, const FrameAcc &rhs) |
|
FrameAcc | operator* (const FrameAcc &lhs, const Frame &rhs) |
|
FrameAcc | operator* (const Frame &lhs, const FrameAcc &rhs) |
|
TwistAcc | operator* (const TwistAcc &lhs, double rhs) |
|
TwistAcc | operator* (double lhs, const TwistAcc &rhs) |
|
TwistAcc | operator/ (const TwistAcc &lhs, double rhs) |
|
TwistAcc | operator* (const TwistAcc &lhs, const doubleAcc &rhs) |
|
TwistAcc | operator* (const doubleAcc &lhs, const TwistAcc &rhs) |
|
TwistAcc | operator/ (const TwistAcc &lhs, const doubleAcc &rhs) |
|
TwistAcc | operator+ (const TwistAcc &lhs, const TwistAcc &rhs) |
|
TwistAcc | operator- (const TwistAcc &lhs, const TwistAcc &rhs) |
|
TwistAcc | operator- (const TwistAcc &arg) |
|
std::ostream & | operator<< (std::ostream &os, const VectorAcc &r) |
|
std::ostream & | operator<< (std::ostream &os, const RotationAcc &r) |
|
std::ostream & | operator<< (std::ostream &os, const FrameAcc &r) |
|
std::ostream & | operator<< (std::ostream &os, const TwistAcc &r) |
|
bool | Equal (const Rotation &a, const Rotation &b, double eps) |
|
Rotation | operator* (const Rotation &lhs, const Rotation &rhs) |
|
bool | operator== (const Rotation &a, const Rotation &b) |
|
bool | Equal (const Vector &a, const Vector &b, double eps=epsilon) |
|
bool | Equal (const Frame &a, const Frame &b, double eps=epsilon) |
|
bool | Equal (const Twist &a, const Twist &b, double eps=epsilon) |
|
bool | Equal (const Wrench &a, const Wrench &b, double eps=epsilon) |
|
bool | Equal (const Vector2 &a, const Vector2 &b, double eps=epsilon) |
|
bool | Equal (const Rotation2 &a, const Rotation2 &b, double eps=epsilon) |
|
bool | Equal (const Frame2 &a, const Frame2 &b, double eps=epsilon) |
|
IMETHOD Vector | diff (const Vector &p_w_a, const Vector &p_w_b, double dt=1) |
| determines the difference of vector b with vector a. More...
|
|
IMETHOD Vector | diff (const Rotation &R_a_b1, const Rotation &R_a_b2, double dt=1) |
| determines the (scaled) rotation axis necessary to rotate from b1 to b2. More...
|
|
IMETHOD Twist | diff (const Frame &F_a_b1, const Frame &F_a_b2, double dt=1) |
| determines the rotation axis necessary to rotate the frame b1 to the same orientation as frame b2 and the vector necessary to translate the origin of b1 to the origin of b2, and stores the result in a Twist datastructure. More...
|
|
IMETHOD Twist | diff (const Twist &a, const Twist &b, double dt=1) |
| determines the difference between two twists i.e. More...
|
|
IMETHOD Wrench | diff (const Wrench &W_a_p1, const Wrench &W_a_p2, double dt=1) |
| determines the difference between two wrenches i.e. More...
|
|
IMETHOD Vector | addDelta (const Vector &p_w_a, const Vector &p_w_da, double dt=1) |
| adds vector da to vector a. More...
|
|
IMETHOD Rotation | addDelta (const Rotation &R_w_a, const Vector &da_w, double dt=1) |
| returns the rotation matrix resulting from the rotation of frame a by the axis and angle specified with da_w. More...
|
|
IMETHOD Frame | addDelta (const Frame &F_w_a, const Twist &da_w, double dt=1) |
| returns the frame resulting from the rotation of frame a by the axis and angle specified in da_w and the translation of the origin (also specified in da_w). More...
|
|
IMETHOD Twist | addDelta (const Twist &a, const Twist &da, double dt=1) |
| adds the twist da to the twist a. More...
|
|
IMETHOD Wrench | addDelta (const Wrench &a, const Wrench &da, double dt=1) |
| adds the wrench da to the wrench w. More...
|
|
IMETHOD Vector | operator+ (const Vector &lhs, const Vector &rhs) |
|
IMETHOD Vector | operator- (const Vector &lhs, const Vector &rhs) |
|
Vector | operator* (const Vector &lhs, double rhs) |
|
Vector | operator* (double lhs, const Vector &rhs) |
|
Vector | operator/ (const Vector &lhs, double rhs) |
|
Vector | operator* (const Vector &lhs, const Vector &rhs) |
|
Wrench | operator* (const Wrench &lhs, double rhs) |
|
Wrench | operator* (double lhs, const Wrench &rhs) |
|
Wrench | operator/ (const Wrench &lhs, double rhs) |
|
Wrench | operator+ (const Wrench &lhs, const Wrench &rhs) |
|
Wrench | operator- (const Wrench &lhs, const Wrench &rhs) |
|
Wrench | operator- (const Wrench &arg) |
|
Twist | operator* (const Twist &lhs, double rhs) |
|
Twist | operator* (double lhs, const Twist &rhs) |
|
Twist | operator/ (const Twist &lhs, double rhs) |
|
Twist | operator+ (const Twist &lhs, const Twist &rhs) |
|
Twist | operator- (const Twist &lhs, const Twist &rhs) |
|
Twist | operator- (const Twist &arg) |
|
Twist | operator* (const Twist &lhs, const Twist &rhs) |
|
Wrench | operator* (const Twist &lhs, const Wrench &rhs) |
|
Frame | operator* (const Frame &lhs, const Frame &rhs) |
|
Vector | operator- (const Vector &arg) |
|
IMETHOD Vector2 | operator+ (const Vector2 &lhs, const Vector2 &rhs) |
|
IMETHOD Vector2 | operator- (const Vector2 &lhs, const Vector2 &rhs) |
|
IMETHOD Vector2 | operator* (const Vector2 &lhs, double rhs) |
|
IMETHOD Vector2 | operator* (double lhs, const Vector2 &rhs) |
|
IMETHOD Vector2 | operator/ (const Vector2 &lhs, double rhs) |
|
IMETHOD Vector2 | operator- (const Vector2 &arg) |
|
IMETHOD Rotation2 | operator* (const Rotation2 &lhs, const Rotation2 &rhs) |
|
IMETHOD Frame2 | operator* (const Frame2 &lhs, const Frame2 &rhs) |
|
IMETHOD double | dot (const Vector &lhs, const Vector &rhs) |
|
IMETHOD double | dot (const Twist &lhs, const Wrench &rhs) |
|
IMETHOD double | dot (const Wrench &rhs, const Twist &lhs) |
|
IMETHOD void | SetToZero (Vector &v) |
|
IMETHOD void | SetToZero (Twist &v) |
|
IMETHOD void | SetToZero (Wrench &v) |
|
IMETHOD void | SetToZero (Vector2 &v) |
|
IMETHOD Rotation | Rot (const Vector &axis_a_b) |
| axis_a_b is a rotation vector, its norm is a rotation angle axis_a_b rotates the a frame towards the b frame. More...
|
|
IMETHOD void | random (Vector &a) |
| addDelta operator for displacement rotational velocity. More...
|
|
IMETHOD void | random (Twist &a) |
|
IMETHOD void | random (Wrench &a) |
|
IMETHOD void | random (Rotation &R) |
|
IMETHOD void | random (Frame &F) |
|
IMETHOD void | posrandom (Vector &a) |
|
IMETHOD void | posrandom (Twist &a) |
|
IMETHOD void | posrandom (Wrench &a) |
|
IMETHOD void | posrandom (Rotation &R) |
|
IMETHOD void | posrandom (Frame &F) |
|
IMETHOD bool | operator== (const Frame &a, const Frame &b) |
|
IMETHOD bool | operator!= (const Frame &a, const Frame &b) |
|
IMETHOD bool | operator== (const Vector &a, const Vector &b) |
|
IMETHOD bool | operator!= (const Vector &a, const Vector &b) |
|
IMETHOD bool | operator== (const Twist &a, const Twist &b) |
|
IMETHOD bool | operator!= (const Twist &a, const Twist &b) |
|
IMETHOD bool | operator== (const Wrench &a, const Wrench &b) |
|
IMETHOD bool | operator!= (const Wrench &a, const Wrench &b) |
|
IMETHOD bool | operator!= (const Rotation &a, const Rotation &b) |
|
IMETHOD bool | operator== (const Vector2 &a, const Vector2 &b) |
|
IMETHOD bool | operator!= (const Vector2 &a, const Vector2 &b) |
|
std::ostream & | operator<< (std::ostream &os, const Vector &v) |
| width to be used when printing variables out with frames_io.h global variable, can be changed. More...
|
|
std::ostream & | operator<< (std::ostream &os, const Twist &v) |
|
std::ostream & | operator<< (std::ostream &os, const Wrench &v) |
|
std::ostream & | operator<< (std::ostream &os, const Rotation &R) |
|
std::ostream & | operator<< (std::ostream &os, const Frame &T) |
|
std::ostream & | operator<< (std::ostream &os, const Vector2 &v) |
|
std::ostream & | operator<< (std::ostream &os, const Rotation2 &R) |
|
std::ostream & | operator<< (std::ostream &os, const Frame2 &T) |
|
std::istream & | operator>> (std::istream &is, Vector &v) |
|
std::istream & | operator>> (std::istream &is, Twist &v) |
|
std::istream & | operator>> (std::istream &is, Wrench &v) |
|
std::istream & | operator>> (std::istream &is, Rotation &r) |
|
std::istream & | operator>> (std::istream &is, Frame &T) |
|
std::istream & | operator>> (std::istream &is, Vector2 &v) |
|
std::istream & | operator>> (std::istream &is, Rotation2 &r) |
|
std::istream & | operator>> (std::istream &is, Frame2 &T) |
|
IMETHOD doubleVel | diff (const doubleVel &a, const doubleVel &b, double dt=1.0) |
|
IMETHOD doubleVel | addDelta (const doubleVel &a, const doubleVel &da, double dt=1.0) |
|
IMETHOD void | random (doubleVel &F) |
|
IMETHOD void | posrandom (doubleVel &F) |
|
IMETHOD bool | Equal (const VectorVel &r1, const VectorVel &r2, double eps=epsilon) |
|
IMETHOD bool | Equal (const Vector &r1, const VectorVel &r2, double eps=epsilon) |
|
IMETHOD bool | Equal (const VectorVel &r1, const Vector &r2, double eps=epsilon) |
|
IMETHOD bool | Equal (const RotationVel &r1, const RotationVel &r2, double eps=epsilon) |
|
IMETHOD bool | Equal (const Rotation &r1, const RotationVel &r2, double eps=epsilon) |
|
IMETHOD bool | Equal (const RotationVel &r1, const Rotation &r2, double eps=epsilon) |
|
IMETHOD bool | Equal (const FrameVel &r1, const FrameVel &r2, double eps=epsilon) |
|
IMETHOD bool | Equal (const Frame &r1, const FrameVel &r2, double eps=epsilon) |
|
IMETHOD bool | Equal (const FrameVel &r1, const Frame &r2, double eps=epsilon) |
|
IMETHOD bool | Equal (const TwistVel &a, const TwistVel &b, double eps=epsilon) |
|
IMETHOD bool | Equal (const Twist &a, const TwistVel &b, double eps=epsilon) |
|
IMETHOD bool | Equal (const TwistVel &a, const Twist &b, double eps=epsilon) |
|
IMETHOD VectorVel | diff (const VectorVel &a, const VectorVel &b, double dt=1.0) |
|
IMETHOD VectorVel | addDelta (const VectorVel &a, const VectorVel &da, double dt=1.0) |
|
IMETHOD VectorVel | diff (const RotationVel &a, const RotationVel &b, double dt=1.0) |
|
IMETHOD RotationVel | addDelta (const RotationVel &a, const VectorVel &da, double dt=1.0) |
|
IMETHOD TwistVel | diff (const FrameVel &a, const FrameVel &b, double dt=1.0) |
|
IMETHOD FrameVel | addDelta (const FrameVel &a, const TwistVel &da, double dt=1.0) |
|
IMETHOD void | random (VectorVel &a) |
|
IMETHOD void | random (TwistVel &a) |
|
IMETHOD void | random (RotationVel &R) |
|
IMETHOD void | random (FrameVel &F) |
|
IMETHOD void | posrandom (VectorVel &a) |
|
IMETHOD void | posrandom (TwistVel &a) |
|
IMETHOD void | posrandom (RotationVel &R) |
|
IMETHOD void | posrandom (FrameVel &F) |
|
FrameVel | operator* (const FrameVel &lhs, const FrameVel &rhs) |
|
FrameVel | operator* (const FrameVel &lhs, const Frame &rhs) |
|
FrameVel | operator* (const Frame &lhs, const FrameVel &rhs) |
|
RotationVel | operator* (const RotationVel &r1, const RotationVel &r2) |
|
RotationVel | operator* (const Rotation &r1, const RotationVel &r2) |
|
RotationVel | operator* (const RotationVel &r1, const Rotation &r2) |
|
VectorVel | operator+ (const VectorVel &r1, const VectorVel &r2) |
|
VectorVel | operator- (const VectorVel &r1, const VectorVel &r2) |
|
VectorVel | operator+ (const VectorVel &r1, const Vector &r2) |
|
VectorVel | operator- (const VectorVel &r1, const Vector &r2) |
|
VectorVel | operator+ (const Vector &r1, const VectorVel &r2) |
|
VectorVel | operator- (const Vector &r1, const VectorVel &r2) |
|
VectorVel | operator- (const VectorVel &r) |
|
void | SetToZero (VectorVel &v) |
|
VectorVel | operator* (const VectorVel &r1, const VectorVel &r2) |
|
VectorVel | operator* (const VectorVel &r1, const Vector &r2) |
|
VectorVel | operator* (const Vector &r1, const VectorVel &r2) |
|
VectorVel | operator* (double r1, const VectorVel &r2) |
|
VectorVel | operator* (const VectorVel &r1, double r2) |
|
VectorVel | operator* (const doubleVel &r1, const VectorVel &r2) |
|
VectorVel | operator* (const VectorVel &r2, const doubleVel &r1) |
|
VectorVel | operator/ (const VectorVel &r1, double r2) |
|
VectorVel | operator/ (const VectorVel &r2, const doubleVel &r1) |
|
VectorVel | operator* (const Rotation &R, const VectorVel &x) |
|
IMETHOD doubleVel | dot (const VectorVel &lhs, const VectorVel &rhs) |
|
IMETHOD doubleVel | dot (const VectorVel &lhs, const Vector &rhs) |
|
IMETHOD doubleVel | dot (const Vector &lhs, const VectorVel &rhs) |
|
TwistVel | operator* (const TwistVel &lhs, double rhs) |
|
TwistVel | operator* (double lhs, const TwistVel &rhs) |
|
TwistVel | operator/ (const TwistVel &lhs, double rhs) |
|
TwistVel | operator* (const TwistVel &lhs, const doubleVel &rhs) |
|
TwistVel | operator* (const doubleVel &lhs, const TwistVel &rhs) |
|
TwistVel | operator/ (const TwistVel &lhs, const doubleVel &rhs) |
|
TwistVel | operator+ (const TwistVel &lhs, const TwistVel &rhs) |
|
TwistVel | operator- (const TwistVel &lhs, const TwistVel &rhs) |
|
TwistVel | operator- (const TwistVel &arg) |
|
void | SetToZero (TwistVel &v) |
|
std::ostream & | operator<< (std::ostream &os, const VectorVel &r) |
|
std::ostream & | operator<< (std::ostream &os, const RotationVel &r) |
|
std::ostream & | operator<< (std::ostream &os, const FrameVel &r) |
|
std::ostream & | operator<< (std::ostream &os, const TwistVel &r) |
|
void | SetToZero (Jacobian &jac) |
|
bool | changeRefPoint (const Jacobian &src1, const Vector &base_AB, Jacobian &dest) |
|
bool | changeBase (const Jacobian &src1, const Rotation &rot, Jacobian &dest) |
|
bool | changeRefFrame (const Jacobian &src1, const Frame &frame, Jacobian &dest) |
|
bool | Equal (const Jacobian &a, const Jacobian &b, double eps) |
|
void | Add (const JntArray &src1, const JntArray &src2, JntArray &dest) |
| Function to add two joint arrays, all the arguments must have the same size: A + B = C. More...
|
|
void | Subtract (const JntArray &src1, const JntArray &src2, JntArray &dest) |
| Function to subtract two joint arrays, all the arguments must have the same size: A - B = C. More...
|
|
void | Multiply (const JntArray &src, const double &factor, JntArray &dest) |
| Function to multiply all the array values with a scalar factor: A*b=C. More...
|
|
void | Divide (const JntArray &src, const double &factor, JntArray &dest) |
| Function to divide all the array values with a scalar factor: A/b=C. More...
|
|
void | MultiplyJacobian (const Jacobian &jac, const JntArray &src, Twist &dest) |
| Function to multiply a KDL::Jacobian with a KDL::JntArray to get a KDL::Twist, it should not be used to calculate the forward velocity kinematics, the solver classes are built for this purpose. More...
|
|
void | SetToZero (JntArray &array) |
| Function to set all the values of the array to 0. More...
|
|
bool | Equal (const JntArray &src1, const JntArray &src2, double eps=epsilon) |
| Function to check if two arrays are the same with a precision of eps. More...
|
|
bool | operator== (const JntArray &src1, const JntArray &src2) |
|
void | Add (const JntArrayAcc &src1, const JntArrayAcc &src2, JntArrayAcc &dest) |
|
void | Add (const JntArrayAcc &src1, const JntArrayVel &src2, JntArrayAcc &dest) |
|
void | Add (const JntArrayAcc &src1, const JntArray &src2, JntArrayAcc &dest) |
|
void | Subtract (const JntArrayAcc &src1, const JntArrayAcc &src2, JntArrayAcc &dest) |
|
void | Subtract (const JntArrayAcc &src1, const JntArrayVel &src2, JntArrayAcc &dest) |
|
void | Subtract (const JntArrayAcc &src1, const JntArray &src2, JntArrayAcc &dest) |
|
void | Multiply (const JntArrayAcc &src, const double &factor, JntArrayAcc &dest) |
|
void | Multiply (const JntArrayAcc &src, const doubleVel &factor, JntArrayAcc &dest) |
|
void | Multiply (const JntArrayAcc &src, const doubleAcc &factor, JntArrayAcc &dest) |
|
void | Divide (const JntArrayAcc &src, const double &factor, JntArrayAcc &dest) |
|
void | Divide (const JntArrayAcc &src, const doubleVel &factor, JntArrayAcc &dest) |
|
void | Divide (const JntArrayAcc &src, const doubleAcc &factor, JntArrayAcc &dest) |
|
void | SetToZero (JntArrayAcc &array) |
|
bool | Equal (const JntArrayAcc &src1, const JntArrayAcc &src2, double eps) |
|
void | Add (const JntArrayVel &src1, const JntArrayVel &src2, JntArrayVel &dest) |
|
void | Add (const JntArrayVel &src1, const JntArray &src2, JntArrayVel &dest) |
|
void | Subtract (const JntArrayVel &src1, const JntArrayVel &src2, JntArrayVel &dest) |
|
void | Subtract (const JntArrayVel &src1, const JntArray &src2, JntArrayVel &dest) |
|
void | Multiply (const JntArrayVel &src, const double &factor, JntArrayVel &dest) |
|
void | Multiply (const JntArrayVel &src, const doubleVel &factor, JntArrayVel &dest) |
|
void | Divide (const JntArrayVel &src, const double &factor, JntArrayVel &dest) |
|
void | Divide (const JntArrayVel &src, const doubleVel &factor, JntArrayVel &dest) |
|
void | SetToZero (JntArrayVel &array) |
|
bool | Equal (const JntArrayVel &src1, const JntArrayVel &src2, double eps) |
|
void | Add (const JntSpaceInertiaMatrix &src1, const JntSpaceInertiaMatrix &src2, JntSpaceInertiaMatrix &dest) |
|
void | Subtract (const JntSpaceInertiaMatrix &src1, const JntSpaceInertiaMatrix &src2, JntSpaceInertiaMatrix &dest) |
|
void | Multiply (const JntSpaceInertiaMatrix &src, const double &factor, JntSpaceInertiaMatrix &dest) |
|
void | Divide (const JntSpaceInertiaMatrix &src, const double &factor, JntSpaceInertiaMatrix &dest) |
|
void | Multiply (const JntSpaceInertiaMatrix &src, const JntArray &vec, JntArray &dest) |
|
void | SetToZero (JntSpaceInertiaMatrix &mat) |
|
bool | Equal (const JntSpaceInertiaMatrix &src1, const JntSpaceInertiaMatrix &src2, double eps) |
|
bool | operator== (const JntSpaceInertiaMatrix &src1, const JntSpaceInertiaMatrix &src2) |
|
std::ostream & | operator<< (std::ostream &os, const Joint &joint) |
|
std::istream & | operator>> (std::istream &is, Joint &joint) |
|
std::ostream & | operator<< (std::ostream &os, const Segment &segment) |
|
std::istream & | operator>> (std::istream &is, Segment &segment) |
|
std::ostream & | operator<< (std::ostream &os, const Chain &chain) |
|
std::istream & | operator>> (std::istream &is, Chain &chain) |
|
std::ostream & | operator<< (std::ostream &os, const Tree &tree) |
|
std::ostream & | operator<< (std::ostream &os, SegmentMap::const_iterator root) |
|
std::istream & | operator>> (std::istream &is, Tree &tree) |
|
std::ostream & | operator<< (std::ostream &os, const JntArray &array) |
|
std::istream & | operator>> (std::istream &is, JntArray &array) |
|
std::ostream & | operator<< (std::ostream &os, const Jacobian &jac) |
|
std::istream & | operator>> (std::istream &is, Jacobian &jac) |
|
std::ostream & | operator<< (std::ostream &os, const JntSpaceInertiaMatrix &jntspaceinertiamatrix) |
|
std::istream & | operator>> (std::istream &is, JntSpaceInertiaMatrix &jntspaceinertiamatrix) |
|
RigidBodyInertia | operator* (double a, const RigidBodyInertia &I) |
| Scalar product: I_new = double * I_old. More...
|
|
RigidBodyInertia | operator+ (const RigidBodyInertia &Ia, const RigidBodyInertia &Ib) |
| addition I: I_new = I_old1 + I_old2, make sure that I_old1 and I_old2 are expressed in the same reference frame/point, otherwise the result is worth nothing More...
|
|
Wrench | operator* (const RigidBodyInertia &I, const Twist &t) |
| calculate spatial momentum: h = I*v make sure that the twist v and the inertia are expressed in the same reference frame/point More...
|
|
RigidBodyInertia | operator* (const Frame &T, const RigidBodyInertia &I) |
| Coordinate system transform Ia = T_a_b*Ib with T_a_b the frame from a to b. More...
|
|
RigidBodyInertia | operator* (const Rotation &R, const RigidBodyInertia &I) |
| Reference frame orientation change Ia = R_a_b*Ib with R_a_b the rotation of b expressed in a. More...
|
|
RotationalInertia | operator* (double a, const RotationalInertia &I) |
|
RotationalInertia | operator+ (const RotationalInertia &Ia, const RotationalInertia &Ib) |
|
Wrench | operator* (const Stiffness &s, const Twist &t) |
|
Stiffness | operator+ (const Stiffness &s1, const Stiffness &s2) |
|
void | posrandom (Stiffness &F) |
|
void | random (Stiffness &F) |
|
static void | generatePowers (int n, double x, double *powers) |
|
int | svd_eigen_Macie (const MatrixXd &A, MatrixXd &U, VectorXd &S, MatrixXd &V, MatrixXd &B, VectorXd &tempi, double threshold, bool toggle) |
| svd_eigen_Macie provides Maciejewski implementation for SVD. More...
|
|