Go to the documentation of this file.
28 using namespace std::placeholders;
30 using namespace gtsam;
37 Unit3 bMeasured(0, 0, 1);
38 Unit3 nDown(0, 0, -1);
51 auto err_fn = [&factor](
const Rot3& r) {
55 Matrix expectedH = numericalDerivative11<Vector, Rot3>(err_fn,
nRb);
67 Unit3 nDown(0, 0, -1);
87 Unit3 bMeasured(0, 0, 1);
88 Unit3 nDown(0, 0, -1);
103 auto err_fn = [&factor](
const Pose3&
p) {
107 Matrix expectedH = numericalDerivative11<Vector, Pose3>(err_fn,
T);
119 Unit3 nDown(0, 0, -1);
static int runAllTests(TestResult &result)
Array< double, 1, 3 > e(1./3., 0.5, 2.)
Concept check for values that can be used in unit tests.
#define EXPECT(condition)
typedef and functions to augment Eigen's MatrixXd
Eigen::Triplet< double > T
Header file for Attitude factor.
Some functions to compute numerical derivatives.
Rot3 is a 3D rotation represented as a rotation matrix if the preprocessor symbol GTSAM_USE_QUATERNIO...
noiseModel::Base::shared_ptr SharedNoiseModel
noiseModel::Diagonal::shared_ptr model
const gtsam::Symbol key('X', 0)
Vector evaluateError(const Pose3 &nTb, OptionalMatrixType H) const override
static const Eigen::MatrixBase< Vector2 >::ConstantReturnType Z_2x1
bool assert_equal(const Matrix &expected, const Matrix &actual, double tol)
Represents a 3D point on a unit sphere.
TEST(Rot3AttitudeFactor, Constructor)
std::uint64_t Key
Integer nonlinear key type.
Vector evaluateError(const Rot3 &nRb, OptionalMatrixType H) const override
gtsam
Author(s):
autogenerated on Sat Nov 16 2024 04:07:12