stateObservation Namespace Reference

Namespaces

 algorithm
 
 cst
 
 detail
 
 examples
 
 flexibilityEstimation
 
 hrp2
 
 kine
 
 tools
 

Classes

class  AccelerometerGyrometer
 Implements the accelerometer-gyrometer measurements. More...
 
class  AccelerometerGyrometerMagnetometer
 Implements the accelerometer-gyrometer-magnetometer measurements. More...
 
class  AlgebraicSensor
 The base class for algebraic sensors. Algebraic sensors are sensors which depend only on the state value and the current time and do not have internal dynamics (or a dynamics which converges fast enough to be ignored). This class implements mostly the containers and the interface to algebraic sensors. Algebraic sensors must be derived from this class. More...
 
class  BidimElasticInvPendulum
 The class is an implementation of the dynamical system defined by a 2D inverted pendulum with an elastic joint. The input is the horizontal acceleration. More...
 
class  CheckedItem
 this is a structure allowing for automatically verifying that the item has been initialized or not. The chckitm_reset() function allows to set it back to "not initialized" state. More...
 
struct  CheckNaN
 Additional checker that allows to check for the presence of NaN values in the item. More...
 
class  DebugItem
 
class  DebugItem< T, defaultValue, false >
 this specialization contains no object More...
 
class  DebugItemDefaultValue
 
class  DynamicalSystemFunctorBase
 This is the base class of any functor that describes the dynamics of the state and the measurement. This class is to be derived in order to be given to the Extended Kalman Filter. More...
 
class  DynamicalSystemSimulator
 The class gives a small encapsulation of the dynamics functor, which enables the simulation of the dynamics and the storage of states, inputs and measurements. More...
 
struct  EigenType
 
struct  EmptyChecker
 This structure is used as an additionalChecker for a CheckedItem that doesn't require additional tests. More...
 
class  ExtendedKalmanFilter
 
class  FixOrDynMatrixTools
 
class  FixOrDynMatrixToolsBySize
 
class  FixOrDynMatrixToolsBySize< compileTimeRows, -1 >
 
class  FixOrDynMatrixToolsBySize<-1, -1 >
 
class  FixOrDynMatrixToolsBySize<-1, compileTimeCols >
 
class  GaussianWhiteNoise
 The class derivates the NoiseBase class to implement a gaussian white noise with a given covariance matrix, and bias. More...
 
class  IMUDynamicalSystem
 The class is an implementation of the dynamical system defined by an inertial measurement unit (IMU) fixed on a rigid body. The state is the position velocity and acceleration and the orientaion and rotation velocity and acceleration. The sensors are the accelerometer and the gyrometer. More...
 
class  IMUMagnetometerDynamicalSystem
 The class is an implementation of the dynamical system defined by an inertial measurement unit (IMU) fixed on a rigid body. The state is the position velocity and acceleration and the orientation and rotation velocity and acceleration. The sensors are the accelerometer, the gyrometer and the magnetometer. More...
 
class  IMUMltpctiveDynamicalSystem
 The class is an implementation of the dynamical system defined by an inertial measurement unit (IMU) fixed on a rigid body. The state is the position velocity and acceleration and the orientaion and rotation velocity and acceleration. The sensors are the accelerometer and the gyrometer. More...
 
class  IndexedMatrixArrayT
 This class describes a structure that enables to store array of matrices with time indexation. More...
 
class  IndexedMatrixT
 This class describes a structure composed by a matrix of a given size and a time-index parameter. It can tell also if it is initialized or not. More...
 
struct  isEigen
 Checks if it is derived from EigenBase (the base class of all dense functions) More...
 
struct  isMatrix
 Checks if a class is a specialization of Eigen::Matrix. More...
 
struct  isMatrix< Eigen::Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >
 
class  KalmanFilterBase
 It mostly implements the equations of Kalman filtering It is suitablle by derivation to be used incases of Linear, linearized and extended Kalman filtering. It may be derived to unscented Kalman filtering, but non-straighforwardly because the state vector is modified. This class requires to be derived to overload the update routine and the measurements simulation routine. More...
 
class  KineticsObserver
 This observer estimates the kinematics, the external forces, the bias on the gyrometers measurements, and the contacts forces and pose. More...
 
class  LinearKalmanFilter
 The class of a Linear Kalman filter. More...
 
class  LipmDcmEstimator
 Filtering of divergent component of motion (DCM) and estimation of a bias betweeen the DCM and the corresponding zero moment point for a linearized inverted pendulum model. More...
 
struct  MatrixType
 
class  NoiseBase
 
class  ObserverBase
 The base class for observers. The observer is destinated to any dynamical system with a vector state representation. This class mostly defined an abstract interface, static constants and types. It is templated by: More...
 
class  SensorBase
 The base class for sensors. This must be derived to implement a sensor. More...
 
class  StateVectorArithmetics
 This class is used to customize the way the difference between measurements, the state update function and the differentiation are performed. default is the usual natual arithmetics. overload any ohter one. More...
 
class  TiltEstimator
 Description is pending. More...
 
class  TiltEstimatorHumanoid
 Version of the Tilt Estimator for humanoid robots. More...
 
class  UnidimLipmDcmEstimator
 1D version of the estimation of a bias betweeen the divergent component of motion and the corresponding zero moment point for a linearized inverted pendulum model. More...
 
class  ZeroDelayObserver
 Defines the base class of online zero delay observers. Zero delay observers are the classical state observers where input and state values at instant k and the measurement value at instant k+1 are enough to provide the estimation of the state at instant k+1. This class mostly defines the data structures for storing the vectors, it describes the set routines and the observation loop mechanism. It requires to be derviated to implement the new oneStepEstimation_() method. More...
 
class  ZmpTrackingGainEstimator
 

Typedefs

typedef Eigen::VectorXd Vector
 Dynamic sized scalar vector. More...
 
typedef Eigen::Matrix< double, 1, 1 > Vector1
 1D Vector More...
 
typedef Eigen::Matrix< double, 2, 1 > Vector2
 2d Vector More...
 
typedef Eigen::Vector3d Vector3
 3D vector More...
 
typedef Eigen::Matrix< double, 3, 1, Eigen::DontAlign > Vector3Unaligned
 3D vector unaligned More...
 
typedef Eigen::Vector4d Vector4
 4D vector More...
 
typedef Eigen::Matrix< double, 5, 1 > Vector5
 5D vector More...
 
typedef Eigen::Matrix< double, 6, 1 > Vector6
 6D vector More...
 
typedef Eigen::MatrixXd Matrix
 Dynamic sized Matrix. More...
 
typedef Eigen::Matrix< double, 1, 1 > Matrix1
 1D scalar Matrix More...
 
typedef Eigen::Matrix2d Matrix2
 2D scalar Matrix More...
 
typedef Eigen::Matrix3d Matrix3
 3x3 Scalar Matrix More...
 
typedef Eigen::Matrix< double, 3, 3, Eigen::DontAlign > Matrix3Unaligned
 3x3 Scalar Matrix Unaligned More...
 
typedef Eigen::Matrix4d Matrix4
 4x4 Scalar Matrix More...
 
typedef Eigen::Matrix< double, 5, 5 > Matrix5
 5x5 Scalar Matrix More...
 
typedef Eigen::Matrix< double, 6, 6 > Matrix6
 6x6 Scalar Matrix More...
 
typedef Eigen::Matrix< double, 12, 12 > Matrix12
 12x12 scalar Matrix More...
 
typedef Eigen::Quaterniond Quaternion
 Quaternion. More...
 
typedef Eigen::Quaternion< double, Eigen::DontAlign > QuaternionUnaligned
 Quaternion Unaligned. More...
 
typedef Eigen::AngleAxis< double > AngleAxis
 Euler Axis/Angle representation of orientation. More...
 
typedef Eigen::Rotation2D< double > Rotation2D
 2D rotations More...
 
typedef Eigen::Index Index
 
typedef long int TimeIndex
 
typedef Index TimeSize
 
typedef CheckedItem< Matrix3, false, false, true, true, CheckNaNCheckedMatrix3
 
typedef CheckedItem< Matrix6, false, false, true, true, CheckNaNCheckedMatrix6
 
typedef CheckedItem< Matrix12, false, false, true, true, CheckNaNCheckedMatrix12
 
typedef CheckedItem< Vector3, false, false, true, true, CheckNaNCheckedVector3
 
typedef CheckedItem< Vector6, false, false, true, true, CheckNaNCheckedVector6
 
typedef CheckedItem< Quaternion, false, false, true, true > CheckedQuaternion
 
typedef IndexedMatrixT< MatrixIndexedMatrix
 
typedef IndexedMatrixT< VectorIndexedVector
 
typedef IndexedMatrixT< Vector3IndexedVector3
 
typedef IndexedMatrixT< Matrix3IndexedMatrix3
 
typedef IndexedMatrixArrayT< MatrixIndexedMatrixArray
 
typedef IndexedMatrixArrayT< VectorIndexedVectorArray
 
typedef boost::timer::auto_cpu_timer auto_cpu_timer
 
typedef boost::timer::cpu_timer cpu_timer
 
typedef boost::timer::cpu_timer cpu_times
 

Functions

bool isApprox (double a, double b, double relativePrecision=cst::epsilon1)
 checks if two scalars have approximately the same value up to a given relative precision More...
 
bool isApproxAbs (double a, double b, double absolutePrecision=cst::epsilon1)
 checks if two scalars have approximately the same value up to a given absolute precision More...
 

Typedef Documentation

◆ AngleAxis

typedef Eigen::AngleAxis<double> stateObservation::AngleAxis

Euler Axis/Angle representation of orientation.

◆ auto_cpu_timer

typedef boost::timer::auto_cpu_timer stateObservation::auto_cpu_timer

◆ CheckedMatrix12

typedef CheckedItem<Matrix12, false, false, true, true, CheckNaN> stateObservation::CheckedMatrix12

◆ CheckedMatrix3

typedef CheckedItem<Matrix3, false, false, true, true, CheckNaN> stateObservation::CheckedMatrix3

◆ CheckedMatrix6

typedef CheckedItem<Matrix6, false, false, true, true, CheckNaN> stateObservation::CheckedMatrix6

◆ CheckedQuaternion

typedef CheckedItem<Quaternion, false, false, true, true> stateObservation::CheckedQuaternion

◆ CheckedVector3

typedef CheckedItem<Vector3, false, false, true, true, CheckNaN> stateObservation::CheckedVector3

◆ CheckedVector6

typedef CheckedItem<Vector6, false, false, true, true, CheckNaN> stateObservation::CheckedVector6

◆ cpu_timer

typedef boost::timer::cpu_timer stateObservation::cpu_timer

◆ cpu_times

typedef boost::timer::cpu_timer stateObservation::cpu_times

◆ Index

typedef Eigen::Index stateObservation::Index

◆ IndexedMatrix

◆ IndexedMatrix3

◆ IndexedMatrixArray

◆ IndexedVector

◆ IndexedVector3

◆ IndexedVectorArray

◆ Matrix

typedef Eigen::MatrixXd stateObservation::Matrix

Dynamic sized Matrix.

◆ Matrix1

typedef Eigen::Matrix<double, 1, 1> stateObservation::Matrix1

1D scalar Matrix

◆ Matrix12

typedef Eigen::Matrix<double, 12, 12> stateObservation::Matrix12

12x12 scalar Matrix

◆ Matrix2

typedef Eigen::Matrix2d stateObservation::Matrix2

2D scalar Matrix

◆ Matrix3

typedef Eigen::Matrix3d stateObservation::Matrix3

3x3 Scalar Matrix

◆ Matrix3Unaligned

typedef Eigen::Matrix<double, 3, 3, Eigen::DontAlign> stateObservation::Matrix3Unaligned

3x3 Scalar Matrix Unaligned

◆ Matrix4

typedef Eigen::Matrix4d stateObservation::Matrix4

4x4 Scalar Matrix

◆ Matrix5

typedef Eigen::Matrix<double, 5, 5> stateObservation::Matrix5

5x5 Scalar Matrix

◆ Matrix6

typedef Eigen::Matrix<double, 6, 6> stateObservation::Matrix6

6x6 Scalar Matrix

◆ Quaternion

typedef Eigen::Quaterniond stateObservation::Quaternion

Quaternion.

◆ QuaternionUnaligned

typedef Eigen::Quaternion<double, Eigen::DontAlign> stateObservation::QuaternionUnaligned

Quaternion Unaligned.

◆ Rotation2D

typedef Eigen::Rotation2D<double> stateObservation::Rotation2D

2D rotations

◆ TimeIndex

typedef long int stateObservation::TimeIndex

◆ TimeSize

◆ Vector

typedef Eigen::VectorXd stateObservation::Vector

Dynamic sized scalar vector.

◆ Vector1

typedef Eigen::Matrix<double, 1, 1> stateObservation::Vector1

1D Vector

◆ Vector2

typedef Eigen::Matrix<double, 2, 1> stateObservation::Vector2

2d Vector

◆ Vector3

typedef Eigen::Vector3d stateObservation::Vector3

3D vector

◆ Vector3Unaligned

typedef Eigen::Matrix<double, 3, 1, Eigen::DontAlign> stateObservation::Vector3Unaligned

3D vector unaligned

◆ Vector4

typedef Eigen::Vector4d stateObservation::Vector4

4D vector

◆ Vector5

typedef Eigen::Matrix<double, 5, 1> stateObservation::Vector5

5D vector

◆ Vector6

typedef Eigen::Matrix<double, 6, 1> stateObservation::Vector6

6D vector

Function Documentation

◆ isApprox()

bool stateObservation::isApprox ( double  a,
double  b,
double  relativePrecision = cst::epsilon1 
)
inline

checks if two scalars have approximately the same value up to a given relative precision

Parameters
athe first scalar
bthe second scalar
relativePrecisionthe relative precision (no need to multiply by the scales of a and b)
Returns
true they are equal
false they are not

◆ isApproxAbs()

bool stateObservation::isApproxAbs ( double  a,
double  b,
double  absolutePrecision = cst::epsilon1 
)
inline

checks if two scalars have approximately the same value up to a given absolute precision

Parameters
athe first scalar
bthe second scalar
absolutePrecisionthe absoilute precision
Returns
true they are equal
false they are not