Namespaces | |
| namespace | FilterUtilities |
| namespace | NavsatConversions |
| namespace | RosFilterUtilities |
Classes | |
| class | Ekf |
| Extended Kalman filter class. More... | |
| class | FilterBase |
| class | FilterDerived |
| class | FilterDerived2 |
| struct | Measurement |
| Structure used for storing and comparing measurements (for priority queues) More... | |
| class | NavSatTransform |
| class | RosFilter |
| class | Ukf |
| Unscented Kalman filter class. More... | |
Typedefs | |
| typedef std::priority_queue < Measurement, std::vector < Measurement >, Measurement > | MeasurementQueue |
| typedef RosFilter< Ekf > | RosEkf |
| typedef RosFilter< Ukf > | RosUkf |
Enumerations | |
| enum | StateMembers { StateMemberX = 0, StateMemberY, StateMemberZ, StateMemberRoll, StateMemberPitch, StateMemberYaw, StateMemberVx, StateMemberVy, StateMemberVz, StateMemberVroll, StateMemberVpitch, StateMemberVyaw, StateMemberAx, StateMemberAy, StateMemberAz } |
| Enumeration that defines the state vector. More... | |
Variables | |
| const int | ACCELERATION_SIZE = 3 |
| const int | ORIENTATION_OFFSET = StateMemberRoll |
| const int | ORIENTATION_SIZE = 3 |
| const int | ORIENTATION_V_OFFSET = StateMemberVroll |
| const double | PI = 3.141592653589793 |
| Common variables. | |
| const int | POSE_SIZE = 6 |
| Pose and twist messages each contain six variables. | |
| const int | POSITION_A_OFFSET = StateMemberAx |
| const int | POSITION_OFFSET = StateMemberX |
| const int | POSITION_SIZE = 3 |
| const int | POSITION_V_OFFSET = StateMemberVx |
| const int | STATE_SIZE = 15 |
| Global constants that define our state vector size and offsets to groups of values within that state. | |
| const double | TAU = 6.283185307179587 |
| const int | TWIST_SIZE = 6 |
| typedef std::priority_queue<Measurement, std::vector<Measurement>, Measurement> RobotLocalization::MeasurementQueue |
Definition at line 71 of file ros_filter.h.
| typedef RosFilter<Ekf> RobotLocalization::RosEkf |
Definition at line 42 of file ros_filter_types.h.
| typedef RosFilter<Ukf> RobotLocalization::RosUkf |
Definition at line 43 of file ros_filter_types.h.
Enumeration that defines the state vector.
Definition at line 40 of file filter_common.h.
| const int RobotLocalization::ACCELERATION_SIZE = 3 |
Definition at line 75 of file filter_common.h.
| const int RobotLocalization::ORIENTATION_OFFSET = StateMemberRoll |
Definition at line 64 of file filter_common.h.
| const int RobotLocalization::ORIENTATION_SIZE = 3 |
Definition at line 74 of file filter_common.h.
Definition at line 66 of file filter_common.h.
| const double RobotLocalization::PI = 3.141592653589793 |
Common variables.
Definition at line 78 of file filter_common.h.
| const int RobotLocalization::POSE_SIZE = 6 |
Pose and twist messages each contain six variables.
Definition at line 71 of file filter_common.h.
| const int RobotLocalization::POSITION_A_OFFSET = StateMemberAx |
Definition at line 67 of file filter_common.h.
| const int RobotLocalization::POSITION_OFFSET = StateMemberX |
Definition at line 63 of file filter_common.h.
| const int RobotLocalization::POSITION_SIZE = 3 |
Definition at line 73 of file filter_common.h.
| const int RobotLocalization::POSITION_V_OFFSET = StateMemberVx |
Definition at line 65 of file filter_common.h.
| const int RobotLocalization::STATE_SIZE = 15 |
Global constants that define our state vector size and offsets to groups of values within that state.
Definition at line 62 of file filter_common.h.
| const double RobotLocalization::TAU = 6.283185307179587 |
Definition at line 79 of file filter_common.h.
| const int RobotLocalization::TWIST_SIZE = 6 |
Definition at line 72 of file filter_common.h.