Attitude Estimation Version 1.0

Size: px
Start display at page:

Download "Attitude Estimation Version 1.0"

Transcription

1 Attitude Estimation Version 1. Francesco Farina May 23, 216 Contents 1 Introduction 2 2 Mathematical background Reference frames and coordinate systems Euler angles Rotation matrices Quaternions Quaternion properties Quaternions and rotations Frame transformation Attitude perturbations Quaternion time derivatives The Kalman Filter Sensors Calibration MEMS underlying models Gyroscope Characterization Accelerometer Characterization Magnetometer Characterization Attitude quaternions from data Attitude through magnetometer and accelerometer Attitude from gyroscope Bibliography 12 1

2 1 Introduction NB. This material is still a work in progress. 2 Mathematical background 2.1 Reference frames and coordinate systems In this paper two reference frames are used. The first one is the Inertial Frame (I) that is a frame in which the first principle of dynamic holds. We assume it to be centered in the earth center. The second one is a non inertial frame and it is called Body Frame (B). It is assumed to be centered at the center of mass of the considered body (the smartphone in our case) and to be aligned with the principal axis of inertia of the body. In particular, regarding the coordinate system used to label the axis of the smartphone in this work, the standard North-East-Down (NED) is used. 2.2 Euler angles Euler angles are a means of representing the spatial orientation of a coordinate system with respect to any reference frame. In particular, for us (φ, θ, ψ) represent the angles between the the (x,y,z) axis of the body frame and the ones of the inertial frame. According to Euler s theorem, the motion of a rigid body with one point fixed, can also be defined as a rotation by an angle φ around some axis (a unit vector e). So, a rotation vector is defined as This is called axis-angle formulation. Problem: Gimbal lock. 2.3 Rotation matrices a = φe. (1) A rotation matrix is a matrix whose multiplication with a vector rotates the vector while preserving its lemgth. In particular, focusing on the orthogonal group of 3 3 rotation matrices (SO(3)), if R SO(3), then the following property holds: detr = 1 (2) R 1 = R T (3) Regarding the rotation of a vector x = [x 1 x 2 x 3 ] T it is performed as x rot = Rx (4) where x rot denotes the rotated vector. The inverse operation is straightforward x = R T x rot. (5) 2

3 In this work we define the rotation matrix that encodes the attitude of a rigid body to be the matrix that if multiply a vector expressed in the body frame yields the same vector expressed in the inertial frame, i.e. x I = Rx B (6) x B = R T x I (7) where the I and B subscripts denotes that vector x is expressed in the inertial or body frame respectively. If different reference frames are use, such as A and B they will be explicitly expressed as x B = R B Ax A = (R A B) T x A (8) x A = (R B A) T x B = R A Bx B. (9) We define a coordinate rotation to be a rotation about a single coordinate axis. Rotation of an angle α about axis x, y and z are define respectively as R 1 (α) = 1 cosα sinα (1) sinα cosα cosα sinα R 2 (α) = 1 (11) sinα cosα cosα sinα R 3 (α) = sinα cosα (12) 1 The conversion between Euler angles and rotation matrices is so unswerving The inverse operation is performed as R(φ,θ,ψ) = R 1 (φ)r 2 (θ)r 3 (ψ). (13) φ θ = ψ atan2(r 2,3,R 3,3 ) arcsin(r 1,3 ) atan2(r 1,2,R 1,1 ), (14) where R i,j denotes the element in row i and column j in R. Ifwe considerthe axisangleformulationinstead, given arotationvectora = φe, the corresponding rotation matrix is given by R(a) = e [a] (15) which through the Taylor expansion leads to the Rodrigues rotation formula R(a) = I 3 3 +sinφ[e] +(1 cosφ)[e] 2. (16) where [ ] is the skew operator, i.e. [a] = a 3 a 2 a 3 a 1 (17) a 2 a 1 3

4 which produces a skew-simmetric matrix, [a] T = [a] starting from any 3- tuple a. The skew operator is very useful in order to rewrite the cross product as a matrix-vector multiplication, [a] b = a b, a,b R 3. (18) Note that, since the cross product is anti-commutative it holds that, Problem: singularity in inversions. 2.4 Quaternions [a] b = [b] a (19) Due to the absence of singularity and Gimbal lock problems, unit quaternions are the best way to represent rotation in space. Following the Hamilton formulation, we represent a quaternion q as a 4-tuple [ q q q = q 1 q], (2) where q is reffered to as the real part, and q as the vector part. Notice that many authors use a different convention for quaternions representation, for example in the JPL formulation a quaternion is defined as q = [q, q ] T. These different choices can lead to the same results presented hereafter, but with differences in details; for example the quaternion multiplication is defined in a different way. Given that the results and the properties in the following hold only with the adopted convention for quaternion representation. q 2 q Quaternion properties The sum of two (or more) quaternions is straightforwardd defined as [ ] p ±q p±q = p±q (21) and it is commutative and associative by definition. The product of two quaternions, denoted by is defined as [ ] p p q q p T q. (22) p q+q p+p q The quaternion product is associative and distributive over the sum, however it must be stressed out that the quaternion product is in general not commutative (as it can be seen by the presence of the cross product), i.e. p q q p. (23) 4

5 The product of two quaternions is bi-linear and can be expressed equivalently with two different matrix products, i.e. where, p q = [p] L q (24) p q = [q] R p (25) [ ] q T [q] L = q I q [q] [ ] q T [q] R = q I q [q] (26) (27) The norm of a quaternion is defined as q = q 2 +q2 1 +q2 2 +q2 3. (28) Given a quaterion q = [q q] T, it can be defined its conjugate q as [ ] q q, (29) q which has the following properties: [ ] q q q = q 2 q = 3 1 The inverse of a quaternion q is defined as (3) (p q) = q p. (31) q 1 = q q. (32) It must be stressed out that for unit quaternions, i.e. q = 1 it holds that q = q 1 (33) Unit quaternions are used for attitude representation since, in general, a quaternion can not only change the orientation of a vector, but its length too. In order to perform rotations only, the norm of the quaternion must remain equat to 1. Unit quaternions can always be written in the form [ ] cosθ q = (34) esinθ where e is a unit vector and θ is a scalar. This property will be used in the following for converting Euler axis-angle representation to quaterion form. Finally, we define the exponential of a quaternion q as e q = e q+q = e q e q, (35) then, using the Euler formula we get [ ] cos q e q = e q q q sin q. (36) This will be useful in the following, when performing quaternion integration. Notice since now that the exponential of a pure quaternion, i.e. q =, is a unit quaternion. 5

6 2.4.2 Quaternions and rotations If we consider the rotation vector a = φe, the corresponding unit quaternion is defined as [ cos φ ] [ ] cos a q(a) = 2 asin φ = 2 a a. (37) 2 a sin 2 Conversely, given a quaternion q φ = atan2( q,q ) (38) e = q q. (39) In order to rotate a vector u by φ around e, the double quaternion product is used, u rot q = q u q q. (4) where u rot q, i.e. denotes the rotated vector, and q is the quaternion form of vector [ x q = x] (41) It can be easily seen unit quaternions and rotation matrices act in a similar way, in fact [ ] q u q q = (42) Rx where R = e [a] is calculated by (16). Given a quaternion q, the corresponding attitude matrix A(q) is defined as A(q) = (q 2 q 2 )I q [q] +2qq T (43) which has the following useful properties Frame transformation A(p)A(q) = A(p q) (44) A( q) = A(q) (45) A(q ) = A(q) T (46) According to the Hamilton formulation, we consider the representation of a vector x B in the body frame to be the mapping of its inertial representation x I by the quaternion q, i.e. x I = q x B q = A(q)x B. (47) The inverse operation is straightforward defined as x B = q x I q = A(q) T x I. (48) 6

7 2.5 Attitude perturbations The quaternion representing the true attitude of a body q can be expressed as the composition of the estimated attitude ˆq and a perturbation of an angle around an axis δq(a), where a is defined in (1), i.e. q = ˆq δq(a) (49) If the perturbation angle is small, then from (37) the perturbation quaternion can be approximated as [ ] [ ] 1 δq(a) a (5) 2 1 a 2 2 a 2 Similarly, the true attitude matrix can be expressed as A(q) = A(ˆq)A(δq(a)) (51) and if the small angle hypothesis holds we can approximate the perturbation matrix as A(δq(a)) I 3 3 +[a] ( a 2 I 3 3 aa T ) I 3 3 +[a] (52) Quaternion time derivatives In order to develop the time derivative of a quaternion q let us consider q = q(t) as the original state and ˆq = q(t+δt) = q δq as the perturbed state, q(t+δt) q(t) q δq q q lim = lim = (53) δt δt δt δt ([ ] [ 1 1 q a/2 ]) = lim (54) δt δt [ ] q a/2 = lim (55) δt δt Then we can note that since a is a local angular perturbation, its derivative corresponds to the angular velocity vector ω, and hence q = 1 2 q ω q (56) Finally we can define the time derivative of the quaternion product as 2.6 The Kalman Filter Work in progress. (p q) = ṗ q +p q (57) 7

8 ωout ωout bω time (s) time (s) Figure 1: On the right the biased output of the gyroscope during a static phase, on the left the unbiased measurements. 3 Sensors Calibration 3.1 MEMS underlying models First of all the models of Micro Electro Mechanical Systems (MEMS) inertial sensors in the IMU are introduced. Supposing no axis misalignment, each sensor can be modeled as follow: x out = x+b x +w x, (58) ḃ x = β x +w bx. (59) where x out is the sensor s output, x is the true reading, b x is the sensor bias, β x is a parameter representing a linear drift of the bias and w x WN(,Σ x ) and w bx WN(,Σ bx ) are respectively the sensor and the bias noises. In the following we denote with ω, g and m the gyroscope, accelerometer and magnetometer readings respectively. 3.2 Gyroscope Characterization In order to characterize the gyroscope, parameters b ω, w ω, β ω and w bω must be identified. To do so, data have to be collected for a sufficiently long static period. Once the data have been collected the bias b ω and the linear bias drift (if present) β ω can be easilycomputed bylinearly interpolatingthe data. In Figure 1 is shown an example of raw and filtered gyroscope data. The measurement and bias noises can be characterized as Σ ω = var(ω out b ω ) (6) ( ) d Σ bω = var dt (ω out b ω ) (61) It must be noted that, by calculating the covariance matrices this way the one of the bias, Σ bω, is probably overestimated. A more accurate way to proceed in order to estimate the noise s variances is to use the Allan variance (see [1]). 8

9 3.3 Accelerometer Characterization The accelerometer calibration follows the same procedure as the one of the gyroscope. A more accurate characterization involves the axis misalignment too. 3.4 Magnetometer Characterization It must be noted that in general the measures of the magnetic field obtained from the magnetometer could be affected by Hard and Soft-iron interferences. In fact, while the magnetometers readings should be distributed on a sphere of radius B centered at the origin, the Hard-Iron interferences add an offset to the measurements and the Soft-Iron ones deform the sphere in an ellipsoid. Hard-iron is due to... Soft-iron is due to... Given that, let us define the magnetic and gravitational reference field in the inertial frame as G I = [ g] T, (62) M I = [Bcosδ Bsinδ] T, (63) where g is the gravity acceleration, B is the geomagnetic field and δ is the geomagnetic field inclination (note that B and δ vary over the Earth s surface). The magnetic measurements are distributed on an ellipsoid defined by (m b m ) T W(m b m ) = B 2 (64) where m are the magnetometer readings and b m and W S 3 + represent respectively the offsets (biases) due to the Hard-Iron and the deformation due to the Soft-Iron interferences. Due to the highly variability of the Soft-Iron interferences in a closed environment (for example inside a building) one can consider the Hard-Iron ones only and filter them out. In order to do it properly, the calibration must be done in an Soft-iron interferences free environment and the data must be collected while moving the body in many direction as possible in order to map the whole magnetic field. If we ignore the term W, we can rewrite (64) as (m b m ) T (m b m ) = B 2, (65) which can be easily solved a least square problem. Suppose we have n > 4 measurements; let us define m x m y m z 1 m x1 m y1 m z1 1 X =.... (66).... m xn m yn m zn 1 m 2 x +m 2 y +m 2 z m 2 x 1 +m 2 y 1 +m 2 z 1 Y =. m 2 x n +m 2 y n +m 2 z n (67) 9

10 mz mzf m y -4-2 m x m yf m xf 2 4 Figure 2: Raw magnetic field readings (in red) and filtered magnetic filed (in blue). 2b mx χ = 2b my 2b mz (68) B 2 b 2 m x b 2 m y b 2 m z. then b m and B from (65) can be computed as the solution of χ = (X T X) 1 X T Y, (69) and the filtered magnetometers reading are can be defined as m f = m b m. (7) An example of raw and filtered magnetometer readings is shown in Figure 2. It is obviously possible to estimate the matrix W in (64) too (see for example [2] or [3] for a general least square ellipsoid fitting algorithm), however it is almost useless in an indoor environment because of the highly variability of the Soft-iron disturbances. Regarding the magnetometer noise characterization, a procedure similar to the one used for the gyroscope can be performed. While it has no sense to identify the bias drift and noise for the magnetometer because of its highly variable nature. 4 Attitude quaternions from data In this section two methods to determine the attitude of a rigid body are presented. The first one involves both the magnetometer and the accelerometer and provides an instantaneous measurement of the body pose, while the second one involves the gyroscope and calculates the current body attitude by integrating the previous one through the measured angular rates. 1

11 4.1 Attitude through magnetometer and accelerometer The accelerometer and magnetometer reading in the body frame can be expressed as g = R 1 (φ)r 2 (θ)r 3 (ψ)g I (71) m f = R 1 (φ)r 2 (θ)r 3 (ψ)m I (72) where φ, θ and ψ are respectively the roll, pitch and yaw angles. The measurements from the accelerometer are used to determine φ and θ, which are used to de-rotate the magnetometer readings in order to obtain the ψ (the angle to the north). Equation (71) can be rewritten as R 2 ( θ)r 1 ( φ)g = R 3 (ψ)g I. (73) Since R 3 (ψ)g I = [ g] T, we obtain cosθ sinθ 1 1 cosφ sinφ G x G y = (74) sinθ cosθ sinφ cosφ G z g which gives: φ = arctan ( gy g z ) ( ) g x θ = arctan g y sinφ+g z cosφ Then, in a similar way we obtain from (72) ( ) m fz sinφ m fy cosφ ψ = arctan m fz cosθ +m fy sinθsinφ+m fx sinθcosφ (75) (76) (77) As a standard convention, in order to have a unique solution, θ [ π/2,π/2] and φ,ψ [ π,π]. An example of the attitude quaternion computed using magnetometer and accelerometer in a Soft-iron free environment is shown in Figure Attitude from gyroscope While using the magnetometer and the accelerometer the attitude can be computed at each time instant, using the gyroscope the attitude is obtained as integration from the initial condition. Let us denote ω = [ω x ω y ω z ] T as the angular rate of the gyroscope, the derivative of the unit quaternion q representing the attitude has been defined in (56) as q = 1 2 q ω q In order to perform a discrete time integration, many method have been proposed, however, in order to preserve the unit length of the quaternion the direct multiplication method is used. 11

12 q q time (s) time (s) Figure 3: Attitude quaternion components. On the left the one obtained using the gyroscope and on the right the one from magnetometer and accelerometer. The unit quaternion at time t+δt can be expressed using the Taylor expansion as q t+δt = q t + q t δt+ 1 2 q tδt (78) where, by using (56) and (57) q t = 1 2 q t ω qt (79) q t = 1 4 q t ωq 2 t q tω q (8) If we suppose ω to be constant over a sampling interval δt, we get ω = and then ( q t+δt = q t ω q t δt+ 1 ( ) ω q t δt +...) (81) Finally, by identifying the Taylor expansion of e ωq t δt/2 in (81) and using (36), we get q t+δt = q t q(ωδt), (82) where q(ωδt) is defined in (37) and δt represents the sampling interval. An example of the computed attitude quaternion is shown in Figure 3. References [1] N. El-Sheimy, H. Hou, and X. Niu, Analysis and modeling of inertial sensors using allan variance, Instrumentation and Measurement, IEEE Transactions on, vol. 57, no. 1, pp , 28. [2] V. Renaudin, M. H. Afzal, and G. Lachapelle, New method for magnetometers based orientation estimation, in Position Location and Navigation Symposium (PLANS), 21 IEEE/ION. IEEE, 21, pp [3] A. Fitzgibbon, M. Pilu, and R. B. Fisher, Direct least square fitting of ellipses, Pattern Analysis and Machine Intelligence, IEEE Transactions on, vol. 21, no. 5, pp ,

13 [4] F. L. Markley, Attitude error representations for kalman filtering, Journal of guidance, control, and dynamics, vol. 26, no. 2, pp ,

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

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

Smartphone sensor based orientation determination for indoor navigation

Smartphone sensor based orientation determination for indoor navigation Smartphone sensor based orientation determination for indoor naviation LBS Conference 15.11.2016 Andreas Ettliner Research Group Enineerin Geodesy Contact: andreas.ettliner@tuwien.ac.at Outline Motivation

More information

Chapter 2 Math Fundamentals

Chapter 2 Math Fundamentals Chapter 2 Math Fundamentals Part 5 2.8 Quaternions 1 Outline 2.8.1 Representations and Notation 2.7.2 Quaternion Multiplication 2.7.3 Other Quaternion Operations 2.7.4 Representing 3D Rotations 2.7.5 Attitude

More information

Ridig Body Motion Homogeneous Transformations

Ridig Body Motion Homogeneous Transformations Ridig Body Motion Homogeneous Transformations Claudio Melchiorri Dipartimento di Elettronica, Informatica e Sistemistica (DEIS) Università di Bologna email: claudio.melchiorri@unibo.it C. Melchiorri (DEIS)

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

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

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

Calibration of a magnetometer in combination with inertial sensors

Calibration of a magnetometer in combination with inertial sensors Calibration of a magnetometer in combination with inertial sensors Manon Kok, Jeroen D. Hol, Thomas B. Schön, Fredrik Gustafsson and Henk Luinge Division of Automatic Control Linköping University, Sweden

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

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

Calibration of a magnetometer in combination with inertial sensors

Calibration of a magnetometer in combination with inertial sensors Calibration of a magnetometer in combination with inertial sensors Manon Kok, Linköping University, Sweden Joint work with: Thomas Schön, Uppsala University, Sweden Jeroen Hol, Xsens Technologies, the

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

Simplified Filtering Estimator for Spacecraft Attitude Determination from Phase Information of GPS Signals

Simplified Filtering Estimator for Spacecraft Attitude Determination from Phase Information of GPS Signals WCE 7, July - 4, 7, London, U.K. Simplified Filtering Estimator for Spacecraft Attitude Determination from Phase Information of GPS Signals S. Purivigraipong, Y. Hashida, and M. Unwin Abstract his paper

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

GPS/INS Tightly coupled position and attitude determination with low-cost sensors Master Thesis

GPS/INS Tightly coupled position and attitude determination with low-cost sensors Master Thesis GPS/INS Tightly coupled position and attitude determination with low-cost sensors Master Thesis Michele Iafrancesco Institute for Communications and Navigation Prof. Dr. Christoph Günther Supervised by

More information

Lecture 9: Modeling and motion models

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

More information

UAV Coordinate Frames and Rigid Body Dynamics

UAV Coordinate Frames and Rigid Body Dynamics Brigham Young University BYU ScholarsArchive All Faculty Publications 24-- UAV oordinate Frames and Rigid Body Dynamics Randal Beard beard@byu.edu Follow this and additional works at: https://scholarsarchive.byu.edu/facpub

More information

Classical Mechanics. Luis Anchordoqui

Classical Mechanics. Luis Anchordoqui 1 Rigid Body Motion Inertia Tensor Rotational Kinetic Energy Principal Axes of Rotation Steiner s Theorem Euler s Equations for a Rigid Body Eulerian Angles Review of Fundamental Equations 2 Rigid body

More information

Rotational Kinematics. Description of attitude kinematics using reference frames, rotation matrices, Euler parameters, Euler angles, and quaternions

Rotational Kinematics. Description of attitude kinematics using reference frames, rotation matrices, Euler parameters, Euler angles, and quaternions Rotational Kinematics Description of attitude kinematics using reference frames, rotation matrices, Euler parameters, Euler angles, and quaternions Recall the fundamental dynamics equations ~ f = d dt

More information

arxiv: v1 [math.ds] 18 Nov 2008

arxiv: v1 [math.ds] 18 Nov 2008 arxiv:0811.2889v1 [math.ds] 18 Nov 2008 Abstract Quaternions And Dynamics Basile Graf basile.graf@epfl.ch February, 2007 We give a simple and self contained introduction to quaternions and their practical

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

arxiv: v1 [cs.sy] 29 Aug 2017

arxiv: v1 [cs.sy] 29 Aug 2017 Quaternions and Attitude Representation Hardik Parwana, Mangal Kothari Department of Aerospace Engineering, Indian Institute of Technology Kanpur, India 1 Attitude Representation arxiv:178.868v1 [cs.sy]

More information

Robotics, Geometry and Control - Rigid body motion and geometry

Robotics, Geometry and Control - Rigid body motion and geometry Robotics, Geometry and Control - Rigid body motion and geometry Ravi Banavar 1 1 Systems and Control Engineering IIT Bombay HYCON-EECI Graduate School - Spring 2008 The material for these slides is largely

More information

NAWCWPNS TM 8128 CONTENTS. Introduction Two-Dimensinal Motion Three-Dimensional Motion Nonrotating Spherical Earth...

NAWCWPNS TM 8128 CONTENTS. Introduction Two-Dimensinal Motion Three-Dimensional Motion Nonrotating Spherical Earth... CONTENTS Introduction... 3 Two-Dimensinal Motion... 3 Three-Dimensional Motion... 5 Nonrotating Spherical Earth...10 Rotating Spherical Earth...12 WGS84...14 Conclusion...14 Appendixes: A. Kalman Filter...15

More information

Chapter 1. Rigid Body Kinematics. 1.1 Introduction

Chapter 1. Rigid Body Kinematics. 1.1 Introduction Chapter 1 Rigid Body Kinematics 1.1 Introduction This chapter builds up the basic language and tools to describe the motion of a rigid body this is called rigid body kinematics. This material will be the

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

Lecture Notes - Modeling of Mechanical Systems

Lecture Notes - Modeling of Mechanical Systems Thomas Bak Lecture Notes - Modeling of Mechanical Systems February 19, 2002 Aalborg University Department of Control Engineering Fredrik Bajers Vej 7C DK-9220 Aalborg Denmark 2 Table of Contents Table

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

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

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

Lecture 37: Principal Axes, Translations, and Eulerian Angles

Lecture 37: Principal Axes, Translations, and Eulerian Angles Lecture 37: Principal Axes, Translations, and Eulerian Angles When Can We Find Principal Axes? We can always write down the cubic equation that one must solve to determine the principal moments But if

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

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

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

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

Torque and Rotation Lecture 7

Torque and Rotation Lecture 7 Torque and Rotation Lecture 7 ˆ In this lecture we finally move beyond a simple particle in our mechanical analysis of motion. ˆ Now we consider the so-called rigid body. Essentially, a particle with extension

More information

Lecture 38: Equations of Rigid-Body Motion

Lecture 38: Equations of Rigid-Body Motion Lecture 38: Equations of Rigid-Body Motion It s going to be easiest to find the equations of motion for the object in the body frame i.e., the frame where the axes are principal axes In general, we can

More information

Kinematics. Basilio Bona. Semester 1, DAUIN Politecnico di Torino. B. Bona (DAUIN) Kinematics Semester 1, / 15

Kinematics. Basilio Bona. Semester 1, DAUIN Politecnico di Torino. B. Bona (DAUIN) Kinematics Semester 1, / 15 Kinematics Basilio Bona DAUIN Politecnico di Torino Semester 1, 2014-15 B. Bona (DAUIN) Kinematics Semester 1, 2014-15 1 / 15 Introduction The kinematic quantities used are: position r, linear velocity

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

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

Chapter 2 Coordinate Systems and Transformations

Chapter 2 Coordinate Systems and Transformations Chapter 2 Coordinate Systems and Transformations 2.1 Coordinate Systems This chapter describes the coordinate systems used in depicting the position and orientation (pose) of the aerial robot and its manipulator

More information

Kinematics. Basilio Bona. October DAUIN - Politecnico di Torino. Basilio Bona (DAUIN - Politecnico di Torino) Kinematics October / 15

Kinematics. Basilio Bona. October DAUIN - Politecnico di Torino. Basilio Bona (DAUIN - Politecnico di Torino) Kinematics October / 15 Kinematics Basilio Bona DAUIN - Politecnico di Torino October 2013 Basilio Bona (DAUIN - Politecnico di Torino) Kinematics October 2013 1 / 15 Introduction The kinematic quantities used are: position r,

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

EE 570: Location and Navigation

EE 570: Location and Navigation EE 570: Location and Navigation Navigation Mathematics: Coordinate Frames Kevin Wedeward Aly El-Osery Electrical Engineering Department, New Mexico Tech Socorro, New Mexico, USA In Collaboration with Stephen

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

Discussions on multi-sensor Hidden Markov Model for human motion identification

Discussions on multi-sensor Hidden Markov Model for human motion identification Acta Technica 62 No. 3A/2017, 163 172 c 2017 Institute of Thermomechanics CAS, v.v.i. Discussions on multi-sensor Hidden Markov Model for human motion identification Nan Yu 1 Abstract. Based on acceleration

More information

Appendix Composite Point Rotation Sequences

Appendix Composite Point Rotation Sequences Appendix Composite Point Rotation Sequences A. Euler Rotations In Chap. 6 we considered composite Euler rotations comprising individual rotations about the x, y and z axes such as R γ,x R β,y R α,z and

More information

Unscented Kalman filter and Magnetic Angular Rate Update (MARU) for an improved Pedestrian Dead-Reckoning

Unscented Kalman filter and Magnetic Angular Rate Update (MARU) for an improved Pedestrian Dead-Reckoning Submitted to the 212 IEEE/ION Position, Location and Navigation Symposium Unscented Kalman filter and Magnetic Angular Rate Update (MARU) for an improved Pedestrian Dead-Reckoning Francisco Zampella, Mohammed

More information

We are IntechOpen, the world s leading publisher of Open Access books Built by scientists, for scientists. International authors and editors

We are IntechOpen, the world s leading publisher of Open Access books Built by scientists, for scientists. International authors and editors We are IntechOpen, the world s leading publisher of Open Access books Built by scientists, for scientists 3,500 108,000 1.7 M Open access books available International authors and editors Downloads Our

More information

Lecture D21 - Pendulums

Lecture D21 - Pendulums J. Peraire 16.07 Dynamics Fall 2004 Version 1.1 ecture D21 - Pendulums A pendulum is a rigid body suspended from a fixed point (hinge) which is offset with respect to the body s center of mass. If all

More information

Lecture 38: Equations of Rigid-Body Motion

Lecture 38: Equations of Rigid-Body Motion Lecture 38: Equations of Rigid-Body Motion It s going to be easiest to find the equations of motion for the object in the body frame i.e., the frame where the axes are principal axes In general, we can

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

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

Kinematics. Basilio Bona. Semester 1, DAUIN Politecnico di Torino. B. Bona (DAUIN) Kinematics Semester 1, / 15

Kinematics. Basilio Bona. Semester 1, DAUIN Politecnico di Torino. B. Bona (DAUIN) Kinematics Semester 1, / 15 Kinematics Basilio Bona DAUIN Politecnico di Torino Semester 1, 2016-17 B. Bona (DAUIN) Kinematics Semester 1, 2016-17 1 / 15 Introduction The kinematic quantities used to represent a body frame are: position

More information

Differential Kinematics

Differential Kinematics Differential Kinematics Relations between motion (velocity) in joint space and motion (linear/angular velocity) in task space (e.g., Cartesian space) Instantaneous velocity mappings can be obtained through

More information

Calibrating an ecompass in the Presence of Hard and Soft-Iron Interference by: Talat Ozyagcilar Applications Engineer

Calibrating an ecompass in the Presence of Hard and Soft-Iron Interference by: Talat Ozyagcilar Applications Engineer Freescale Semiconductor Application Note Document Number: AN4246 Rev. 3, 04/2013 Calibrating an ecompass in the Presence of Hard and Soft-Iron Interference by: Talat Ozyagcilar Applications Engineer 1

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

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

Kinematics (special case) Dynamics gravity, tension, elastic, normal, friction. Energy: kinetic, potential gravity, spring + work (friction)

Kinematics (special case) Dynamics gravity, tension, elastic, normal, friction. Energy: kinetic, potential gravity, spring + work (friction) Kinematics (special case) a = constant 1D motion 2D projectile Uniform circular Dynamics gravity, tension, elastic, normal, friction Motion with a = constant Newton s Laws F = m a F 12 = F 21 Time & Position

More information

Maximum likelihood calibration of a magnetometer using inertial sensors

Maximum likelihood calibration of a magnetometer using inertial sensors Preprints of the 9th World Congress The International Federation of Automatic Control Cape Town, South Africa. August 24-29, 24 Maximum likelihood calibration of a magnetometer using inertial sensors Manon

More information

Position and orientation of rigid bodies

Position and orientation of rigid bodies Robotics 1 Position and orientation of rigid bodies Prof. Alessandro De Luca Robotics 1 1 Position and orientation right-handed orthogonal Reference Frames RF A A z A p AB B RF B z B x B y A rigid body

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

Figure 1: Inverted Pendulum. Why not just make a 4-wheeled or 3-wheeled robot? The following aresome reasons:

Figure 1: Inverted Pendulum. Why not just make a 4-wheeled or 3-wheeled robot? The following aresome reasons: AIM As the name suggests, the robot would be a bicycle balancing autonomously.the self stabilizing bicycle will employ a control system to keep itself from falling over while in motion. INTRODUCTION Bicycles

More information

(3.1) a 2nd-order vector differential equation, as the two 1st-order vector differential equations (3.3)

(3.1) a 2nd-order vector differential equation, as the two 1st-order vector differential equations (3.3) Chapter 3 Kinematics As noted in the Introduction, the study of dynamics can be decomposed into the study of kinematics and kinetics. For the translational motion of a particle of mass m, this decomposition

More information

Vectors in Three Dimensions and Transformations

Vectors in Three Dimensions and Transformations Vectors in Three Dimensions and Transformations University of Pennsylvania 1 Scalar and Vector Functions φ(q 1, q 2,...,q n ) is a scalar function of n variables φ(q 1, q 2,...,q n ) is independent of

More information

Representing Attitude: Euler Angles, Unit Quaternions, and Rotation Vectors

Representing Attitude: Euler Angles, Unit Quaternions, and Rotation Vectors Representing Attitude: Euler Angles, Unit Quaternions, and Rotation Vectors James Diebel Stanford University Stanford, California 94301 9010 Email: diebel@stanford.edu 0 October 006 Abstract We present

More information

EE 570: Location and Navigation

EE 570: Location and Navigation EE 570: Location and Navigation Error Mechanization (ECEF) Aly El-Osery Electrical Engineering Department, New Mexico Tech Socorro, New Mexico, USA April 11, 2013 Attitude Velocity Gravity Position Summary

More information

Chapter 4 The Equations of Motion

Chapter 4 The Equations of Motion Chapter 4 The Equations of Motion Flight Mechanics and Control AEM 4303 Bérénice Mettler University of Minnesota Feb. 20-27, 2013 (v. 2/26/13) Bérénice Mettler (University of Minnesota) Chapter 4 The Equations

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

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

Lecture Note 1: Background

Lecture Note 1: Background ECE5463: Introduction to Robotics Lecture Note 1: Background Prof. Wei Zhang Department of Electrical and Computer Engineering Ohio State University Columbus, Ohio, USA Spring 2018 Lecture 1 (ECE5463 Sp18)

More information

16.333: Lecture #3. Frame Rotations. Euler Angles. Quaternions

16.333: Lecture #3. Frame Rotations. Euler Angles. Quaternions 16.333: Lecture #3 Frame Rotations Euler Angles Quaternions Fall 2004 16.333 3 1 Euler Angles For general applications in 3D, often need to perform 3 separate rotations to relate our inertial frame to

More information

Quaternions. R. J. Renka 11/09/2015. Department of Computer Science & Engineering University of North Texas. R. J.

Quaternions. R. J. Renka 11/09/2015. Department of Computer Science & Engineering University of North Texas. R. J. Quaternions R. J. Renka Department of Computer Science & Engineering University of North Texas 11/09/2015 Definition A quaternion is an element of R 4 with three operations: addition, scalar multiplication,

More information

Position and orientation of rigid bodies

Position and orientation of rigid bodies Robotics 1 Position and orientation of rigid bodies Prof. Alessandro De Luca Robotics 1 1 Position and orientation right-handed orthogonal Reference Frames RF A A p AB B RF B rigid body position: A p AB

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

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

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

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

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

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

Lecture AC-1. Aircraft Dynamics. Copy right 2003 by Jon at h an H ow

Lecture AC-1. Aircraft Dynamics. Copy right 2003 by Jon at h an H ow Lecture AC-1 Aircraft Dynamics Copy right 23 by Jon at h an H ow 1 Spring 23 16.61 AC 1 2 Aircraft Dynamics First note that it is possible to develop a very good approximation of a key motion of an aircraft

More information

Mathematical Models for the Triaxial Attitude Control Testbed

Mathematical Models for the Triaxial Attitude Control Testbed Draft Article (For Engineering Journals) Mathematical Models for the Triaxial Attitude Control Testbed Sangbum Cho, Jinglai Shen, N. Harris McClamroch Department of Aerospace Engineering University of

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

ENHANCED PROPORTIONAL-DERIVATIVE CONTROL OF A MICRO QUADCOPTER

ENHANCED PROPORTIONAL-DERIVATIVE CONTROL OF A MICRO QUADCOPTER ENHANCED PROPORTIONAL-DERIVATIVE CONTROL OF A MICRO QUADCOPTER Norman L. Johnson and Kam K. Leang Department of Mechanical Engineering University of Nevada, Reno Reno, Nevada 897-312, USA ABSTRACT This

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

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

Lesson Rigid Body Dynamics

Lesson Rigid Body Dynamics Lesson 8 Rigid Body Dynamics Lesson 8 Outline Problem definition and motivations Dynamics of rigid bodies The equation of unconstrained motion (ODE) User and time control Demos / tools / libs Rigid Body

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

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

Problem 1: Ship Path-Following Control System (35%)

Problem 1: Ship Path-Following Control System (35%) Problem 1: Ship Path-Following Control System (35%) Consider the kinematic equations: Figure 1: NTNU s research vessel, R/V Gunnerus, and Nomoto model: T ṙ + r = Kδ (1) with T = 22.0 s and K = 0.1 s 1.

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

IMU-Camera Calibration: Observability Analysis

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

More information

Dynamic Modeling of Fixed-Wing UAVs

Dynamic Modeling of Fixed-Wing UAVs Autonomous Systems Laboratory Dynamic Modeling of Fixed-Wing UAVs (Fixed-Wing Unmanned Aerial Vehicles) A. Noth, S. Bouabdallah and R. Siegwart Version.0 1/006 1 Introduction Dynamic modeling is an important

More information

Attitude Regulation About a Fixed Rotation Axis

Attitude Regulation About a Fixed Rotation Axis AIAA Journal of Guidance, Control, & Dynamics Revised Submission, December, 22 Attitude Regulation About a Fixed Rotation Axis Jonathan Lawton Raytheon Systems Inc. Tucson, Arizona 85734 Randal W. Beard

More information

Refinements to the General Methodology Behind Strapdown Airborne Gravimetry

Refinements to the General Methodology Behind Strapdown Airborne Gravimetry Refinements to the General Methodology Behind Strapdown Airborne Gravimetry AE 8900 MS Special Problems Report Space Systems Design Lab (SSDL) Guggenheim School of Aerospace Engineering Georgia Institute

More information

4. Two-level systems. 4.1 Generalities

4. Two-level systems. 4.1 Generalities 4. Two-level systems 4.1 Generalities 4. Rotations and angular momentum 4..1 Classical rotations 4.. QM angular momentum as generator of rotations 4..3 Example of Two-Level System: Neutron Interferometry

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

Chapter 11. Angular Momentum

Chapter 11. Angular Momentum Chapter 11 Angular Momentum Angular Momentum Angular momentum plays a key role in rotational dynamics. There is a principle of conservation of angular momentum. In analogy to the principle of conservation

More information