49 std::vector<boost::shared_ptr<Cal3_S2Stereo>>
K_all_;
85 const boost::shared_ptr<Cal3_S2Stereo>&
K);
95 void add(
const std::vector<StereoPoint2>& measurements,
97 const std::vector<boost::shared_ptr<Cal3_S2Stereo>>& Ks);
108 void add(
const std::vector<StereoPoint2>& measurements,
110 const boost::shared_ptr<Cal3_S2Stereo>&
K);
129 inline std::vector<boost::shared_ptr<Cal3_S2Stereo>>
calibration()
const {
145 template <
class ARCHIVE>
147 ar& BOOST_SERIALIZATION_BASE_OBJECT_NVP(Base);
148 ar& BOOST_SERIALIZATION_NVP(K_all_);
156 :
public Testable<SmartStereoProjectionPoseFactor> {};
void serialize(ARCHIVE &ar, const unsigned int)
void print(const std::string &s="", const KeyFormatter &keyFormatter=DefaultKeyFormatter) const override
~SmartStereoProjectionPoseFactor() override=default
Smart stereo factor on StereoCameras (pose + calibration)
#define EIGEN_MAKE_ALIGNED_OPERATOR_NEW
static Cal3_S2 K(500, 500, 0.1, 640/2, 480/2)
std::vector< boost::shared_ptr< Cal3_S2Stereo > > calibration() const
void add(const StereoPoint2 &measured, const Key &poseKey, const boost::shared_ptr< Cal3_S2Stereo > &K)
bool equals(const NonlinearFactor &p, double tol=1e-9) const override
equals
static const KeyFormatter DefaultKeyFormatter
FastVector< Key > KeyVector
Define collection type once and for all - also used in wrappers.
double error(const Values &values) const override
EIGEN_MAKE_ALIGNED_OPERATOR_NEW typedef SmartStereoProjectionFactor Base
shorthand for base class type
std::function< std::string(Key)> KeyFormatter
Typedef for a function to format a key, i.e. to convert it to a string.
SmartStereoProjectionPoseFactor(const SharedNoiseModel &sharedNoiseModel, const SmartStereoProjectionParams ¶ms=SmartStereoProjectionParams(), const boost::optional< Pose3 > &body_P_sensor=boost::none)
Array< double, 1, 3 > e(1./3., 0.5, 2.)
static SmartStereoProjectionParams params
Base::Cameras cameras(const Values &values) const override
Pose3 body_P_sensor() const
std::vector< boost::shared_ptr< Cal3_S2Stereo > > K_all_
shared pointer to calibration object (one for each camera)
boost::shared_ptr< This > shared_ptr
shorthand for a smart pointer to a factor
const ZVector & measured() const
std::uint64_t Key
Integer nonlinear key type.
SmartStereoProjectionPoseFactor This
shorthand for this class
noiseModel::Base::shared_ptr SharedNoiseModel
friend class boost::serialization::access
Serialization function.
SmartProjectionParams SmartStereoProjectionParams