Classes | |
class | EqF |
Equivariant Filter (EqF) implementation. More... | |
struct | G |
struct | Input |
Input struct for the Biased Attitude System. More... | |
struct | Measurement |
Measurement struct. More... | |
class | State |
State class representing the state of the Biased Attitude System. More... | |
Functions | |
Matrix | blockDiag (const Matrix &A, const Matrix &B) |
Create a block diagonal matrix from two matrices. More... | |
bool | checkNorm (const Vector3 &x, double tol=1e-3) |
Check if a vector is a unit vector. More... | |
bool | hasNaN (const Vector3 &vec) |
Check if vector contains NaN values. More... | |
template<size_t N> | |
Vector | lift (const State< N > &xi, const Input &u) |
Matrix | numericalDifferential (std::function< Vector(const Vector &)> f, const Vector &x) |
Calculate numerical differential. More... | |
template<size_t N> | |
State< N > | operator* (const G< N > &X, const State< N > &xi) |
template<size_t N> | |
Vector3 | outputAction (const G< N > &X, const Unit3 &y, int idx) |
Matrix | repBlock (const Matrix &A, int n) |
Repeat a block matrix n times along the diagonal. More... | |
template<size_t N> | |
Matrix | stateActionDiff (const State< N > &xi) |
template<size_t N> | |
Input | velocityAction (const G< N > &X, const Input &u) |
bool gtsam::abc_eqf_lib::checkNorm | ( | const Vector3 & | x, |
double | tol | ||
) |
bool gtsam::abc_eqf_lib::hasNaN | ( | const Vector3 & | vec | ) |
Matrix gtsam::abc_eqf_lib::numericalDifferential | ( | std::function< Vector(const Vector &)> | f, |
const Vector & | x | ||
) |
Calculate numerical differential.
Calculates the Jacobian matrix using central difference approximation.
f | Vector function f |
x | The point at which Jacobian is evaluated |
State< N > gtsam::abc_eqf_lib::operator* | ( | const G< N > & | X, |
const State< N > & | xi | ||
) |
Action of the symmetry group on the state space (Equation 4)
X | Group element |
xi | State |
Implements group actions on the states
X | A symmetry group element G consisting of the attitude, bias and the calibration components X.a -> Rotation matrix containing the attitude X.b -> A skew-symmetric matrix representing bias X.B -> A vector of Rotation matrices for the calibration components |
xi | State object xi.R -> Attitude (Rot3) xi.b -> Gyroscope Bias(Vector 3) xi.S -> Vector of calibration matrices(Rot3) |
Vector3 gtsam::abc_eqf_lib::outputAction | ( | const G< N > & | X, |
const Unit3 & | y, | ||
int | idx | ||
) |
Action of the symmetry group on the output space (Equation 6)
X | Group element |
y | Direction measurement |
idx | Calibration index |
Transforms the Direction measurements based on the calibration type ( Eqn 6)
X | Group element X |
y | Direction measurement y |
idx | Calibration index |
Differential of the phi action at E = Id in local coordinates
xi | State |
Computes the differential of a state action at the identity of the symmetry group
xi | State object Xi representing the point at which to evaluate the differential |
Action of the symmetry group on the input space (Equation 5)
X | Group element |
u | Input |
Transforms the angular velocity measurements b/w frames
X | A symmetry group element X with the components |
u | Inputs |