#include <fwd.hpp>
Public Types | |
enum | { Options = _Options } |
typedef std::map< std::string, ConfigVectorType > | ConfigVectorMap |
Map between a string (key) and a configuration vector. More... | |
typedef VectorXs | ConfigVectorType |
Dense vectorized version of a joint configuration vector. More... | |
typedef DataTpl< Scalar, Options, JointCollectionTpl > | Data |
typedef ForceTpl< Scalar, Options > | Force |
typedef FrameTpl< Scalar, Options > | Frame |
typedef pinocchio::FrameIndex | FrameIndex |
typedef pinocchio::GeomIndex | GeomIndex |
typedef pinocchio::Index | Index |
typedef std::vector< Index > | IndexVector |
typedef InertiaTpl< Scalar, Options > | Inertia |
typedef JointCollectionTpl< Scalar, Options > | JointCollection |
typedef JointDataTpl< Scalar, Options, JointCollectionTpl > | JointData |
typedef pinocchio::JointIndex | JointIndex |
typedef JointModelTpl< Scalar, Options, JointCollectionTpl > | JointModel |
typedef MotionTpl< Scalar, Options > | Motion |
typedef SE3Tpl< Scalar, Options > | SE3 |
typedef VectorXs | TangentVectorType |
Dense vectorized version of a joint tangent vector (e.g. velocity, acceleration, etc). It also handles the notion of co-tangent vector (e.g. torque, etc). More... | |
typedef Eigen::Matrix< Scalar, 3, 1, Options > | Vector3 |
typedef Eigen::Matrix< Scalar, Eigen::Dynamic, 1, Options > | VectorXs |
Public Member Functions | |
FrameIndex | addBodyFrame (const std::string &body_name, const JointIndex &parentJoint, const SE3 &body_placement=SE3::Identity(), int previousFrame=-1) |
Add a body to the frame tree. More... | |
FrameIndex | addFrame (const Frame &frame, const bool append_inertia=true) |
Adds a frame to the kinematic tree. The inertia stored within the frame will be happened to the inertia supported by the joint (frame.parent). More... | |
JointIndex | addJoint (const JointIndex parent, const JointModel &joint_model, const SE3 &joint_placement, const std::string &joint_name) |
Add a joint to the kinematic tree with infinite bounds. More... | |
JointIndex | addJoint (const JointIndex parent, const JointModel &joint_model, const SE3 &joint_placement, const std::string &joint_name, const VectorXs &max_effort, const VectorXs &max_velocity, const VectorXs &min_config, const VectorXs &max_config) |
Add a joint to the kinematic tree with infinite bounds. More... | |
JointIndex | addJoint (const JointIndex parent, const JointModel &joint_model, const SE3 &joint_placement, const std::string &joint_name, const VectorXs &max_effort, const VectorXs &max_velocity, const VectorXs &min_config, const VectorXs &max_config, const VectorXs &friction, const VectorXs &damping) |
Add a joint to the kinematic tree with infinite bounds. More... | |
FrameIndex | addJointFrame (const JointIndex &joint_index, int previous_frame_index=-1) |
Add a joint to the frame tree. More... | |
void | appendBodyToJoint (const JointIndex joint_index, const Inertia &Y, const SE3 &body_placement=SE3::Identity()) |
Append a body to a given joint of the kinematic tree. More... | |
template<typename NewScalar > | |
ModelTpl< NewScalar, Options, JointCollectionTpl > | cast () const |
template<typename D > | |
bool | check (const AlgorithmCheckerBase< D > &checker=AlgorithmCheckerBase< D >()) const |
Check the validity of the attributes of Model with respect to the specification of some algorithms. More... | |
bool | check () const |
Run check(fusion::list) with DEFAULT_CHECKERS as argument. More... | |
bool | check (const Data &data) const |
Run checkData on data and current model. More... | |
bool | existBodyName (const std::string &name) const |
Check if a body given by its name exists. More... | |
bool | existFrame (const std::string &name, const FrameType &type=(FrameType)(JOINT|FIXED_JOINT|BODY|OP_FRAME|SENSOR)) const |
Checks if a frame given by its name exists. More... | |
bool | existJointName (const std::string &name) const |
Check if a joint given by its name exists. More... | |
FrameIndex | getBodyId (const std::string &name) const |
Return the index of a body given by its name. More... | |
FrameIndex | getFrameId (const std::string &name, const FrameType &type=(FrameType)(JOINT|FIXED_JOINT|BODY|OP_FRAME|SENSOR)) const |
Returns the index of a frame given by its name. More... | |
JointIndex | getJointId (const std::string &name) const |
Return the index of a joint given by its name. More... | |
ModelTpl () | |
Default constructor. Builds an empty model with no joints. More... | |
bool | operator!= (const ModelTpl &other) const |
bool | operator== (const ModelTpl &other) const |
Equality comparison operator. More... | |
typedef | PINOCCHIO_ALIGNED_STD_VECTOR (JointModel) JointModelVector |
typedef | PINOCCHIO_ALIGNED_STD_VECTOR (JointData) JointDataVector |
typedef | PINOCCHIO_ALIGNED_STD_VECTOR (Frame) FrameVector |
PINOCCHIO_ALIGNED_STD_VECTOR (Inertia) inertias | |
Spatial inertias of the body i expressed in the supporting joint frame i. More... | |
PINOCCHIO_ALIGNED_STD_VECTOR (SE3) jointPlacements | |
Placement (SE3) of the input of joint i regarding to the parent joint output li. More... | |
~ModelTpl () | |
Public Member Functions inherited from pinocchio::serialization::Serializable< ModelTpl< _Scalar, _Options, JointCollectionTpl > > | |
void | loadFromBinary (const std::string &filename) |
Loads a Derived object from an binary file. More... | |
void | loadFromBinary (boost::asio::streambuf &container) |
Loads a Derived object from a binary container. More... | |
void | loadFromBinary (StaticBuffer &container) |
Loads a Derived object from a static binary container. More... | |
void | loadFromString (const std::string &str) |
Loads a Derived object from a string. More... | |
void | loadFromStringStream (std::istringstream &is) |
Loads a Derived object from a stream string. More... | |
void | loadFromText (const std::string &filename) |
Loads a Derived object from a text file. More... | |
void | loadFromXML (const std::string &filename, const std::string &tag_name) |
Loads a Derived object from an XML file. More... | |
void | saveToBinary (const std::string &filename) const |
Saves a Derived object as an binary file. More... | |
void | saveToBinary (boost::asio::streambuf &container) const |
Saves a Derived object as a binary container. More... | |
void | saveToBinary (StaticBuffer &container) const |
Saves a Derived object as a static binary container. More... | |
std::string | saveToString () const |
Saves a Derived object to a string. More... | |
void | saveToStringStream (std::stringstream &ss) const |
Saves a Derived object to a string stream. More... | |
void | saveToText (const std::string &filename) const |
Saves a Derived object as a text file. More... | |
void | saveToXML (const std::string &filename, const std::string &tag_name) const |
Saves a Derived object as an XML file. More... | |
Public Attributes | |
TangentVectorType | damping |
Vector of joint damping parameters. More... | |
TangentVectorType | effortLimit |
Vector of maximal joint torques. More... | |
FrameVector | frames |
Vector of operational frames registered on the model. More... | |
TangentVectorType | friction |
Vector of joint friction parameters. More... | |
Motion | gravity |
Spatial gravity of the model. More... | |
std::vector< int > | idx_qs |
Starting index of the joint i in the configuration space. More... | |
std::vector< int > | idx_vs |
Starting index of the joint i in the tangent configuration space. More... | |
JointModelVector | joints |
Model of joint i, encapsulated in a JointModelAccessor. More... | |
ConfigVectorType | lowerPositionLimit |
Lower joint configuration limit. More... | |
std::string | name |
Model name;. More... | |
std::vector< std::string > | names |
Name of joint i More... | |
int | nbodies |
Number of bodies. More... | |
int | nframes |
Number of operational frames. More... | |
int | njoints |
Number of joints. More... | |
int | nq |
Dimension of the configuration vector representation. More... | |
std::vector< int > | nqs |
Dimension of the joint i configuration subspace. More... | |
int | nv |
Dimension of the velocity vector space. More... | |
std::vector< int > | nvs |
Dimension of the joint i tangent subspace. More... | |
std::vector< JointIndex > | parents |
Joint parent of joint i, denoted li (li==parents[i]). More... | |
ConfigVectorMap | referenceConfigurations |
Map of reference configurations, indexed by user given names. More... | |
TangentVectorType | rotorGearRatio |
Vector of rotor gear ratio parameters. More... | |
TangentVectorType | rotorInertia |
Vector of rotor inertia parameters. More... | |
EIGEN_MAKE_ALIGNED_OPERATOR_NEW typedef _Scalar | Scalar |
std::vector< IndexVector > | subtrees |
Vector of joint subtrees. subtree[j] corresponds to the subtree supported by the joint j. The first element of subtree[j] is the index of the joint j itself. More... | |
std::vector< IndexVector > | supports |
Vector of joint supports. supports[j] corresponds to the collection of all joints located on the path between body j and the root. The last element of supports[j] is the index of the joint j itself. More... | |
ConfigVectorType | upperPositionLimit |
Upper joint configuration limit. More... | |
TangentVectorType | velocityLimit |
Vector of maximal joint velocities. More... | |
Static Public Attributes | |
static const Vector3 | gravity981 |
Default 3D gravity vector (=(0,0,-9.81)). More... | |
Protected Member Functions | |
void | addJointIndexToParentSubtrees (const JointIndex joint_id) |
Add the joint_id to its parent subtrees. More... | |
Definition at line 23 of file src/multibody/fwd.hpp.
typedef std::map<std::string, ConfigVectorType> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::ConfigVectorMap |
Map between a string (key) and a configuration vector.
Definition at line 69 of file src/multibody/model.hpp.
typedef VectorXs pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::ConfigVectorType |
Dense vectorized version of a joint configuration vector.
Definition at line 66 of file src/multibody/model.hpp.
typedef DataTpl<Scalar,Options,JointCollectionTpl> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::Data |
Definition at line 40 of file src/multibody/model.hpp.
typedef ForceTpl<Scalar,Options> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::Force |
Definition at line 44 of file src/multibody/model.hpp.
typedef FrameTpl<Scalar,Options> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::Frame |
Definition at line 46 of file src/multibody/model.hpp.
typedef pinocchio::FrameIndex pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::FrameIndex |
Definition at line 51 of file src/multibody/model.hpp.
typedef pinocchio::GeomIndex pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::GeomIndex |
Definition at line 50 of file src/multibody/model.hpp.
typedef pinocchio::Index pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::Index |
Definition at line 48 of file src/multibody/model.hpp.
typedef std::vector<Index> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::IndexVector |
Definition at line 52 of file src/multibody/model.hpp.
typedef InertiaTpl<Scalar,Options> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::Inertia |
Definition at line 45 of file src/multibody/model.hpp.
typedef JointCollectionTpl<Scalar,Options> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::JointCollection |
Definition at line 39 of file src/multibody/model.hpp.
typedef JointDataTpl<Scalar,Options,JointCollectionTpl> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::JointData |
Definition at line 55 of file src/multibody/model.hpp.
typedef pinocchio::JointIndex pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::JointIndex |
Definition at line 49 of file src/multibody/model.hpp.
typedef JointModelTpl<Scalar,Options,JointCollectionTpl> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::JointModel |
Definition at line 54 of file src/multibody/model.hpp.
typedef MotionTpl<Scalar,Options> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::Motion |
Definition at line 43 of file src/multibody/model.hpp.
typedef SE3Tpl<Scalar,Options> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::SE3 |
Definition at line 42 of file src/multibody/model.hpp.
typedef VectorXs pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::TangentVectorType |
Dense vectorized version of a joint tangent vector (e.g. velocity, acceleration, etc). It also handles the notion of co-tangent vector (e.g. torque, etc).
Definition at line 73 of file src/multibody/model.hpp.
typedef Eigen::Matrix<Scalar,3,1,Options> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::Vector3 |
Definition at line 63 of file src/multibody/model.hpp.
typedef Eigen::Matrix<Scalar,Eigen::Dynamic,1,Options> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::VectorXs |
Definition at line 62 of file src/multibody/model.hpp.
anonymous enum |
Enumerator | |
---|---|
Options |
Definition at line 37 of file src/multibody/model.hpp.
|
inline |
Default constructor. Builds an empty model with no joints.
Definition at line 167 of file src/multibody/model.hpp.
|
inline |
Definition at line 192 of file src/multibody/model.hpp.
FrameIndex pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::addBodyFrame | ( | const std::string & | body_name, |
const JointIndex & | parentJoint, | ||
const SE3 & | body_placement = SE3::Identity() , |
||
int | previousFrame = -1 |
||
) |
Add a body to the frame tree.
[in] | body_name | Name of the body. |
[in] | parentJoint | Index of the parent joint. |
[in] | body_placement | The relative placement of the body regarding to the parent joint. Set default to the Identity placement. |
[in] | previousFrame | Index of the parent frame. If negative, the parent frame is the frame of the parent joint. |
FrameIndex pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::addFrame | ( | const Frame & | frame, |
const bool | append_inertia = true |
||
) |
Adds a frame to the kinematic tree. The inertia stored within the frame will be happened to the inertia supported by the joint (frame.parent).
[in] | frame | The frame to add to the kinematic tree. |
[in] | append_inertia | Append the inertia contained in the Frame to the inertia supported by the joint. |
JointIndex pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::addJoint | ( | const JointIndex | parent, |
const JointModel & | joint_model, | ||
const SE3 & | joint_placement, | ||
const std::string & | joint_name | ||
) |
Add a joint to the kinematic tree with infinite bounds.
JointModelDerived | The type of the joint model. |
[in] | parent | Index of the parent joint. |
[in] | joint_model | The joint model. |
[in] | joint_placement | Placement of the joint inside its parent joint. |
[in] | joint_name | Name of the joint. If empty, the name is random. |
JointIndex pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::addJoint | ( | const JointIndex | parent, |
const JointModel & | joint_model, | ||
const SE3 & | joint_placement, | ||
const std::string & | joint_name, | ||
const VectorXs & | max_effort, | ||
const VectorXs & | max_velocity, | ||
const VectorXs & | min_config, | ||
const VectorXs & | max_config | ||
) |
Add a joint to the kinematic tree with infinite bounds.
JointModelDerived | The type of the joint model. |
[in] | parent | Index of the parent joint. |
[in] | joint_model | The joint model. |
[in] | joint_placement | Placement of the joint inside its parent joint. |
[in] | joint_name | Name of the joint. If empty, the name is random. |
[in] | max_effort | Maximal joint torque. |
[in] | max_velocity | Maximal joint velocity. |
[in] | min_config | Lower joint configuration. |
[in] | max_config | Upper joint configuration. |
JointIndex pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::addJoint | ( | const JointIndex | parent, |
const JointModel & | joint_model, | ||
const SE3 & | joint_placement, | ||
const std::string & | joint_name, | ||
const VectorXs & | max_effort, | ||
const VectorXs & | max_velocity, | ||
const VectorXs & | min_config, | ||
const VectorXs & | max_config, | ||
const VectorXs & | friction, | ||
const VectorXs & | damping | ||
) |
Add a joint to the kinematic tree with infinite bounds.
JointModelDerived | The type of the joint model. |
[in] | parent | Index of the parent joint. |
[in] | joint_model | The joint model. |
[in] | joint_placement | Placement of the joint inside its parent joint. |
[in] | joint_name | Name of the joint. If empty, the name is random. |
[in] | max_effort | Maximal joint torque. |
[in] | max_velocity | Maximal joint velocity. |
[in] | min_config | Lower joint configuration. |
[in] | max_config | Upper joint configuration. |
[in] | friction | Joint friction parameters. |
[in] | damping | Joint damping parameters. |
FrameIndex pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::addJointFrame | ( | const JointIndex & | joint_index, |
int | previous_frame_index = -1 |
||
) |
Add a joint to the frame tree.
[in] | jointIndex | Index of the joint. |
[in] | frameIndex | Index of the parent frame. If negative, the parent frame is the frame of the parent joint. |
|
protected |
Add the joint_id to its parent subtrees.
[in] | joint_id | The id of the joint to add to the subtrees |
void pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::appendBodyToJoint | ( | const JointIndex | joint_index, |
const Inertia & | Y, | ||
const SE3 & | body_placement = SE3::Identity() |
||
) |
Append a body to a given joint of the kinematic tree.
[in] | joint_index | Index of the supporting joint. |
[in] | Y | Spatial inertia of the body. |
[in] | body_placement | The relative placement of the body regarding to the parent joint. Set default to the Identity placement. |
|
inline |
copy into vectors
Definition at line 196 of file src/multibody/model.hpp.
|
inline |
Check the validity of the attributes of Model with respect to the specification of some algorithms.
The method is a template so that the checkers can be defined in each algorithms.
[in] | checker | a class, typically defined in the algorithm module, that validates the attributes of model. |
Definition at line 549 of file src/multibody/model.hpp.
|
inline |
Run check(fusion::list) with DEFAULT_CHECKERS as argument.
Definition at line 21 of file default-check.hpp.
|
inline |
Run checkData on data and current model.
[in] | data | to be checked wrt *this. |
bool pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::existBodyName | ( | const std::string & | name | ) | const |
Check if a body given by its name exists.
[in] | name | Name of the body. |
bool pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::existFrame | ( | const std::string & | name, |
const FrameType & | type = (FrameType)(JOINT|FIXED_JOINT|BODY|OP_FRAME|SENSOR) |
||
) | const |
Checks if a frame given by its name exists.
[in] | name | Name of the frame. |
[in] | type | Type of the frame. |
bool pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::existJointName | ( | const std::string & | name | ) | const |
Check if a joint given by its name exists.
[in] | name | Name of the joint. |
FrameIndex pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::getBodyId | ( | const std::string & | name | ) | const |
Return the index of a body given by its name.
[in] | name | Name of the body. |
FrameIndex pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::getFrameId | ( | const std::string & | name, |
const FrameType & | type = (FrameType)(JOINT|FIXED_JOINT|BODY|OP_FRAME|SENSOR) |
||
) | const |
Returns the index of a frame given by its name.
[in] | name | Name of the frame. |
[in] | type | Type of the frame. |
JointIndex pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::getJointId | ( | const std::string & | name | ) | const |
Return the index of a joint given by its name.
[in] | name | Name of the joint. |
|
inline |
Definition at line 356 of file src/multibody/model.hpp.
|
inline |
Equality comparison operator.
Definition at line 259 of file src/multibody/model.hpp.
typedef pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::PINOCCHIO_ALIGNED_STD_VECTOR | ( | JointModel | ) |
typedef pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::PINOCCHIO_ALIGNED_STD_VECTOR | ( | JointData | ) |
typedef pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::PINOCCHIO_ALIGNED_STD_VECTOR | ( | Frame | ) |
pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::PINOCCHIO_ALIGNED_STD_VECTOR | ( | Inertia | ) |
Spatial inertias of the body i expressed in the supporting joint frame i.
pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::PINOCCHIO_ALIGNED_STD_VECTOR | ( | SE3 | ) |
Placement (SE3) of the input of joint i regarding to the parent joint output li.
TangentVectorType pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::damping |
Vector of joint damping parameters.
Definition at line 130 of file src/multibody/model.hpp.
TangentVectorType pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::effortLimit |
Vector of maximal joint torques.
Definition at line 133 of file src/multibody/model.hpp.
FrameVector pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::frames |
Vector of operational frames registered on the model.
Definition at line 145 of file src/multibody/model.hpp.
TangentVectorType pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::friction |
Vector of joint friction parameters.
Definition at line 127 of file src/multibody/model.hpp.
Motion pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::gravity |
Spatial gravity of the model.
Definition at line 158 of file src/multibody/model.hpp.
|
static |
Default 3D gravity vector (=(0,0,-9.81)).
Definition at line 161 of file src/multibody/model.hpp.
std::vector<int> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::idx_qs |
Starting index of the joint i in the configuration space.
Definition at line 100 of file src/multibody/model.hpp.
std::vector<int> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::idx_vs |
Starting index of the joint i in the tangent configuration space.
Definition at line 106 of file src/multibody/model.hpp.
JointModelVector pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::joints |
Model of joint i, encapsulated in a JointModelAccessor.
Definition at line 97 of file src/multibody/model.hpp.
ConfigVectorType pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::lowerPositionLimit |
Lower joint configuration limit.
Definition at line 139 of file src/multibody/model.hpp.
std::string pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::name |
Model name;.
Definition at line 164 of file src/multibody/model.hpp.
std::vector<std::string> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::names |
Name of joint i
Definition at line 115 of file src/multibody/model.hpp.
int pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::nbodies |
Number of bodies.
Definition at line 85 of file src/multibody/model.hpp.
int pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::nframes |
Number of operational frames.
Definition at line 88 of file src/multibody/model.hpp.
int pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::njoints |
Number of joints.
Definition at line 82 of file src/multibody/model.hpp.
int pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::nq |
Dimension of the configuration vector representation.
Definition at line 76 of file src/multibody/model.hpp.
std::vector<int> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::nqs |
Dimension of the joint i configuration subspace.
Definition at line 103 of file src/multibody/model.hpp.
int pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::nv |
Dimension of the velocity vector space.
Definition at line 79 of file src/multibody/model.hpp.
std::vector<int> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::nvs |
Dimension of the joint i tangent subspace.
Definition at line 109 of file src/multibody/model.hpp.
std::vector<JointIndex> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::parents |
Joint parent of joint i, denoted li (li==parents[i]).
Definition at line 112 of file src/multibody/model.hpp.
ConfigVectorMap pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::referenceConfigurations |
Map of reference configurations, indexed by user given names.
Definition at line 118 of file src/multibody/model.hpp.
TangentVectorType pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::rotorGearRatio |
Vector of rotor gear ratio parameters.
Definition at line 124 of file src/multibody/model.hpp.
TangentVectorType pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::rotorInertia |
Vector of rotor inertia parameters.
Definition at line 121 of file src/multibody/model.hpp.
EIGEN_MAKE_ALIGNED_OPERATOR_NEW typedef _Scalar pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::Scalar |
Definition at line 36 of file src/multibody/model.hpp.
std::vector<IndexVector> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::subtrees |
Vector of joint subtrees. subtree[j] corresponds to the subtree supported by the joint j. The first element of subtree[j] is the index of the joint j itself.
Definition at line 155 of file src/multibody/model.hpp.
std::vector<IndexVector> pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::supports |
Vector of joint supports. supports[j] corresponds to the collection of all joints located on the path between body j and the root. The last element of supports[j] is the index of the joint j itself.
Definition at line 150 of file src/multibody/model.hpp.
ConfigVectorType pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::upperPositionLimit |
Upper joint configuration limit.
Definition at line 142 of file src/multibody/model.hpp.
TangentVectorType pinocchio::ModelTpl< _Scalar, _Options, JointCollectionTpl >::velocityLimit |
Vector of maximal joint velocities.
Definition at line 136 of file src/multibody/model.hpp.