Public Types | Public Member Functions | Protected Types | Protected Attributes | List of all members
Map< Wrench< _Scalar >, MapOptions, StrideType > Class Template Reference

Class map an array to wrench. More...

#include <Wrench.h>

Inheritance diagram for Map< Wrench< _Scalar >, MapOptions, StrideType >:
Inheritance graph
[legend]

Public Types

typedef internal::traits< Map >::Coefficients Coefficients
 
- Public Types inherited from WrenchBase< Map< Wrench< _Scalar >, MapOptions, StrideType > >
typedef Base::BaseType BaseType
 
typedef internal::traits< Map< Wrench< _Scalar >, MapOptions, StrideType > >::Coefficients Coefficients
 
typedef Matrix< Scalar, 3, 1 > Force
 
typedef LieAlgebraDual< Matrix< Scalar, 3, 1 > > Torque
 
- Public Types inherited from LieAlgebraDualBase< Matrix< internal::traits< Map< Wrench< _Scalar >, MapOptions, StrideType > >::Scalar, 6, 1 >, Map< Wrench< _Scalar >, MapOptions, StrideType > >
typedef LieAlgebra< BaseTypeAlgebra
 
typedef Matrix< internal::traits< Map< Wrench< _Scalar >, MapOptions, StrideType > >::Scalar, 6, 1 > BaseType
 
typedef internal::traits< Map< Wrench< _Scalar >, MapOptions, StrideType > >::Coefficients Coefficients
 
typedef internal::traits< Map< Wrench< _Scalar >, MapOptions, StrideType > >::Group Group
 
typedef LieAlgebraDual< BaseTypePlainObject
 

Public Member Functions

Coefficientsget ()
 
const Coefficientsget () const
 
 Map (const Wrench< Scalar > &w)
 
template<int _Rows, int _Cols, int _Options, int _MaxRows, int _MaxCols>
 Map (const Array< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > &g)
 
 Map (Scalar *data)
 
 Map (const Map &m)
 
- Public Member Functions inherited from WrenchBase< Map< Wrench< _Scalar >, MapOptions, StrideType > >
Wrench< Scalar > changeFrame (const LieGroupBase< Quaternion< Scalar >, RotationDerived > &) const
 
Wrench< Scalar > changePoint (const MatrixBase< OtherDerived > &point) const
 
Scalar fx () const
 
Scalar & fx ()
 
Scalar fy () const
 
Scalar & fy ()
 
Scalar fz () const
 
Scalar & fz ()
 
Map< ForcegetForce ()
 
Map< const ForcegetForce () const
 
Map< TorquegetTorque ()
 
Map< const TorquegetTorque () const
 
Scalar tx () const
 
Scalar & tx ()
 
Scalar ty () const
 
Scalar & ty ()
 
Scalar tz () const
 
Scalar & tz ()
 
- Public Member Functions inherited from LieAlgebraDualBase< Matrix< internal::traits< Map< Wrench< _Scalar >, MapOptions, StrideType > >::Scalar, 6, 1 >, Map< Wrench< _Scalar >, MapOptions, StrideType > >
const Map< Wrench< _Scalar >, MapOptions, StrideType > & derived () const
 
Map< Wrench< _Scalar >, MapOptions, StrideType > & derived ()
 
Coefficientsget ()
 
const Coefficientsget () const
 
EIGEN_STRONG_INLINE LieAlgebraDualBaseoperator= (const LieAlgebraDualBase &other)
 
EIGEN_STRONG_INLINE Map< Wrench< _Scalar >, MapOptions, StrideType > & operator= (const LieAlgebraDualBase< BaseType, OtherDerived > &other)
 

Protected Types

typedef WrenchBase< Map< Wrench< _Scalar > > > Base
 
- Protected Types inherited from WrenchBase< Map< Wrench< _Scalar >, MapOptions, StrideType > >
typedef LieAlgebraDualBase< Matrix< typename internal::traits< Map< Wrench< _Scalar >, MapOptions, StrideType > >::Scalar, 6, 1 >, Map< Wrench< _Scalar >, MapOptions, StrideType > > Base
 
- Protected Types inherited from LieAlgebraDualBase< Matrix< internal::traits< Map< Wrench< _Scalar >, MapOptions, StrideType > >::Scalar, 6, 1 >, Map< Wrench< _Scalar >, MapOptions, StrideType > >
typedef MatrixBase< Map< Wrench< _Scalar >, MapOptions, StrideType > > Base
 

Protected Attributes

Coefficients m_coeffs
 

Detailed Description

template<typename _Scalar, int MapOptions, typename StrideType>
class Map< Wrench< _Scalar >, MapOptions, StrideType >

Class map an array to wrench.

Template Parameters
_Scalarthe type of the underlying array
MapOptions
See also
Map<Matrix>
Template Parameters
StrideType
See also
Map<Matrix>
The methods are defined in LieAlgebraBase and WrenchBase

Definition at line 217 of file Wrench.h.

Member Typedef Documentation

template<typename _Scalar , int MapOptions, typename StrideType >
typedef WrenchBase<Map<Wrench<_Scalar> > > Map< Wrench< _Scalar >, MapOptions, StrideType >::Base
protected

Definition at line 219 of file Wrench.h.

template<typename _Scalar , int MapOptions, typename StrideType >
typedef internal::traits<Map>::Coefficients Map< Wrench< _Scalar >, MapOptions, StrideType >::Coefficients

Definition at line 224 of file Wrench.h.

Constructor & Destructor Documentation

template<typename _Scalar , int MapOptions, typename StrideType >
Map< Wrench< _Scalar >, MapOptions, StrideType >::Map ( const Wrench< Scalar > &  w)
inline

Definition at line 226 of file Wrench.h.

template<typename _Scalar , int MapOptions, typename StrideType >
template<int _Rows, int _Cols, int _Options, int _MaxRows, int _MaxCols>
Map< Wrench< _Scalar >, MapOptions, StrideType >::Map ( const Array< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > &  g)
inline

Definition at line 228 of file Wrench.h.

template<typename _Scalar , int MapOptions, typename StrideType >
Map< Wrench< _Scalar >, MapOptions, StrideType >::Map ( Scalar *  data)
inline

Definition at line 230 of file Wrench.h.

template<typename _Scalar , int MapOptions, typename StrideType >
Map< Wrench< _Scalar >, MapOptions, StrideType >::Map ( const Map< Wrench< _Scalar >, MapOptions, StrideType > &  m)
inline

Definition at line 231 of file Wrench.h.

Member Function Documentation

template<typename _Scalar , int MapOptions, typename StrideType >
Coefficients& Map< Wrench< _Scalar >, MapOptions, StrideType >::get ( )
inline

Definition at line 233 of file Wrench.h.

template<typename _Scalar , int MapOptions, typename StrideType >
const Coefficients& Map< Wrench< _Scalar >, MapOptions, StrideType >::get ( ) const
inline

Definition at line 234 of file Wrench.h.

Member Data Documentation

template<typename _Scalar , int MapOptions, typename StrideType >
Coefficients Map< Wrench< _Scalar >, MapOptions, StrideType >::m_coeffs
protected

Definition at line 237 of file Wrench.h.


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


lgsm
Author(s): Roberto Martín-Martín
autogenerated on Mon Jun 10 2019 14:05:59