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

Size: px
Start display at page:

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

Transcription

1 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 University of Newfoundland, Canada. Abstract In this paper we detail a numerical optimization method for automated tuning of a nonlinear filter used in Attitude Heading Reference Systems (AHRS). First, the Levenberg Marquardt method is used for nonlinear parameter estimation of the observer model. Two approaches are described; Extended Kalman Filter (EKF) based supervised implementation and unsupervised error minimization based implementation. The quaternion formulation is used in the development in order to have a global minimum parametrization in the rotation group. These two methods are then compared using both simulated and experimental data taken from a commercial Inertial Measurement Unit (IMU) used in an autopilot system of an unmanned aerial vehicle. The results reveal that the proposed EKF based supervised implementation is faster and also has a better robustness against different initial conditions.. INTRODUCTION Estimation of attitude and heading (roll, pitch and yaw) of a body in three dimensions is a primary problem in autonomous vehicles operating in both underwater and aerial settings. Conventionally the problem is tackled using navigation grade Inertial Measurement Units (IMU) powered by Extended Kalman Filtering (EKF) approaches. As these systems are miniaturized for small scale or team deployment, limitations are faced with respect to payload, cost and availability. Low cost Micro Electro Mechanical Sensors (MEMS) are used to meet these constraints, while relying on simpler observers in place of the more resource demanding EKF. Observers based on the nonlinear complementary filter proposed by [] are viewed as a popular simpler alternative to the problem. As the accuracy of such an approach depends on the user tuned gains, the filter lacks the intuitiveness of the tuning process present in the standard stochastic methods, where gains are dependant on the variances of the sensors used. Therefore there exists a requirement for proper tuning approaches for optimal performance of the nonlinear complementary filter. Tuning of filter parameters (gains) in general are approached via numerous methods. These includes heuristic tuning [], analytical gain selection [2], gain adaptation [3] [4] and numerical optimization (both batch and recursive applications). The EKF for attitude estimation adapts the gains using optimality principles. For empirical selection of the process Q and sensor R noise filter parameters of the EKF, numerical variance estimation methods are in place during initialization of these systems [5]. Also, online identification of process and measurement noise variances are proposed using adaptive methods [3]. These stochastic adaptive formulations for observer gains, although powerful, are more suited for systems with high processing capability. This is due to the estimation of covariance states and calculation of matrix inverse. For low cost applications, deterministic nonlinear formulations are preferred for the attitude estimation problem. Reference [2] reports deterministic formulation of the invariant observers for low cost applications. The tuning of this nonlinear observer is performed analytically, by designing the gains using the observer dynamics. The absence of an analytical gain selection method for the nonlinear complementary filter proposed in [] requires the gains to be selected by the user. An automated approach to the problem is by numerical optimization of the filter tuning parameters with a supervisor providing estimates for tuning. Established nonlinear parameter estimation algorithms allow the problem to be addressed as a grey box system identification exercise [6]. Such numerical optimization approaches are particularly reported for automated gain tuning of various controllers [7] [8]. This work analyzes the application of nonlinear parameter estimation schemes for the complementary filter tuning problem. An EKF model reference tuning structure and an unsupervised error minimization method are implemented /2/$ /3/$ IEEE 7

2 for off-line automated tuning of the parameters. The main contribution of this paper is in the development of an automated tuning methodology for the filter parameter estimation of the nonlinear complementary filter. The proposed tuning methodology can readily be used in practical filter tuning of low cost autopilot systems. The designer can overcome the accuracy limitations of the heuristic trial and error tuning process by using the proposed tuning structure and the optimization scheme. The rest of the paper is organized in the following manner. Section 2 formulates the problem and summarizes the two observers used in the study, namely the EKF and the nonlinear complementary filter. Section 3 introduces the parameter estimation schemes with off-line batch estimation procedures. The proposed tuning scheme is applied on a simulated data set and an actual data set captured by a commercial IMU. Results are summarized in section 4. Performance in terms of robustness, speed of convergence, and complexity is discussed. 2. Considered Problem Following is a summary of the low cost attitude estimation problem and its solutions using the approaches of EKF and the nonlinear complementary filter. Quaternion parametrization is used in place of Euler or Direction Cosine Matrix (DCM) parameterizations, to achieve global parametrization of the body orientation while minimizing the number of parameters. Specific details of the attitude observer design used in the study is reported in [5]. 2.. Low Cost Attitude Estimation Problem The attitude estimation problem considered only uses inertial, gyroscopic and magnetic sensors for its solution. Additionally, it neglects the effects of earth rotation thus assumes a flat, non-rotating earth. Under this assumption the earth fixed frame can be considered an inertial frame which is used as the navigation frame for the problem considered. The kinematic and the sensor models used for simulation and observer design take the following form. 2.. Kinematic model q = 2 q ωb ib () In equation (), q is the unit quaternion representing the orientation of the body fixed frame with respect to the earth fixed frame and ωib b is the angular velocity vector of the body with respect to the inertial frame measured in the body fixed frame Gyroscope model ω m = ωib b + ω B + ν ω (2) ω B = ν B In equation (2), ω m is the measured signal from the gyroscope, ω B is the gyroscope bias term which is modeled as a random walk process and ν ω, ν B are measurement noises of the gyroscope, modeled as white noise Accelerometer model a m = a b ib + a B q g e q + ν a (3) ȧ B = ν ab In equation (3), a m is the measured signal of the accelerometer, a b ib is the acceleration of the body relative to inertial (earth) frame, measured in body fixed coordinate system, g e is the earth gravity reference vector, expressed in the earth coordinate system and ν a is the accelerometer measurement noise modeled as white noise. The accelerometer bias a B is not generally considered in the unaided attitude estimation problem, but is an essential element for solving the inertial navigation problem. As there are no additional sources to estimate the acceleration of the body a b ib, low acceleration motions are assumed and the term is absorbed in the sensor noise ν a Magnetometer model b m = B + q b e q + ν b (4) In equation (4), b m is the measured signal from the magnetometer, B is the magnetic disturbance experienced at the body frame due to actuators, cables, etc., b e is the earth magnetic field reference vector for the certain position of the earth expressed in the earth coordinate system and ν b is the magnetometer measurement noise modeled as white noise. For attitude estimation the model is simplified by absorbing the magnetic disturbance B in the noise term of the sensor model. Alternatively, the value of B occurring due to self-excited fields of the system can be found experimentally The Extended Kalman Filter The EKF is used as a supervisor to provide the automated tuner with reference trajectories. It is selected since the natural parametrization of the filter which only depend on the identifiable variance of the sensors. No additional fine tuning is performed on the filter in this study apart from setting the variances of the sensors to their provided values. The system model used for EKF formulation takes the following form. { ẋ } = { f(x, u, ν) = 2 q ωb q (ω } m ω B + ν ω ) ν B (5) 72

3 ȳ } = { h(x) } q = g e q + ν a b m q b e q + ν b { am The prediction correction structure of the EKF used for this study follows the equation set (7),(8). For computation the set of equations are discretized by first order expansion and the quaternions are normalized at each update step. P rediction F = f(x, x u, ν) x=ˆx,ν=ˆν= G = f(x, ν u, ν) x=ˆx,ν=ˆν= ˆq = 2 ˆq (ω m ˆω B ) ˆω B = P = F P + P F T + GQG T ŷ a = ˆq g e ˆq = ˆq b e ˆq ŷ b Correction H e K ˆx P = h(x) x x=ˆx = z ŷ a = P H T (HP H T + R) = ˆx + Ke = P KHP In equation set (7) and (8), P is the state covariance matrix, x is the state vector, z is the measurement vector, F,G,H are linearizations of the nonlinear state space equations at ˆx, K is defined as the Kalman gain matrix, Q is defined as the process noise matrix and R is defined as the measurement noise matrix. It is important to note that the EKF is the defacto standard for nonlinear estimation, although several improved versions of the filter are reported in literature. The linear quaternion error representation is modified to nonlinear multiplicative error term in the Multiplicative Extended Kalman Filter (MEKF) [9]. The Uncented Kalman Filter (UKF) uses nonlinear mapping of carefully selected sample points to estimate the probability distribution []. The Invariant Extended Kalman Filter (IEKF) proposed by [4] exploits symmetry which leads to a class of filters with a larger domain of convergence. All of these are candidate supervisors for the filter parameter adaptation method proposed. The IEKF in particular would be a strong supervisor due to its convergence characteristics and the symmetry preserving formulation as in the nonlinear complementary filter Nonlinear Complementary Filter The nonlinear complementary filter uses a deterministic approach to the attitude estimation problem. For this study we used the quaternion formulation of the explicit complementary filter as proposed in []. Figure 2 illustrates the (6) (7) (8) basic structure of the filter. When compared with a Luenberger observer structure, the nonlinear complementary filter performs a partial state update (only ω B state) using a fixed gain. But the filter differs in its output error calculation, which is nonlinear and exploits symmetry of the Special Orthogonal group in 3 dimensions (SO(3)), enabling good convergence characteristics. P rediction ˆ q = 2 ˆq (ω m ˆω B ) ŷ a = ˆq g e ˆq = ˆq b e ˆq ŷ b (9) Correction e = w (ŷ a a m ) + w 2 (ŷ b b m ) ˆω B = K p e + K i edt () Where w and w 2 are weights given to errors with reference to the accelerometer estimate and the magnetometer estimate, respectively. The terms K p and K i are the proportional and integral gains of the filter. The gains of the nonlinear complementary filter are selected by the user. But for low cost applications it is often the case that there is no reference for these filter parameters to be set to optimal values. In practice it would be advantageous if methods are in place to tune the values using some relevant objective function. 3. Parameter Estimation Method This study attempts to apply general nonlinear parameter estimation methods for tuning of the nonlinear complementary filter. The filter runs on an embedded system with relatively low processing capability, so the application of the nonlinear parameter estimation methods require the process to be done off-line on a powerful system. This tuning process would provide filter parameters to be plugged in for operation and also provide reference values for online filter tuning algorithm development. Most techniques rely on steepest decent based and Newton-based methods. To exploit both characteristics of robustness of the steepest decent and convergence of Newton s method, the Levenberg Marquardt(LM) algorithm is used. The LM method was found to meet the sufficient performance in this particular application, so other algorithms such as trust region based methods and global optimization schemes (simulated annealing, genetic algorithms) were not explored. 3.. Levenberg Marquardt Algorithm The LM algorithm selects between Gauss Newton direction and the steepest decent direction for parameter update. The algorithm controls the transition between the two methods and the update step of gradient decent by a damping factor µ. Because of the nonlinear nature of the observer 73

4 gyro m acc m mag m K p K i Non-Linear Complementary Filter Extended Kalman Filter Gain Tuning Algorithm ˆq NCF ˆq EKF Figure. EKF model reference supervised tuning structure + - Tracking error (deg) mean and variance ACC EKF Tuner Tuner 2 acc m mag m gyro m + - ˆω B Non-Linear Complimentary Filter 2 ˆq (ω m ˆω B )dt K i K p y acc ˆ = ˆq g e ˆq y mag ˆ ˆq b e ˆq edt error ˆq NCF Pitch Roll Yaw Figure 3. Comparison of the tracking results of simulated dataset. ACC-estimate from using only the accelerometers and magnetometers, EKF- estimates form the extended kalman filter, Tuner - tuned complementary filter using supervised structure, Tuner 2- tuned complementary filter using the unsupervised structure Gain Tuning Algorithm Figure 2. Unsupervised self tuning structure update rule, numerical methods are used for Jacobian calculation. It is found by experiment that the calculated Jacobian at each data point tends to degrade the robustness of the algorithm. Rather, a Jacobian of the total error of the data set is found. The parameters of the standard LM algorithm [6] were set so the maximum iterations is 5, initial parameter estimates are, the initial trust parameter is 3 and update tolerance for convergence checking is EKF model reference supervised tuning The first approach uses reference trajectory estimates provided by an EKF on the training data set. Figure illustrates the structure of the tuning method proposed. The quaternion reference trajectory is compared against the trajectory provided by the nonlinear complementary filter to form an error signal. Instead of the linear error terms for the quaternions, the more accurate multiplicative error term can be used in the algorithm. The linear formulation was found to be sufficient for the purpose. Optimization is then performed using the squared error of this signal as the cost function Unsupervised error minimization self tuning The second approach uses the error calculated by the filter itself as the signal to be minimized in a least squares sense. This unsupervised method is illustrated in Figure 2. This method relieves the computational overhead of applying an EKF for reference trajectory generation. In both approaches it is found that the Jacobian calculated at each data point is ill conditioned, therefore a Jacobian is numerically calculated on the whole data set. 4. Results The proposed tuning method was used for tuning of a simulated dataset developed using the models reported in Section 2. It was then performed on an actual dataset captured by a commercial IMU, VectorNav VN(T). 4.. Simulated results Simulations were performed to validate the convergence of the tuning structures proposed. Both the tuning structures were iterated with the same parameters. The optimized tuning parameters were able to achieve close performance to that of the EKF estimates. The robustness of the two methods was tested and verified for different parameter initializations. The convergence efficiency of the supervised method was better in terms of elapsed time and the damping parameter update of the LM algorithm. Figure 3 illustrates the results of the two tuning structures where both structures successfully produces accurate results. The minimum performance level expected from the filter is illustrated as ACC in Figure 3. These are the estimates gathered by only utilizing the accelerometer and the magnetometer. This estimate is obtained by solving for the rotation matrix which corresponds to the two vector observations in the two frames (Wahba s problem) using singular value decomposition [] Experimental results The verified tuning algorithms were used to tune the nonlinear complementary filter for an experimental data set captured by the VN(T) commercial IMU. The IMU was 74

5 subjected to a random motion profile manually covering the full range of motion in terms of roll, pitch, yaw values and samples of data (accelerometer, gyroscope and magnetometer measurements) were collected at a data rate of 3Hz. This data set was used for tuning purposes employing the proposed automated tuning methodology. The VN(T) IMU posses onboard high speed signal processing which fuses the measurements from the sensors using a dedicated EKF which incorporates fully calibrated and temperature compensated sensor models. The estimates given by the onboard electronics at the high data rate of 3Hz was assumed as ground truth data for comparison of results. Both the tuning structures were implemented where the unsupervised approach optimizes the parameters using the measurement prediction error as a cost, while the supervised approach first implements an EKF based on the noise variances of the sensors and reference it for parameter optimization. The convergence of the tuned parameters were checked for various parameter initializations of the filter. Iteration Cost Update K p K i Table. EKF supervised tuning iteration steps of the experimental data set. Elapsed time is 9.2 seconds. During parameter estimation, to better handle the nonlinearities of the system, updates were performed so that the K p filter parameter converges before the K i update steps are attempted. This allows the optimization to be stable at distant parameter initializations. To generalize the applicability of the system the initial estimates are set to zero in the generated results. Tables and 2 presents the iterations performed in the supervised and the unsupervised tuning structures presented in this study. Figures 4 and 5 illustrates the performance of the two tuning structures. The EKF supervised tuning structure proposed in this study was observed to give better tuning parameters, and its convergence was faster than the unsupervised method. The faster convergence was a result of Gauss Newton iterative steps which it appears to take during the process. The unsupervised method similarly solves Tracking error (deg) mean and variance Pitch Roll Yaw ACC EKF DC DC2 Figure 4. Validation results - Comparison of the tuned complementary filter using the supervised approach against EKF performance on an actual data set. ACC-estimate from using only the accelerometers and magnetometers, EKF- estimates from the extended Kalman filter, DC- Complementary filter with only parameter K p, DC2- Complementary filter with two parameters K p, K i Iteration Cost Update K p K i Table 2. Unsupervised tuning iteration steps of the actual data set Elapsed time is 6 seconds. the least squares optimization with respect to the available information, but the updates were more based on damped gradient direction. This slows down the convergence of the solution. The EKF supervised method also appeared robust to various initial conditions. Initialization of the gain parameter was varied from to 5 to verify robustness in the neighborhood. Both the methods were successful in tuning the nonlinear complementary filters although EKF supervised method is preferred for speed and robustness. 5. Conclusion and Future work This paper reported the application of nonlinear parameter estimation methods for nonlinear complementary filter tuning. Parameter estimation scheme utilized a Levenberg Marquardt algorithm with modifications to the Jacobian calculation and sequential update of parameters. The following two tuning structures were proposed and experimented. 75

6 Tracking error (deg) mean and variance Pitch Roll Yaw ACC EKF DC DC2 Figure 5. Validation results - Comparison of the tuned complementary filter using the unsupervised approach against EKF performance on an actual dataset. ACC-estimate from using only the accelerometers and magnetometers, EKF- estimates from the extended Kalman filter, DC- Complementary filter with only parameter K p, DC2- Complementary filter with two parameters K p, K i Roll(rad) Pitch(rad) Yaw(rad) Reference data Tuned NCF Data point Figure 6. Tracking performance of the Tuned nonlinear complementary filter using supervised method on a validation data set captured by the Inertial Measurement Unit Unsupervised error minimization structure: The error signal of the nonlinear complementary filter itself is minimized in a least squared sense. This self tuning method does not require additional supervisor for tuning purpose. EKF supervised tuning structure: An EKF attitude estimator is applied on a training data set and the output quaternion was used as the reference signal for nonlinear complementary filter parameter tuning. This method exhibits faster and more accurate tuning of the filter parameters. The EKF supervised structure is recommended for nonlinear complementary filter tuning. The algorithm can be readily applied for low cost autopilot system development by replacing the ad-hoc tuning procedures which are used for the nonlinear complementary filter. This study is expected to be developed to online parameter estimation of the filter parameters. Furthermore, it is expected to extend the application of nonlinear system identification to applications entailing model reference inertial navigation schemes. References [] R. Mahony, T. Hamel, and J.-M. Pflimlin, Nonlinear Complementary Filters on the Special Orthogonal Group, IEEE Transactions on Automatic Control, vol. 53, pp , June 28. [2] P. Martin and E. Salaün, Design and implementation of a low-cost observer-based attitude and heading reference system, Control Engineering Practice, vol. 8, pp , July 2. [3] R. Mehra, On the identification of variances and adaptive kalman filtering, Automatic Control, IEEE Transactions on, vol. 5, pp , apr 97. [4] S. Bonnabel, P. Martin, and E. Salaun, Invariant extended kalman filter: theory and application to a velocity-aided attitude estimation problem, Decision and Control, 29 held jointly with the 29 28th Chinese Control Conference. CDC/CCC 29. Proceedings of the 48th IEEE Conference on, pp , 29. [5] J. Farrell, Aided navigation: GPS with high rate sensors. Mcgraw-hill, 28. [6] J. Nocedal and S. Wright, Numerical optimization. Springer verlag, 999. [7] S. Woodward and D. Garg, A numerical optimization approach for tuning fuzzy logic controllers, Systems, Man, and Cybernetics, Part B: Cybernetics, IEEE Transactions on, vol. 29, pp , aug 999. [8] A. Varsek, T. Urbancic, and B. Filipic, Genetic algorithms in controller design and tuning, Systems, Man and Cybernetics, IEEE Transactions on, vol. 23, pp , sep/oct 993. [9] F. Markley, Attitude error representations for kalman filtering, Journal of guidance, control, and dynamics, vol. 26, no. 2, pp. 3 37, 23. [] J. Crassidis and F. Markley, Unscented filtering for spacecraft attitude estimation, Journal of Guidance Control and Dynamics, vol. 26, no. 4, pp , 23. [] F. Markley, Attitude determination using vector observations and the singular value decomposition, Journal of the Astronautical Sciences, vol. 36, no. 3, pp ,

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

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

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

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

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

IEEE TRANSACTIONS ON AUTOMATIC CONTROL, VOL. 53, NO. 5, JUNE

IEEE TRANSACTIONS ON AUTOMATIC CONTROL, VOL. 53, NO. 5, JUNE IEEE TRANSACTIONS ON AUTOMATIC CONTROL, VOL 53, NO 5, JUNE 2008 1203 Nonlinear Complementary Filters on the Special Orthogonal Group Robert Mahony, Senior Member, IEEE, Tarek Hamel, Member, IEEE, and Jean-Michel

More information

A Complementary Filter for Attitude Estimation of a Fixed-Wing UAV

A Complementary Filter for Attitude Estimation of a Fixed-Wing UAV A Complementary Filter for Attitude Estimation of a Fixed-Wing UAV Mark Euston, Paul Coote, Robert Mahony, Jonghyuk Kim and Tarek Hamel Abstract This paper considers the question of using a nonlinear complementary

More information

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

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

More information

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

Generalized Multiplicative Extended Kalman Filter for Aided Attitude and Heading Reference System

Generalized Multiplicative Extended Kalman Filter for Aided Attitude and Heading Reference System Generalized Multiplicative Extended Kalman Filter for Aided Attitude and Heading Reference System Philippe Martin, Erwan Salaün To cite this version: Philippe Martin, Erwan Salaün. Generalized Multiplicative

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

Integration of a strapdown gravimeter system in an Autonomous Underwater Vehicle

Integration of a strapdown gravimeter system in an Autonomous Underwater Vehicle Integration of a strapdown gravimeter system in an Autonomous Underwater Vehicle Clément ROUSSEL PhD - Student (L2G - Le Mans - FRANCE) April 17, 2015 Clément ROUSSEL ISPRS / CIPA Workshop April 17, 2015

More information

VN-100 Velocity Compensation

VN-100 Velocity Compensation VN-100 Velocity Compensation Velocity / Airspeed Aiding for AHRS Applications Application Note Abstract This application note describes how the VN-100 can be used in non-stationary applications which require

More information

A NONLINEARITY MEASURE FOR ESTIMATION SYSTEMS

A NONLINEARITY MEASURE FOR ESTIMATION SYSTEMS AAS 6-135 A NONLINEARITY MEASURE FOR ESTIMATION SYSTEMS Andrew J. Sinclair,JohnE.Hurtado, and John L. Junkins The concept of nonlinearity measures for dynamical systems is extended to estimation systems,

More information

State observers for invariant dynamics on a Lie group

State observers for invariant dynamics on a Lie group State observers for invariant dynamics on a Lie group C. Lageman, R. Mahony, J. Trumpf 1 Introduction This paper concerns the design of full state observers for state space systems where the state is evolving

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

arxiv: v1 [math.oc] 7 Oct 2018

arxiv: v1 [math.oc] 7 Oct 2018 To cite this article: H. A. Hashim, L. J. Brown, and K. McIsaac, Nonlinear Stochastic Attitude Filters on the Special Orthogonal Group 3: Ito and Stratonovich, IEEE Transactions on Systems, Man, and Cybernetics:

More information

Quadrotor Modeling and Control

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

More information

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

Attitude Determination for NPS Three-Axis Spacecraft Simulator

Attitude Determination for NPS Three-Axis Spacecraft Simulator AIAA/AAS Astrodynamics Specialist Conference and Exhibit 6-9 August 4, Providence, Rhode Island AIAA 4-5386 Attitude Determination for NPS Three-Axis Spacecraft Simulator Jong-Woo Kim, Roberto Cristi and

More information

Spacecraft Angular Rate Estimation Algorithms For Star Tracker-Based Attitude Determination

Spacecraft Angular Rate Estimation Algorithms For Star Tracker-Based Attitude Determination AAS 3-191 Spacecraft Angular Rate Estimation Algorithms For Star Tracker-Based Attitude Determination Puneet Singla John L. Crassidis and John L. Junkins Texas A&M University, College Station, TX 77843

More information

Attitude Estimation for Augmented Reality with Smartphones

Attitude Estimation for Augmented Reality with Smartphones Attitude Estimation for Augmented Reality with Smartphones Thibaud Michel Pierre Genevès Hassen Fourati Nabil Layaïda Université Grenoble Alpes, INRIA LIG, GIPSA-Lab, CNRS June 13 th, 2017 http://tyrex.inria.fr/mobile/benchmarks-attitude

More information

Model Reference Adaptive Control of Underwater Robotic Vehicle in Plane Motion

Model Reference Adaptive Control of Underwater Robotic Vehicle in Plane Motion Proceedings of the 11th WSEAS International Conference on SSTEMS Agios ikolaos Crete Island Greece July 23-25 27 38 Model Reference Adaptive Control of Underwater Robotic Vehicle in Plane Motion j.garus@amw.gdynia.pl

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

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

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

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

More information

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

Robust Attitude Estimation from Uncertain Observations of Inertial Sensors using Covariance Inflated Multiplicative Extended Kalman Filter

Robust Attitude Estimation from Uncertain Observations of Inertial Sensors using Covariance Inflated Multiplicative Extended Kalman Filter IEEE TRANSACTIONS ON INSTRUMENTATION AND MEASUREMENT, VOL. X, NO. X, MONTH X Robust Attitude Estimation from Uncertain Observations of Inertial Sensors using Covariance Inflated Multiplicative Extended

More information

Two dimensional rate gyro bias estimation for precise pitch and roll attitude determination utilizing a dual arc accelerometer array

Two dimensional rate gyro bias estimation for precise pitch and roll attitude determination utilizing a dual arc accelerometer array Rochester Institute of Technology RIT Scholar Works Theses Thesis/Dissertation Collections -- Two dimensional rate gyro bias estimation for precise pitch and roll attitude determination utilizing a dual

More information

Trajectory tracking & Path-following control

Trajectory tracking & Path-following control Cooperative Control of Multiple Robotic Vehicles: Theory and Practice Trajectory tracking & Path-following control EECI Graduate School on Control Supélec, Feb. 21-25, 2011 A word about T Tracking and

More information

A Close Examination of Multiple Model Adaptive Estimation Vs Extended Kalman Filter for Precision Attitude Determination

A Close Examination of Multiple Model Adaptive Estimation Vs Extended Kalman Filter for Precision Attitude Determination A Close Examination of Multiple Model Adaptive Estimation Vs Extended Kalman Filter for Precision Attitude Determination Quang M. Lam LexerdTek Corporation Clifton, VA 4 John L. Crassidis University at

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

Discrete Time-Varying Attitude Complementary Filter

Discrete Time-Varying Attitude Complementary Filter 29 American Control Conference Hyatt Regency Riverfront, St. Louis, MO, USA June 1-12, 29 FrA4.2 Discrete Time-Varying Attitude Complementary Filter J.F. Vasconcelos, C. Silvestre, P. Oliveira, P. Batista,

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

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

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

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

CS491/691: Introduction to Aerial Robotics

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

More information

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

Unit quaternion observer based attitude stabilization of a rigid spacecraft without velocity measurement

Unit quaternion observer based attitude stabilization of a rigid spacecraft without velocity measurement Proceedings of the 45th IEEE Conference on Decision & Control Manchester Grand Hyatt Hotel San Diego, CA, USA, December 3-5, 6 Unit quaternion observer based attitude stabilization of a rigid spacecraft

More information

Multi-layer Flight Control Synthesis and Analysis of a Small-scale UAV Helicopter

Multi-layer Flight Control Synthesis and Analysis of a Small-scale UAV Helicopter Multi-layer Flight Control Synthesis and Analysis of a Small-scale UAV Helicopter Ali Karimoddini, Guowei Cai, Ben M. Chen, Hai Lin and Tong H. Lee Graduate School for Integrative Sciences and Engineering,

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

Nonlinear attitude estimation with measurement decoupling and anti-windup gyro-bias compensation

Nonlinear attitude estimation with measurement decoupling and anti-windup gyro-bias compensation Nonlinear attitude estimation with measurement decoupling and anti-windup gyro-bias compensation Minh-Duc Hua, Konrad Rudin, Guillaume Ducard, Tarek Hamel, Robert Mahony I3S UNS CNRS, Sophia Antipolis,

More information

Research Article Design of an Attitude and Heading Reference System Based on Distributed Filtering for Small UAV

Research Article Design of an Attitude and Heading Reference System Based on Distributed Filtering for Small UAV Mathematical Problems in Engineering Volume 13 Article ID 498739 8 pages http://dx.doi.org/1.1155/13/498739 Research Article Design of an Attitude and Heading System Based on Distributed Filtering for

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

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

Nonlinear State Estimation! Particle, Sigma-Points Filters!

Nonlinear State Estimation! Particle, Sigma-Points Filters! Nonlinear State Estimation! Particle, Sigma-Points Filters! Robert Stengel! Optimal Control and Estimation, MAE 546! Princeton University, 2017!! Particle filter!! Sigma-Points Unscented Kalman ) filter!!

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

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

COMBINED ADAPTIVE CONTROLLER FOR UAV GUIDANCE

COMBINED ADAPTIVE CONTROLLER FOR UAV GUIDANCE COMBINED ADAPTIVE CONTROLLER FOR UAV GUIDANCE B.R. Andrievsky, A.L. Fradkov Institute for Problems of Mechanical Engineering of Russian Academy of Sciences 61, Bolshoy av., V.O., 199178 Saint Petersburg,

More information

TTK4190 Guidance and Control Exam Suggested Solution Spring 2011

TTK4190 Guidance and Control Exam Suggested Solution Spring 2011 TTK4190 Guidance and Control Exam Suggested Solution Spring 011 Problem 1 A) The weight and buoyancy of the vehicle can be found as follows: W = mg = 15 9.81 = 16.3 N (1) B = 106 4 ( ) 0.6 3 3 π 9.81 =

More information

Adaptive Kalman Filter for Orientation Estimation in Micro-sensor Motion Capture

Adaptive Kalman Filter for Orientation Estimation in Micro-sensor Motion Capture 14th International Conference on Information Fusion Chicago, Illinois, USA, July 5-8, 211 Adaptive Kalman Filter for Orientation Estimation in Micro-sensor Motion Capture Shuyan Sun 1,2, Xiaoli Meng 1,2,

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

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

Attitude Estimation for Indoor Navigation and Augmented Reality with Smartphones

Attitude Estimation for Indoor Navigation and Augmented Reality with Smartphones Attitude Estimation for Indoor Navigation and Augmented Reality with Smartphones Thibaud Michel, Pierre Genevès, Hassen Fourati, Nabil Layaïda To cite this version: Thibaud Michel, Pierre Genevès, Hassen

More information

Attitude Estimation and Control of VTOL UAVs

Attitude Estimation and Control of VTOL UAVs Western University Scholarship@Western Electronic Thesis and Dissertation Repository November 2011 Attitude Estimation and Control of VTOL UAVs Andrew D. Roberts The University of Western Ontario Supervisor

More information

Effective Use of Magnetometer Feedback for Smart Projectile Applications

Effective Use of Magnetometer Feedback for Smart Projectile Applications Effective Use of Magnetometer Feedback for Smart Projectile Applications JONATHAN ROGERS and MARK COSTELLO Georgia Institute of Technology, Atlanta, GA, 30332 THOMAS HARKINS US Army Research Laboratory,

More information

MARINE biologists, oceanographers, and other ocean researchers

MARINE biologists, oceanographers, and other ocean researchers IEEE TRANSACTIONS ON CONTROL SYSTEMS TECHNOLOGY, VOL. 19, NO. 1, JANUARY 2011 181 Discrete-Time Complementary Filters for Attitude and Position Estimation: Design, Analysis and Experimental Validation

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

A Sensor Driven Trade Study for Autonomous Navigation Capabilities

A Sensor Driven Trade Study for Autonomous Navigation Capabilities A Sensor Driven Trade Study for Autonomous Navigation Capabilities Sebastián Muñoz and E. Glenn Lightsey The University of Texas at Austin, Austin, TX, 78712 Traditionally, most interplanetary exploration

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

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

ROBUST CONSTRAINED ESTIMATION VIA UNSCENTED TRANSFORMATION. Pramod Vachhani a, Shankar Narasimhan b and Raghunathan Rengaswamy a 1

ROBUST CONSTRAINED ESTIMATION VIA UNSCENTED TRANSFORMATION. Pramod Vachhani a, Shankar Narasimhan b and Raghunathan Rengaswamy a 1 ROUST CONSTRINED ESTIMTION VI UNSCENTED TRNSFORMTION Pramod Vachhani a, Shankar Narasimhan b and Raghunathan Rengaswamy a a Department of Chemical Engineering, Clarkson University, Potsdam, NY -3699, US.

More information

Simultaneous Adaptation of the Process and Measurement Noise Covariances for the UKF Applied to Nanosatellite Attitude Estimation

Simultaneous Adaptation of the Process and Measurement Noise Covariances for the UKF Applied to Nanosatellite Attitude Estimation Preprints of the 9th World Congress The International Federation of Automatic Control Simultaneous Adaptation of the Process and Measurement Noise Covariances for the UKF Applied to Nanosatellite Attitude

More information

2010 Small Satellite Systems and Services Symposium - Funchal, Madeira, Portugal 1

2010 Small Satellite Systems and Services Symposium - Funchal, Madeira, Portugal 1 INTERACTIONS OF POSE ESTIMATION AND ONLINE DYNAMIC MODELING FOR A SMALL INSPECTOR SPACECRAFT Mishari Alarfaj 1 and Forrest Rogers-Marcovitz 2 1 ECE Dept., Carnegie Mellon University, Pittsburgh, PA, USA,

More information

Quaternion-Based Tracking Control Law Design For Tracking Mode

Quaternion-Based Tracking Control Law Design For Tracking Mode A. M. Elbeltagy Egyptian Armed forces Conference on small satellites. 2016 Logan, Utah, USA Paper objectives Introduction Presentation Agenda Spacecraft combined nonlinear model Proposed RW nonlinear attitude

More information

Kalman Filters with Uncompensated Biases

Kalman Filters with Uncompensated Biases Kalman Filters with Uncompensated Biases Renato Zanetti he Charles Stark Draper Laboratory, Houston, exas, 77058 Robert H. Bishop Marquette University, Milwaukee, WI 53201 I. INRODUCION An underlying assumption

More information

Nonlinear Estimation Techniques for Impact Point Prediction of Ballistic Targets

Nonlinear Estimation Techniques for Impact Point Prediction of Ballistic Targets Nonlinear Estimation Techniques for Impact Point Prediction of Ballistic Targets J. Clayton Kerce a, George C. Brown a, and David F. Hardiman b a Georgia Tech Research Institute, Georgia Institute of Technology,

More information

Observabilty Properties and Deterministic Algorithms in Visual-Inertial Structure from Motion

Observabilty Properties and Deterministic Algorithms in Visual-Inertial Structure from Motion Observabilty Properties and Deterministic Algorithms in Visual-Inertial Structure from Motion Agostino Martinelli To cite this version: Agostino Martinelli. Observabilty Properties and Deterministic Algorithms

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

Design of Adaptive Filtering Algorithm for Relative Navigation

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

More information

Attitude Determination System of Small Satellite

Attitude Determination System of Small Satellite Attitude Determination System of Small Satellite Satellite Research Centre Jiun Wei Chia, M. Sheral Crescent Tissera and Kay-Soon Low School of EEE, Nanyang Technological University, Singapore 24 th October

More information

Visual Feedback Attitude Control of a Bias Momentum Micro Satellite using Two Wheels

Visual Feedback Attitude Control of a Bias Momentum Micro Satellite using Two Wheels Visual Feedback Attitude Control of a Bias Momentum Micro Satellite using Two Wheels Fuyuto Terui a, Nobutada Sako b, Keisuke Yoshihara c, Toru Yamamoto c, Shinichi Nakasuka b a National Aerospace Laboratory

More information

Nonlinear Landing Control for Quadrotor UAVs

Nonlinear Landing Control for Quadrotor UAVs Nonlinear Landing Control for Quadrotor UAVs Holger Voos University of Applied Sciences Ravensburg-Weingarten, Mobile Robotics Lab, D-88241 Weingarten Abstract. Quadrotor UAVs are one of the most preferred

More information

Experiments in Control of Rotational Mechanics

Experiments in Control of Rotational Mechanics International Journal of Automation, Control and Intelligent Systems Vol. 2, No. 1, 2016, pp. 9-22 http://www.aiscience.org/journal/ijacis ISSN: 2381-7526 (Print); ISSN: 2381-7534 (Online) Experiments

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

Acceleration of Levenberg-Marquardt method training of chaotic systems fuzzy modeling

Acceleration of Levenberg-Marquardt method training of chaotic systems fuzzy modeling ISSN 746-7233, England, UK World Journal of Modelling and Simulation Vol. 3 (2007) No. 4, pp. 289-298 Acceleration of Levenberg-Marquardt method training of chaotic systems fuzzy modeling Yuhui Wang, Qingxian

More information

RESEARCH ON AEROCRAFT ATTITUDE TESTING TECHNOLOGY BASED ON THE BP ANN

RESEARCH ON AEROCRAFT ATTITUDE TESTING TECHNOLOGY BASED ON THE BP ANN RESEARCH ON AEROCRAFT ATTITUDE TESTING TECHNOLOGY BASED ON THE BP ANN 1 LIANG ZHI-JIAN, 2 MA TIE-HUA 1 Assoc. Prof., Key Laboratory of Instrumentation Science & Dynamic Measurement, North University of

More information

Metric Visual-Inertial Navigation System Using Single Optical Flow Feature

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

More information

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

Presenter: Siu Ho (4 th year, Doctor of Engineering) Other authors: Dr Andy Kerr, Dr Avril Thomson

Presenter: Siu Ho (4 th year, Doctor of Engineering) Other authors: Dr Andy Kerr, Dr Avril Thomson The development and evaluation of a sensor-fusion and adaptive algorithm for detecting real-time upper-trunk kinematics, phases and timing of the sit-to-stand movements in stroke survivors Presenter: Siu

More information

Nonlinear Identification of Backlash in Robot Transmissions

Nonlinear Identification of Backlash in Robot Transmissions Nonlinear Identification of Backlash in Robot Transmissions G. Hovland, S. Hanssen, S. Moberg, T. Brogårdh, S. Gunnarsson, M. Isaksson ABB Corporate Research, Control Systems Group, Switzerland ABB Automation

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

Multiplicative vs. Additive Filtering for Spacecraft Attitude Determination

Multiplicative vs. Additive Filtering for Spacecraft Attitude Determination Multiplicative vs. Additive Filtering for Spacecraft Attitude Determination F. Landis Markley, NASA s Goddard Space Flight Center, Greenbelt, MD, USA Abstract The absence of a globally nonsingular three-parameter

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

Thrust acceleration estimation using an on-line non-linear recursive least squares algorithm

Thrust acceleration estimation using an on-line non-linear recursive least squares algorithm 7 Thrust acceleration estimation using an on-line non-linear recursive least squares algorithm N Ghahramani, A Naghash 2, and F Towhidkhah 2 Department of Aerospace Engineering, Amirkabir University of

More information

I. INTRODUCTION AN INERTIAL measurement unit (IMU) determines the

I. INTRODUCTION AN INERTIAL measurement unit (IMU) determines the IEEE TRANSACTIONS ON INSTRUMENTATION AND MEASUREMENT, VOL. 63, NO. 12, DECEMBER 2014 3137 Observing Relative Motion With Three Accelerometer Triads Patrick Schopp, Hagen Graf, Michael Maurer, Michailas

More information

UNSCENTED KALMAN FILTERING FOR SPACECRAFT ATTITUDE STATE AND PARAMETER ESTIMATION

UNSCENTED KALMAN FILTERING FOR SPACECRAFT ATTITUDE STATE AND PARAMETER ESTIMATION AAS-04-115 UNSCENTED KALMAN FILTERING FOR SPACECRAFT ATTITUDE STATE AND PARAMETER ESTIMATION Matthew C. VanDyke, Jana L. Schwartz, Christopher D. Hall An Unscented Kalman Filter (UKF) is derived in an

More information

A Low-Cost GPS Aided Inertial Navigation System for Vehicular Applications

A Low-Cost GPS Aided Inertial Navigation System for Vehicular Applications A Low-Cost GPS Aided Inertial Navigation System for Vehicular Applications ISAAC SKOG Master of Science Thesis Stockholm, Sweden 2005-03-09 IR-SB-EX-0506 1 Abstract In this report an approach for integration

More information

The Variational Attitude Estimator in the Presence of Bias in Angular Velocity Measurements

The Variational Attitude Estimator in the Presence of Bias in Angular Velocity Measurements The Variational Attitude Estimator in the Presence of Bias in Angular Velocity Measurements Maziar Izadi 1, Sasi Prabhakaran 1, Amit Sanyal 2,, Carlos Silvestre 3, and Paulo Oliveira 4 Abstract Estimation

More information

Design of Advanced Control Techniques for an Underwater Vehicle

Design of Advanced Control Techniques for an Underwater Vehicle Design of Advanced Control Techniques for an Underwater Vehicle Divine Maalouf Advisors: Vincent Creuze Ahmed Chemori René Zapata 5 juillet 2012 OUTLINE I. Introduction: Problems/Challenges II. Modeling

More information

Cascade Attitude Observer for the SLAM filtering problem

Cascade Attitude Observer for the SLAM filtering problem Cascade Attitude Observer for the filtering problem Elias Bjørne Edmund Førland Brekke Tor Arne Johansen Abstract This article presents an attitude observer that exploits both bearing and range measurements

More information

Angle estimation using gyros and accelerometers

Angle estimation using gyros and accelerometers Angle estimation using gyros and accelerometers This version: January 23, 2018 Name: LERTEKNIK REG P-number: Date: AU T O MA RO TI C C O N T L Passed: LINKÖPING Chapter 1 Introduction The purpose of this

More information

Chapter 1. Introduction. 1.1 System Architecture

Chapter 1. Introduction. 1.1 System Architecture Chapter 1 Introduction 1.1 System Architecture The objective of this book is to prepare the reader to do research in the exciting and rapidly developing field of autonomous navigation, guidance, and control

More information

Angle estimation using gyros and accelerometers

Angle estimation using gyros and accelerometers Lab in Dynamical systems and control TSRT21 Angle estimation using gyros and accelerometers This version: January 25, 2017 Name: LERTEKNIK REG P-number: Date: AU T O MA R TI C C O N T OL Passed: LINKÖPING

More information

NONLINEAR ATTITUDE AND GYROSCOPE S BIAS ESTIMATION FOR A VTOL UAV

NONLINEAR ATTITUDE AND GYROSCOPE S BIAS ESTIMATION FOR A VTOL UAV NONLINEAR ATTITUDE AND GYROSCOPE S BIAS ESTIMATION FOR A VTOL UAV Jean Michel Pflimlin,1 Tarek Hamel Philippe Souères Najib Metni LAAS - CNRS, 7, Av. du colonel Roche, 3177 Toulouse I3S - CNRS, Les Algorithmes,

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

FILTERING SOLUTION TO RELATIVE ATTITUDE DETERMINATION PROBLEM USING MULTIPLE CONSTRAINTS

FILTERING SOLUTION TO RELATIVE ATTITUDE DETERMINATION PROBLEM USING MULTIPLE CONSTRAINTS (Preprint) AAS FILTERING SOLUTION TO RELATIVE ATTITUDE DETERMINATION PROBLEM USING MULTIPLE CONSTRAINTS Richard Linares, John L. Crassidis and Yang Cheng INTRODUCTION In this paper a filtering solution

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

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