TSRT14: Sensor Fusion Lecture 9

Size: px
Start display at page:

Download "TSRT14: Sensor Fusion Lecture 9"

Transcription

1 TSRT14: Sensor Fusion Lecture 9 Simultaneous localization and mapping (SLAM) Gustaf Hendeby gustaf.hendeby@liu.se

2 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 Le 9: simultaneous localization and mapping (SLAM) Whiteboard: ˆ SLAM problem formulation ˆ Framewor for EKF-SLAM and fastslam (with PF and MPF) Slides: ˆ Algorithms ˆ Properties ˆ Examples and illustrations

3 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 Lecture 8: summary SIS PF Algorithm Choose the number of particles N, a proposal density q(x (i) x(i) 0: 1, y 1:), and a threshold N th (for instance N th = 2 3 N). ˆ Initialization: Generate x (i) 0 p x0, i = 1,..., N. Iterate for = 1, 2,... : 1. Measurement update: For i = 1, 2,..., N: w (i) w(i) p(y x (i) ), and normalize w(i). 2. Estimation: MMSE ˆx N i=1 w(i) x(i). 3. Resampling: Resample with replacement when 1 N eff = i < N th. (w(i) )2 4. Prediction: Generate samples x (i) +1 q(x x (i) update the weights w (i) +1 w(i) w (i) +1. p(x (i) x(i) 1 ) q(x (i) x(i) 1,y ) 1, y ),, and normalize

4 Simultaneous Localization and Mapping (SLAM)

5 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 SLAM: problem formulations Localization concerns the estimation of pose from nown landmars. Navigation concerns estimation of pose, velocities and other states from nown landmars. Mapping concerns the estimation of landmar positions from nown values of pose. SLAM concerns the joint estimation of pose and landmar positions. ˆ Variations on the same theme: Simultaneous navigation and mapping SNAM?! and Simultaneous tracing and mapping STAM?!

6 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 EKF SLAM: model ˆ Assume a linear(-ized) model x +1 = F x + Gv m +1 = m cov(v ) = Q y = H x x + H m (c1:i )m + e, cov(e ) = R. ˆ The map is represented by m. ˆ The index c 1:I relate the observed landmar i to a map landmar j i, which affects the measurement model. ˆ Association is crucial for some sensors (laser, radar, etc.), but less of a problem some applications (camera using image features, microphones using designed pings). ˆ The state and its covariance matrix ( ) ( ) ˆx P xx P xm ẑ =, P =. ˆm P mx P mm

7 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 Original SLAM Application ˆ Assume a ground robot with three states: x = (X, Y, ψ) T. ˆ Robot measures speed and turn rate: u = (v, ψ) T. ˆ Simple dynamics. ˆ Sensor: 1. Ranging sensor (sonar, laser scanner, radar) measures distance to obstacles (walls, furniture); tens to hundreds of landmars. 2. Vision (camera, Kinect, stereo camera) provides detections (corners, marers, patterns) as potential landmars; thousands or tens of thousands of landmars. ˆ P xx small matrix, P mx Approach? thin matrix and P mm large matrix. Both EKF and PF apply to the problem, but how to handle the large dimensions in the best way? Start with studying the basic EKF.

8 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 EKF SLAM: basic KF steps Time update: ( F 0 ẑ 1 = 0 I P 1 = Measurement update: S = H x P 1 xx HxT K x = ( H x P xx 1 + Hm P mx K m ) ẑ 1 1, ( F P xx 1 1 F T + G Q G T F P xm 1 1 P mx 1 1 F T + H m P 1 mm HmT ) 1 S 1 ) S 1 = ( H x P xm 1 + Hm P mm 1 ε = y H x ˆx 1 H m ) ε ẑ = ẑ 1 + ( K x K m P = P 1 ( K x K m ˆm 1 ) ( ) S 1 K x T K m P mm H m P 1 mx HxT + H x P 1 xm HmT + R )

9 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 EKF SLAM: KF problems ˆ All elements in P mm are affected by the measurement update. ˆ It turns out that the cross correlations are essential for performance. ˆ No simple turn-around.

10 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 EKF SLAM: information form ˆ Focus on sufficient statistics and information matrix ı l = I l ẑ l I l = P 1 l = ( P xx l P mx l ˆ Measurement update trivial P l xm P l mm ) 1 = ( I xx l I mx l I xm l I mm l ). ı = ı 1 + H T R 1 y I = I 1 +H T R 1 H. Note: The update is sparse!!!

11 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 EKF SLAM: information filter algorithm (1/4) Initialization: ı x 1 0 = ı m 1 0 = I xx 1 0 = I mx 1 0 = I mm 1 0 = Note: The information form allows for representing no prior nowledge with zero information (infinite covariance).

12 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 EKF SLAM: information filter algorithm (2/4) 1. Associate a map landmar j = c i to each observed landmar j, and construct the matrix H m. This step includes data gating for outlier rejection and trac handling to start and end landmar tracs. 2. Measurement update: Note: ı x = ıx 1 + HxT ı m = ım 1 + HmT I xx = Ixx I xm = Ixm I mm 1 +HxT 1 +HxT = Imm 1 +HmT R 1 y R 1 y R 1 Hx R 1 Hm R 1 Hm H m is very thic, but contains mostly zeros. The low-ran sparse corrections influencing only a fraction of the matrix elements.

13 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 EKF SLAM: information filter algorithm (3/4) 3. Time update: Note: Ī xx 1 = F 1 Ī xm 1 = F 1 I xx 1 1 F T I xm 1 1 ( M = G G T F 1 I xx 1 1 F T I xx 1 = Īxx 1 Īxx 1M Ī xx 1 I xm 1 = Īxm 1 Īxx 1M Ī xm 1, I mm 1 = Īmm 1 Īmx 1M G T Īxm 1 ı x 1 = ( I I xx 1 G Q G T F T + Q 1 ) 1G T, ) ı x 1 1 ı m 1 = ım 1 1 Imx 1 G Q G T F T ı x 1 Now, I mm 1 is corrected with the inner product of Īxm 1 which gives a full matrix. Many of the elements in I xm 1 are close to zero and may be truncated!

14 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 EKF SLAM: information filter algorithm (4/4) 4. Estimation: P = I 1, ˆx = P xx ıx + P xm ım, ˆm = P mx ıx + P mm ım. Here is another catch, the information matrix needs to be inverted! The pose is needed at all times for linearization and data gating. How to proceed? Idea: Solve ı l = I l ẑ l, directly using a gradient search algorithm initialized at previous estimate.

15 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 EKF SLAM: summary ˆ EKF SLAM scales well in state dimension. ˆ EKF SLAM scales badly in landmar dimension, though natural approximations exist for the information form. ˆ EKF SLAM is not robust to incorrect associations.

16 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 FastSLAM: idea Basic factorization idea: p(x 1:, m y 1: ) = p(m x 1:, y 1: )p(x 1: y 1: ). ˆ The first factor corresponds to a classical mapping problem, and is solved by the (E)KF. ˆ The second factor is approximated by the PF. ˆ Leads to a marginalized PF (MPF) where each particle is a pose trajectory with an attached map corresponding to mean and covariance of each landmar, but no cross-correlations.

17 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 FastSLAM: mapping solution (1/3) Assume observation model linear(-ized) in landmar position 0 = h 0 (y n, x ) + h 1 (y n, x )m ln + en, cov(en ) = Rn. This formulation covers: ˆ First order Taylor expansions. ˆ Bearing and range measurements, where h i (y n, x ) has two rows per landmar in 2D SLAM. ˆ Bearing-only measurements coming from a camera detection.

18 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 FastSLAM: mapping solution (2/3) Linear estimation theory applies. WLS estimate: ˆm l = ( N =1 h1t (y n l, x )(R n l ) 1 h 1 (y n l, x ) }{{} I l N N ) 1 =1 h1t (y n l, x )(R n l ) 1 h 0 (y n l, x ) = (I l N) 1 ı l N. }{{} ı l N In this sum, h i is an empty matrix if the map landmar n does not get an associated observation landmar at time. Under a Gaussian noise assumption, the posterior distribution is Gaussian ( m l y 1:N, x 1:N ) N ( (I l N ) 1 ı l N, (I l N) 1).

19 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 FastSLAM: mapping solution (3/3) Kalman filter for mapping on information form ı l = ıl 1 + h1t (y n l, x )R 1 h0 (y n l, x ), I l = Il 1 +h1t (y n l, x )R 1 h1 (y n l, x ), ˆm l = (I l ) 1 ı l. Note the problem of inverting a large matrix to compute the landmar positions. Lielihood in the Gaussian case: p(y n l y 1: 1, x 1: ) = N ( h 0 (y n l, x )+h 1 (y n l, x ) ˆm l 1, Rn l +h1 (y n l, x )(I l ) 1 h 1T (y n l, x ) ).

20 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 FastSLAM: the algorithm (1/2) 1. Initialize the particles x (i) 1 p 0 (x), where N denotes the number of particles. 2. Data association that assigns a map landmar n l to each observed landmar l. Initialize new map landmars if necessary. 3. Importance weights w (i) = l N ( h 0 (y l, x )+h 1 (y l, x ) ˆm n l 1, Rl +h 1 (y l, x )(I n l ) 1 h 1T (y l, x ) ). where the product is taen over all observed landmars l, and normalize w (i) = w (i) / N j=1 w(j). 4. Resampling a new set of particles with replacement Pr(x (i) = x(j) ) = w(j), j = 1,..., N.

21 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 FastSLAM: the algorithm (2/2) 5. Map measurement update: p(m (i) x (i) 1:, y 1:) = N ( (I (i) ) 1 ı (i), (I(i) ) 1), 6. Pose time update: fastslam 1.0 (SIR PF) ı = ı 1 + h 1T (y, x )R 1 h0 (y, x ), I = I 1 +h 1T (y, x )R 1 h1 (y, x ). x (i) +1 p(x +1 x (i) 1: ). fastslam 2.0 (PF with optimal proposal) x (i) +1 p(x +1 x (i) 1:, y 1:+1) p(x +1 x (i) 1: )p(y +1 x +1, x (i) 1:, y 1:).

22 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 FastSLAM: summary FastSLAM is ideal for a ground robot with three states and vision sensors providing thousands of landmars. ˆ FastSLAM scales linearly in landmar dimension. ˆ As the standard PF, FastSLAM scales badly in the state dimension. ˆ FastSLAM is relatively robust to incorrect assocations, since associations are local for each particle and not global as in EKF-SLAM. MfastSLAM combines all the good landmars of the EKF SLAM and fastslam!

23 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 MFastSLAM: idea Factorization in three factors p(x P 1:, xj, m y 1: ) = p(m x j, xp 1:, y 1:)p(x j xp 1:, y 1:)p(x P 1: y 1:) corresponding to: ˆ one low-dimensional PF, ˆ one (E)KF attached to each particle, ˆ one WLS estimate to each particle and each map landmar.

24 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 SLAM Illustration Airborne simultanous localization and mapping (SLAM) using UAV with camera. Research collaboration with IDA. General idea: augment state vector with parameters representing the map. Comparison of EKF and FastSLAM on same dataset.

25 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 SLAM Illustration Airborne simultanous localization and mapping (SLAM) using UAV with camera. Research collaboration with IDA. General idea: augment state vector with parameters representing the map. Comparison of EKF and FastSLAM on same dataset.

26 TSRT14 Lecture 9 Gustaf Hendeby Ex: RSS SLAM (1/2) Prize winning MSc thesis at FOI Foot-mounted IMU for odometry. Opportunistic radio signals for fingerprinting. RSS at Hz Signal strength (dbm) Samples Spring / 28

27 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 Ex: RSS SLAM (2/2) ˆ Estimate the error in the odometry. ˆ Gaussian process to represent the map. ˆ Particle filter solution Y (m) X (m)

28 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 Ex: RSS SLAM (2/2) ˆ Estimate the error in the odometry. ˆ Gaussian process to represent the map. ˆ Particle filter solution Y (m) X (m)

29 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 SLAM Examples on Youtube ˆ LEGO Mindstorm ground robot with sonar ˆ Indoor mapping by UAV with laser scanner ˆ Indoor mapping using hand-held stereo camera with IMU at FOI ˆ Intelligent vacuum cleaner using ceiling vision ˆ App Ball Invasion uses augmented reality based on SLAM (KTH student did the SLAM implementation)

30 Summary

31 TSRT14 Lecture 9 Gustaf Hendeby Spring / 28 Lecture 9: summary Simultaneous Localization And Mapping (SLAM) Joint estimation of trajectory x1: and map parameters θ in sensor model y = h(x ; θ) + e. Algorithms: NLS SLAM: iterate between filtering and mapping. EKF-SLAM: EKF (information form) on augmented state vector z = (xt, θt )T. FastSLAM: MPF on augmented state vector z = (xt, θt )T.

32 Gustaf Hendeby

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

TSRT14: Sensor Fusion Lecture 1

TSRT14: Sensor Fusion Lecture 1 TSRT14: Sensor Fusion Lecture 1 Course overview Estimation theory for linear models Gustaf Hendeby gustaf.hendeby@liu.se Course Overview TSRT14 Lecture 1 Gustaf Hendeby Spring 2018 2 / 23 Course Goals:

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

Sensor Fusion, 2014 Lecture 1: 1 Lectures

Sensor Fusion, 2014 Lecture 1: 1 Lectures Sensor Fusion, 2014 Lecture 1: 1 Lectures Lecture Content 1 Course overview. Estimation theory for linear models. 2 Estimation theory for nonlinear models 3 Sensor networks and detection theory 4 Nonlinear

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

Simultaneous Localization and Mapping

Simultaneous Localization and Mapping Simultaneous Localization and Mapping Miroslav Kulich Intelligent and Mobile Robotics Group Czech Institute of Informatics, Robotics and Cybernetics Czech Technical University in Prague Winter semester

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

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

Particle Filters; Simultaneous Localization and Mapping (Intelligent Autonomous Robotics) Subramanian Ramamoorthy School of Informatics

Particle Filters; Simultaneous Localization and Mapping (Intelligent Autonomous Robotics) Subramanian Ramamoorthy School of Informatics Particle Filters; Simultaneous Localization and Mapping (Intelligent Autonomous Robotics) Subramanian Ramamoorthy School of Informatics Recap: State Estimation using Kalman Filter Project state and error

More information

CIS 390 Fall 2016 Robotics: Planning and Perception Final Review Questions

CIS 390 Fall 2016 Robotics: Planning and Perception Final Review Questions CIS 390 Fall 2016 Robotics: Planning and Perception Final Review Questions December 14, 2016 Questions Throughout the following questions we will assume that x t is the state vector at time t, z t is the

More information

Introduction to Mobile Robotics SLAM: Simultaneous Localization and Mapping

Introduction to Mobile Robotics SLAM: Simultaneous Localization and Mapping Introduction to Mobile Robotics SLAM: Simultaneous Localization and Mapping Wolfram Burgard, Cyrill Stachniss, Kai Arras, Maren Bennewitz What is SLAM? Estimate the pose of a robot and the map of the environment

More information

9 Multi-Model State Estimation

9 Multi-Model State Estimation Technion Israel Institute of Technology, Department of Electrical Engineering Estimation and Identification in Dynamical Systems (048825) Lecture Notes, Fall 2009, Prof. N. Shimkin 9 Multi-Model State

More information

Chapter 9: Bayesian Methods. CS 336/436 Gregory D. Hager

Chapter 9: Bayesian Methods. CS 336/436 Gregory D. Hager Chapter 9: Bayesian Methods CS 336/436 Gregory D. Hager A Simple Eample Why Not Just Use a Kalman Filter? Recall Robot Localization Given Sensor readings y 1, y 2, y = y 1: Known control inputs u 0, u

More information

Introduction to Mobile Robotics Bayes Filter Particle Filter and Monte Carlo Localization

Introduction to Mobile Robotics Bayes Filter Particle Filter and Monte Carlo Localization Introduction to Mobile Robotics Bayes Filter Particle Filter and Monte Carlo Localization Wolfram Burgard, Cyrill Stachniss, Maren Bennewitz, Kai Arras 1 Motivation Recall: Discrete filter Discretize the

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

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

Manipulators. Robotics. Outline. Non-holonomic robots. Sensors. Mobile Robots

Manipulators. Robotics. Outline. Non-holonomic robots. Sensors. Mobile Robots Manipulators P obotics Configuration of robot specified by 6 numbers 6 degrees of freedom (DOF) 6 is the minimum number required to position end-effector arbitrarily. For dynamical systems, add velocity

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

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

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

RAO-BLACKWELLIZED PARTICLE FILTER FOR MARKOV MODULATED NONLINEARDYNAMIC SYSTEMS

RAO-BLACKWELLIZED PARTICLE FILTER FOR MARKOV MODULATED NONLINEARDYNAMIC SYSTEMS RAO-BLACKWELLIZED PARTICLE FILTER FOR MARKOV MODULATED NONLINEARDYNAMIC SYSTEMS Saiat Saha and Gustaf Hendeby Linöping University Post Print N.B.: When citing this wor, cite the original article. 2014

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

ECE276A: Sensing & Estimation in Robotics Lecture 10: Gaussian Mixture and Particle Filtering

ECE276A: Sensing & Estimation in Robotics Lecture 10: Gaussian Mixture and Particle Filtering ECE276A: Sensing & Estimation in Robotics Lecture 10: Gaussian Mixture and Particle Filtering Lecturer: Nikolay Atanasov: natanasov@ucsd.edu Teaching Assistants: Siwei Guo: s9guo@eng.ucsd.edu Anwesan Pal:

More information

Lecture 4: Extended Kalman filter and Statistically Linearized Filter

Lecture 4: Extended Kalman filter and Statistically Linearized Filter Lecture 4: Extended Kalman filter and Statistically Linearized Filter Department of Biomedical Engineering and Computational Science Aalto University February 17, 2011 Contents 1 Overview of EKF 2 Linear

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

Modeling and state estimation Examples State estimation Probabilities Bayes filter Particle filter. Modeling. CSC752 Autonomous Robotic Systems

Modeling and state estimation Examples State estimation Probabilities Bayes filter Particle filter. Modeling. CSC752 Autonomous Robotic Systems Modeling CSC752 Autonomous Robotic Systems Ubbo Visser Department of Computer Science University of Miami February 21, 2017 Outline 1 Modeling and state estimation 2 Examples 3 State estimation 4 Probabilities

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 Probabilistic Models of Mobile Robots Robotic mapping Basilio Bona DAUIN Politecnico di Torino July 2010 Course Outline Basic mathematical framework Probabilistic

More information

Lecture 2: From Linear Regression to Kalman Filter and Beyond

Lecture 2: From Linear Regression to Kalman Filter and Beyond Lecture 2: From Linear Regression to Kalman Filter and Beyond January 18, 2017 Contents 1 Batch and Recursive Estimation 2 Towards Bayesian Filtering 3 Kalman Filter and Bayesian Filtering and Smoothing

More information

Towards airborne seismic. Thomas Rapstine & Paul Sava

Towards airborne seismic. Thomas Rapstine & Paul Sava Towards airborne seismic Thomas Rapstine & Paul Sava Research goal measure a strong motion signal from an airborne platform 2 Proposed method Monitor ground motion from an UAV using cameras Unmanned Aerial

More information

Lecture 6: Multiple Model Filtering, Particle Filtering and Other Approximations

Lecture 6: Multiple Model Filtering, Particle Filtering and Other Approximations Lecture 6: Multiple Model Filtering, Particle Filtering and Other Approximations Department of Biomedical Engineering and Computational Science Aalto University April 28, 2010 Contents 1 Multiple Model

More information

Introduction to Unscented Kalman Filter

Introduction to Unscented Kalman Filter Introduction to Unscented Kalman Filter 1 Introdution In many scientific fields, we use certain models to describe the dynamics of system, such as mobile robot, vision tracking and so on. The word dynamics

More information

Introduction to Mobile Robotics Probabilistic Sensor Models

Introduction to Mobile Robotics Probabilistic Sensor Models Introduction to Mobile Robotics Probabilistic Sensor Models Wolfram Burgard 1 Sensors for Mobile Robots Contact sensors: Bumpers Proprioceptive sensors Accelerometers (spring-mounted masses) Gyroscopes

More information

Autonomous Mobile Robot Design

Autonomous Mobile Robot Design Autonomous Mobile Robot Design Topic: Extended Kalman Filter Dr. Kostas Alexis (CSE) These slides relied on the lectures from C. Stachniss, J. Sturm and the book Probabilistic Robotics from Thurn et al.

More information

2D Image Processing (Extended) Kalman and particle filter

2D Image Processing (Extended) Kalman and particle filter 2D Image Processing (Extended) Kalman and particle filter Prof. Didier Stricker Dr. Gabriele Bleser Kaiserlautern University http://ags.cs.uni-kl.de/ DFKI Deutsches Forschungszentrum für Künstliche Intelligenz

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

Estimating the Shape of Targets with a PHD Filter

Estimating the Shape of Targets with a PHD Filter Estimating the Shape of Targets with a PHD Filter Christian Lundquist, Karl Granström, Umut Orguner Department of Electrical Engineering Linöping University 583 33 Linöping, Sweden Email: {lundquist, arl,

More information

A Comparison of the EKF, SPKF, and the Bayes Filter for Landmark-Based Localization

A Comparison of the EKF, SPKF, and the Bayes Filter for Landmark-Based Localization A Comparison of the EKF, SPKF, and the Bayes Filter for Landmark-Based Localization and Timothy D. Barfoot CRV 2 Outline Background Objective Experimental Setup Results Discussion Conclusion 2 Outline

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

Parameter Estimation in a Moving Horizon Perspective

Parameter Estimation in a Moving Horizon Perspective Parameter Estimation in a Moving Horizon Perspective State and Parameter Estimation in Dynamical Systems Reglerteknik, ISY, Linköpings Universitet State and Parameter Estimation in Dynamical Systems OUTLINE

More information

Sampling Based Filters

Sampling Based Filters Statistical Techniques in Robotics (16-831, F12) Lecture#03 (Monday September 5) Sampling Based Filters Lecturer: Drew Bagnell Scribes: M. Taylor, M. Shomin 1 1 Beam-based Sensor Model Many common sensors

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

The Unscented Particle Filter

The Unscented Particle Filter The Unscented Particle Filter Rudolph van der Merwe (OGI) Nando de Freitas (UC Bereley) Arnaud Doucet (Cambridge University) Eric Wan (OGI) Outline Optimal Estimation & Filtering Optimal Recursive Bayesian

More information

Rao-Blackwellised posterior linearisation backward SLAM

Rao-Blackwellised posterior linearisation backward SLAM 1 Rao-Blacwellised posterior linearisation bacward SLAM Ángel F. García-Fernández, Roland Hostettler, Member, IEEE, Simo Särä, Senior Member, IEEE Abstract This paper proposes the posterior linearisation

More information

Lecture 2: From Linear Regression to Kalman Filter and Beyond

Lecture 2: From Linear Regression to Kalman Filter and Beyond Lecture 2: From Linear Regression to Kalman Filter and Beyond Department of Biomedical Engineering and Computational Science Aalto University January 26, 2012 Contents 1 Batch and Recursive Estimation

More information

Fisher Information Matrix-based Nonlinear System Conversion for State Estimation

Fisher Information Matrix-based Nonlinear System Conversion for State Estimation Fisher Information Matrix-based Nonlinear System Conversion for State Estimation Ming Lei Christophe Baehr and Pierre Del Moral Abstract In practical target tracing a number of improved measurement conversion

More information

SIMULTANEOUS STATE AND PARAMETER ESTIMATION USING KALMAN FILTERS

SIMULTANEOUS STATE AND PARAMETER ESTIMATION USING KALMAN FILTERS ECE5550: Applied Kalman Filtering 9 1 SIMULTANEOUS STATE AND PARAMETER ESTIMATION USING KALMAN FILTERS 9.1: Parameters versus states Until now, we have assumed that the state-space model of the system

More information

Lecture 7: Optimal Smoothing

Lecture 7: Optimal Smoothing Department of Biomedical Engineering and Computational Science Aalto University March 17, 2011 Contents 1 What is Optimal Smoothing? 2 Bayesian Optimal Smoothing Equations 3 Rauch-Tung-Striebel Smoother

More information

For final project discussion every afternoon Mark and I will be available

For final project discussion every afternoon Mark and I will be available Worshop report 1. Daniels report is on website 2. Don t expect to write it based on listening to one project (we had 6 only 2 was sufficient quality) 3. I suggest writing it on one presentation. 4. Include

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

COS Lecture 16 Autonomous Robot Navigation

COS Lecture 16 Autonomous Robot Navigation COS 495 - Lecture 16 Autonomous Robot Navigation Instructor: Chris Clark Semester: Fall 011 1 Figures courtesy of Siegwart & Nourbakhsh Control Structure Prior Knowledge Operator Commands Localization

More information

Chapter 4 State Estimation

Chapter 4 State Estimation Chapter 4 State Estimation Navigation of an unmanned vehicle, always depends on a good estimation of the vehicle states. Especially if no external sensors or marers are available, more or less complex

More information

Method 1: Geometric Error Optimization

Method 1: Geometric Error Optimization Method 1: Geometric Error Optimization we need to encode the constraints ŷ i F ˆx i = 0, rank F = 2 idea: reconstruct 3D point via equivalent projection matrices and use reprojection error equivalent projection

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

Robot Localisation. Henrik I. Christensen. January 12, 2007

Robot Localisation. Henrik I. Christensen. January 12, 2007 Robot Henrik I. Robotics and Intelligent Machines @ GT College of Computing Georgia Institute of Technology Atlanta, GA hic@cc.gatech.edu January 12, 2007 The Robot Structure Outline 1 2 3 4 Sum of 5 6

More information

Autonomous Navigation for Flying Robots

Autonomous Navigation for Flying Robots Computer Vision Group Prof. Daniel Cremers Autonomous Navigation for Flying Robots Lecture 6.2: Kalman Filter Jürgen Sturm Technische Universität München Motivation Bayes filter is a useful tool for state

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 Probabilistic Models of Mobile Robots Robot localization Basilio Bona DAUIN Politecnico di Torino July 2010 Course Outline Basic mathematical framework Probabilistic

More information

RECURSIVE OUTLIER-ROBUST FILTERING AND SMOOTHING FOR NONLINEAR SYSTEMS USING THE MULTIVARIATE STUDENT-T DISTRIBUTION

RECURSIVE OUTLIER-ROBUST FILTERING AND SMOOTHING FOR NONLINEAR SYSTEMS USING THE MULTIVARIATE STUDENT-T DISTRIBUTION 1 IEEE INTERNATIONAL WORKSHOP ON MACHINE LEARNING FOR SIGNAL PROCESSING, SEPT. 3 6, 1, SANTANDER, SPAIN RECURSIVE OUTLIER-ROBUST FILTERING AND SMOOTHING FOR NONLINEAR SYSTEMS USING THE MULTIVARIATE STUDENT-T

More information

Particle Filters. Pieter Abbeel UC Berkeley EECS. Many slides adapted from Thrun, Burgard and Fox, Probabilistic Robotics

Particle Filters. Pieter Abbeel UC Berkeley EECS. Many slides adapted from Thrun, Burgard and Fox, Probabilistic Robotics Particle Filters Pieter Abbeel UC Berkeley EECS Many slides adapted from Thrun, Burgard and Fox, Probabilistic Robotics Motivation For continuous spaces: often no analytical formulas for Bayes filter updates

More information

Lecture 22: Graph-SLAM (2)

Lecture 22: Graph-SLAM (2) Lecture 22: Graph-SLAM (2) Dr. J.B. Hayet CENTRO DE INVESTIGACIÓN EN MATEMÁTICAS Abril 2014 J.B. Hayet Probabilistic robotics Abril 2014 1 / 35 Outline 1 Data association in Graph-SLAM 2 Improvements and

More information

Robotics 2 Target Tracking. Kai Arras, Cyrill Stachniss, Maren Bennewitz, Wolfram Burgard

Robotics 2 Target Tracking. Kai Arras, Cyrill Stachniss, Maren Bennewitz, Wolfram Burgard Robotics 2 Target Tracking Kai Arras, Cyrill Stachniss, Maren Bennewitz, Wolfram Burgard Slides by Kai Arras, Gian Diego Tipaldi, v.1.1, Jan 2012 Chapter Contents Target Tracking Overview Applications

More information

4 Derivations of the Discrete-Time Kalman Filter

4 Derivations of the Discrete-Time Kalman Filter Technion Israel Institute of Technology, Department of Electrical Engineering Estimation and Identification in Dynamical Systems (048825) Lecture Notes, Fall 2009, Prof N Shimkin 4 Derivations of the Discrete-Time

More information

Probabilistic Fundamentals in Robotics

Probabilistic Fundamentals in Robotics Probabilistic Fundamentals in Robotics Probabilistic Models of Mobile Robots Robot localization Basilio Bona DAUIN Politecnico di Torino June 2011 Course Outline Basic mathematical framework Probabilistic

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

Comparision of Probabilistic Navigation methods for a Swimming Robot

Comparision of Probabilistic Navigation methods for a Swimming Robot Comparision of Probabilistic Navigation methods for a Swimming Robot Anwar Ahmad Quraishi Semester Project, Autumn 2013 Supervisor: Yannic Morel BioRobotics Laboratory Headed by Prof. Aue Jan Ijspeert

More information

Sensor Fusion: Particle Filter

Sensor Fusion: Particle Filter Sensor Fusion: Particle Filter By: Gordana Stojceska stojcesk@in.tum.de Outline Motivation Applications Fundamentals Tracking People Advantages and disadvantages Summary June 05 JASS '05, St.Petersburg,

More information

Local Probabilistic Models: Continuous Variable CPDs

Local Probabilistic Models: Continuous Variable CPDs Local Probabilistic Models: Continuous Variable CPDs Sargur srihari@cedar.buffalo.edu 1 Topics 1. Simple discretizing loses continuity 2. Continuous Variable CPDs 3. Linear Gaussian Model Example of car

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

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

A Constant-Time Algorithm for Vector Field SLAM Using an Exactly Sparse Extended Information Filter

A Constant-Time Algorithm for Vector Field SLAM Using an Exactly Sparse Extended Information Filter A Constant-Time Algorithm for Vector Field SLAM Using an Exactly Sparse Extended Information Filter Jens-Steffen Gutmann, Ethan Eade, Philip Fong, and Mario Munich Evolution Robotics, 55 E. Colorado Blvd.,

More information

EXAMINATION IN TSRT14 SENSOR FUSION

EXAMINATION IN TSRT14 SENSOR FUSION EXAMINATION IN TSRT14 SENSOR FUSION ROOM: ISY:s computer rooms TIME: 2015-06-03 at 14:00 18:00 COURSE: TSRT14 Sensor Fusion PROVKOD: DAT1 DEPARTMENT: ISY NUMBER OF EXERCISES: 4 RESPONSIBLE TEACHER: Gustaf

More information

Terrain Navigation Using the Ambient Magnetic Field as a Map

Terrain Navigation Using the Ambient Magnetic Field as a Map Terrain Navigation Using the Ambient Magnetic Field as a Map Aalto University IndoorAtlas Ltd. August 30, 017 In collaboration with M. Kok, N. Wahlström, T. B. Schön, J. Kannala, E. Rahtu, and S. Särkkä

More information

Bayesian Methods / G.D. Hager S. Leonard

Bayesian Methods / G.D. Hager S. Leonard Bayesian Methods Recall Robot Localization Given Sensor readings z 1, z 2,, z t = z 1:t Known control inputs u 0, u 1, u t = u 0:t Known model t+1 t, u t ) with initial 1 u 0 ) Known map z t t ) Compute

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

FUNDAMENTAL FILTERING LIMITATIONS IN LINEAR NON-GAUSSIAN SYSTEMS

FUNDAMENTAL FILTERING LIMITATIONS IN LINEAR NON-GAUSSIAN SYSTEMS FUNDAMENTAL FILTERING LIMITATIONS IN LINEAR NON-GAUSSIAN SYSTEMS Gustaf Hendeby Fredrik Gustafsson Division of Automatic Control Department of Electrical Engineering, Linköpings universitet, SE-58 83 Linköping,

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

A Tree Search Approach to Target Tracking in Clutter

A Tree Search Approach to Target Tracking in Clutter 12th International Conference on Information Fusion Seattle, WA, USA, July 6-9, 2009 A Tree Search Approach to Target Tracking in Clutter Jill K. Nelson and Hossein Roufarshbaf Department of Electrical

More information

Square Root Unscented Particle Filtering for Grid Mapping

Square Root Unscented Particle Filtering for Grid Mapping Square Root Unscented Particle Filtering for Grid Mapping Technical Report 2009/246 Simone Zandara and Ann E. Nicholson Clayton School of Information Technology Monash University Clayton, Victoria Australia.

More information

Exact State and Covariance Sub-matrix Recovery for Submap Based Sparse EIF SLAM Algorithm

Exact State and Covariance Sub-matrix Recovery for Submap Based Sparse EIF SLAM Algorithm 8 IEEE International Conference on Robotics and Automation Pasadena, CA, USA, May 19-3, 8 Exact State and Covariance Sub-matrix Recovery for Submap Based Sparse EIF SLAM Algorithm Shoudong Huang, Zhan

More information

Lego NXT: Navigation and localization using infrared distance sensors and Extended Kalman Filter. Miguel Pinto, A. Paulo Moreira, Aníbal Matos

Lego NXT: Navigation and localization using infrared distance sensors and Extended Kalman Filter. Miguel Pinto, A. Paulo Moreira, Aníbal Matos Lego NXT: Navigation and localization using infrared distance sensors and Extended Kalman Filter Miguel Pinto, A. Paulo Moreira, Aníbal Matos 1 Resume LegoFeup Localization Real and simulated scenarios

More information

GMTI Tracking in the Presence of Doppler and Range Ambiguities

GMTI Tracking in the Presence of Doppler and Range Ambiguities 14th International Conference on Information Fusion Chicago, Illinois, USA, July 5-8, 2011 GMTI Tracing in the Presence of Doppler and Range Ambiguities Michael Mertens Dept. Sensor Data and Information

More information

A Sequential Monte Carlo Approach for Extended Object Tracking in the Presence of Clutter

A Sequential Monte Carlo Approach for Extended Object Tracking in the Presence of Clutter A Sequential Monte Carlo Approach for Extended Object Tracing in the Presence of Clutter Niolay Petrov 1, Lyudmila Mihaylova 1, Amadou Gning 1 and Dona Angelova 2 1 Lancaster University, School of Computing

More information

Parameterized Joint Densities with Gaussian Mixture Marginals and their Potential Use in Nonlinear Robust Estimation

Parameterized Joint Densities with Gaussian Mixture Marginals and their Potential Use in Nonlinear Robust Estimation Proceedings of the 2006 IEEE International Conference on Control Applications Munich, Germany, October 4-6, 2006 WeA0. Parameterized Joint Densities with Gaussian Mixture Marginals and their Potential

More information

Maximum Likelihood Diffusive Source Localization Based on Binary Observations

Maximum Likelihood Diffusive Source Localization Based on Binary Observations Maximum Lielihood Diffusive Source Localization Based on Binary Observations Yoav Levinboo and an F. Wong Wireless Information Networing Group, University of Florida Gainesville, Florida 32611-6130, USA

More information

Instituto de Sistemas e Robótica * Pólo de Coimbra * Tracking and Data Association Using Data from a LRF

Instituto de Sistemas e Robótica * Pólo de Coimbra * Tracking and Data Association Using Data from a LRF Instituto de Sistemas e Robótica * Pólo de Coimbra * Tracing and Data Association Using Data from a LRF Technical Report Nº ISRLM2005/04 Cristiano Premebida October, 2005. Departamento de Engenharia Electrotécnica

More information

Data Fusion of Dual Foot-Mounted Zero Velocity Update (ZUPT) Aided Inertial Navigation Systems (INSs) using Centroid Method

Data Fusion of Dual Foot-Mounted Zero Velocity Update (ZUPT) Aided Inertial Navigation Systems (INSs) using Centroid Method February 02, 2013 Data Fusion of Dual Foot-Mounted Zero Velocity Update (ZUPT) Aided Inertial Navigation Systems (INSs) using Centroid Method Girisha Under the guidance of Prof. K.V.S. Hari Notations Define

More information

Data assimilation with and without a model

Data assimilation with and without a model Data assimilation with and without a model Tim Sauer George Mason University Parameter estimation and UQ U. Pittsburgh Mar. 5, 2017 Partially supported by NSF Most of this work is due to: Tyrus Berry,

More information

Mini-Course 07 Kalman Particle Filters. Henrique Massard da Fonseca Cesar Cunha Pacheco Wellington Bettencurte Julio Dutra

Mini-Course 07 Kalman Particle Filters. Henrique Massard da Fonseca Cesar Cunha Pacheco Wellington Bettencurte Julio Dutra Mini-Course 07 Kalman Particle Filters Henrique Massard da Fonseca Cesar Cunha Pacheco Wellington Bettencurte Julio Dutra Agenda State Estimation Problems & Kalman Filter Henrique Massard Steady State

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

(Extended) Kalman Filter

(Extended) Kalman Filter (Extended) Kalman Filter Brian Hunt 7 June 2013 Goals of Data Assimilation (DA) Estimate the state of a system based on both current and all past observations of the system, using a model for the system

More information

Lecture 13 Visual Inertial Fusion

Lecture 13 Visual Inertial Fusion Lecture 13 Visual Inertial Fusion Davide Scaramuzza Outline Introduction IMU model and Camera-IMU system Different paradigms Filtering Maximum a posteriori estimation Fix-lag smoothing 2 What is an IMU?

More information

Lecture 6: April 19, 2002

Lecture 6: April 19, 2002 EE596 Pat. Recog. II: Introduction to Graphical Models Spring 2002 Lecturer: Jeff Bilmes Lecture 6: April 19, 2002 University of Washington Dept. of Electrical Engineering Scribe: Huaning Niu,Özgür Çetin

More information

Cooperative relative robot localization with audible acoustic sensing

Cooperative relative robot localization with audible acoustic sensing Cooperative relative robot localization with audible acoustic sensing Yuanqing Lin, Paul Vernaza, Jihun Ham, and Daniel D. Lee GRASP Laboratory, Department of Electrical and Systems Engineering, University

More information

PATTERN RECOGNITION AND MACHINE LEARNING CHAPTER 13: SEQUENTIAL DATA

PATTERN RECOGNITION AND MACHINE LEARNING CHAPTER 13: SEQUENTIAL DATA PATTERN RECOGNITION AND MACHINE LEARNING CHAPTER 13: SEQUENTIAL DATA Contents in latter part Linear Dynamical Systems What is different from HMM? Kalman filter Its strength and limitation Particle Filter

More information

AUTOMOTIVE ENVIRONMENT SENSORS

AUTOMOTIVE ENVIRONMENT SENSORS AUTOMOTIVE ENVIRONMENT SENSORS Lecture 5. Localization BME KÖZLEKEDÉSMÉRNÖKI ÉS JÁRMŰMÉRNÖKI KAR 32708-2/2017/INTFIN SZÁMÚ EMMI ÁLTAL TÁMOGATOTT TANANYAG Related concepts Concepts related to vehicles moving

More information

2D Image Processing. Bayes filter implementation: Kalman filter

2D Image Processing. Bayes filter implementation: Kalman filter 2D Image Processing Bayes filter implementation: Kalman filter Prof. Didier Stricker Kaiserlautern University http://ags.cs.uni-kl.de/ DFKI Deutsches Forschungszentrum für Künstliche Intelligenz http://av.dfki.de

More information

(W: 12:05-1:50, 50-N201)

(W: 12:05-1:50, 50-N201) 2015 School of Information Technology and Electrical Engineering at the University of Queensland Schedule Week Date Lecture (W: 12:05-1:50, 50-N201) 1 29-Jul Introduction Representing Position & Orientation

More information

2D Image Processing. Bayes filter implementation: Kalman filter

2D Image Processing. Bayes filter implementation: Kalman filter 2D Image Processing Bayes filter implementation: Kalman filter Prof. Didier Stricker Dr. Gabriele Bleser Kaiserlautern University http://ags.cs.uni-kl.de/ DFKI Deutsches Forschungszentrum für Künstliche

More information

Censoring and Fusion in Non-linear Distributed Tracking Systems with Application to 2D Radar

Censoring and Fusion in Non-linear Distributed Tracking Systems with Application to 2D Radar Virginia Commonwealth University VCU Scholars Compass Theses and Dissertations Graduate School 15 Censoring and Fusion in Non-linear Distributed Tracking Systems with Application to D Radar Armond S. Conte

More information

Kalman filtering and friends: Inference in time series models. Herke van Hoof slides mostly by Michael Rubinstein

Kalman filtering and friends: Inference in time series models. Herke van Hoof slides mostly by Michael Rubinstein Kalman filtering and friends: Inference in time series models Herke van Hoof slides mostly by Michael Rubinstein Problem overview Goal Estimate most probable state at time k using measurement up to time

More information

Aided Inertial Navigation With Geometric Features: Observability Analysis

Aided Inertial Navigation With Geometric Features: Observability Analysis Aided Inertial Navigation With Geometric Features: Observability Analysis Yulin Yang - yuyang@udeledu Guoquan Huang - ghuang@udeledu Department of Mechanical Engineering University of Delaware, Delaware,

More information