27 using namespace gtsam;
36 Unit3 nDown(0, 0, -1);
50 Matrix expectedH = numericalDerivative11<Vector,Rot3>(
51 boost::bind(&Rot3AttitudeFactor::evaluateError, &factor, _1, boost::none),
69 Unit3 nDown(0, 0, -1);
80 Unit3 nDown(0, 0, -1);
102 Unit3 nDown(0, 0, -1);
116 Matrix expectedH = numericalDerivative11<Vector,Pose3>(
117 boost::bind(&Pose3AttitudeFactor::evaluateError, &factor, _1,
130 Unit3 nDown(0, 0, -1);
141 Unit3 nDown(0, 0, -1);
Concept check for values that can be used in unit tests.
static int runAllTests(TestResult &result)
noiseModel::Diagonal::shared_ptr model
Vector evaluateError(const Rot3 &nRb, boost::optional< Matrix & > H=boost::none) const override
bool equalsObj(const T &input=T())
Some functions to compute numerical derivatives.
BOOST_CLASS_EXPORT(gtsam::noiseModel::Isotropic)
bool equalsXML(const T &input=T())
bool equalsBinary(const T &input=T())
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, boost::optional< Matrix & > H=boost::none) const override
bool assert_equal(const Matrix &expected, const Matrix &actual, double tol)
TEST(Rot3AttitudeFactor, Constructor)
static const Eigen::MatrixBase< Vector2 >::ConstantReturnType Z_2x1
std::uint64_t Key
Integer nonlinear key type.
noiseModel::Base::shared_ptr SharedNoiseModel