29 using namespace gtsam;
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);
89 Unit3 nDown(0, 0, -1);
104 auto err_fn = [&factor](
const Pose3&
p){
108 Matrix expectedH = numericalDerivative11<Vector,Pose3>(err_fn,
T);
120 Unit3 nDown(0, 0, -1);
const gtsam::Symbol key('X', 0)
Concept check for values that can be used in unit tests.
static int runAllTests(TestResult &result)
noiseModel::Diagonal::shared_ptr model
bool assert_equal(const Matrix &expected, const Matrix &actual, double tol)
Vector evaluateError(const Rot3 &nRb, OptionalMatrixType H) const override
Some functions to compute numerical derivatives.
Rot3 is a 3D rotation represented as a rotation matrix if the preprocessor symbol GTSAM_USE_QUATERNIO...
Represents a 3D point on a unit sphere.
#define EXPECT(condition)
Eigen::Triplet< double > T
Array< double, 1, 3 > e(1./3., 0.5, 2.)
gtsam::Point3 bZ(0, 0, 1)
Vector evaluateError(const Pose3 &nTb, OptionalMatrixType H) const override
Header file for Attitude factor.
TEST(Rot3AttitudeFactor, Constructor)
static const Eigen::MatrixBase< Vector2 >::ConstantReturnType Z_2x1
std::uint64_t Key
Integer nonlinear key type.
noiseModel::Base::shared_ptr SharedNoiseModel