27 using namespace gtsam;
53 Pose3 body_P_sensor(Rot3::RzRyRx(-M_PI_2, 0.0, -M_PI_2),
Point3(0.25, -0.10, 1.0));
70 Pose3 measurement2(Rot3::RzRyRx(0.20, -0.30, 0.45),
Point3(-5.0, 8.0, -11.0));
83 Pose3 body_P_sensor(Rot3::RzRyRx(-M_PI_2, 0.0, -M_PI_2),
Point3(0.25, -0.10, 1.0));
90 Pose3 body_P_sensor2(Rot3::RzRyRx(-M_PI_2, 0.0, -M_PI_2),
Point3(0.30, -0.10, 1.0));
106 #if defined(GTSAM_ROT3_EXPMAP) || defined(GTSAM_USE_QUATERNIONS) 107 expectedError << -0.0298135267953815,
110 #if defined(GTSAM_POSE3_EXPMAP) 120 expectedError << -0.029839512616488,
145 Pose3 body_P_sensor(Rot3::RzRyRx(-M_PI_2, 0.0, -M_PI_2),
Point3(0.25, -0.10, 1.0));
150 #if defined(GTSAM_ROT3_EXPMAP) || defined(GTSAM_USE_QUATERNIONS) 151 expectedError << 0.0173358202010741,
154 #if defined(GTSAM_POSE3_EXPMAP) 157 0.000175859555693563;
164 expectedError << 0.017337193670445,
195 Pose3 pose2(Rot3::RzRyRx(0.179693265735950, 0.002945368776519, 0.102274823253840),
196 Point3(-3.37493895, 6.14660244, -8.93650986));
219 Pose3 body_P_sensor(Rot3::RzRyRx(-M_PI_2, 0.0, -M_PI_2),
Point3(0.25, -0.10, 1.0));
224 Pose3 pose2(Rot3::RzRyRx(0.162672458989103, 0.013665177349534, 0.224649482928184),
225 Point3(-3.5257579, 6.02637531, -8.98382384));
Provides additional testing facilities for common data structures.
static int runAllTests(TestResult &result)
noiseModel::Diagonal::shared_ptr model
Some functions to compute numerical derivatives.
JacobianFactor factor3(keyY, A32, keyZ, A33, b3, noiseModel::Isotropic::Sigma(2, sigma3))
Array< double, 1, 3 > e(1./3., 0.5, 2.)
static const Pose3 pose1(Rot3(), Point3(0, 1, 0.5))
bool assert_equal(const Matrix &expected, const Matrix &actual, double tol)
PoseBetweenFactor< Pose3 > TestPoseBetweenFactor
bool assert_inequal(const Matrix &A, const Matrix &B, double tol)
JacobianFactor factor2(keyX, A21, keyY, A22, b2, noiseModel::Isotropic::Sigma(2, sigma2))
Vector evaluateError(const POSE &p1, const POSE &p2, boost::optional< Matrix & > H1=boost::none, boost::optional< Matrix & > H2=boost::none) const override
std::uint64_t Key
Integer nonlinear key type.
noiseModel::Base::shared_ptr SharedNoiseModel
TEST(PoseBetweenFactor, Constructor)
JacobianFactor factor1(keyX, A11, b1, noiseModel::Isotropic::Sigma(2, sigma1))