Lecture 13 Visual Inertial Fusion

Size: px
Start display at page:

Download "Lecture 13 Visual Inertial Fusion"

Transcription

1 Lecture 13 Visual Inertial Fusion Davide Scaramuzza

2 Outline Introduction IMU model and Camera-IMU system Different paradigms Filtering Maximum a posteriori estimation Fix-lag smoothing 2

3 What is an IMU? Inertial Measurement Unit Angular velocity Linear Accelerations 3

4 What is an IMU? Different categories Mechanical Optical MEMS. For mobile robots: MEMS IMU Cheap Power efficient Light weight and solid state 4

5 MEMS Accelerometer A spring-like structure connects the device to a seismic mass vibrating in a capacity devider. A capacitive divider converts the displacement of the seismic mass into an electric signal. Damping is created by the gas sealed in the device. capacitive divider spring M a M a M

6 MEMS Gyroscopes MEMS gyroscopes measure the Coriolis forces acting on MEMS vibrating structures (tuning forks, vibrating wheels, or resonant solids) Their working principle is similar to the haltere of a fly Haltere are small structures of some two-winged insects, such as flies. They are flapped rapidly and function as gyroscopes, informing the insect about rotation of the body during flight. 6

7 Why IMU? Monocular vision is scale ambiguous. Pure vision is not robust enough Low texture High dynamic range High speed motion Robustness is a critical issue: Tesla accident The autopilot sensors on the Model S failed to distinguish a white tractor-trailer crossing the highway against a bright sky. 7

8 Why vision? Pure IMU integration will lead to large drift (especially cheap IMUs) Will see later mathematically Intuition - Integration of angular velocity to get orientation: error proportional to t - Double integration of acceleration to get position: if there is a bias in acceleration, the error of position is proportional to t 2 - Worse, the actually position error also depends on the error of orientation. Smartphone accelerometers 8

9 Why visual inertial fusion? Summary: IMU and vision are complementary Visual sensor Precise in case of non-aggressive motion Rich information for other purposes Inertial sensor Robust High output rate (~1,000 Hz) ᵡ ᵡ ᵡ Limited output rate (~100 Hz) Scale ambiguity in monocular setup. Lack of robustness ᵡ ᵡ Large relative uncertainty when at low acceleration/angular velocity Ambiguity in gravity / acceleration In common: state estimation based on visual or/and inertial sensor is dead-reckoning, which suffers from drifting over time. (solution: loop detection and loop closure) 9

10 Outline Introduction IMU model and Camera-IMU system Different paradigms Filtering Maximum a posteriori estimation Fix-lag smoothing 10

11 IMU model: Measurement Model Measures angular velocity and acceleration in the body frame: ω t ω t b t n t g g B WB B WB B WB BW W WB w a a a t R t a t g b t n t measurements noise where the superscript g stands for Gyroscope and a for Accelerometer Notations: Left subscript: reference frame in which the quantity is expressed Right subscript {Q}{Frame1}{Frame2}: Q of Frame2 with respect to Frame1 Noises are all in the body frame 11

12 IMU model: Noise Property Additive Gaussian white noise: E n t 0 2 E n t n t t t Bias: b g b() t bw t t, b a t i.e., the derivative of the bias is white Gaussian noise (so-called random walk) n Trawny, Nikolas, and Stergios I. Roumeliotis. "Indirect Kalman filter for 3D attitude estimation. g t, n a t d wk ~ N(0,1) n k w k d / t k k 1 k b b w bd w k b t ~ N(0,1) The biases are usually estimated with the other states can change every time the IMU is started can change due to temperature change, mechanical pressure, etc. bd 12

13 IMU model: Integration Per component: {t} stands for {B}ody frame at time t t2 Wt Wt 2 1 Wt Wt w d a p p t t v R t a t b t g t Depends on initial position and velocity The rotation R(t) is computed from the gyroscope t 1 2 Trawny, Nikolas, and Stergios I. Roumeliotis. "Indirect Kalman filter for 3D attitude estimation." 14

14 Camera-IMU System There can be multiple cameras. 15

15 Outline Introduction IMU model and Camera-IMU system Different paradigms Closed-form solution Filtering Fix-lag smoothing Maximum a posteriori estimation 16

16 Closed-form Solution (intuitive idea) The absolute pose x is known up to a scale s, thus x = sx From the IMU x = x 0 + v 0 (t 1 t 0 ) + t 1 a t dt t 0 By equating them t 1 sx = x 0 + v 0 t 1 t 0 + a t dt t 0 As shown in [Martinelli 14], for 6DOF, both s and v 0 can be determined in closed form from a single feature observation and 3 views. x 0 can be set to 0. Martinelli, Closed-form solution of visual-inertial structure from motion, International Journal of Computer Vision,

17 Closed-form Solution t 1 sx 1 = v 0 t 1 t 0 + a t dt t 0 t 2 sx 2 = v 0 t 2 t 0 + a t dt t 0 t 0 t 1 t 2 L 1 x 1 (t 0 t 1 ) x 2 (t 0 t 2 ) s v 0 = t 1 a t dt t 0 2 t 0 a t dt Martinelli, Closed-form solution of visual-inertial structure from motion, International Journal of Computer Vision,

18 Different paradigms Loosely coupled: use the output of individual system Estimate the states individually from visual and inertial data Combine the separate states estimations Tightly coupled: use the internal states Make use of the raw measurements - Feature positions - IMU readings - Example: - Use IMU for guided feature matching - Minimizing reprojection error and IMU error together - More accurate More implementation effort. 19

19 Different paradigms images Feature Extraction Feature Matching Feature correspondence Motion Estimation position attitude IMU measurements IMU Integration position attitude velocity Loosely coupled Tightly coupled More accurate More implementation effort. 20

20 Different paradigms Filtering Fix-lag Smoothing Maximum-A-Posteriori (MAP) Estimation Filtering the most recent states (e.g., extended Kalman filter) Optimize window of states Marginalization Nonlinear least squares optimization Optimize all states Nonlinear Least squares optimization 1 Linearization Accumulation of linearization errors Gaussian approximation of marginalized states Faster Re-Linearize Accumulation of linearization errors Gaussian approximation of marginalized states Fast Re-Linearize Sparse Matrices Highest Accuracy Slow 21

21 Filtering: Kalman Filter in a Nutshell Assumptions: linear system, Gaussian noise System dynamics 1 uk 1 vk 1 x k A k x k z k H k x k w k x(k): state u(k): control input, can be 0 z(k): measurement 0 ~ 0, 0 ~ 0, ~ 0, x N x P v k N Q k w k N R k Kalman Filter x 0 x, P 0 P m 0 m 0 Prediction xˆ k A k x k u k p p 1 ˆm 1 1 T 1 m 1 1 Qk 1 P k A k P k A k Measurement update m T 1 p ˆ P k P k H k R k H k xˆ k x k m m p T 1 ˆ 1 P k H k R k z k H k x k Weight between the model prediction and measurement p 22

22 Filtering: Kalman Filter in a Nutshell Nonlinear system: linearization System dynamics k1 1, 1, 1, x k q x k u k v k k z k h x k w k Process and measurement noise and initial state are Gaussian. Key idea: Linearize around the estimated states A(k) L(k) H(k) M(k) are partial derivatives with respect to states and noise Extended Kalman Filter Prediction xˆ k q xˆ k 1, u k 1,0 1 T 1 m 1 1 T Lk 1Q k 1 L k 1 p k m P k A k P k A k p Measurement update T T p ( p T M k Rk M k K k P k H k H k P k H k xˆ k xˆ k K k z k h xˆ,0 m p k p m p P k I K k H k P k ) 23 1

23 Filtering: Visual Inertial Formulation System states: Tightly coupled: a g t t t t t X Wp ; qwb ; Wv ; b ; b ; WL1; WL2;...,; W L Loosely coupled: ; ; ; a g X p t q t v t b t; b t W WB W K Process Model: from IMU Integration of IMU states (rotation, position, velocity) Propagation of IMU noise needed for calculating the Kalman Filter gain 24

24 Filtering: Visual Inertial Formulation Measurement Model: from camera Transform point to camera frame C x y R R L p p C z C CB BW W W CB Pinhole projection (without distortion) u v C x fx + cx C z C y fy cy C z H H H X proj H H H L B L proj pose Landmark H R R = R H Landmark CB BW CW H R R L pose CB BW B proj f 0 x 1 0 z f y f 1 f z x y x 2 z y 2 z Drop C for clarity 25

25 Filtering: ROVIO Use pixel intensities as measurements. Bloesch, Michael, et al. "Robust visual inertial odometry using a direct EKF-based approach." 26

26 Filtering: Potential Problems Wrong linearization point Linearization depends on the current estimates of states, which may be erroneous Linearization around different values of the same variable leads to estimator inconsistency (wrong observability/covariance estimation) Wrong covariance/initial states Intuitively, wrong weights for measurements and prediction May be overconfident/underconfident Explosion of number of states Roughly cubic of the number of the states Each 3D point: 3 variables 27

27 Filtering: Potential Problems Wrong linearization point Linearization depends on the current estimates of states, which may be erroneous Linearization around different values of the same variable leads to estimator inconsistency (wrong observability/covariance estimation) Wrong covariance/initial states Intuitively, wrong weights for measurements and prediction May be overconfident/underconfident Explosion of number of states Each 3D point: 3 variables 28

28 Filtering: MSCKF (Multi-State Constraint Kalman Filter): used in Google Tango Key idea: Keep a window of recent states incorporate visual observations without including point positions into the states Li, Mingyang, and Anastasios I. Mourikis. "High-precision, consistent EKF-based visual inertial odometry." 29

29 Filtering: Google Tango

30 Optimization-based Approaches (MAP, Fix-lag smoothing) Fusion solved as a non-linear optimization problem Increased accuracy over filtering methods * * { X, L } argmax P( X, L Z) { X, L} { X, L} N argmin f ( x ) x h( x, l ) z 2 k1 k i 1 k 1 k i j i k i M i 2 Forster, Carlone, Dellaert, Scaramuzza, IMU Preintegration on Manifold for efficient Visual-Inertial Maximum-a- Posteriori Estimation, Robotics Science and Systens 15, Best Paper Award Finalist

31 MAP: a nonlinear least squares problem Bayesian Theorem P( A B) P( B A) P( A) PB ( ) Applied to state estimation problem: X: states (position, attitude, velocity, and 3D point position) Z: measurements (feature positions, IMU readings) Max a Posteriori: given the observation, what is the optimal estimation of the states? Gaussian Property: for iid variables 1 2 x 2 1 i f ( x,..., x, ) e k Maximizing the probability is equivalent to minimizing the square root sum 32

32 MAP: a nonlinear least squares problem SLAM as a MAP problem x k f ( x ) k1 z h( x, l ) i i i k j X = {x 1, x N }: robot states L = {l 1, }: 3D points Z = {z i, z M }: feature positions P( X, L Z) P( Z X, L) P( X, L) M P( zi X, L) P( X ) i1 X L are independent, and no prior information about L Measurements are independent Markov process model M N P( x0) P( zi xi, l ) ( 1) k i P x j k x k i1 k2 33

33 MAP: a nonlinear least squares problem SLAM as a least squares problem (, ) ( ) M (, ) N P X L Z P x ( ) 0 P zi xi l k i P x j k x k 1 i1 k2 Without the prior, applying the property of Gaussian distribution: * * { X, L } argmax P( X, L Z) { X, L} Notes: { X, L} k N argmin f ( x ) x h( x, l ) z 2 k1 k i 1 k 1 k i j i i Normalize the residuals with the variance of process noise and measurement noise (so-called Mahalanobis distance) M i 2 34

34 MAP: Nonlinear optimization Gauss-Newton method Solve it iteratively M * 2 θ argmin fi( θ) zi θ i1 M * s 2 ε argmin fi( θ ε) zi i1 s1 s θ θ ε Applying first-order approximation: M * s 2 ε argmin fi ( θ ) zi Jiε i1 M s argmin r ( θ ) J ε i1 * T 1 T ε J J J r θ ( ) ( ) i i 2 J1 r1 J 2 r 2 J r JM rm 35

35 MAP: visual inertial formulation States a g X k R p k WB, q k WB, vwb[k], b k, b k,,..., X X 1, X 2,..., X k, X X L L L L W1 W2 WL Combined: Dynamics Jacobians R R R L IMU integration w.r.t x k-1 Residual w.r.t. x k f x k1 x K Measurements Jacobians (same as filtering method) Feature position w.r.t. pose Feature position w.r.t. 3D coordinates h x, L z ik ij i 36

36 MAP: why it is slow Re-linearization Need to recalculate the Jacobian for each iteration But it is also an important reason why MAP is accurate The number of states is large Will see next: fix-lag smoothing and marginalization Re-integration of IMU measurements The integration from k to k+1 is related to the state estimation at time k Preintegration Lupton, Todd, and Salah Sukkarieh. "Visual-inertial-aided navigation for high-dynamic motion in built environments without initial conditions." Forster, Christian, et al. "IMU preintegration on manifold for efficient visual-inertial maximum-a-posteriori estimation." 37

37 MAP: IMU Preintegration {ω, a} ΔR, Δv, Δp R, p, v Standard: Evaluate error in global frame: e R = R ω, R k 1 T R k ev = v(ω, a, v k 1 ) v k e p = p (ω, a, p k 1 ) p k Predicted Estimate Repeat integration when previous state changes! Preintegration: Evaluate relative errors: e R = ΔR T ΔR ev = Δv Δv e p = Δp Δp Preintegration of IMU deltas possible with no initial condition required. 38

38 Optimization-based Approaches (MAP, Fix-lag smoothing) Fusion solved as a non-linear optimization problem Increased accuracy over filtering methods IMU residuals Reprojection residuals Forster, Carlone, Dellaert, Scaramuzza, IMU Preintegration on Manifold for efficient Visual-Inertial Maximum-a- Posteriori Estimation, Robotics Science and Systens 15, Best Paper Award Finalist 39

39 MAP: SVO + IMU Preintegration Open Source Accuracy: 0.1% of the travel distance Proposed Google Tango OKVIS Forster, Carlone, Dellaert, Scaramuzza, IMU Preintegration on Manifold for efficient Visual-Inertial Maximum-a- Posteriori Estimation, Robotics Science and Systens 15 and IEEE TRO 16, Best Paper Award Finalist 40

40 MAP: SVO + IMU Preintegration 41

41 Fix-lag smoothing: Basic Idea Recall MAP estimation T J J * T 1 T ε J J J r θ ( ) ( ) is also called the Hessian matrix. Hessian for full bundle adjustment: n x n, n number of all the states pose, velocity landmarks If only part of the states are of interest, can we think of a way for simplification? 42

42 Fix-lag smoothing: Marginalization Schur complement A B M C D 1 D D CA B 1 A A BD C Schur complement of A in M Schur complement of D in M Reduced linear system A B x1 b1 C D x b A B x1 1 0 b1 1 1 CA 1 C D 2 CA 1 x b2 A B b 1 0 D b 2 b b CA b We can then just solve for x 2, and (optionally) solve for x 1 by back substitution. 43

43 Fix-lag smoothing: Marginalization Generalized Schur complement Any principal submatrix: selecting n rows and n columns of the same index (i.e., select any states to marginalize) Nonsingular submatrix: use generalized inverse (e.g., Moore Penrose pseudoinverse) Special structure of SLAM Marginalization causes fillin, no longer maintaining the sparse structure. Inverse of diagonal matrix is very efficient to calculate. D 1 44

44 Fix-lag smoothing: Implementation States and formulations are similar to MAP estimation. Which states to marginalize? Old states: keep a window of recent frames Landmarks: structureless Marginalizing states vs. dropping the states Dropping the states: loss of information, not optimal Marginalization: optimal if there is no linearization error, but introduces fill-in, causing performance penalty Therefore, dropping states is also used to trade accuracy for speed. Leutenegger, Stefan, et al. "Keyframe-based visual inertial odometry using nonlinear optimization." 45

45 Fix-lag smoothing: OKVIS 46

46 Further topics Rotation parameterization Rotation is tricky to deal with Euler angle / Rotation matrix / Quaternion / SO(3) Consistency: filtering and fix-lag smoothing Linearization around different values of the same variable may lead to error 47

Motion Tracking with Fixed-lag Smoothing: Algorithm and Consistency Analysis

Motion Tracking with Fixed-lag Smoothing: Algorithm and Consistency Analysis Motion Tracking with Fixed-lag Smoothing: Algorithm and Consistency Analysis Tue-Cuong Dong-Si and Anastasios I Mourikis Dept of Electrical Engineering, University of California, Riverside E-mail: tdong@studentucredu,

More information

Visual SLAM Tutorial: Bundle Adjustment

Visual SLAM Tutorial: Bundle Adjustment Visual SLAM Tutorial: Bundle Adjustment Frank Dellaert June 27, 2014 1 Minimizing Re-projection Error in Two Views In a two-view setting, we are interested in finding the most likely camera poses T1 w

More information

UAV Navigation: Airborne Inertial SLAM

UAV Navigation: Airborne Inertial SLAM Introduction UAV Navigation: Airborne Inertial SLAM Jonghyuk Kim Faculty of Engineering and Information Technology Australian National University, Australia Salah Sukkarieh ARC Centre of Excellence in

More information

L11. EKF SLAM: PART I. NA568 Mobile Robotics: Methods & Algorithms

L11. EKF SLAM: PART I. NA568 Mobile Robotics: Methods & Algorithms L11. EKF SLAM: PART I NA568 Mobile Robotics: Methods & Algorithms Today s Topic EKF Feature-Based SLAM State Representation Process / Observation Models Landmark Initialization Robot-Landmark Correlation

More information

Continuous Preintegration Theory for Graph-based Visual-Inertial Navigation

Continuous Preintegration Theory for Graph-based Visual-Inertial Navigation Continuous Preintegration Theory for Graph-based Visual-Inertial Navigation Kevin Ecenhoff - ec@udel.edu Patric Geneva - pgeneva@udel.edu Guoquan Huang - ghuang@udel.edu Department of Mechanical Engineering

More information

Rao-Blackwellized Particle Filtering for 6-DOF Estimation of Attitude and Position via GPS and Inertial Sensors

Rao-Blackwellized Particle Filtering for 6-DOF Estimation of Attitude and Position via GPS and Inertial Sensors Rao-Blackwellized Particle Filtering for 6-DOF Estimation of Attitude and Position via GPS and Inertial Sensors GRASP Laboratory University of Pennsylvania June 6, 06 Outline Motivation Motivation 3 Problem

More information

Inertial Odometry on Handheld Smartphones

Inertial Odometry on Handheld Smartphones Inertial Odometry on Handheld Smartphones Arno Solin 1 Santiago Cortés 1 Esa Rahtu 2 Juho Kannala 1 1 Aalto University 2 Tampere University of Technology 21st International Conference on Information Fusion

More information

with Application to Autonomous Vehicles

with Application to Autonomous Vehicles Nonlinear with Application to Autonomous Vehicles (Ph.D. Candidate) C. Silvestre (Supervisor) P. Oliveira (Co-supervisor) Institute for s and Robotics Instituto Superior Técnico Portugal January 2010 Presentation

More information

Pose Tracking II! Gordon Wetzstein! Stanford University! EE 267 Virtual Reality! Lecture 12! stanford.edu/class/ee267/!

Pose Tracking II! Gordon Wetzstein! Stanford University! EE 267 Virtual Reality! Lecture 12! stanford.edu/class/ee267/! Pose Tracking II! Gordon Wetzstein! Stanford University! EE 267 Virtual Reality! Lecture 12! stanford.edu/class/ee267/!! WARNING! this class will be dense! will learn how to use nonlinear optimization

More information

Bayes Filter Reminder. Kalman Filter Localization. Properties of Gaussians. Gaussians. Prediction. Correction. σ 2. Univariate. 1 2πσ e.

Bayes Filter Reminder. Kalman Filter Localization. Properties of Gaussians. Gaussians. Prediction. Correction. σ 2. Univariate. 1 2πσ e. Kalman Filter Localization Bayes Filter Reminder Prediction Correction Gaussians p(x) ~ N(µ,σ 2 ) : Properties of Gaussians Univariate p(x) = 1 1 2πσ e 2 (x µ) 2 σ 2 µ Univariate -σ σ Multivariate µ Multivariate

More information

Cooperative Visual-Inertial Sensor Fusion: Fundamental Equations

Cooperative Visual-Inertial Sensor Fusion: Fundamental Equations Cooperative Visual-Inertial Sensor Fusion: Fundamental Equations Agostino Martinelli, Alessandro Renzaglia To cite this version: Agostino Martinelli, Alessandro Renzaglia. Cooperative Visual-Inertial Sensor

More information

Inertial Navigation and Various Applications of Inertial Data. Yongcai Wang. 9 November 2016

Inertial Navigation and Various Applications of Inertial Data. Yongcai Wang. 9 November 2016 Inertial Navigation and Various Applications of Inertial Data Yongcai Wang 9 November 2016 Types of Gyroscope Mechanical Gyroscope Laser Gyroscope Sagnac Effect Stable Platform IMU and Strapdown IMU In

More information

Quaternion based Extended Kalman Filter

Quaternion based Extended Kalman Filter Quaternion based Extended Kalman Filter, Sergio Montenegro About this lecture General introduction to rotations and quaternions. Introduction to Kalman Filter for Attitude Estimation How to implement and

More information

SLAM Techniques and Algorithms. Jack Collier. Canada. Recherche et développement pour la défense Canada. Defence Research and Development Canada

SLAM Techniques and Algorithms. Jack Collier. Canada. Recherche et développement pour la défense Canada. Defence Research and Development Canada SLAM Techniques and Algorithms Jack Collier Defence Research and Development Canada Recherche et développement pour la défense Canada Canada Goals What will we learn Gain an appreciation for what SLAM

More information

On the Observability and Self-Calibration of Visual-Inertial Navigation Systems

On the Observability and Self-Calibration of Visual-Inertial Navigation Systems Center for Robotics and Embedded Systems University of Southern California Technical Report CRES-08-005 R B TIC EMBEDDED SYSTEMS LABORATORY On the Observability and Self-Calibration of Visual-Inertial

More information

EKF and SLAM. McGill COMP 765 Sept 18 th, 2017

EKF and SLAM. McGill COMP 765 Sept 18 th, 2017 EKF and SLAM McGill COMP 765 Sept 18 th, 2017 Outline News and information Instructions for paper presentations Continue on Kalman filter: EKF and extension to mapping Example of a real mapping system:

More information

Using the Kalman Filter for SLAM AIMS 2015

Using the Kalman Filter for SLAM AIMS 2015 Using the Kalman Filter for SLAM AIMS 2015 Contents Trivial Kinematics Rapid sweep over localisation and mapping (components of SLAM) Basic EKF Feature Based SLAM Feature types and representations Implementation

More information

Vision-Aided Navigation Based on Three-View Geometry

Vision-Aided Navigation Based on Three-View Geometry Vision-Aided Navigation Based on hree-view Geometry Vadim Indelman, Pini Gurfil Distributed Space Systems Lab, Aerospace Engineering, echnion Ehud Rivlin Computer Science, echnion Hector Rotstein RAFAEL

More information

L06. LINEAR KALMAN FILTERS. NA568 Mobile Robotics: Methods & Algorithms

L06. LINEAR KALMAN FILTERS. NA568 Mobile Robotics: Methods & Algorithms L06. LINEAR KALMAN FILTERS NA568 Mobile Robotics: Methods & Algorithms 2 PS2 is out! Landmark-based Localization: EKF, UKF, PF Today s Lecture Minimum Mean Square Error (MMSE) Linear Kalman Filter Gaussian

More information

Vlad Estivill-Castro. Robots for People --- A project for intelligent integrated systems

Vlad Estivill-Castro. Robots for People --- A project for intelligent integrated systems 1 Vlad Estivill-Castro Robots for People --- A project for intelligent integrated systems V. Estivill-Castro 2 Probabilistic Map-based Localization (Kalman Filter) Chapter 5 (textbook) Based on textbook

More information

CS 532: 3D Computer Vision 6 th Set of Notes

CS 532: 3D Computer Vision 6 th Set of Notes 1 CS 532: 3D Computer Vision 6 th Set of Notes Instructor: Philippos Mordohai Webpage: www.cs.stevens.edu/~mordohai E-mail: Philippos.Mordohai@stevens.edu Office: Lieb 215 Lecture Outline Intro to Covariance

More information

From Bayes to Extended Kalman Filter

From Bayes to Extended Kalman Filter From Bayes to Extended Kalman Filter Michal Reinštein Czech Technical University in Prague Faculty of Electrical Engineering, Department of Cybernetics Center for Machine Perception http://cmp.felk.cvut.cz/

More information

Robotics. Mobile Robotics. Marc Toussaint U Stuttgart

Robotics. Mobile Robotics. Marc Toussaint U Stuttgart Robotics Mobile Robotics State estimation, Bayes filter, odometry, particle filter, Kalman filter, SLAM, joint Bayes filter, EKF SLAM, particle SLAM, graph-based SLAM Marc Toussaint U Stuttgart DARPA Grand

More information

IMU-Camera Calibration: Observability Analysis

IMU-Camera Calibration: Observability Analysis IMU-Camera Calibration: Observability Analysis Faraz M. Mirzaei and Stergios I. Roumeliotis {faraz stergios}@cs.umn.edu Dept. of Computer Science & Engineering University of Minnesota Minneapolis, MN 55455

More information

Adaptive Estimation of Measurement Bias in Six Degree of Freedom Inertial Measurement Units: Theory and Preliminary Simulation Evaluation

Adaptive Estimation of Measurement Bias in Six Degree of Freedom Inertial Measurement Units: Theory and Preliminary Simulation Evaluation Adaptive Estimation of Measurement Bias in Six Degree of Freedom Inertial Measurement Units: Theory and Preliminary Simulation Evaluation Andrew R. Spielvogel and Louis L. Whitcomb Abstract Six-degree

More information

Miscellaneous. Regarding reading materials. Again, ask questions (if you have) and ask them earlier

Miscellaneous. Regarding reading materials. Again, ask questions (if you have) and ask them earlier Miscellaneous Regarding reading materials Reading materials will be provided as needed If no assigned reading, it means I think the material from class is sufficient Should be enough for you to do your

More information

Mobile Robot Geometry Initialization from Single Camera

Mobile Robot Geometry Initialization from Single Camera Author manuscript, published in "6th International Conference on Field and Service Robotics - FSR 2007, Chamonix : France (2007)" Mobile Robot Geometry Initialization from Single Camera Daniel Pizarro

More information

Autonomous Mobile Robot Design

Autonomous Mobile Robot Design Autonomous Mobile Robot Design Topic: Inertial Measurement Unit Dr. Kostas Alexis (CSE) Where am I? What is my environment? Robots use multiple sensors to understand where they are and how their environment

More information

Sensors for mobile robots

Sensors for mobile robots ROBOTICS 01PEEQW Basilio Bona DAUIN Politecnico di Torino Mobile & Service Robotics Sensors for Robotics 2 Sensors for mobile robots Sensors are used to perceive, analyze and understand the environment

More information

ROBOTICS 01PEEQW. Basilio Bona DAUIN Politecnico di Torino

ROBOTICS 01PEEQW. Basilio Bona DAUIN Politecnico di Torino ROBOTICS 01PEEQW Basilio Bona DAUIN Politecnico di Torino Probabilistic Fundamentals in Robotics Gaussian Filters Course Outline Basic mathematical framework Probabilistic models of mobile robots Mobile

More information

Mobile Robot Localization

Mobile Robot Localization Mobile Robot Localization 1 The Problem of Robot Localization Given a map of the environment, how can a robot determine its pose (planar coordinates + orientation)? Two sources of uncertainty: - observations

More information

MEMS Gyroscope Control Systems for Direct Angle Measurements

MEMS Gyroscope Control Systems for Direct Angle Measurements MEMS Gyroscope Control Systems for Direct Angle Measurements Chien-Yu Chi Mechanical Engineering National Chiao Tung University Hsin-Chu, Taiwan (R.O.C.) 3 Email: chienyu.me93g@nctu.edu.tw Tsung-Lin Chen

More information

Mobile Robots Localization

Mobile Robots Localization Mobile Robots Localization Institute for Software Technology 1 Today s Agenda Motivation for Localization Odometry Odometry Calibration Error Model 2 Robotics is Easy control behavior perception modelling

More information

SC-KF Mobile Robot Localization: A Stochastic-Cloning Kalman Filter for Processing Relative-State Measurements

SC-KF Mobile Robot Localization: A Stochastic-Cloning Kalman Filter for Processing Relative-State Measurements 1 SC-KF Mobile Robot Localization: A Stochastic-Cloning Kalman Filter for Processing Relative-State Measurements Anastasios I. Mourikis, Stergios I. Roumeliotis, and Joel W. Burdick Abstract This paper

More information

Local Reference Filter for Life-Long Vision Aided Inertial Navigation

Local Reference Filter for Life-Long Vision Aided Inertial Navigation Local Reference Filter for Life-Long Vision Aided Inertial Navigation Korbinian Schmid Department of Perception and Cognition Robotics and Mechatronics Center German Aerospace Center (DLR Email: Korbinian.Schmid@dlr.de

More information

the robot in its current estimated position and orientation (also include a point at the reference point of the robot)

the robot in its current estimated position and orientation (also include a point at the reference point of the robot) CSCI 4190 Introduction to Robotic Algorithms, Spring 006 Assignment : out February 13, due February 3 and March Localization and the extended Kalman filter In this assignment, you will write a program

More information

Automated Tuning of the Nonlinear Complementary Filter for an Attitude Heading Reference Observer

Automated Tuning of the Nonlinear Complementary Filter for an Attitude Heading Reference Observer Automated Tuning of the Nonlinear Complementary Filter for an Attitude Heading Reference Observer Oscar De Silva, George K.I. Mann and Raymond G. Gosine Faculty of Engineering and Applied Sciences, Memorial

More information

Mobile Robot Localization

Mobile Robot Localization Mobile Robot Localization 1 The Problem of Robot Localization Given a map of the environment, how can a robot determine its pose (planar coordinates + orientation)? Two sources of uncertainty: - observations

More information

Delayed Fusion of Relative State Measurements by Extending Stochastic Cloning via Direct Kalman Filtering

Delayed Fusion of Relative State Measurements by Extending Stochastic Cloning via Direct Kalman Filtering Delayed Fusion of Relative State Measurements by Extending Stochastic Cloning via Direct Kalman Filtering Ehsan Asadi and Carlo L Bottasso Department of Aerospace Science and echnology Politecnico di Milano,

More information

System identification and sensor fusion in dynamical systems. Thomas Schön Division of Systems and Control, Uppsala University, Sweden.

System identification and sensor fusion in dynamical systems. Thomas Schön Division of Systems and Control, Uppsala University, Sweden. System identification and sensor fusion in dynamical systems Thomas Schön Division of Systems and Control, Uppsala University, Sweden. The system identification and sensor fusion problem Inertial sensors

More information

On-Manifold Preintegration Theory for Fast and Accurate Visual-Inertial Navigation

On-Manifold Preintegration Theory for Fast and Accurate Visual-Inertial Navigation 1 On-Manifold Preintegration heory for Fast and Accurate Visual-Inertial Navigation Christian Forster, Luca Carlone, Fran Dellaert, Davide Scaramuzza arxiv:1510363v1 [csro] 8 Dec 015 Abstract Current approaches

More information

Consistent Triangulation for Mobile Robot Localization Using Discontinuous Angular Measurements

Consistent Triangulation for Mobile Robot Localization Using Discontinuous Angular Measurements Seminar on Mechanical Robotic Systems Centre for Intelligent Machines McGill University Consistent Triangulation for Mobile Robot Localization Using Discontinuous Angular Measurements Josep M. Font Llagunes

More information

Tracking for VR and AR

Tracking for VR and AR Tracking for VR and AR Hakan Bilen November 17, 2017 Computer Graphics University of Edinburgh Slide credits: Gordon Wetzstein and Steven M. La Valle 1 Overview VR and AR Inertial Sensors Gyroscopes Accelerometers

More information

EE 570: Location and Navigation

EE 570: Location and Navigation EE 570: Location and Navigation Aided INS Aly El-Osery Kevin Wedeward Electrical Engineering Department, New Mexico Tech Socorro, New Mexico, USA In Collaboration with Stephen Bruder Electrical and Computer

More information

Sensor Aided Inertial Navigation Systems

Sensor Aided Inertial Navigation Systems Arvind Ramanandan Department of Electrical Engineering University of California, Riverside Riverside, CA 92507 April, 28th 2011 Acknowledgements: 1 Prof. Jay A. Farrell 2 Anning Chen 3 Anh Vu 4 Prof. Matthew

More information

Localización Dinámica de Robots Móviles Basada en Filtrado de Kalman y Triangulación

Localización Dinámica de Robots Móviles Basada en Filtrado de Kalman y Triangulación Universidad Pública de Navarra 13 de Noviembre de 2008 Departamento de Ingeniería Mecánica, Energética y de Materiales Localización Dinámica de Robots Móviles Basada en Filtrado de Kalman y Triangulación

More information

Probabilistic Fundamentals in Robotics. DAUIN Politecnico di Torino July 2010

Probabilistic Fundamentals in Robotics. DAUIN Politecnico di Torino July 2010 Probabilistic Fundamentals in Robotics Gaussian Filters Basilio Bona DAUIN Politecnico di Torino July 2010 Course Outline Basic mathematical framework Probabilistic models of mobile robots Mobile robot

More information

On-Manifold Preintegration for Real-Time Visual-Inertial Odometry

On-Manifold Preintegration for Real-Time Visual-Inertial Odometry 1 On-Manifold Preintegration for Real-ime Visual-Inertial Odometry Christian Forster, Luca Carlone, Fran Dellaert, Davide Scaramuzza Abstract Current approaches for visual-inertial odometry VIO are able

More information

Kalman Filter. Predict: Update: x k k 1 = F k x k 1 k 1 + B k u k P k k 1 = F k P k 1 k 1 F T k + Q

Kalman Filter. Predict: Update: x k k 1 = F k x k 1 k 1 + B k u k P k k 1 = F k P k 1 k 1 F T k + Q Kalman Filter Kalman Filter Predict: x k k 1 = F k x k 1 k 1 + B k u k P k k 1 = F k P k 1 k 1 F T k + Q Update: K = P k k 1 Hk T (H k P k k 1 Hk T + R) 1 x k k = x k k 1 + K(z k H k x k k 1 ) P k k =(I

More information

EE 565: Position, Navigation, and Timing

EE 565: Position, Navigation, and Timing EE 565: Position, Navigation, and Timing Kalman Filtering Example Aly El-Osery Kevin Wedeward Electrical Engineering Department, New Mexico Tech Socorro, New Mexico, USA In Collaboration with Stephen Bruder

More information

High-Accuracy Preintegration for Visual Inertial Navigation

High-Accuracy Preintegration for Visual Inertial Navigation High-Accuracy Preintegration for Visual Inertial Navigation Kevin Ecenhoff - ec@udel.edu Patric Geneva - pgeneva@udel.edu Guoquan Huang - ghuang@udel.edu Department of Mechanical Engineering University

More information

Multi-Sensor Fusion for Localization of a Mobile Robot in Outdoor Environments

Multi-Sensor Fusion for Localization of a Mobile Robot in Outdoor Environments Multi-Sensor Fusion for Localization of a Mobile Robot in Outdoor Environments Thomas Emter, Arda Saltoğlu and Janko Petereit Introduction AMROS Mobile platform equipped with multiple sensors for navigation

More information

SC-KF Mobile Robot Localization: A Stochastic Cloning-Kalman Filter for Processing Relative-State Measurements

SC-KF Mobile Robot Localization: A Stochastic Cloning-Kalman Filter for Processing Relative-State Measurements SC-KF Mobile Robot Localization: A Stochastic Cloning-Kalman Filter for Processing Relative-State Measurements Anastasios I. Mourikis, Stergios I. Roumeliotis, and Joel W. Burdick Abstract This paper presents

More information

A Study of Covariances within Basic and Extended Kalman Filters

A Study of Covariances within Basic and Extended Kalman Filters A Study of Covariances within Basic and Extended Kalman Filters David Wheeler Kyle Ingersoll December 2, 2013 Abstract This paper explores the role of covariance in the context of Kalman filters. The underlying

More information

Sensors Fusion for Mobile Robotics localization. M. De Cecco - Robotics Perception and Action

Sensors Fusion for Mobile Robotics localization. M. De Cecco - Robotics Perception and Action Sensors Fusion for Mobile Robotics localization 1 Until now we ve presented the main principles and features of incremental and absolute (environment referred localization systems) could you summarize

More information

ESTIMATOR STABILITY ANALYSIS IN SLAM. Teresa Vidal-Calleja, Juan Andrade-Cetto, Alberto Sanfeliu

ESTIMATOR STABILITY ANALYSIS IN SLAM. Teresa Vidal-Calleja, Juan Andrade-Cetto, Alberto Sanfeliu ESTIMATOR STABILITY ANALYSIS IN SLAM Teresa Vidal-Calleja, Juan Andrade-Cetto, Alberto Sanfeliu Institut de Robtica i Informtica Industrial, UPC-CSIC Llorens Artigas 4-6, Barcelona, 88 Spain {tvidal, cetto,

More information

CS491/691: Introduction to Aerial Robotics

CS491/691: Introduction to Aerial Robotics CS491/691: Introduction to Aerial Robotics Topic: Midterm Preparation Dr. Kostas Alexis (CSE) Areas of Focus Coordinate system transformations (CST) MAV Dynamics (MAVD) Navigation Sensors (NS) State Estimation

More information

1 Kalman Filter Introduction

1 Kalman Filter Introduction 1 Kalman Filter Introduction You should first read Chapter 1 of Stochastic models, estimation, and control: Volume 1 by Peter S. Maybec (available here). 1.1 Explanation of Equations (1-3) and (1-4) Equation

More information

Mobile Robotics, Mathematics, Models, and Methods

Mobile Robotics, Mathematics, Models, and Methods Mobile Robotics, Mathematics, Models, and Methods Errata in Initial Revision Prepared by Professor Alonzo Kelly Rev 10, June 0, 015 Locations in the first column are given in several formats: 1 x,y,z means

More information

One Approach to the Integration of Inertial and Visual Navigation Systems

One Approach to the Integration of Inertial and Visual Navigation Systems FATA UNIVERSITATIS (NIŠ) SER.: ELE. ENERG. vol. 18, no. 3, December 2005, 479-491 One Approach to the Integration of Inertial and Visual Navigation Systems Dedicated to Professor Milić Stojić on the occasion

More information

SLAM for Ship Hull Inspection using Exactly Sparse Extended Information Filters

SLAM for Ship Hull Inspection using Exactly Sparse Extended Information Filters SLAM for Ship Hull Inspection using Exactly Sparse Extended Information Filters Matthew Walter 1,2, Franz Hover 1, & John Leonard 1,2 Massachusetts Institute of Technology 1 Department of Mechanical Engineering

More information

Observability-based Rules for Designing Consistent EKF SLAM Estimators

Observability-based Rules for Designing Consistent EKF SLAM Estimators The International Journal of Robotics Research OnlineFirst, published on December 11, 2009 as doi:10.1177/0278364909353640 Guoquan P. Huang Department of Computer Science and Engineering, University of

More information

Motion Tracking with Fixed-lag Smoothing: Algorithm and Consistency Analysis

Motion Tracking with Fixed-lag Smoothing: Algorithm and Consistency Analysis Motion Tracing with Fixed-lag Smoothing: Algorithm and Consistency Analysis Tue-Cuong Dong-Si and Anastasios I. Mouriis Dept. of Electrical Engineering, University of California, Riverside E-mail: tdongsi@ee.ucr.edu,

More information

Lecture 9: Modeling and motion models

Lecture 9: Modeling and motion models Sensor Fusion, 2014 Lecture 9: 1 Lecture 9: Modeling and motion models Whiteboard: Principles and some examples. Slides: Sampling formulas. Noise models. Standard motion models. Position as integrated

More information

Efficient and Consistent Vision-aided Inertial Navigation using Line Observations

Efficient and Consistent Vision-aided Inertial Navigation using Line Observations Efficient and Consistent Vision-aided Inertial Navigation using Line Observations Dimitrios. Kottas and Stergios I. Roumeliotis Abstract This paper addresses the problem of estimating the state of a vehicle

More information

TSRT14: Sensor Fusion Lecture 8

TSRT14: Sensor Fusion Lecture 8 TSRT14: Sensor Fusion Lecture 8 Particle filter theory Marginalized particle filter Gustaf Hendeby gustaf.hendeby@liu.se TSRT14 Lecture 8 Gustaf Hendeby Spring 2018 1 / 25 Le 8: particle filter theory,

More information

Numerical Methods I Solving Nonlinear Equations

Numerical Methods I Solving Nonlinear Equations Numerical Methods I Solving Nonlinear Equations Aleksandar Donev Courant Institute, NYU 1 donev@courant.nyu.edu 1 MATH-GA 2011.003 / CSCI-GA 2945.003, Fall 2014 October 16th, 2014 A. Donev (Courant Institute)

More information

Vision-Aided Inertial Navigation: Closed-Form Determination of Absolute Scale, Speed and Attitude

Vision-Aided Inertial Navigation: Closed-Form Determination of Absolute Scale, Speed and Attitude Vision-Aided Inertial Navigation: Closed-Form Determination of Absolute Scale, Speed and Attitude Agostino Martinelli, Chiara Troiani, Alessandro Renzaglia To cite this version: Agostino Martinelli, Chiara

More information

Multiple Autonomous Robotic Systems Laboratory Technical Report Number

Multiple Autonomous Robotic Systems Laboratory Technical Report Number Observability-constrained EKF Implementation of the IMU-RGBD Camera Navigation using Point and Plane Features Chao X. Guo and Stergios I. Roumeliotis Multiple Autonomous Robotic Systems Laboratory Technical

More information

arxiv: v2 [cs.ro] 1 Mar 2017

arxiv: v2 [cs.ro] 1 Mar 2017 An Invariant-EKF VINS Algorithm for Improving Consistency Kanzhi Wu, Teng Zhang, Daobilige Su, Shoudong Huang and Gamini Dissanayae arxiv:17.79v [cs.ro 1 Mar 17 Abstract The main contribution of this paper

More information

Invariant Kalman Filtering for Visual Inertial SLAM

Invariant Kalman Filtering for Visual Inertial SLAM Invariant Kalman Filtering for Visual Inertial SLAM Martin Brossard, Silvère Bonnabel, Axel Barrau To cite this version: Martin Brossard, Silvère Bonnabel, Axel Barrau. Invariant Kalman Filtering for Visual

More information

Unscented Kalman Filtering on Lie Groups for Fusion of IMU and Monocular Vision

Unscented Kalman Filtering on Lie Groups for Fusion of IMU and Monocular Vision Unscented Kalman Filtering on Lie Groups for Fusion of IMU and Monocular Vision Martin Brossard, Silvère Bonnabel, Axel Barrau To cite this version: Martin Brossard, Silvère Bonnabel, Axel Barrau. Unscented

More information

Robot Mapping. Least Squares. Cyrill Stachniss

Robot Mapping. Least Squares. Cyrill Stachniss Robot Mapping Least Squares Cyrill Stachniss 1 Three Main SLAM Paradigms Kalman filter Particle filter Graphbased least squares approach to SLAM 2 Least Squares in General Approach for computing a solution

More information

Continuous Preintegration Theory for Graph-based Visual-Inertial Navigation

Continuous Preintegration Theory for Graph-based Visual-Inertial Navigation Continuous Preintegration Theory for Graph-based Visual-nertial Navigation Kevin Ecenhoff, Patric Geneva, and Guoquan Huang arxiv:805.0774v [cs.ro] 7 May 08 Abstract n this paper we propose a new continuous

More information

EE565:Mobile Robotics Lecture 6

EE565:Mobile Robotics Lecture 6 EE565:Mobile Robotics Lecture 6 Welcome Dr. Ahmad Kamal Nasir Announcement Mid-Term Examination # 1 (25%) Understand basic wheel robot kinematics, common mobile robot sensors and actuators knowledge. Understand

More information

TSRT14: Sensor Fusion Lecture 9

TSRT14: Sensor Fusion Lecture 9 TSRT14: Sensor Fusion Lecture 9 Simultaneous localization and mapping (SLAM) Gustaf Hendeby gustaf.hendeby@liu.se TSRT14 Lecture 9 Gustaf Hendeby Spring 2018 1 / 28 Le 9: simultaneous localization and

More information

Aided Inertial Navigation with Geometric Features: Observability Analysis

Aided Inertial Navigation with Geometric Features: Observability Analysis Aided nertial Navigation with eometric Features: Observability Analysis Yulin Yang and uoquan Huang Abstract n this paper, we perform observability analysis for inertial navigation systems NS aided by

More information

Fundamentals of attitude Estimation

Fundamentals of attitude Estimation Fundamentals of attitude Estimation Prepared by A.Kaviyarasu Assistant Professor Department of Aerospace Engineering Madras Institute Of Technology Chromepet, Chennai Basically an IMU can used for two

More information

Off-the-Shelf Sensor Integration for mono-slam on Smart Devices

Off-the-Shelf Sensor Integration for mono-slam on Smart Devices Off-the-Shelf Sensor ntegration for mono-slam on Smart Devices Philipp Tiefenbacher, Timo Schulze and Gerhard Rigoll Technische Universität München philipp.tiefenbacher@tum.de, schulzetimo@gmail.com, rigoll@tum.de

More information

The Kalman filter is arguably one of the most notable algorithms

The Kalman filter is arguably one of the most notable algorithms LECTURE E NOTES «Kalman Filtering with Newton s Method JEFFREY HUMPHERYS and JEREMY WEST The Kalman filter is arguably one of the most notable algorithms of the 0th century [1]. In this article, we derive

More information

Simultaneous Localization and Mapping (SLAM) Corso di Robotica Prof. Davide Brugali Università degli Studi di Bergamo

Simultaneous Localization and Mapping (SLAM) Corso di Robotica Prof. Davide Brugali Università degli Studi di Bergamo Simultaneous Localization and Mapping (SLAM) Corso di Robotica Prof. Davide Brugali Università degli Studi di Bergamo Introduction SLAM asks the following question: Is it possible for an autonomous vehicle

More information

Cubature Particle filter applied in a tightly-coupled GPS/INS navigation system

Cubature Particle filter applied in a tightly-coupled GPS/INS navigation system Cubature Particle filter applied in a tightly-coupled GPS/INS navigation system Yingwei Zhao & David Becker Physical and Satellite Geodesy Institute of Geodesy TU Darmstadt 1 Yingwei Zhao & David Becker

More information

Metric Visual-Inertial Navigation System Using Single Optical Flow Feature

Metric Visual-Inertial Navigation System Using Single Optical Flow Feature 13 European Control Conference (ECC) July 17-19, 13, Zürich, Switzerland. Metric Visual-Inertial Navigation System Using Single Optical Flow Feature Sammy Omari 1 and Guillaume Ducard Abstract This paper

More information

Fuzzy Adaptive Kalman Filtering for INS/GPS Data Fusion

Fuzzy Adaptive Kalman Filtering for INS/GPS Data Fusion A99936769 AMA-99-4307 Fuzzy Adaptive Kalman Filtering for INS/GPS Data Fusion J.Z. Sasiadek* and Q. Wang** Dept. of Mechanical & Aerospace Engineering Carleton University 1125 Colonel By Drive, Ottawa,

More information

Inter-robot Transformations in 3D

Inter-robot Transformations in 3D 1 Inter-robot Transformations in 3D Nikolas Trawny, Student Member, IEEE, Xun S. Zhou, Student Member, IEEE, Ke Zhou, Student Member, IEEE, and Stergios I. Roumeliotis, Member, IEEE Abstract In this paper,

More information

Information and Observability Metrics of Inertial SLAM for On-line Path-planning on an Aerial Vehicle

Information and Observability Metrics of Inertial SLAM for On-line Path-planning on an Aerial Vehicle Information and Observability Metrics of Inertial SLAM for On-line Path-planning on an Aerial Vehicle Mitch Bryson, Jonghyuk Kim and Salah Sukkarieh ARC Centre of Excellence in Autonomous Systems University

More information

Lecture. Aided INS EE 570: Location and Navigation. 1 Overview. 1.1 ECEF as and Example. 1.2 Inertial Measurements

Lecture. Aided INS EE 570: Location and Navigation. 1 Overview. 1.1 ECEF as and Example. 1.2 Inertial Measurements Lecture Aided EE 570: Location and Navigation Lecture Notes Update on April 13, 2016 Aly El-Osery and Kevin Wedeward, Electrical Engineering Dept., New Mexico Tech In collaoration with Stephen Bruder,

More information

Stochastic Cloning: A generalized framework for processing relative state measurements

Stochastic Cloning: A generalized framework for processing relative state measurements Stochastic Cloning: A generalized framework for processing relative state measurements Stergios I. Roumeliotis and Joel W. Burdick Division of Engineering and Applied Science California Institute of Technology,

More information

Design of Adaptive Filtering Algorithm for Relative Navigation

Design of Adaptive Filtering Algorithm for Relative Navigation Design of Adaptive Filtering Algorithm for Relative Navigation Je Young Lee, Hee Sung Kim, Kwang Ho Choi, Joonhoo Lim, Sung Jin Kang, Sebum Chun, and Hyung Keun Lee Abstract Recently, relative navigation

More information

E190Q Lecture 11 Autonomous Robot Navigation

E190Q Lecture 11 Autonomous Robot Navigation E190Q Lecture 11 Autonomous Robot Navigation Instructor: Chris Clark Semester: Spring 013 1 Figures courtesy of Siegwart & Nourbakhsh Control Structures Planning Based Control Prior Knowledge Operator

More information

Image Alignment and Mosaicing Feature Tracking and the Kalman Filter

Image Alignment and Mosaicing Feature Tracking and the Kalman Filter Image Alignment and Mosaicing Feature Tracking and the Kalman Filter Image Alignment Applications Local alignment: Tracking Stereo Global alignment: Camera jitter elimination Image enhancement Panoramic

More information

Fundamentals of High Accuracy Inertial Navigation Averil B. Chatfield Table of Contents

Fundamentals of High Accuracy Inertial Navigation Averil B. Chatfield Table of Contents Navtech Part #2440 Preface Fundamentals of High Accuracy Inertial Navigation Averil B. Chatfield Table of Contents Chapter 1. Introduction...... 1 I. Forces Producing Motion.... 1 A. Gravitation......

More information

Closed-form solution of visual-inertial structure from motion

Closed-form solution of visual-inertial structure from motion Closed-form solution of visual-inertial structure from motion Agostino Martinelli To cite this version: Agostino Martinelli. Closed-form solution of visual-inertial structure from motion. International

More information

Quadrotor Modeling and Control

Quadrotor Modeling and Control 16-311 Introduction to Robotics Guest Lecture on Aerial Robotics Quadrotor Modeling and Control Nathan Michael February 05, 2014 Lecture Outline Modeling: Dynamic model from first principles Propeller

More information

L03. PROBABILITY REVIEW II COVARIANCE PROJECTION. NA568 Mobile Robotics: Methods & Algorithms

L03. PROBABILITY REVIEW II COVARIANCE PROJECTION. NA568 Mobile Robotics: Methods & Algorithms L03. PROBABILITY REVIEW II COVARIANCE PROJECTION NA568 Mobile Robotics: Methods & Algorithms Today s Agenda State Representation and Uncertainty Multivariate Gaussian Covariance Projection Probabilistic

More information

TSRT14: Sensor Fusion Lecture 6. Kalman Filter (KF) Le 6: Kalman filter (KF), approximations (EKF, UKF) Lecture 5: summary

TSRT14: Sensor Fusion Lecture 6. Kalman Filter (KF) Le 6: Kalman filter (KF), approximations (EKF, UKF) Lecture 5: summary TSRT14 Lecture 6 Gustaf Hendeby Spring 217 1 / 42 Le 6: Kalman filter KF approximations EKF UKF TSRT14: Sensor Fusion Lecture 6 Kalman filter KF KF approximations EKF UKF Gustaf Hendeby hendeby@isyliuse

More information

On the Treatment of Relative-Pose Measurements for Mobile Robot Localization

On the Treatment of Relative-Pose Measurements for Mobile Robot Localization On the Treatment of Relative-Pose Measurements for Mobile Robot Localization Anastasios I. Mourikis and Stergios I. Roumeliotis Dept. of Computer Science & Engineering, University of Minnesota, Minneapolis,

More information

Observability-constrained Vision-aided Inertial Navigation

Observability-constrained Vision-aided Inertial Navigation Observability-constrained Vision-aided Inertial Navigation Joel A. Hesch, Dimitrios. Kottas, Sean L. Bowman, and Stergios I. Roumeliotis {joel dkottas bowman stergios}@cs.umn.edu Department of Computer

More information

Arrow Brasil. Rodrigo Rodrigues Field Application Engineer F: Date: 30/01/2014 TM 2

Arrow Brasil. Rodrigo Rodrigues Field Application Engineer F: Date: 30/01/2014 TM 2 TM Arrow Brasil Rodrigo Rodrigues Field Application Engineer Rodrigo.rodrigues@arrowbrasil.com.br F:+55 11 3613-9331 Date: 30/01/2014 TM 2 State-of-the-art review Introduction How a Gyro Works Performance

More information

FIBER OPTIC GYRO-BASED ATTITUDE DETERMINATION FOR HIGH- PERFORMANCE TARGET TRACKING

FIBER OPTIC GYRO-BASED ATTITUDE DETERMINATION FOR HIGH- PERFORMANCE TARGET TRACKING FIBER OPTIC GYRO-BASED ATTITUDE DETERMINATION FOR HIGH- PERFORMANCE TARGET TRACKING Elias F. Solorzano University of Toronto (Space Flight Laboratory) Toronto, ON (Canada) August 10 th, 2016 30 th AIAA/USU

More information