Chapter 4 State Estimation

Size: px
Start display at page:

Download "Chapter 4 State Estimation"

Transcription

1 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 algorithms have to be used. For this project, the orientation estimation is done by the widely used Kalman filter. However, position estimation is still an object of ongoing research. The here described approach uses the company own software RECONSTRUCTME. 4.1 Orientation With using Euler angles (Z Y X ) between π and π, it should also be taen care of potential problems referring to the transition between maxima. For this project, Φ and Θ do not need special treatment, as the robot is not expected to exceed the maxima, since this would mean that the thrust vector is pointing to the ground. For the same reason the singularity at Θ = 90 of the used Euler angle representation of the orientation is irrelevant. However, the Ψ angle can and will mae this mentioned maxima transition. This demands special treatment considering the calculation of e in the PID controller in Fig. 3.2b. To compensate this overflow, a simple algorithm can be used: 1 i f (e Ψ > π ) 2 Ψ = 2π ; 3 e l s e i f (e Ψ < π ) 4 Ψ += 2π ; Kalman Filter A good introduction to the topic can be found in [52]. A more detailed description of the concept, derivation and properties is given in [50]. The Kalman filter, also nown as linear quadratic estimator, is an optimal estimator for discrete linear system of the form with the statex R n, and a measurement x +1 = A x +w (4.1) z = H x +v (4.2) withz R m, if process noisew and the measurement noisev are assumed to be independent random variables with Gaussian probability density functions and zero mean value. The normal probability distributionspare then p(w) N(0,Q), withq = diag{σ 2 w1,σ2 w2,...} p(v) N(0,R), withr = diag{σ 2 v1,σ2 v2,...} (4.3) withσ 2 being the variance of the corresponding noise distribution. Then n matixa in (4.1) describes the transition of the system between time step and + 1, in the absence of neither input nor process 27

2 4 State Estimation Kalman Filter 28 noise. Them n matrixhin the measurement equation (4.2) relates the statex to the measurementz. The filter (in one popular algebraic form) consists of two stages. First, a prediction of the state ˆx at time, using the system dynamic matrixa 1 and state ˆx 1 in (4.1) from the last iteration1. This will be referred to as a priori estimation 1. Second, a correction of this estimation, using the measurements z. Using the a priori estimation ˆx in (4.2), an innovation variable (or residual)y can be defined as y = z H ˆx. (4.4) The innovation variable is used to correct the a priori prediction using then m gain matrixk ˆx = ˆx +Ky. (4.5) This estimation is referred to as a posteriori estimation ˆx. The gain matrix K describes a blending factor between the model based prediction, and the measurement. To achieve a readable description of the optimal choice fork, the a priori and a posteriori estimate errors are defined as e x ˆx (4.6) e x ˆx and the corresponding error covariances are P = E [ (x ˆx )(x ˆx )T] P = E [ (x ˆx )(x ˆx ) T]. (4.7) The core tas of the Kalman filter, is to choose the gain matrixk so that the a posterioiri estimate error covariance P is minimized with respect of the mean square error. For more details on that derivation see [50]. One popular form of the resultingk that minimizes the a posteriori estimate error covariance is the so called Kalman gain K = P HT ( H P HT +R ) 1. (4.8) It can be seen, that the covariance R of the measurement noise defined in (4.3) and the a priori error covariance P defined in (4.7) have direct influence on the optimal gain matrix K. To point out the extreme cases, ifr is zero meaning that the measurement is very trustworthy, the gain matrix becomes lim K = H 1 R 0 (4.9) and thus (4.5) degenerates to ˆx = H 1 z. (4.10) The estimation then is only based on the measurement. On the other hand, if the error covariance P approaches zero, meaning that the model based estimation is accurate, the gain matrix K does not consider the measurement at all lim P 0 K = 0 ˆx (K = 0) = ˆx. (4.11) The summary of the whole Kalman filter algorithm is shown in Fig note the super script in ˆx and later inp

3 4 State Estimation Extended Kalman Filter 29 Initial estimates for ˆx andp a priori prediction (1) Project the state ahead ˆx +1 = A ˆx (2) Project the error covariance ahead P +1 = A P A T +Q a posteriori correction (1) Compute the Kalman gain K = P ( HT H P HT +R 1 ) (2) Update estimate with measurement z ˆx = ˆx +K ( z H ˆx ) (3) Update the error covariance P = (IK H )P Figure 4.1: Data flow of the Kalman filter operation Extended Kalman Filter For estimation of a non-linear system, several extended versions of the Kalman filter exist. A widely used approach is to linearize the system dynamics in every step around the a priori estimation ˆx, and proceed as for a linear system. This approach is nown as the EKF. The fundamental imperfection of the EKF, as also pointed out in [52], is that the distributions of the various random variables are no longer normal, after undergoing their respective non-linear transformations. Thus, the optimality of the estimation is only approximated by linearization. The stochastic system equations from (4.1) and (4.2) are now generalized to the non-linear case again with the state vector x R n and x +1 = f(x,w ) (4.12) z = h(x,v ) (4.13) with the measurement vector z R m. By deriving the Jacobian matrix of the partial derivatives of f andhwith respect to the state vector x and the noise vectors w and v f(x,w ) T A lin, = x f(x,w ) T W lin, = w h(x,v ) T H lin, = x h(x,v ) T V lin, = v (4.14a) (4.14b) (4.14c), (4.14d) the EKF is implemented as shown in Fig A detailed derivation can again be found in [52] and [50].

4 4 State Estimation Orientation Estimation in Use 30 Initial estimates for ˆx andp a priori prediction (1) Project the state ahead ˆx +1 = f(ˆx,0) (2) Project the error covariance ahead P +1 = A lin,p A T lin, +W lin,q W lin, a posteriori correction (1) Compute the Kalman gain ) 1 K = P HT lin, (H lin, P HT lin, +V lin,r V lin, (2) Update estimate with measurement z ˆx = ˆx +K ( z h(ˆx,0)) (3) Update the error covariance P = (IK H lin, )P Figure 4.2: Data flow of the extended Kalman filter operation Orientation Estimation in Use The orientation estimator in use, as already implemented in the open-source code [18] in the module attitude_estimator_ef, is an EKF. As there did not exist a documentation of the module, the code was analyzed and is described in this section. The state vector and measurement vector are x = Bω IB B ω IB Br g Br m,z = B ω IB B r g B r m (4.15) with the angular velocity of the quadcopter B ω IB = [ω x,ω y,ω z ] T, the estimated angular acceleration B ω IB = [ ω x, ω y, ω z ] T, the vector of the earth s gravitation field B r g = [ B r g,x, B r g,y, B r g,z ] T and the magnetic field vector B r m = [ B r m,x, B r m,y, B r m,z ] T. The available measurements are the angular velocities B ω IB from the gyroscopic sensors, the vector of gravitation B r g from the acceleration sensors 2 and the vector of the magnetic field of the earth B r m directly from the magnetic sensors on the IMU. Note that all variables are described in the body fixed coordinate system (compare chapter 2.2.1). To simplify notation, the left side index B will be omitted in the following explanation and if no other coordinate index is given, the variable shall be referred with respect to the body fixed system Prediction Step Under the assumption of the angular acceleration staying constant during the time step t, the angular velocity B ω IB for the next time+1 can be predicted withω +1 = ω + ω t. The prediction of the two vector fields can be derived similarly with r +1 = r +v t. However, the velocity vectors B v a, and B v m, are not directly measured. They can be derived from the relation of velocity and position in 2 neglecting the actual translational accelerations of the quadcopter, as they are assumed to be smaller by factor 10

5 4 State Estimation Orientation Estimation in Use 31 the inertial frame with Bv = A BI d dt Ir Iv = d dt I r (4.16) = A d BI (A dt IBB r) = A BI A }{{ IB } Bṙ+A BI Ȧ }{{ IB } Br I ω B IB = B ṙ+ B ω IBB r. (4.17) As for the gravitation and magnetic vector field the translational velocities B ṙ are irrelevant, because the acting force is invariant to translational movement, only the rotational terms B ω IBB r have to be taen into account. Thus, the non-linear system dynamics are described with x +1 = f(x,w) = ω + ω t+wω, ω +w ω, r a, + ω r a, t+w ra, r m, + ω r m, t+w rm,. (4.18) For the two equations needed for the algorithm shown in Fig. 4.2, the matrices A lin, and W lin,, as shown in (4.14a) and (4.14b), are the calculated Jacobi matrices 3 A lin, = f(x,w ) x = W lin, = f(x,w ) w I I t I 0 0 r a, t 0 I+ ω t 0 r m, t 0 0 I+ ω t = I I I I The implemented formulas for the a priori prediction step at time +1 are with neglected process noisew, and. (4.19a) (4.19b) ˆx +1 = f(ˆx,0) (4.20) P +1 = A lin,p A T lin, +Q (4.21) where the measurement noise matrix Q holds the variances σ 2 of the states as diagonal entries. They represent the uncertainty of the prediction. As this variances are unnown and can not be measured, they act as tuning variables for the filter Correction Step Unlie the state prediction, the measurement of the system can be described with trivial linear functions I σ 2 ω z = 0 0 I 0 x + σ 2 r a. (4.22) I } {{ } H σ 2 r m }{{} R 3 Note the cross product is anticommutative: ãb = ba in line3and 4 of matrix definition A lin,

6 4 State Estimation Orientation Estimation in Use 32 Thus, the linear observation matrix H is already given, and also the Jacobian matrix from (4.14d), linearizing the influence of the measurement noiser, degenerates to a identity matrixi. The implemented functions for the correction step as listed in Fig. 4.2 are directly given with the Kalman gain K = P HT ( H P HT +R ) 1, (4.23) the a posteriori estimation ˆx = ˆx +K ( z H ˆx ) and the propagation of the error covariance during the correction step (4.24) P = (IK H )P. (4.25) For the first iteration, initial values for the first a posteriori have to be chosen. The first estimation ˆx is initialized with measurements Bω IB B ω IB ˆx,init = B ω IB Br a = 0 B r g. (4.26) Br m B r m,init The first error covariance is initialized 4 with P,init = 100I. Over time, the chosen initial value of the error covariance matrix does not have any influence, as it will converge, as long as it is not initialized with equal to Incomplete measurements As the three 3D sensors (gyro, acceleration, magnetometer) deliver measurements at independent sample rates, the measurement vector from (4.22) will not always be fully available. To avoid using old measurements multiple times, the observation matrix H and noise matrix R vary in their size, depending on which sensor has new measurements available. If all sensors have new measurements, the vectors are as in (4.22). As the gyroscope sensor has the fastest sampling rate, and is the most crucial measurement for the estimation of the angular acceleration ω, the correction step will only be calculated, once a new ω measurement is available. For an incomplete measurement, the matrices are given with,init z = [ I ] x + ( σ 2 ω ) (4.27) }{{}}{{} H R if only gyroscope measurements are available, [ ] ) I σ z = x 0 0 I 0 +( 2 ω σ 2 r }{{}}{{ a } H R (4.28) for gyroscope and acceleration measurements and [ ] ) I σ z = x I +( 2 ω σ 2 r. (4.29) }{{}}{{ m } H R in case of gyroscope and a magnetometer measurements. The remaining formalism (4.23) to (4.25) remains the same. Subsequently, only the states for which measurements are available will be corrected. 4 I is the identity matrix

7 4 State Estimation 4.2 Position Extraction of the Orientation In every iteration step of the Kalman filter, the angular velocity B ω IB and acceleration B ω IB are estimated. The orientation which is also from interest has to be extracted. To avoid any singularity problems, the orientation is directly represented with the 3 3 rotation matrix A BI by describing the three unit base vectors of the initial coordinate system in the body fixed coordinate system A BI = [ Be Ix Be Iy Be Iz ]. (4.30) The three base vectors are extracted from the estimated acceleration vector Bˆr a and the estimated magnetic field vector Bˆr m. Note, that a NED inertial coordinate system is used. As mentioned above, by neglecting the translational acceleration of the robot over the gravity field, the base vector in z-direction is given by 5 Be Iz = B r a B r a 2. (4.31) This estimation is especially accurate if the copter is hovering. Furthermore, the inertial system can always be chosen in a way that the base vector in x direction corresponds with the magnetic field of the earth. However, as the estimation will never be accurate, this vector is not directly taen to derive Br Ix. Rather to preserve orthogonality of the inertial system, it is used to calculate the base vector in y-direction Be Iy = B e Iz B r m B e Iz B r m 2. (4.32) Given two base vectors, the third one can always be calculated for an orthogonal system: 4.2 Position Be Ix = B e Iy B e Iz B e Iy B e Iz 2. (4.33) Initial experiments were done using the PX4FLOW module [6]. It is a flow sensor module based on low-cost components. See chapter for a more detailed description of the module.to gather velocity information in x- and y direction, an optical flow estimation is done based on the sum of absolute differences (SAD) bloc matching algorithm with angular rate compensation using the gyroscope measurement [33]. The sensor module further delivers height measurement using a sonar sensor. However, the results of using the PX4FLOW as a standalone position estimation by integrating the measurements, were not very satisfying due to an unacceptable drift. For now, the position estimation process is only based on the software RECONSTRUCTME [37]. Unlie common SLAM algorihms such as Davison s MonoSLAM [30] or Klein and Murray s PTAM [36], the here used approach does create real surfaces instead of than only dense maps ReconstructMe The software RECONSTRUCTME that is used for position estimation, is developed by the company PROFACTOR in Steyr (Austria). It is a portable, low-cost 3D body scanning system [37]. It wors with publicly available low-cost active technology, such as the here used PRIMESENSE CARMINE 1.09 [5]. The algorithms are processed on decent standard computer hardware, which is designed for accelerated processing (e.g. general purpose computation on graphics processing unit (GPGPU)). The sensor uses the approach of structured light for depth calculation [35]. To do so, a constant pattern of specles is projected onto the scene by splitting up a laser beam via a diffraction grid. This pattern is captured by a 5 To provide the normalized unit base vectors, the 2-Norm v 2 = vi 2 is used. i

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

Application of state observers in attitude estimation using low-cost sensors

Application of state observers in attitude estimation using low-cost sensors Application of state observers in attitude estimation using low-cost sensors Martin Řezáč Czech Technical University in Prague, Czech Republic March 26, 212 Introduction motivation for inertial estimation

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

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

Attitude Estimation Version 1.0

Attitude Estimation Version 1.0 Attitude Estimation Version 1. Francesco Farina May 23, 216 Contents 1 Introduction 2 2 Mathematical background 2 2.1 Reference frames and coordinate systems............. 2 2.2 Euler angles..............................

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

Invariant Extended Kalman Filter: Theory and application to a velocity-aided estimation problem

Invariant Extended Kalman Filter: Theory and application to a velocity-aided estimation problem Invariant Extene Kalman Filter: Theory an application to a velocity-aie estimation problem S. Bonnabel (Mines ParisTech) Joint work with P. Martin (Mines ParisTech) E. Salaun (Georgia Institute of Technology)

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

Optimization-Based Control

Optimization-Based Control Optimization-Based Control Richard M. Murray Control and Dynamical Systems California Institute of Technology DRAFT v1.7a, 19 February 2008 c California Institute of Technology All rights reserved. This

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

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

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

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

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

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

Evaluation of different wind estimation methods in flight tests with a fixed-wing UAV

Evaluation of different wind estimation methods in flight tests with a fixed-wing UAV Evaluation of different wind estimation methods in flight tests with a fixed-wing UAV Julian Sören Lorenz February 5, 2018 Contents 1 Glossary 2 2 Introduction 3 3 Tested algorithms 3 3.1 Unfiltered Method

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

Lie Groups for 2D and 3D Transformations

Lie Groups for 2D and 3D Transformations Lie Groups for 2D and 3D Transformations Ethan Eade Updated May 20, 2017 * 1 Introduction This document derives useful formulae for working with the Lie groups that represent transformations in 2D and

More information

UAVBook Supplement Full State Direct and Indirect EKF

UAVBook Supplement Full State Direct and Indirect EKF UAVBook Supplement Full State Direct and Indirect EKF Randal W. Beard March 14, 217 This supplement will explore alternatives to the state estimation scheme presented in the book. In particular, we will

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

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 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

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

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

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

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

An Adaptive Filter for a Small Attitude and Heading Reference System Using Low Cost Sensors

An Adaptive Filter for a Small Attitude and Heading Reference System Using Low Cost Sensors An Adaptive Filter for a Small Attitude and eading Reference System Using Low Cost Sensors Tongyue Gao *, Chuntao Shen, Zhenbang Gong, Jinjun Rao, and Jun Luo Department of Precision Mechanical Engineering

More information

Extension of Farrenkopf Steady-State Solutions with Estimated Angular Rate

Extension of Farrenkopf Steady-State Solutions with Estimated Angular Rate Extension of Farrenopf Steady-State Solutions with Estimated Angular Rate Andrew D. Dianetti and John L. Crassidis University at Buffalo, State University of New Yor, Amherst, NY 46-44 Steady-state solutions

More information

Measurement Observers for Pose Estimation on SE(3)

Measurement Observers for Pose Estimation on SE(3) Measurement Observers for Pose Estimation on SE(3) By Geoffrey Stacey u4308250 Supervised by Prof. Robert Mahony 24 September 2010 A thesis submitted in part fulfilment of the degree of Bachelor of Engineering

More information

Adaptive Kalman Filter for MEMS-IMU based Attitude Estimation under External Acceleration and Parsimonious use of Gyroscopes

Adaptive Kalman Filter for MEMS-IMU based Attitude Estimation under External Acceleration and Parsimonious use of Gyroscopes Author manuscript, published in "European Control Conference ECC (214" Adaptive Kalman Filter for MEMS-IMU based Attitude Estimation under External Acceleration and Parsimonious use of Gyroscopes Aida

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

Nonlinear Parameter Estimation for State-Space ARCH Models with Missing Observations

Nonlinear Parameter Estimation for State-Space ARCH Models with Missing Observations Nonlinear Parameter Estimation for State-Space ARCH Models with Missing Observations SEBASTIÁN OSSANDÓN Pontificia Universidad Católica de Valparaíso Instituto de Matemáticas Blanco Viel 596, Cerro Barón,

More information

A KALMAN FILTERING TUTORIAL FOR UNDERGRADUATE STUDENTS

A KALMAN FILTERING TUTORIAL FOR UNDERGRADUATE STUDENTS A KALMAN FILTERING TUTORIAL FOR UNDERGRADUATE STUDENTS Matthew B. Rhudy 1, Roger A. Salguero 1 and Keaton Holappa 2 1 Division of Engineering, Pennsylvania State University, Reading, PA, 19610, USA 2 Bosch

More information

A Stochastic Observability Test for Discrete-Time Kalman Filters

A Stochastic Observability Test for Discrete-Time Kalman Filters A Stochastic Observability Test for Discrete-Time Kalman Filters Vibhor L. Bageshwar 1, Demoz Gebre-Egziabher 2, William L. Garrard 3, and Tryphon T. Georgiou 4 University of Minnesota Minneapolis, MN

More information

Quantitative Trendspotting. Rex Yuxing Du and Wagner A. Kamakura. Web Appendix A Inferring and Projecting the Latent Dynamic Factors

Quantitative Trendspotting. Rex Yuxing Du and Wagner A. Kamakura. Web Appendix A Inferring and Projecting the Latent Dynamic Factors 1 Quantitative Trendspotting Rex Yuxing Du and Wagner A. Kamakura Web Appendix A Inferring and Projecting the Latent Dynamic Factors The procedure for inferring the latent state variables (i.e., [ ] ),

More information

On Underweighting Nonlinear Measurements

On Underweighting Nonlinear Measurements On Underweighting Nonlinear Measurements Renato Zanetti The Charles Stark Draper Laboratory, Houston, Texas 7758 Kyle J. DeMars and Robert H. Bishop The University of Texas at Austin, Austin, Texas 78712

More information

Inertial Odometry using AR Drone s IMU and calculating measurement s covariance

Inertial Odometry using AR Drone s IMU and calculating measurement s covariance Inertial Odometry using AR Drone s IMU and calculating measurement s covariance Welcome Lab 6 Dr. Ahmad Kamal Nasir 25.02.2015 Dr. Ahmad Kamal Nasir 1 Today s Objectives Introduction to AR-Drone On-board

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

Autonomous Ship-board Landing using Monocular Vision

Autonomous Ship-board Landing using Monocular Vision Autonomous Ship-board Landing using Monocular Vision William K. Holmes wh11@psu.edu Jac W. Langelaan jlangelaan@psu.edu Department of Aerospace Engineering, Penn State University University Par, PA 1682

More information

Multi-Robotic Systems

Multi-Robotic Systems CHAPTER 9 Multi-Robotic Systems The topic of multi-robotic systems is quite popular now. It is believed that such systems can have the following benefits: Improved performance ( winning by numbers ) Distributed

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

THE goal of simultaneous localization and mapping

THE goal of simultaneous localization and mapping IEEE TRANSACTIONS ON ROBOTICS, MANUSCRIPT SEPTEMBER 7, 2008 1 isam: Incremental Smoothing and Mapping Michael Kaess, Student Member, IEEE, Ananth Ranganathan, Student Member, IEEE, and Fran Dellaert, Member,

More information

A Monocular Vision-aided Inertial Navigation System with Improved Numerical Stability

A Monocular Vision-aided Inertial Navigation System with Improved Numerical Stability AIAA SciTech 5-9 January 215, Kissimmee, Florida AIAA Guidance, Navigation, and Control Conference AIAA 215-97 A Monocular Vision-aided Inertial Navigation System with Improved Numerical Stability Daniel

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

Verification of a Dual-State Extended Kalman Filter with Lidar-Enabled Autonomous Hazard- Detection for Planetary Landers

Verification of a Dual-State Extended Kalman Filter with Lidar-Enabled Autonomous Hazard- Detection for Planetary Landers Marquette University e-publications@marquette Master's Theses (29 -) Dissertations, Theses, and Professional Projects Verification of a Dual-State Extended Kalman Filter with Lidar-Enabled Autonomous Hazard-

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

A NOVEL OPTIMAL PROBABILITY DENSITY FUNCTION TRACKING FILTER DESIGN 1

A NOVEL OPTIMAL PROBABILITY DENSITY FUNCTION TRACKING FILTER DESIGN 1 A NOVEL OPTIMAL PROBABILITY DENSITY FUNCTION TRACKING FILTER DESIGN 1 Jinglin Zhou Hong Wang, Donghua Zhou Department of Automation, Tsinghua University, Beijing 100084, P. R. China Control Systems Centre,

More information

VEHICLE WHEEL-GROUND CONTACT ANGLE ESTIMATION: WITH APPLICATION TO MOBILE ROBOT TRACTION CONTROL

VEHICLE WHEEL-GROUND CONTACT ANGLE ESTIMATION: WITH APPLICATION TO MOBILE ROBOT TRACTION CONTROL 1/10 IAGNEMMA AND DUBOWSKY VEHICLE WHEEL-GROUND CONTACT ANGLE ESTIMATION: WITH APPLICATION TO MOBILE ROBOT TRACTION CONTROL K. IAGNEMMA S. DUBOWSKY Massachusetts Institute of Technology, Cambridge, MA

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

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

Robotics 2 Target Tracking. Giorgio Grisetti, Cyrill Stachniss, Kai Arras, Wolfram Burgard

Robotics 2 Target Tracking. Giorgio Grisetti, Cyrill Stachniss, Kai Arras, Wolfram Burgard Robotics 2 Target Tracking Giorgio Grisetti, Cyrill Stachniss, Kai Arras, Wolfram Burgard Linear Dynamical System (LDS) Stochastic process governed by is the state vector is the input vector is the process

More information

Modeling Verticality Estimation During Locomotion

Modeling Verticality Estimation During Locomotion Proceedings of the 19th CISM-IFToMM Symposium on Robot Design, Dynamics, and Control, Romansy 212. pp. 651-656 Modeling Verticality Estimation During Locomotion Ildar Farkhatdinov 1 Hannah Michalska 2

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

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

Automatic Control II Computer exercise 3. LQG Design

Automatic Control II Computer exercise 3. LQG Design Uppsala University Information Technology Systems and Control HN,FS,KN 2000-10 Last revised by HR August 16, 2017 Automatic Control II Computer exercise 3 LQG Design Preparations: Read Chapters 5 and 9

More information

Estimation and Control of a Quadrotor Attitude

Estimation and Control of a Quadrotor Attitude Estimation and Control of a Quadrotor Attitude Bernardo Sousa Machado Henriques Mechanical Engineering Department, Instituto Superior Técnico, Lisboa, Portugal E-mail: henriquesbernardo@gmail.com Abstract

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

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

Extended Kalman Filter for Spacecraft Pose Estimation Using Dual Quaternions*

Extended Kalman Filter for Spacecraft Pose Estimation Using Dual Quaternions* Extended Kalman Filter for Spacecraft Pose Estimation Using Dual Quaternions* Nuno Filipe Michail Kontitsis 2 Panagiotis Tsiotras 3 Abstract Based on the highly successful Quaternion Multiplicative Extended

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

STATISTICAL ORBIT DETERMINATION

STATISTICAL ORBIT DETERMINATION STATISTICAL ORBIT DETERMINATION Satellite Tracking Example of SNC and DMC ASEN 5070 LECTURE 6 4.08.011 1 We will develop a simple state noise compensation (SNC) algorithm. This algorithm adds process noise

More information

Using the Kalman Filter to Estimate the State of a Maneuvering Aircraft

Using the Kalman Filter to Estimate the State of a Maneuvering Aircraft 1 Using the Kalman Filter to Estimate the State of a Maneuvering Aircraft K. Meier and A. Desai Abstract Using sensors that only measure the bearing angle and range of an aircraft, a Kalman filter is implemented

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

Research Article Error Modeling, Calibration, and Nonlinear Interpolation Compensation Method of Ring Laser Gyroscope Inertial Navigation System

Research Article Error Modeling, Calibration, and Nonlinear Interpolation Compensation Method of Ring Laser Gyroscope Inertial Navigation System Abstract and Applied Analysis Volume 213, Article ID 359675, 7 pages http://dx.doi.org/1.1155/213/359675 Research Article Error Modeling, Calibration, and Nonlinear Interpolation Compensation Method of

More information

REAL-TIME ATTITUDE-INDEPENDENT THREE-AXIS MAGNETOMETER CALIBRATION

REAL-TIME ATTITUDE-INDEPENDENT THREE-AXIS MAGNETOMETER CALIBRATION REAL-TIME ATTITUDE-INDEPENDENT THREE-AXIS MAGNETOMETER CALIBRATION John L. Crassidis and Ko-Lam Lai Department of Mechanical & Aerospace Engineering University at Buffalo, State University of New Yor Amherst,

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

Sigma-Point Kalman Filters for Nonlinear Estimation and Sensor-Fusion - Applications to Integrated Navigation - Rudolph van der Merwe and Eric A.

Sigma-Point Kalman Filters for Nonlinear Estimation and Sensor-Fusion - Applications to Integrated Navigation - Rudolph van der Merwe and Eric A. Sigma-Point Kalman Filters for Nonlinear Estimation and Sensor-Fusion - Applications to Integrated Navigation - Rudolph van der Merwe and Eric A. Wan OGI School of Science & Engineering, Oregon Health

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

An Introduction to the Kalman Filter

An Introduction to the Kalman Filter An Introduction to the Kalman Filter by Greg Welch 1 and Gary Bishop 2 Department of Computer Science University of North Carolina at Chapel Hill Chapel Hill, NC 275993175 Abstract In 1960, R.E. Kalman

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

Adaptive ensemble Kalman filtering of nonlinear systems. Tyrus Berry and Timothy Sauer George Mason University, Fairfax, VA 22030

Adaptive ensemble Kalman filtering of nonlinear systems. Tyrus Berry and Timothy Sauer George Mason University, Fairfax, VA 22030 Generated using V3.2 of the official AMS LATEX template journal page layout FOR AUTHOR USE ONLY, NOT FOR SUBMISSION! Adaptive ensemble Kalman filtering of nonlinear systems Tyrus Berry and Timothy Sauer

More information

Kalman filter using the orthogonality principle

Kalman filter using the orthogonality principle Appendix G Kalman filter using the orthogonality principle This appendix presents derivation steps for obtaining the discrete Kalman filter equations using a method based on the orthogonality principle.

More information

Adaptive Kalman Filter for MEMS-IMU based Attitude Estimation under External Acceleration and Parsimonious use of Gyroscopes

Adaptive Kalman Filter for MEMS-IMU based Attitude Estimation under External Acceleration and Parsimonious use of Gyroscopes Adaptive Kalman Filter for MEMS-IMU based Attitude Estimation under External Acceleration and Parsimonious use of Gyroscopes Aida Mani, Hassen Fourati, Alain Kibangou To cite this version: Aida Mani, Hassen

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

VISION TRACKING PREDICTION

VISION TRACKING PREDICTION VISION RACKING PREDICION Eri Cuevas,2, Daniel Zaldivar,2, and Raul Rojas Institut für Informati, Freie Universität Berlin, ausstr 9, D-495 Berlin, German el 0049-30-83852485 2 División de Electrónica Computación,

More information

OPTIMAL ESTIMATION of DYNAMIC SYSTEMS

OPTIMAL ESTIMATION of DYNAMIC SYSTEMS CHAPMAN & HALL/CRC APPLIED MATHEMATICS -. AND NONLINEAR SCIENCE SERIES OPTIMAL ESTIMATION of DYNAMIC SYSTEMS John L Crassidis and John L. Junkins CHAPMAN & HALL/CRC A CRC Press Company Boca Raton London

More information

v are uncorrelated, zero-mean, white

v are uncorrelated, zero-mean, white 6.0 EXENDED KALMAN FILER 6.1 Introduction One of the underlying assumptions of the Kalman filter is that it is designed to estimate the states of a linear system based on measurements that are a linear

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

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

ESTIMATION THEORY. Chapter Estimation of Random Variables

ESTIMATION THEORY. Chapter Estimation of Random Variables Chapter ESTIMATION THEORY. Estimation of Random Variables Suppose X,Y,Y 2,...,Y n are random variables defined on the same probability space (Ω, S,P). We consider Y,...,Y n to be the observed random variables

More information

Locating and supervising relief forces in buildings without the use of infrastructure

Locating and supervising relief forces in buildings without the use of infrastructure Locating and supervising relief forces in buildings without the use of infrastructure Tracking of position with low-cost inertial sensors Martin Trächtler 17.10.2014 18th Leibniz Conference of advanced

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

Robot Control Basics CS 685

Robot Control Basics CS 685 Robot Control Basics CS 685 Control basics Use some concepts from control theory to understand and learn how to control robots Control Theory general field studies control and understanding of behavior

More information

Aerial Robotics. Vision-based control for Vertical Take-Off and Landing UAVs. Toulouse, October, 2 nd, Henry de Plinval (Onera - DCSD)

Aerial Robotics. Vision-based control for Vertical Take-Off and Landing UAVs. Toulouse, October, 2 nd, Henry de Plinval (Onera - DCSD) Aerial Robotics Vision-based control for Vertical Take-Off and Landing UAVs Toulouse, October, 2 nd, 2014 Henry de Plinval (Onera - DCSD) collaborations with P. Morin (UPMC-ISIR), P. Mouyon (Onera), T.

More information

IMU Filter. Michael Asher Emmanuel Malikides November 5, 2011

IMU Filter. Michael Asher Emmanuel Malikides November 5, 2011 IMU Filter Michael Asher Emmanuel Malikides November 5, 2011 Abstract Despite the ubiquitousness of GPS devices, on board inertial navigation remains important. An IMU like the Sparkfun Ultimate IMU used,

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

Adaptive Unscented Kalman Filter with Multiple Fading Factors for Pico Satellite Attitude Estimation

Adaptive Unscented Kalman Filter with Multiple Fading Factors for Pico Satellite Attitude Estimation Adaptive Unscented Kalman Filter with Multiple Fading Factors for Pico Satellite Attitude Estimation Halil Ersin Söken and Chingiz Hajiyev Aeronautics and Astronautics Faculty Istanbul Technical University

More information

Stochastic State Estimation

Stochastic State Estimation Chapter 7 Stochastic State Estimation Perhaps the most important part of studying a problem in robotics or vision, as well as in most other sciences, is to determine a good model for the phenomena and

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

NAVAL POSTGRADUATE SCHOOL THESIS

NAVAL POSTGRADUATE SCHOOL THESIS NAVAL POSTGRADUATE SCHOOL MONTEREY, CALIFORNIA THESIS ATTITUDE DETERMINATION FOR THE THREE-AXIS SPACECRAFT SIMULATOR (TASS) BY APPLICATION OF PARTICLE FILTERING TECHNIQUES by Ioannis Kassalias June 2005

More information

State estimation and the Kalman filter

State estimation and the Kalman filter State estimation and the Kalman filter PhD, David Di Ruscio Telemark university college Department of Technology Systems and Control Engineering N-3914 Porsgrunn, Norway Fax: +47 35 57 52 50 Tel: +47 35

More information

Computer Vision Group Prof. Daniel Cremers. 14. Sampling Methods

Computer Vision Group Prof. Daniel Cremers. 14. Sampling Methods Prof. Daniel Cremers 14. Sampling Methods Sampling Methods Sampling Methods are widely used in Computer Science as an approximation of a deterministic algorithm to represent uncertainty without a parametric

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

Investigation of the Attitude Error Vector Reference Frame in the INS EKF

Investigation of the Attitude Error Vector Reference Frame in the INS EKF Investigation of the Attitude Error Vector Reference Frame in the INS EKF Stephen Steffes, Jan Philipp Steinbach, and Stephan Theil Abstract The Extended Kalman Filter is used extensively for inertial

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

A Robust Extended Kalman Filter for Discrete-time Systems with Uncertain Dynamics, Measurements and Correlated Noise

A Robust Extended Kalman Filter for Discrete-time Systems with Uncertain Dynamics, Measurements and Correlated Noise 2009 American Control Conference Hyatt Regency Riverfront, St. Louis, MO, USA June 10-12, 2009 WeC16.6 A Robust Extended Kalman Filter for Discrete-time Systems with Uncertain Dynamics, Measurements and

More information

State Estimation for Autopilot Control of Small Unmanned Aerial Vehicles in Windy Conditions

State Estimation for Autopilot Control of Small Unmanned Aerial Vehicles in Windy Conditions University of Colorado, Boulder CU Scholar Aerospace Engineering Sciences Graduate Theses & Dissertations Aerospace Engineering Sciences Summer 7-23-2014 State Estimation for Autopilot Control of Small

More information

Least Squares. Ken Kreutz-Delgado (Nuno Vasconcelos) ECE 175A Winter UCSD

Least Squares. Ken Kreutz-Delgado (Nuno Vasconcelos) ECE 175A Winter UCSD Least Squares Ken Kreutz-Delgado (Nuno Vasconcelos) ECE 75A Winter 0 - UCSD (Unweighted) Least Squares Assume linearity in the unnown, deterministic model parameters Scalar, additive noise model: y f (

More information

Adaptive Two-Stage EKF for INS-GPS Loosely Coupled System with Unknown Fault Bias

Adaptive Two-Stage EKF for INS-GPS Loosely Coupled System with Unknown Fault Bias Journal of Gloal Positioning Systems (26 Vol. 5 No. -2:62-69 Adaptive wo-stage EKF for INS-GPS Loosely Coupled System with Unnown Fault Bias Kwang Hoon Kim Jang Gyu Lee School of Electrical Engineering

More information

TOWARDS AUTONOMOUS LOCALIZATION OF AN UNDERWATER DRONE. A Thesis. presented to. the Faculty of California Polytechnic State University,

TOWARDS AUTONOMOUS LOCALIZATION OF AN UNDERWATER DRONE. A Thesis. presented to. the Faculty of California Polytechnic State University, TOWARDS AUTONOMOUS LOCALIZATION OF AN UNDERWATER DRONE A Thesis presented to the Faculty of California Polytechnic State University, San Luis Obispo In Partial Fulfillment of the Requirements for the Degree

More information