Class List
Here are the classes, structs, unions and interfaces with brief descriptions:
KDL::ArticulatedBodyInertia6D Inertia of a articulated body
KDL::Binary< A, B, OpID >A type to specify the implementation of a binary operation
KDL::BinaryOp< ID, A, B >
KDL::BinaryOp< OpAdd, double, double >
KDL::BinaryOp< OpAdd, Twist, Twist >
KDL::BinaryOp< OpAdd, TwistVel, TwistVel >
KDL::BinaryOp< OpAdd, Vector, Vector >
KDL::BinaryOp< OpAdd, VectorVel, VectorVel >
KDL::BinaryOp< OpAdd, Wrench, Wrench >
KDL::BinaryOp< OpAtan2, double, double >
KDL::BinaryOp< OpDiff, Frame, Frame >
KDL::BinaryOp< OpDiff, FrameVel, FrameVel >
KDL::BinaryOp< OpDiff, Rotation, Rotation >
KDL::BinaryOp< OpDiff, RotationVel, RotationVel >
KDL::BinaryOp< OpDiff, Vector, Vector >
KDL::BinaryOp< OpDiff, VectorVel, VectorVel >
KDL::BinaryOp< OpDiv, double, double >
KDL::BinaryOp< OpDot, Vector, Vector >
KDL::BinaryOp< OpDot, VectorVel, VectorVel >
KDL::BinaryOp< OpInverse, Stiffness, Wrench >
KDL::BinaryOp< OpMult, double, double >
KDL::BinaryOp< OpMult, double, Twist >
KDL::BinaryOp< OpMult, double, Vector >
KDL::BinaryOp< OpMult, double, Wrench >
KDL::BinaryOp< OpMult, doubleVel, TwistVel >
KDL::BinaryOp< OpMult, doubleVel, VectorVel >
KDL::BinaryOp< OpMult, Frame, Frame >
KDL::BinaryOp< OpMult, Frame, Vector >
KDL::BinaryOp< OpMult, FrameVel, FrameVel >
KDL::BinaryOp< OpMult, FrameVel, VectorVel >
KDL::BinaryOp< OpMult, Rotation, Rotation >
KDL::BinaryOp< OpMult, Rotation, Twist >
KDL::BinaryOp< OpMult, Rotation, Vector >
KDL::BinaryOp< OpMult, Rotation, Wrench >
KDL::BinaryOp< OpMult, RotationVel, RotationVel >
KDL::BinaryOp< OpMult, RotationVel, TwistVel >
KDL::BinaryOp< OpMult, RotationVel, VectorVel >
KDL::BinaryOp< OpMult, Stiffness, Twist >
KDL::BinaryOp< OpMult, Twist, double >
KDL::BinaryOp< OpMult, TwistVel, doubleVel >
KDL::BinaryOp< OpMult, Vector, double >
KDL::BinaryOp< OpMult, Vector, Vector >
KDL::BinaryOp< OpMult, VectorVel, doubleVel >
KDL::BinaryOp< OpMult, VectorVel, VectorVel >
KDL::BinaryOp< OpMult, Wrench, double >
KDL::BinaryOp< OpRefPoint, Twist, Vector >
KDL::BinaryOp< OpRefPoint, TwistVel, VectorVel >
KDL::BinaryOp< OpRefPoint, Wrench, Vector >
KDL::BinaryOp< OpSub, double, double >
KDL::BinaryOp< OpSub, Twist, Twist >
KDL::BinaryOp< OpSub, TwistVel, TwistVel >
KDL::BinaryOp< OpSub, Vector, Vector >
KDL::BinaryOp< OpSub, VectorVel, VectorVel >
KDL::BinaryOp< OpSub, Wrench, Wrench >
KDL::ChainThis class encapsulates a serial kinematic interconnection structure. It is build out of segments
KDL::ChainDynParam
KDL::ChainFkSolverAccThis abstract class encapsulates a solver for the forward acceleration kinematics for a KDL::Chain
KDL::ChainFkSolverPosThis abstract class encapsulates a solver for the forward position kinematics for a KDL::Chain
KDL::ChainFkSolverPos_recursive
KDL::ChainFkSolverVelThis abstract class encapsulates a solver for the forward velocity kinematics for a KDL::Chain
KDL::ChainFkSolverVel_recursive
KDL::ChainIdSolverThis abstract class encapsulates the inverse dynamics solver for a KDL::Chain
KDL::ChainIdSolver_RNERecursive newton euler inverse dynamics solver
KDL::ChainIdSolver_Vereshchagin
KDL::ChainIkSolverAccThis abstract class encapsulates the inverse acceleration solver for a KDL::Chain
KDL::ChainIkSolverPosThis abstract class encapsulates the inverse position solver for a KDL::Chain
KDL::ChainIkSolverPos_LMASolver for the inverse position kinematics that uses Levenberg-Marquardt
KDL::ChainIkSolverPos_NR
KDL::ChainIkSolverPos_NR_JL
KDL::ChainIkSolverVelThis abstract class encapsulates the inverse velocity solver for a KDL::Chain
KDL::ChainIkSolverVel_pinv
KDL::ChainIkSolverVel_pinv_givens
KDL::ChainIkSolverVel_pinv_nso
KDL::ChainIkSolverVel_wdls
KDL::ChainJntToJacSolverClass to calculate the jacobian of a general KDL::Chain, it is used by other solvers. It should not be used outside of KDL
KDL::checkBinary< OpID, A, B >
KDL::checkBinary_displ< OpID, A, B >
KDL::checkBinaryVel< OpID, A, B >
KDL::checkUnary< OpID, A >
KDL::checkUnaryVel< OpID, A >
Cnst< T >Cnst<T> encapsulates something that only can be constant and never has a derivative
KDL::ConstraintMatrixStores constraints and solves them
KDL::Error
KDL::Error_BasicIO
KDL::Error_BasicIO_Exp_Delim
KDL::Error_BasicIO_File
KDL::Error_BasicIO_Not_A_Space
KDL::Error_BasicIO_Not_Opened
KDL::Error_BasicIO_ToBig
KDL::Error_BasicIO_Unexpected
KDL::Error_Chain_Unexpected_id
KDL::Error_ChainIO
KDL::Error_Criterium
KDL::Error_Criterium_Unexpected_id
KDL::Error_Frame_Frame_Unexpected_id
KDL::Error_Frame_Rotation_Unexpected_id
KDL::Error_Frame_Vector_Unexpected_id
KDL::Error_FrameIO
KDL::Error_IntegratorAbstract subclass of all errors that can be thrown by Adaptive_Integrator
KDL::Error_IO
KDL::Error_Limits
KDL::Error_Limits_Unexpected_id
KDL::Error_MotionIO
KDL::Error_MotionIO_Unexpected_MotProf
KDL::Error_MotionIO_Unexpected_Traj
KDL::Error_MotionPlanning
KDL::Error_MotionPlanning_Circle_No_Plane
KDL::Error_MotionPlanning_Circle_ToSmall
KDL::Error_MotionPlanning_Incompatible
KDL::Error_MotionPlanning_Not_Applicable
KDL::Error_MotionPlanning_Not_Feasible
KDL::Error_Not_Implemented
KDL::Error_Redundancy
KDL::Error_Redundancy_Illegal_Resolutiontype
KDL::Error_Redundancy_Low_Manip
KDL::Error_Redundancy_Unavoidable
KDL::Error_RedundancyIOError_Redundancy indicates an error that occured during solving for redundancy
KDL::Error_Stepsize_To_SmallError_Stepsize_To_Small is thrown if the stepsize becomes to small
KDL::Error_Stepsize_UnderflowError_Stepsize_Underflow is thrown if the stepsize becomes to small
KDL::Error_To_Many_Steps
Expr< T >Template class to mark template expressions
KDL::FrameFrame transformation in 3D space (rotation + translation)
KDL::Frame2
KDL::FrameAcc
FramesTest
KDL::FrameVel
InertiaTest
KDL::Jacobian
Jacobian< T >Jacobian<T> constructs a tangent vector class out of the given basetype
JacobianTest
KDL::JntArrayAcc
KDL::JntArrayVel
KDL::JointThis class encapsulates a simple joint, that is with one parameterized degree of freedom and with scalar dynamic properties
KDL::Joint::joint_type_exception
KinFamTest
KDL::OpAbs
KDL::OpAcos
KDL::OpAdd
KDL::OpAsin
KDL::OpAtan
KDL::OpAtan2
KDL::OpCoordX
KDL::OpCoordY
KDL::OpCoordZ
KDL::OpCos
KDL::OpDiff
KDL::OpDiv
KDL::OpDot
KDL::OpExp
KDL::OpInverse
KDL::OpLog
KDL::OpMult
KDL::OpNegate
KDL::OpNorm
KDL::OpOrigin
KDL::OpRefPoint
KDL::OpRotation
KDL::OpRotX
KDL::OpRotY
KDL::OpRotZ
KDL::OpSin
KDL::OpSqrt
KDL::OpSub
KDL::OpTan
KDL::OpUnitX
KDL::OpUnitY
KDL::OpUnitZ
KDL::Path
KDL::Path_Circle
KDL::Path_Composite
KDL::Path_Cyclic_Closed
KDL::Path_Line
KDL::Path_Point
KDL::Path_RoundedComposite
PseudoInverseHandles (weighted) pseudo-inverses and related operations
Rall1d
KDL::Rall1d< T, V, S >
Rall2d
KDL::Rall2d< T, V, S >
Rall2dN< T, N >
RallNd< N >
RallNd< 1 >
RallNd< 2 >
KDL::Ref< T >A reference to T
KDL::RigidBodyInertia6D Inertia of a rigid body
KDL::RotationRotations in 3 dimensional space
KDL::Rotation2
KDL::RotationAcc
KDL::RotationalInertia
KDL::RotationalInterpolation
KDL::RotationalInterpolation_SingleAxis
KDL::RotationVel
KDL::SegmentThis 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
KDL::ChainIdSolver_Vereshchagin::segment_info
SolverTest
KDL::Stiffness
KDL::SVD_HH
SVD_Ordering
KDL::TI< T >
KDL::TI< double >
KDL::TI< int >
Traits< T >Traits are traits classes to determine the type of a derivative of another type
Traits< double >
Traits< float >
Traits< KDL::doubleVel >
Traits< KDL::Frame >
Traits< KDL::FrameVel >
Traits< KDL::Rotation >
Traits< KDL::RotationVel >
Traits< KDL::Twist >
Traits< KDL::TwistVel >
Traits< KDL::Vector >
Traits< KDL::VectorVel >
Traits< KDL::Wrench >
KDL::Trajectory
KDL::Trajectory_Composite
KDL::Trajectory_Segment
KDL::Trajectory_Stationary
KDL::TreeThis class encapsulates a tree kinematic interconnection structure. It is build out of segments
KDL::TreeElement
KDL::TreeFkSolverPosThis abstract class encapsulates a solver for the forward position kinematics for a KDL::Tree
KDL::TreeFkSolverPos_recursive
KDL::TreeIkSolverPosThis abstract class encapsulates the inverse position solver for a KDL::Chain
KDL::TreeIkSolverPos_NR_JL
KDL::TreeIkSolverPos_Online
KDL::TreeIkSolverVelThis abstract class encapsulates the inverse velocity solver for a KDL::Tree
KDL::TreeIkSolverVel_wdls
KDL::TreeJntToJacSolver
KDL::TwistBoth translational and rotational velocities
KDL::TwistAcc
KDL::TwistVel
KDL::Unary< A, OpID >A type to specify a unary operation
KDL::UnaryOp< OpID, A >A type to specify the implementation of a unary operation
KDL::UnaryOp< OpAbs, double >
KDL::UnaryOp< OpAcos, double >
KDL::UnaryOp< OpAsin, double >
KDL::UnaryOp< OpAtan, double >
KDL::UnaryOp< OpCoordX, Vector >
KDL::UnaryOp< OpCoordX, VectorVel >
KDL::UnaryOp< OpCoordY, Vector >
KDL::UnaryOp< OpCoordY, VectorVel >
KDL::UnaryOp< OpCoordZ, Vector >
KDL::UnaryOp< OpCoordZ, VectorVel >
KDL::UnaryOp< OpCos, double >
KDL::UnaryOp< OpExp, double >
KDL::UnaryOp< OpInverse, Frame >
KDL::UnaryOp< OpInverse, FrameVel >
KDL::UnaryOp< OpInverse, Rotation >
KDL::UnaryOp< OpInverse, RotationVel >
KDL::UnaryOp< OpLog, double >
KDL::UnaryOp< OpNegate, double >
KDL::UnaryOp< OpNegate, Twist >
KDL::UnaryOp< OpNegate, TwistVel >
KDL::UnaryOp< OpNegate, Vector >
KDL::UnaryOp< OpNegate, VectorVel >
KDL::UnaryOp< OpNegate, Wrench >
KDL::UnaryOp< OpNorm, Vector >
KDL::UnaryOp< OpNorm, VectorVel >
KDL::UnaryOp< OpOrigin, Frame >
KDL::UnaryOp< OpOrigin, FrameVel >
KDL::UnaryOp< OpRotation, Frame >
KDL::UnaryOp< OpRotation, FrameVel >
KDL::UnaryOp< OpRotX, double >
KDL::UnaryOp< OpRotY, double >
KDL::UnaryOp< OpRotZ, double >
KDL::UnaryOp< OpSin, double >
KDL::UnaryOp< OpSqrt, double >
KDL::UnaryOp< OpTan, double >
KDL::UnaryOp< OpUnitX, Rotation >
KDL::UnaryOp< OpUnitX, RotationVel >
KDL::UnaryOp< OpUnitY, Rotation >
KDL::UnaryOp< OpUnitY, RotationVel >
KDL::UnaryOp< OpUnitZ, Rotation >
KDL::UnaryOp< OpUnitZ, RotationVel >
KDL::VectorA concrete implementation of a 3 dimensional vector class
KDL::Vector22D version of Vector
KDL::VectorAcc
KDL::VectorVel
KDL::VelocityProfile
KDL::VelocityProfile_Dirac
KDL::VelocityProfile_Rectangular
KDL::VelocityProfile_SplineA spline VelocityProfile trajectory interpolation
KDL::VelocityProfile_Trap
KDL::VelocityProfile_TrapHalf
VelocityProfileTest
KDL::WrenchBoth translational and rotational acceleration


orocos_kdl
Author(s): Ruben Smits, Erwin Aertbelien, Orocos Developers
autogenerated on Sat Dec 28 2013 17:17:26