28 using namespace gtsam;
69 auto huber_model = noiseModel::Robust::Create(
70 noiseModel::mEstimator::Huber::Create(1.345),
rot3_model);
const SharedNoiseModel & noiseModel() const
static const Key kKey2(1)
static int runAllTests(TestResult &result)
bool equals(const Rot3 &p, double tol=1e-9) const
TEST(BinaryMeasurement, Unit3)
bool equals(const Unit3 &s, double tol=1e-9) const
The equals function with tolerance.
Rot3 is a 3D rotation represented as a rotation matrix if the preprocessor symbol GTSAM_USE_QUATERNIO...
static SharedNoiseModel unit3_model(noiseModel::Isotropic::Sigma(2, 0.05))
Represents a 3D point on a unit sphere.
#define EXPECT(condition)
static const Key kKey1(2)
const Unit3 unit3Measured(Vector3(1, 1, 1))
#define EXPECT_LONGS_EQUAL(expected, actual)
const T & measured() const
Binary measurement represents a measurement between two keys in a graph. A binary measurement is simi...
std::uint64_t Key
Integer nonlinear key type.
bool equals(const BinaryMeasurement &expected, double tol=1e-9) const
noiseModel::Base::shared_ptr SharedNoiseModel
static SharedNoiseModel rot3_model(noiseModel::Isotropic::Sigma(3, 0.05))
3D rotation represented as a rotation matrix or quaternion