ethzasl-msf - Modular Sensor Fusion
Time delay compensated single and multi sensor fusion framework based on an EKF
|
eigen_conversions | |
geometry_msgs | Defines the start row and col for the covariance entries in |
msf_core | |
similarity_transform | |
From6DoF | Computes the average similarity transform (rotation, position, scale) between two sets of 6 DoF poses |
GPSConversion | |
CheckFuzzyTracking | |
CheckFuzzyTracking< EKFState_T, mpl_::void_ > | |
MSF_Core | The core class of the EKF Does propagation of state and covariance but also applying measurements and managing states and measurements in lists sorted by time stamp |
IMUHandler | |
IMUHandler_ROS | |
MSF_MeasurementBase | The base class for all measurement types. These are the objects provided to the EKF core to be applied in correct order to the states |
MSF_InvalidMeasurement | An invalid measurement needed for the measurement container to report if something went wrong |
MSF_Measurement | The class for sensor based measurements which we want to apply to a state in the update routine of the EKF. This calls the apply correction method of the EKF core |
MSF_InitMeasurement | A measurement to be send to initialize parts of or the full EKF state this can especially be used to split the initialization of the EKF between multiple sensors which init different parts of the state |
sortMeasurements | A comparator to sort measurements by time |
SensorHandler | Handles a sensor driver which provides the sensor readings |
MSF_SensorManager | A manager for a given sensor set. Handlers for individual sensors (camera/vicon etc.) are registered with this class as handlers of particular sensors. This class also owns the EKF core instance and handles the initialization of the filter |
MSF_SensorManagerROS | Abstract class defining user configurable calculations for the msf_core with ROS interfaces |
SortedContainer | Manages a sorted container with strict less than ordering used to store state and measurement objects which can then be queried for closest states/measurements to a given time instant |
StateVar_T | A state variable with a name as specified in the state name enum |
GenericState_T | The state vector containing all the state variables for this EKF configuration |
sortStates | Comparator for the state objects. sorts by time asc |
StateVisitor | Visitor pattern to allow the user to set state init values |
msf_pose_pressure_sensor | |
PosePressureSensorManager | |
msf_pose_sensor | |
PoseSensorManager | |
msf_position_sensor | |
PositionSensorManager | |
msf_spherical_position | |
SensorManager | |
msf_tmp | |
overflow | Output a compile time constant by overflowing a char, producing a warning |
echoStateVarType< const msf_core::StateVar_T< Eigen::Matrix< double, N, 1 >, NAME, STATE_T, OPTIONS > & > | Runtime output of stateVariable types for const ref eigen matrices |
echoStateVarType< const msf_core::StateVar_T< Eigen::Quaterniond, NAME, STATE_T, OPTIONS > & > | Runtime output of stateVariable types for const ref eigen quaternions |
echoStateVarType< msf_core::StateVar_T< Eigen::Matrix< double, N, 1 >, NAME, STATE_T, OPTIONS > > | Runtime output of stateVariable types for eigen matrices |
echoStateVarType< msf_core::StateVar_T< Eigen::Quaterniond, NAME, STATE_T, OPTIONS > > | Runtime output of stateVariable types for eigen matrices |
CheckCorrectIndexing | Checks whether the ordering in the vector is the same as in the enum this ordering is something that strictly must not change |
IndexOfBestNonTemporalDriftingState | Find the best nontemporal drifting state in the full state vector at compile time |
CountStates | Returns the number of doubles in the state/correction state depending on the counter type supplied |
getStartIndex | Compute start indices in the correction/state vector of a given type |
getStartIndexInCorrection | Compute start indices in the correction vector of a given type |
resetState | Reset the EKF state in a boost fusion unrolled call |
copyInitStates | Copy states from previous to current states, for which there is no propagation in a boost fusion unrolled call |
copyNonPropagationStates | Copy states from previous to current states, for which there is no propagation |
copyQBlocksFromAuxiliaryStatesToQ | Copy the user calculated values in the Q-blocks to the main Q matrix |
correctState | Apply EKF corrections depending on the stateVar type |
CoreStatetoDoubleArray | Copies the values of the single state vars to the double array provided |
GetIndicesInErrorState | Copies pairs of statename and index in correction vector to STL container of pairs or tuples |
getStateIndexInState | Return the index of a given state variable number in the state matrices |
getStateIndexInErrorState | Return the index of a given state variable number in the error state matrices |
FullStatetoString | Copies the values of the single state vars to the string provided |
FullStatetoDoubleArray | Copies the values of the single state vars to the double array provided |
SameType | |
SameType< T, T > | |
StripReference | |
StripReference< T & > | |
StripReference< const T > | |
StripReference< const T & > | |
StripConstReference | |
StripConstReference< T & > | |
StripConstReference< const T & > | |
StripConstReference< const T > | |
StripConstPtr | |
StripConstPtr< T * > | |
StripConstPtr< const T * > | |
StripConstPtr< const T > | |
AddReference | |
AddReference< T & > | |
AddReference< const T > | |
AddReference< const T & > | |
AddConstReference | |
AddConstReference< T & > | |
AddConstReference< const T > | |
AddConstReference< const T & > | |
AddPtr | |
AddPtr< T * > | |
AddPtr< const T > | |
AddPtr< const T * > | |
AddConstPtr | |
AddConstPtr< T * > | |
AddConstPtr< const T > | |
AddConstPtr< const T * > | |
IsReferenceType | |
IsReferenceType< T & > | |
IsReferenceType< const T & > | |
IsPointerType | |
IsPointerType< T * > | |
IsPointerType< const T * > | |
msf_updates | |
PositionPoseSensorManager | |
color | |
palette |