Namespaces | Classes | Typedefs | Enumerations | Functions | Variables
hector_pose_estimation Namespace Reference

Namespaces

 filter
 
 traits
 

Classes

class  AccelerometerModel
 
class  Alias
 
class  AliasT
 
class  Baro
 
class  BaroModel
 
class  BaroUpdate
 
class  BaseState
 
class  Collection
 
struct  ColumnVector_
 
class  Filter
 
class  FullState
 
struct  functor_wrapper
 
class  GenericQuaternionSystemModel
 
class  GlobalReference
 
class  GPS
 
class  GPSModel
 
struct  GPSUpdate
 
class  GravityModel
 
class  GroundVehicleModel
 
class  GyroModel
 
class  HeadingModel
 
class  Height
 
class  HeightBaroCommon
 
class  HeightModel
 
class  ImuInput
 
class  Input
 
class  Input_
 
class  Magnetic
 
class  MagneticModel
 
struct  Matrix_
 
class  Measurement
 
class  Measurement_
 
class  MeasurementModel
 
class  MeasurementModel_
 
class  MeasurementUpdate
 
class  Model
 
class  OrientationOnlyState
 
class  OrientationPositionVelocityState
 
class  Parameter
 
class  ParameterList
 
struct  ParameterRegistry
 
struct  ParameterRegistryROS
 
class  ParameterT
 
class  PoseEstimation
 
class  PoseUpdate
 
class  PositionVelocityState
 
class  PositionXYModel
 
class  PositionZModel
 
class  Queue
 
class  Queue_
 
class  RateModel
 
struct  RowVector_
 
class  State
 
class  SubState
 
class  SubState_
 
struct  SymmetricMatrix_
 
class  System
 
class  System_
 
class  SystemModel
 
class  SystemModel_
 
class  TimeContinuousSystemModel_
 
class  TwistModel
 
class  Update_
 
class  YawModel
 
class  ZeroRateModel
 

Typedefs

typedef System_< AccelerometerModelAccelerometer
 
typedef ColumnVector_< Dynamic >::type ColumnVector
 
typedef ColumnVector_< 3 >::type ColumnVector3
 
typedef VectorBlock< const ColumnVector, 3 > ConstVectorBlock3
 
typedef VectorBlock< const ColumnVector, 4 > ConstVectorBlock4
 
typedef boost::shared_ptr< FilterFilterPtr
 
typedef boost::shared_ptr< GlobalReferenceGlobalReferencePtr
 
typedef Measurement_< GravityModelGravity
 
typedef System_< GyroModelGyro
 
typedef Measurement_< HeadingModelHeading
 
typedef Eigen::DenseIndex IndexType
 
typedef boost::shared_ptr< InputInputPtr
 
typedef Collection< InputInputs
 
typedef boost::weak_ptr< InputInputWPtr
 
typedef Matrix_< Dynamic, Dynamic >::type Matrix
 
typedef Matrix_< 3, 3 >::type Matrix3
 
typedef Eigen::Block< Matrix, Dynamic, Dynamic > MatrixBlock
 
typedef boost::shared_ptr< MeasurementMeasurementPtr
 
typedef Collection< MeasurementMeasurements
 
typedef boost::weak_ptr< MeasurementMeasurementWPtr
 
typedef boost::shared_ptr< const ParameterParameterConstPtr
 
typedef boost::shared_ptr< ParameterParameterPtr
 
typedef boost::function< void(ParameterPtr)> ParameterRegisterFunc
 
typedef Eigen::Quaternion< ScalarTypeQuaternion
 
typedef Measurement_< RateModelRate
 
typedef RowVector_< Dynamic >::type RowVector
 
typedef RowVector_< 3 >::type RowVector3
 
typedef double ScalarType
 
typedef boost::shared_ptr< StateStatePtr
 
typedef boost::shared_ptr< SubStateSubStatePtr
 
typedef boost::weak_ptr< SubStateSubStateWPtr
 
typedef SymmetricMatrix_< Dynamic >::type SymmetricMatrix
 
typedef SymmetricMatrix_< 3 >::type SymmetricMatrix3
 
typedef SymmetricMatrix_< 6 >::type SymmetricMatrix6
 
typedef boost::shared_ptr< SystemSystemPtr
 
typedef Collection< SystemSystems
 
typedef unsigned int SystemStatus
 
typedef boost::weak_ptr< SystemSystemWPtr
 
typedef VectorBlock< ColumnVector, 3 > VectorBlock3
 
typedef VectorBlock< ColumnVector, 4 > VectorBlock4
 
typedef Measurement_< ZeroRateModelZeroRate
 

Enumerations

enum  {
  STATUS_ALIGNMENT = 0x1, STATUS_DEGRADED = 0x2, STATUS_READY = 0x4, STATUS_MASK = 0xf,
  STATE_ROLLPITCH = 0x10, STATE_YAW = 0x20, STATE_RATE_XY = 0x100, STATE_RATE_Z = 0x200,
  STATE_VELOCITY_XY = 0x1000, STATE_VELOCITY_Z = 0x2000, STATE_POSITION_XY = 0x10000, STATE_POSITION_Z = 0x20000,
  STATE_MASK = 0x33330, STATE_PSEUDO_ROLLPITCH = 0x40, STATE_PSEUDO_YAW = 0x80, STATE_PSEUDO_RATE_XY = 0x400,
  STATE_PSEUDO_RATE_Z = 0x800, STATE_PSEUDO_VELOCITY_XY = 0x4000, STATE_PSEUDO_VELOCITY_Z = 0x8000, STATE_PSEUDO_POSITION_XY = 0x40000,
  STATE_PSEUDO_POSITION_Z = 0x80000, STATE_PSEUDO_MASK = 0xcccc0
}
 
enum  VectorIndex { X = 0, Y = 1, Z = 2, W = 3 }
 

Functions

std::string getSystemStatusString (const SystemStatus &status, const SystemStatus &asterisk_status=0)
 
static ParameterList operator+ (ParameterList const &list1, ParameterList const &list2)
 
static std::ostream & operator<< (std::ostream &os, const SystemStatus &status)
 
template<typename T >
std::ostream & operator<< (std::ostream &os, const std::vector< T > &vector)
 
template<typename OtherDerived >
static Matrix3 SkewSymmetricMatrix (const Eigen::MatrixBase< OtherDerived > &other)
 

Variables

static const Matrix3 MinusIdentity = -Matrix3::Identity()
 

Typedef Documentation

Definition at line 94 of file imu_model.h.

Definition at line 58 of file matrix.h.

Definition at line 59 of file matrix.h.

Definition at line 127 of file matrix.h.

Definition at line 128 of file matrix.h.

Definition at line 100 of file types.h.

Definition at line 111 of file types.h.

Definition at line 65 of file gravity.h.

Definition at line 91 of file imu_model.h.

Definition at line 53 of file heading.h.

typedef Eigen::DenseIndex hector_pose_estimation::IndexType

Definition at line 47 of file matrix.h.

Definition at line 94 of file types.h.

Definition at line 97 of file types.h.

typedef boost::weak_ptr<Input> hector_pose_estimation::InputWPtr

Definition at line 96 of file types.h.

typedef Matrix_<Dynamic,Dynamic>::type hector_pose_estimation::Matrix

Definition at line 79 of file matrix.h.

Definition at line 80 of file matrix.h.

typedef Eigen::Block<Matrix,Dynamic,Dynamic> hector_pose_estimation::MatrixBlock

Definition at line 131 of file matrix.h.

Definition at line 89 of file types.h.

Definition at line 92 of file types.h.

Definition at line 91 of file types.h.

Definition at line 43 of file parameters.h.

Definition at line 41 of file parameters.h.

Definition at line 44 of file parameters.h.

typedef Eigen::Quaternion<ScalarType> hector_pose_estimation::Quaternion

Definition at line 49 of file matrix.h.

Definition at line 55 of file rate.h.

Definition at line 68 of file matrix.h.

Definition at line 69 of file matrix.h.

Definition at line 46 of file matrix.h.

Definition at line 102 of file types.h.

Definition at line 107 of file types.h.

Definition at line 109 of file types.h.

Definition at line 88 of file matrix.h.

Definition at line 86 of file matrix.h.

Definition at line 87 of file matrix.h.

Definition at line 81 of file types.h.

Definition at line 84 of file types.h.

Definition at line 70 of file types.h.

typedef boost::weak_ptr<System> hector_pose_estimation::SystemWPtr

Definition at line 83 of file types.h.

Definition at line 125 of file matrix.h.

Definition at line 126 of file matrix.h.

Definition at line 60 of file zerorate.h.

Enumeration Type Documentation

anonymous enum
Enumerator
STATUS_ALIGNMENT 
STATUS_DEGRADED 
STATUS_READY 
STATUS_MASK 
STATE_ROLLPITCH 
STATE_YAW 
STATE_RATE_XY 
STATE_RATE_Z 
STATE_VELOCITY_XY 
STATE_VELOCITY_Z 
STATE_POSITION_XY 
STATE_POSITION_Z 
STATE_MASK 
STATE_PSEUDO_ROLLPITCH 
STATE_PSEUDO_YAW 
STATE_PSEUDO_RATE_XY 
STATE_PSEUDO_RATE_Z 
STATE_PSEUDO_VELOCITY_XY 
STATE_PSEUDO_VELOCITY_Z 
STATE_PSEUDO_POSITION_XY 
STATE_PSEUDO_POSITION_Z 
STATE_PSEUDO_MASK 

Definition at line 44 of file types.h.

Enumerator

Definition at line 37 of file types.h.

Function Documentation

std::string hector_pose_estimation::getSystemStatusString ( const SystemStatus status,
const SystemStatus asterisk_status = 0 
)

Definition at line 33 of file types.cpp.

static ParameterList hector_pose_estimation::operator+ ( ParameterList const &  list1,
ParameterList const &  list2 
)
inlinestatic

Definition at line 182 of file parameters.h.

static std::ostream& hector_pose_estimation::operator<< ( std::ostream &  os,
const SystemStatus status 
)
inlinestatic

Definition at line 73 of file types.h.

template<typename T >
std::ostream& hector_pose_estimation::operator<< ( std::ostream &  os,
const std::vector< T > &  vector 
)

Definition at line 146 of file parameters.cpp.

template<typename OtherDerived >
static Matrix3 hector_pose_estimation::SkewSymmetricMatrix ( const Eigen::MatrixBase< OtherDerived > &  other)
inlinestatic

Definition at line 91 of file matrix.h.

Variable Documentation

const Matrix3 hector_pose_estimation::MinusIdentity = -Matrix3::Identity()
static

Definition at line 38 of file imu_model.cpp.



hector_pose_estimation_core
Author(s): Johannes Meyer
autogenerated on Thu Feb 18 2021 03:29:31