79
Structure from motion Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou Zhang and Marc Pollefyes

Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

  • Upload
    others

  • View
    3

  • Download
    0

Embed Size (px)

Citation preview

Page 1: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Structure from motion

Digital Visual EffectsgYung-Yu Chuang

with slides by Richard Szeliski, Steve Seitz, Zhengyou Zhang and Marc Pollefyes

Page 2: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Outline

• Epipolar geometry and fundamental matrixS f i• Structure from motion

• Factorization method• Bundle adjustment• Applications• Applications

Page 3: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Epipolar geometry & fundamental matrix

Page 4: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

The epipolar geometry

epipolar geometry demo

C C’ x x’ and X are coplanarC,C ,x,x and X are coplanar

Page 5: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

The epipolar geometry

What if only C C’ x are known?What if only C,C ,x are known?

Page 6: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

The epipolar geometry

All points on project on l and l’All points on project on l and l

Page 7: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

The epipolar geometry

Family of planes and lines l and l’ intersect at eFamily of planes and lines l and l intersect at eand e’

Page 8: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

The epipolar geometry

epipolar pole= intersection of baseline with image plane

epipolar geometry demo= intersection of baseline with image plane = projection of projection center in other image

epipolar plane = plane containing baselineepipolar plane plane containing baselineepipolar line = intersection of epipolar plane with image

Page 9: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

The fundamental matrix F

C C’

Rp p’

CT=C’-C

T)-R(p'p Two reference frames are related via the extrinsic parameters

)(pp

0)()( pTTpThe equation of the epipolar plane through X is

0)()'( pTpR0)()( pTTp 0)()'( pTpR

Page 10: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

The fundamental matrix F

0)()'( pTpRSppT

00 yz

TTTT

S

0

0

xy

xz

TTTTS

0)()'( SppR0))('( SpRp 0))('( SpRp

0' Epp essential matrix0Epp essential matrix

Page 11: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

The fundamental matrix F

0' Epp pp

Let M and M’ be the intrinsic matrices, then

xMp 1 ''' 1 xMp

0)()'( 11 xMExM' 0)()( xMExM0' 1 xEMM'x 0xEMMx

0' Fxx fundamental matrix

Page 12: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

The fundamental matrix F

• The fundamental matrix is the algebraic representation of epipolar geometryrepresentation of epipolar geometry

Th f d t l t i ti fi th diti • The fundamental matrix satisfies the condition that for any pair of corresponding points x↔x’ i th t iin the two images

0Fxx'T 0l'x'T 0Fxx 0lx

Page 13: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

The fundamental matrix F

F is the unique 3x3 rank 2 matrix that satisfies x’TFx=0 for all x↔x’for all x↔x

1. Transpose: if F is fundamental matrix for (P,P’), then FT

is fundamental matrix for (P’,P)2 Epipolar lines: l’ F & l FT ’2. Epipolar lines: l’=Fx & l=FTx’3. Epipoles: on all epipolar lines, thus e’TFx=0, x

e’TF=0, similarly Fe=0e F 0, similarly Fe 04. F has 7 d.o.f. , i.e. 3x3-1(homogeneous)-1(rank2)5. F is a correlation, projective mapping from a point x to

a line l’=Fx (not a proper correlation, i.e. not invertible)

Page 14: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

The fundamental matrix F

• It can be used for – Simplifies matching– Allows to detect wrong matchesAllows to detect wrong matches

Page 15: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Estimation of F — 8-point algorithm

• The fundamental matrix F is defined by

0Fxx'for any pair of matches x and x’ in two images.

131211 fff• Let x=(u,v,1)T and x’=(u’,v’,1)T,

232221

131211

fffffffff

F 333231 fff

each match gives a linear equation

0'''''' 333231232221131211 fvfuffvfvvfuvfufvufuu

Page 16: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

8-point algorithm

11

ff

1´´´´´´ 13

12

111111111111

fff

vuvvvvuuuvuu

01´´´´´´

22

21222222222222

111111111111

ff

vuvvvvuuuvuu

1´´´´´´31

23

ff

vuvvvvuuuvuu nnnnnnnnnnnn

33

32

ff

33 f• In reality, instead of solving , we seek f

to minimize subj. . Find the vector 0Af

Af 1fjcorresponding to the least singular value.

Page 17: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

8-point algorithm

• To enforce that F is of rank 2, F is replaced by F’ that minimizes subject to 'FF 0'det FF that minimizes subject to . 'FF 0'det F

• It is achieved by SVD. Let , where VUF Σy ,

let

1

0000

Σ

0000

Σ'1

, let

3

2

0000Σ

00000Σ' 2

then is the solution. VUF Σ''

Page 18: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

8-point algorithm% Build the constraint matrix

A = [x2(1,:)‘.*x1(1,:)' x2(1,:)'.*x1(2,:)' x2(1,:)' ...[ ( , ) ( , ) ( , ) ( , ) ( , )x2(2,:)'.*x1(1,:)' x2(2,:)'.*x1(2,:)' x2(2,:)' ...x1(1,:)' x1(2,:)' ones(npts,1) ];

[U,D,V] = svd(A);

% Extract fundamental matrix from the column of V % corresponding to the smallest singular value.p g g

F = reshape(V(:,9),3,3)';

% E f k2 t i t % Enforce rank2 constraint [U,D,V] = svd(F);F = U*diag([D(1 1) D(2 2) 0])*V';F = U diag([D(1,1) D(2,2) 0]) V ;

Page 19: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

8-point algorithm

• Pros: it is linear, easy to implement and fastC ibl i• Cons: susceptible to noise

Page 20: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Problem with 8-point algorithm

11

ff

1´´´´´´ 13

12

111111111111

fff

vuvvvvuuuvuu

01´´´´´´

22

21222222222222

111111111111

ff

vuvvvvuuuvuu

1´´´´´´31

23

ff

vuvvvvuuuvuu nnnnnnnnnnnn

10000 10000 10000 10000100 ~100 1100 100

33

32

ff

~10000 ~10000 ~10000 ~10000~100 ~100 1~100 ~100

!Orders of magnitude differencebetween column of data matrix 33 f

! between column of data matrix least-squares yields poor results

Page 21: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Normalized 8-point algorithm

1. Transform input by ,2 C ll 8 i b i

ii Txx ˆ 'i

'i Txx ˆ

'ˆˆ ˆ2. Call 8-point on to obtain3.

ii xx ˆ,ˆTFTF ˆΤ'

F

0Fxx' 0Fxx

0ˆ'ˆ 1 xFTTx'

Page 22: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Normalized 8-point algorithm

normalized least squares yields good resultsT f i [ 1 1] [ 1 1]

(700,500)(0,500) (1,1)(-1,1) 2

Transform image to ~[-1,1]x[-1,1]

( , )( , ) ( , )( , )

1500

2

10700

2

(0,0)

1

(0,0) (700,0) (1,-1)(-1,-1)

Page 23: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Normalized 8-point algorithm[x1, T1] = normalise2dpts(x1);[x2, T2] = normalise2dpts(x2);A = [x2(1,:)‘.*x1(1,:)' x2(1,:)'.*x1(2,:)' x2(1,:)' ...

x2(2,:)'.*x1(1,:)' x2(2,:)'.*x1(2,:)' x2(2,:)' ...

[ , ] p ( );

x1(1,:)' x1(2,:)' ones(npts,1) ];

[U D V] svd(A);[U,D,V] = svd(A);

F = reshape(V(:,9),3,3)';F reshape(V(:,9),3,3) ;

[U,D,V] = svd(F);F = U*diag([D(1,1) D(2,2) 0])*V';

% DenormaliseF = T2'*F*T1;

Page 24: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Normalizationfunction [newpts, T] = normalise2dpts(pts)

c = mean(pts(1:2,:)')'; % Centroidnewp(1,:) = pts(1,:)-c(1); % Shift origin to centroid.p( , ) p ( , ) ( ); gnewp(2,:) = pts(2,:)-c(2);

meandist = mean(sqrt(newp(1,:).^2 + newp(2,:).^2));scale = sqrt(2)/meandist;

T = [scale 0 -scale*c(1)0 scale -scale*c(2)0 0 1 ];

t T* tnewpts = T*pts;

Page 25: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

RANSAC

repeatselect minimal sample (8 matches)compute solution(s) for Fdetermine inliers

until (#inliers,#samples)>95% or too many times ( , p ) y

compute F based on all inliers

Page 26: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Results (ground truth)

Page 27: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Results (8-point algorithm)

Page 28: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Results (normalized 8-point algorithm)

Page 29: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Structure from motionStructure from motion

Page 30: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Structure from motion

UnknownUnknownUnknownUnknowncameracamera

viewpointsviewpoints

structure for motion: automatic recovery of camera motionand scene structure from two or more images. It is a self calibration technique and called automatic camera trackingcalibration technique and called automatic camera trackingor matchmoving.

Page 31: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Applications

• For computer vision, multiple-view shape reconstruction novel view synthesis and reconstruction, novel view synthesis and autonomous vehicle navigation.F fil d ti l i ti f CGI • For film production, seamless insertion of CGI into live-action backgrounds

Page 32: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Matchmove

example #1 example #2 example #3 example #4

Page 33: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Structure from motion

2D featuretracking 3D estimation optimization

(bundle adjust)geometry

fitting

SFM pipelineSFM pipeline

Page 34: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Structure from motion

• Step 1: Track FeaturesDetect good features Shi & Tomasi SIFT– Detect good features, Shi & Tomasi, SIFT

– Find correspondences between frames• Lucas & Kanade-style motion estimationy• window-based correlation• SIFT matching

Page 35: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

KLT tracking

http://www ces clemson edu/~stb/klt/http://www.ces.clemson.edu/ stb/klt/

Page 36: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Structure from Motion• Step 2: Estimate Motion and Structure

Si lifi d j ti d l [T i 92]– Simplified projection model, e.g., [Tomasi 92]– 2 or 3 views at a time [Hartley 00]

Page 37: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Structure from Motion• Step 3: Refine estimates

“B dl dj t t” i h t t– “Bundle adjustment” in photogrammetry– Other iterative methods

Page 38: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Structure from Motion• Step 4: Recover surfaces (image-based

triangulation silhouettes stereo )triangulation, silhouettes, stereo…)

Good meshGood mesh

Page 39: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Factorization methodsFactorization methods

Page 40: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Problem statement

Page 41: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Notations

• n 3D points are seen in m views( 1) 2D i i• q=(u,v,1): 2D image point

• p=(x,y,z,1): 3D scene point• : projection matrix• : projection function• : projection function• qij is the projection of the i-th point on image j j ti d th f • ij projective depth of qij

)( pq )//()( zyzxzyx )( ijij pq )/,/(),,( zyzxzyx zij

Page 42: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Structure from motion

• Estimate and to minimizej ip

));((log),,,,,(1 1

11 ijij

m

j

n

iijnm Pw qpΠppΠΠ

j

otherwisej in view visibleis if

01 i

ij

pw

otherwise0j

• Assume isotropic Gaussian noise, it is reduced top ,

2

11 )(),,,,,( ijij

m n

ijw qpΠppΠΠ 1 1

11 )(),,,,,( ijijj i

ijnm w qpΠppΠΠ

• Start from a simpler projection model• Start from a simpler projection model

Page 43: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Orthographic projection• Special case of perspective projection

Di t f th COP t th PP i i fi it– Distance from the COP to the PP is infinite

Image World

– Also called “parallel projection”: (x, y, z) → (x, y)

Page 44: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

SFM under orthographic projection

2D image Orthographic projectionincorporating 3D rotation 3D scene

imageoffsetpoint

incorporating 3D rotation 3D scenepoint

offset

tΠ tΠpq 12 32 13 1212 32 13 12

• Trick– Choose scene origin to be centroid of 3D pointsg p– Choose image origins to be centroid of 2D points– Allows us to drop the camera translation:Allows us to drop the camera translation:

Πpq pq

Page 45: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

factorization (Tomasi & Kanade)

projection of n features in one image:

n332n2

n21n21 pppqqq

111211

n Πqqq

projection of n features in m images

321

222221

11211

nn

n

pppΠqqq

n3

32mn2m21

mmnmm Πqqq

32mn2m

W measurement M motion S shape

Key Observation: rank(W) <= 3

Page 46: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Factorization

3322 SMWknown solve for

• Factorization Technique

n33m2n2m

Factorization Technique– W is at most rank 3 (assuming no noise)– We can use singular value decomposition to factor W:

3322'' SMW

We can use singular value decomposition to factor W:

n33m2n2m

– S’ differs from S by a linear transformation A:

))(('' ASMASMW 1

– Solve for A by enforcing metric constraints on M

Page 47: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Metric constraints

• Orthographic CameraR f th l

10

01T

– Rows of are orthonormal:

• Enforcing “Metric” Constraints

10

– Compute A such that rows of M have these properties

MAM ' MAM 'Trick (not in original Tomasi/Kanade paper, but in followup work)

• Constraints are linear in AAT :

TTTT where AAGGAA

''''

1001

• Solve for G first by writing equations for every i in M• Then G = AAT by SVD (since U = V)

10

Then G AA by SVD (since U V)

Page 48: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Factorization with noisy data

ESMWnm2n33m2n2m

• SVD gives this solutiong– Provides optimal rank 3 approximation W’ of W

' EWWnm2n2mn2m

EWW

• Approach– Estimate W’, then use noise-free factorization of W’

as before– Result minimizes the SSD between positions of image

features and projection of the reconstruction

Page 49: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Results

Page 50: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Extensions to factorization methods

• Projective projectionWi h i i d• With missing data

• Projective projection with missing data

Page 51: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Bundle adjustmentBundle adjustment

Page 52: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Levenberg-Marquardt method

• LM can be thought of as a combination of steepest descent and the Newton method steepest descent and the Newton method. When the current solution is far from the correct one the algorithm behaves like a correct one, the algorithm behaves like a steepest descent method: slow, but guaranteed to converge When the current solution is close to converge. When the current solution is close to the correct solution, it becomes a Newton’s methodmethod.

Page 53: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Nonlinear least square

find try to, tsmeasuremen ofset aGiven x

Hereminimalisdistancesquared that theso vector parameter best the p

T).(ˆ with ,ˆ

Here,minimal.isdistance squaredpxxx f

Page 54: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Levenberg-Marquardt method

Page 55: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Levenberg-Marquardt method

• μ=0 → Newton’s method d h d• μ→∞ → steepest descent method

• Strategy for choosing μ– Start with some small μStart with some small μ– If error is not reduced, keep trying larger μ until it

does– If error is reduced, accept it and reduce μ for the

next iteration

Page 56: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Bundle adjustment

• Bundle adjustment (BA) is a technique for simultaneously refining the 3D structure and simultaneously refining the 3D structure and camera parametersIt i bl f bt i i ti l • It is capable of obtaining an optimal reconstruction under certain assumptions on i d l F G i image error models. For zero-mean Gaussian image errors, BA is the maximum likelihood

ti testimator.

Page 57: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Bundle adjustment

• n 3D points are seen in m viewsi h j i f h i h i i j• xij is the projection of the i-th point on image j

• aj is the parameters for the j-th cameraj

• bi is the parameters for the i-th point• BA attempts to minimize the projection error• BA attempts to minimize the projection error

Euclidean distance

predicted projection

Euclidean distance

Page 58: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Bundle adjustment

Page 59: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Bundle adjustment

3 views and 4 points

Page 60: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Typical Jacobian

Page 61: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Block structure of normal equation

Page 62: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Bundle adjustment

Page 63: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Bundle adjustment

Multiplied by

Page 64: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Issues in SFM

• Track lifetimeN li l di i• Nonlinear lens distortion

• Degeneracy and critical surfaces• Prior knowledge and scene constraints• Multiple motions• Multiple motions

Page 65: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Track lifetime

every 50th frame of a 800-frame sequencey q

Page 66: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Track lifetime

lifetime of 3192 tracks from the previous sequencep q

Page 67: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Track lifetime

track length histogramg g

Page 68: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Nonlinear lens distortion

Page 69: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Nonlinear lens distortion

effect of lens distortion

Page 70: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Prior knowledge and scene constraints

add a constraint that several lines are parallelp

Page 71: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Prior knowledge and scene constraints

add a constraint that it is a turntable sequenceq

Page 72: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Applications of matchmoveApplications of matchmove

Page 73: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Jurassic park

Page 74: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

2d3 boujou

Enemy at the Gate, Double Negative

Page 75: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

2d3 boujou

Enemy at the Gate, Double Negative

Page 76: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Photo Tourism

Page 77: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

VideoTrace

http://www.acvt.com.au/research/videotrace/

Page 78: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

Project #3 MatchMove

• It is more about using tools in this projectY h i h lib i • You can choose either calibration or structure from motion to achieve the goal

• Calibration • Voodoo/Icarus

• Examples from previous classes #1 #2• Examples from previous classes, #1, #2

Page 79: Digital Visual Effects Yung-Yu Chuangcyy/courses/vfx/10spring/... · 2010. 4. 27. · Digital Visual Effects Yung-Yu Chuang with slides by Richard Szeliski, Steve Seitz, Zhengyou

References• Richard Hartley, In Defense of the 8-point Algorithm, ICCV, 1995. • Carlo Tomasi and Takeo Kanade, Shape and Motion from Image , p g

Streams: A Factorization Method, Proceedings of Natl. Acad. Sci., 1993. Manolis Lourakis and Antonis Argyros The Design and • Manolis Lourakis and Antonis Argyros, The Design and Implementation of a Generic Sparse Bundle Adjustment Software Package Based on the Levenberg-Marquardt Algorithm, FORTH-ICS/TR 320 2004 ICS/TR-320 2004.

• N. Snavely, S. Seitz, R. Szeliski, Photo Tourism: Exploring Photo Collections in 3D, SIGGRAPH 2006.,

• A. Hengel et. al., VideoTrace: Rapid Interactive Scene Modelling from Video, SIGGRAPH 2007.