Go to the documentation of this file.
27 using namespace gtsam;
43 auto p = std::make_shared<PreintegratedRotationParams>();
71 const double delta = 0.05;
78 auto g = [&](
const Vector3& increment) {
81 Matrix3 expectedH = numericalDerivative11<Rot3, Vector3>(
g, biasOmegaIncr);
86 expectedH = numericalDerivative11<Rot3, Vector3>(
g, biasOmegaIncr);
95 auto p = std::make_shared<PreintegratedRotationParams>();
128 const double delta = 0.05;
135 auto g = [&](
const Vector3& increment) {
138 Matrix3 expectedH = numericalDerivative11<Rot3, Vector3>(
g, biasOmegaIncr);
144 expectedH = numericalDerivative11<Rot3, Vector3>(
g, biasOmegaIncr);
150 auto p = std::make_shared<PreintegratedRotationParams>();
179 const double delta = 0.05;
184 auto g = [&](
const Vector3& increment) {
187 Matrix3 expectedH = numericalDerivative11<Rot3, Vector3>(
g, biasOmegaIncr);
193 expectedH = numericalDerivative11<Rot3, Vector3>(
g, biasOmegaIncr);
static int runAllTests(TestResult &result)
set noclip points set clip one set noclip two set bar set border lt lw set xdata set ydata set zdata set x2data set y2data set boxwidth set dummy y set format x g set format y g set format x2 g set format y2 g set format z g set angles radians set nogrid set key title set key left top Right noreverse box linetype linewidth samplen spacing width set nolabel set noarrow set nologscale set logscale x set set pointsize set encoding default set nopolar set noparametric set set set set surface set nocontour set clabel set mapping cartesian set nohidden3d set cntrparam order set cntrparam linear set cntrparam levels auto set cntrparam points set size set set xzeroaxis lt lw set x2zeroaxis lt lw set yzeroaxis lt lw set y2zeroaxis lt lw set tics in set ticslevel set tics set mxtics default set mytics default set mx2tics default set my2tics default set xtics border mirror norotate autofreq set ytics border mirror norotate autofreq set ztics border nomirror norotate autofreq set nox2tics set noy2tics set timestamp bottom norotate set rrange[*:*] noreverse nowriteback set trange[*:*] noreverse nowriteback set urange[*:*] noreverse nowriteback set vrange[*:*] noreverse nowriteback set xlabel matrix size set x2label set timefmt d m y n H
const Matrix3 & delRdelBiasOmega() const
typedef and functions to augment Eigen's VectorXd
static std::shared_ptr< PreintegratedRotationParams > paramsWithTransform()
Array< double, 1, 3 > e(1./3., 0.5, 2.)
#define EXPECT(condition)
void integrateGyroMeasurement(const Vector3 &measuredOmega, const Vector3 &biasHat, double deltaT, OptionalJacobian< 3, 3 > F={})
Calculate an incremental rotation given the gyro measurement and a time interval, and update both del...
typedef and functions to augment Eigen's MatrixXd
const Rot3 & deltaRij() const
const Vector3 bias(1, 2, 3)
static Rot3 Yaw(double t)
Positive yaw is to right (as in aircraft heading). See ypr.
static Rot3 Roll(double t)
#define EQUALITY(expected, actual)
const Vector3 trueOmega(omega, 0, 0)
Some functions to compute numerical derivatives.
const Vector3 measuredOmega
static std::shared_ptr< PreintegratedRotationParams > paramsWithArbitraryTransform()
Rot3 is a 3D rotation represented as a rotation matrix if the preprocessor symbol GTSAM_USE_QUATERNIO...
Matrix3 AdjointMap() const
static Rot3 Pitch(double t)
Positive pitch is up (increasing aircraft altitude).See ypr.
Rot3 inverse() const
inverse of a rotation
void g(const string &key, int i)
Point2(* f)(const Point3 &, OptionalJacobian< 2, 3 >)
TEST(SmartFactorBase, Pinhole)
static Rot3 Expmap(const Vector3 &v, OptionalJacobian< 3, 3 > H={})
bool assert_equal(const Matrix &expected, const Matrix &actual, double tol)
Rot3 biascorrectedDeltaRij(const Vector3 &biasOmegaIncr, OptionalJacobian< 3, 3 > H={}) const
Return a bias corrected version of the integrated rotation.
gtsam
Author(s):
autogenerated on Fri Nov 1 2024 03:41:02