33 std::cout << s << (s !=
"" ?
" " :
"");
34 std::cout <<
"K: " << (
Matrix)
K() << std::endl;
35 std::cout <<
"Baseline: " <<
b_ << std::endl;
48 const double x = p.x(),
y = p.y();
49 if (Dcal) *Dcal <<
x, 0.0,
y, 1.0, 0.0, 0.0, 0.0,
y, 0.0, 0.0, 1.0, 0.0;
57 const double u = p.x(),
v = p.y();
58 double delta_u = u -
u0_, delta_v =
v -
v0_;
59 double inv_fx = 1 /
fx_, inv_fy = 1 /
fy_;
60 double inv_fy_delta_v = inv_fy * delta_v;
61 double inv_fx_s_inv_fy = inv_fx *
s_ * inv_fy;
63 Point2 point(inv_fx * (delta_u -
s_ * inv_fy_delta_v), inv_fy_delta_v);
65 *Dcal << -inv_fx * point.x(), inv_fx *
s_ * inv_fy * inv_fy_delta_v,
66 -inv_fx * point.y(), -inv_fx, inv_fx_s_inv_fy, 0, 0,
67 -inv_fy * point.y(), 0, 0, -inv_fy, 0;
69 if (Dp) *Dp << inv_fx, -inv_fx_s_inv_fy, 0, inv_fy;
std::ostream & operator<<(std::ostream &os, const Dih6 &m)
bool equals(const Cal3_S2 &K, double tol=10e-9) const
Check if equal up to specified tolerance.
Matrix3 K() const override
return calibration matrix K, same for left and right
double b_
Stereo baseline.
The most common 5DOF 3D->2D calibration, stereo version.
Array< int, Dynamic, 1 > v
The most common 5DOF 3D->2D calibration.
Point2 uncalibrate(const Point2 &p, OptionalJacobian< 2, 6 > Dcal={}, OptionalJacobian< 2, 2 > Dp={}) const
double v0_
principal point
The most common 5DOF 3D->2D calibration + Stereo baseline.
ofstream os("timeSchurFactors.csv")
void print(const std::string &s="") const override
print with optional string
Annotation indicating that a class derives from another given type.
set noclip points set clip one set noclip two set bar set border lt lw set xdata set ydata set zdata set x2data set y2data set boxwidth set dummy x
double baseline() const
return baseline
bool equals(const Cal3_S2Stereo &other, double tol=10e-9) const
Check if equal up to specified tolerance.
Point2 calibrate(const Point2 &p, OptionalJacobian< 2, 6 > Dcal={}, OptionalJacobian< 2, 2 > Dp={}) const