Go to the documentation of this file.
23 template<
typename POSE = Pose3,
typename POINT = Po
int3>
54 std::cout <<
s <<
"PoseToPointFactor("
55 << keyFormatter(this->
key1()) <<
","
56 << keyFormatter(this->
key2()) <<
")\n"
57 <<
" measured: " << measured_.transpose() << std::endl;
63 double tol = 1
e-9)
const override {
71 return std::static_pointer_cast<gtsam::NonlinearFactor>(
85 const POSE& w_T_b,
const POINT& w_P,
88 return w_T_b.transformTo(w_P, H1, H2) -
measured_;
95 #ifdef GTSAM_ENABLE_BOOST_SERIALIZATION
97 friend class boost::serialization::access;
98 template <
class ARCHIVE>
99 void serialize(ARCHIVE& ar,
const unsigned int ) {
101 ar& boost::serialization::make_nvp(
103 boost::serialization::base_object<Base>(*
this));
std::shared_ptr< This > shared_ptr
Array< double, 1, 3 > e(1./3., 0.5, 2.)
virtual Vector evaluateError(const ValueTypes &... x, OptionalMatrixTypeT< ValueTypes >... H) const=0
std::shared_ptr< PoseToPointFactor > shared_ptr
SharedNoiseModel noiseModel_
KeyFormatter DefaultKeyFormatter
Assign default key formatter.
std::function< std::string(Key)> KeyFormatter
Typedef for a function to format a key, i.e. to convert it to a string.
gtsam::NonlinearFactor::shared_ptr clone() const override
bool equals(const NonlinearFactor &expected, double tol=1e-9) const override
Vector evaluateError(const POSE &w_T_b, const POINT &w_P, OptionalMatrixType H1, OptionalMatrixType H2) const override
Error = w_T_b.inverse()*w_P - measured_.
bool equals(const NonlinearFactor &f, double tol=1e-9) const override
noiseModel::Base::shared_ptr SharedNoiseModel
virtual ~PoseToPointFactor()
noiseModel::Diagonal::shared_ptr model
NoiseModelFactorN< POSE, POINT > Base
Non-linear factor base classes.
PoseToPointFactor(Key key1, Key key2, const POINT &measured, const SharedNoiseModel &model)
void print(const std::string &s, const KeyFormatter &keyFormatter=DefaultKeyFormatter) const override
Matrix * OptionalMatrixType
std::uint64_t Key
Integer nonlinear key type.
const POINT & measured() const
gtsam
Author(s):
autogenerated on Sat Nov 16 2024 04:03:36