Classes | Public Types | Public Member Functions | Protected Attributes | List of all members
pinocchio::ScaledConstraint< Constraint > Struct Template Reference

#include <joint-mimic.hpp>

Inheritance diagram for pinocchio::ScaledConstraint< Constraint >:
Inheritance graph
[legend]

Classes

struct  TransposeConst
 

Public Types

enum  { NV = Constraint::NV }
 
typedef ConstraintBase< ScaledConstraintBase
 
typedef SE3GroupAction< Constraint >::ReturnType SE3ActionReturnType
 

Public Member Functions

template<typename VectorLike >
JointMotion __mult__ (const Eigen::MatrixBase< VectorLike > &v) const
 
const Constraint & constraint () const
 
Constraint & constraint ()
 
bool isEqual (const ScaledConstraint &other) const
 
DenseBase matrix_impl () const
 
template<typename MotionDerived >
MotionAlgebraAction< ScaledConstraint, MotionDerived >::ReturnType motionAction (const MotionDense< MotionDerived > &m) const
 
int nv_impl () const
 
ScaledConstraintoperator= (const ScaledConstraint &other)
 
 ScaledConstraint ()
 
 ScaledConstraint (const Scalar &scaling_factor)
 
 ScaledConstraint (const Constraint &constraint, const Scalar &scaling_factor)
 
 ScaledConstraint (const ScaledConstraint &other)
 
const Scalar & scaling () const
 
Scalar & scaling ()
 
template<typename S1 , int O1>
SE3ActionReturnType se3Action (const SE3Tpl< S1, O1 > &m) const
 
template<typename S1 , int O1>
SE3ActionReturnType se3ActionInverse (const SE3Tpl< S1, O1 > &m) const
 
TransposeConst transpose () const
 
- Public Member Functions inherited from pinocchio::ConstraintBase< ScaledConstraint< Constraint > >
int cols () const
 
EIGEN_MAKE_ALIGNED_OPERATOR_NEW ScaledConstraint< Constraint > & derived ()
 
const ScaledConstraint< Constraint > & derived () const
 
void disp (std::ostream &os) const
 
bool isApprox (const ConstraintBase< OtherDerived > &other, const Scalar &prec=Eigen::NumTraits< Scalar >::dummy_precision()) const
 
MatrixReturnType matrix ()
 
ConstMatrixReturnType matrix () const
 
MotionAlgebraAction< ScaledConstraint< Constraint >, MotionDerived >::ReturnType motionAction (const MotionDense< MotionDerived > &v) const
 
int nv () const
 
JointMotion operator* (const Eigen::MatrixBase< VectorLike > &vj) const
 
bool operator== (const ConstraintBase< ScaledConstraint< Constraint > > &other) const
 
SE3GroupAction< ScaledConstraint< Constraint > >::ReturnType se3Action (const SE3Tpl< Scalar, Options > &m) const
 
SE3GroupAction< ScaledConstraint< Constraint > >::ReturnType se3ActionInverse (const SE3Tpl< Scalar, Options > &m) const
 

Protected Attributes

Constraint m_constraint
 
Scalar m_scaling_factor
 

Additional Inherited Members

- Static Public Member Functions inherited from pinocchio::ConstraintBase< ScaledConstraint< Constraint > >
static int rows ()
 

Detailed Description

template<class Constraint>
struct pinocchio::ScaledConstraint< Constraint >

Definition at line 14 of file joint-mimic.hpp.

Member Typedef Documentation

template<class Constraint>
typedef ConstraintBase<ScaledConstraint> pinocchio::ScaledConstraint< Constraint >::Base

Definition at line 67 of file joint-mimic.hpp.

template<class Constraint>
typedef SE3GroupAction<Constraint>::ReturnType pinocchio::ScaledConstraint< Constraint >::SE3ActionReturnType

Definition at line 70 of file joint-mimic.hpp.

Member Enumeration Documentation

template<class Constraint>
anonymous enum
Enumerator
NV 

Definition at line 66 of file joint-mimic.hpp.

Constructor & Destructor Documentation

template<class Constraint>
pinocchio::ScaledConstraint< Constraint >::ScaledConstraint ( )
inline

Definition at line 72 of file joint-mimic.hpp.

template<class Constraint>
pinocchio::ScaledConstraint< Constraint >::ScaledConstraint ( const Scalar &  scaling_factor)
inlineexplicit

Definition at line 74 of file joint-mimic.hpp.

template<class Constraint>
pinocchio::ScaledConstraint< Constraint >::ScaledConstraint ( const Constraint &  constraint,
const Scalar &  scaling_factor 
)
inline

Definition at line 78 of file joint-mimic.hpp.

template<class Constraint>
pinocchio::ScaledConstraint< Constraint >::ScaledConstraint ( const ScaledConstraint< Constraint > &  other)
inline

Definition at line 84 of file joint-mimic.hpp.

Member Function Documentation

template<class Constraint>
template<typename VectorLike >
JointMotion pinocchio::ScaledConstraint< Constraint >::__mult__ ( const Eigen::MatrixBase< VectorLike > &  v) const
inline

Definition at line 97 of file joint-mimic.hpp.

template<class Constraint>
const Constraint& pinocchio::ScaledConstraint< Constraint >::constraint ( ) const
inline

Definition at line 167 of file joint-mimic.hpp.

template<class Constraint>
Constraint& pinocchio::ScaledConstraint< Constraint >::constraint ( )
inline

Definition at line 168 of file joint-mimic.hpp.

template<class Constraint>
bool pinocchio::ScaledConstraint< Constraint >::isEqual ( const ScaledConstraint< Constraint > &  other) const
inline

Definition at line 170 of file joint-mimic.hpp.

template<class Constraint>
DenseBase pinocchio::ScaledConstraint< Constraint >::matrix_impl ( ) const
inline

Definition at line 149 of file joint-mimic.hpp.

template<class Constraint>
template<typename MotionDerived >
MotionAlgebraAction<ScaledConstraint,MotionDerived>::ReturnType pinocchio::ScaledConstraint< Constraint >::motionAction ( const MotionDense< MotionDerived > &  m) const
inline

Definition at line 157 of file joint-mimic.hpp.

template<class Constraint>
int pinocchio::ScaledConstraint< Constraint >::nv_impl ( ) const
inline

Definition at line 120 of file joint-mimic.hpp.

template<class Constraint>
ScaledConstraint& pinocchio::ScaledConstraint< Constraint >::operator= ( const ScaledConstraint< Constraint > &  other)
inline

Definition at line 89 of file joint-mimic.hpp.

template<class Constraint>
const Scalar& pinocchio::ScaledConstraint< Constraint >::scaling ( ) const
inline

Definition at line 164 of file joint-mimic.hpp.

template<class Constraint>
Scalar& pinocchio::ScaledConstraint< Constraint >::scaling ( )
inline

Definition at line 165 of file joint-mimic.hpp.

template<class Constraint>
template<typename S1 , int O1>
SE3ActionReturnType pinocchio::ScaledConstraint< Constraint >::se3Action ( const SE3Tpl< S1, O1 > &  m) const
inline

Definition at line 106 of file joint-mimic.hpp.

template<class Constraint>
template<typename S1 , int O1>
SE3ActionReturnType pinocchio::ScaledConstraint< Constraint >::se3ActionInverse ( const SE3Tpl< S1, O1 > &  m) const
inline

Definition at line 114 of file joint-mimic.hpp.

template<class Constraint>
TransposeConst pinocchio::ScaledConstraint< Constraint >::transpose ( ) const
inline

Definition at line 147 of file joint-mimic.hpp.

Member Data Documentation

template<class Constraint>
Constraint pinocchio::ScaledConstraint< Constraint >::m_constraint
protected

Definition at line 178 of file joint-mimic.hpp.

template<class Constraint>
Scalar pinocchio::ScaledConstraint< Constraint >::m_scaling_factor
protected

Definition at line 179 of file joint-mimic.hpp.


The documentation for this struct was generated from the following file:


pinocchio
Author(s):
autogenerated on Tue Jun 1 2021 02:45:06