Lecture 9: Modeling and motion models

Size: px
Start display at page:

Download "Lecture 9: Modeling and motion models"

Transcription

1 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 velocity, acceleration,... in nd. Orientation as integrated angular speed in 2D and 3D. Odometry (Extended) Kalman filter applications

2 Sensor Fusion, 2014 Lecture 9: 2 Lecture 8: Summary Simultaneous Localization And Mapping (SLAM) Joint estimation of trajectory x 1:k and map parameters θ in sensor model y k = h(x k ; θ) + e k. Algorithms: NLS SLAM: iterate between filtering and mapping EKF-SLAM: EKF (information form) on augmented state vector z k = (xk T, θt ) T. FastSLAM: MPF on augmented state vector zk = (xk T, θt ) T.

3 Sensor Fusion, 2014 Lecture 9: 3 Modeling First problem: physics give continuous time model, filters require (linear or nonlinear) discrete time model: Classification Nonlinear Linear Continuous time ẋ = a(x, u) + v ẋ = Ax + Bu + v y = c(x, u) + e y = Cx + Du + e Discrete time x k+1 = f (x, u) + v x k+1 = Fx + Gu + v y = h(x, u) + e y = Hx + Ju + e But first, sampling overview.

4 Sensor Fusion, 2014 Lecture 9: 4 Sampling formulas LTI state space model ẋ = Ax + Bu, y = Cx + Du, x k+1 = Fx + Gu y k = Hx + Ju. u is either input or process noise (then J denotes cross-correlated noise!). Zero order hold sampling assuming the input is piecewise constant: T x(t + T ) = }{{} e AT x(t) + e Aτ B u(t + T τ)dτ 0 F }{{} T = e AT x(t) + e Aτ dτbu(t). 0 First order hold sampling assuming the input is piecewise linear is another option. G

5 Sensor Fusion, 2014 Lecture 9: 5 Sampling formulas Bilinear transformation assumes band-limited input gives 2 z 1 x(t) sx(t) = Ax + Bu T z + 1 M = (I nx T /2A) 1, F = M(I nx + T /2A), G = T /2MB, H = CM, J = D + HG.

6 Sensor Fusion, 2014 Lecture 9: 6 Sampling of nonlinear models There are two options: Discretized linearization (general): 1. Linearization: A = a x(x, u), B = a u(x, u), C = c x(x, u), D = c u(x, u), 2. Sampling: F = e AT, G = T 0 eat dtb, H = C and J = D. Linearized discretization (best, when possible!): 1. Nonlinear sampling: t+t x(t + T ) = f (x(t), u(t)) = x(t) + a(x(τ), u(τ))dτ, t 2. Discretization:F = f x (x k, u k ) and G = f u(x k, u k ).

7 Sensor Fusion, 2014 Lecture 9: 7 Sampling of state noise a v t is continuous white noise with variance Q. T Q a = e f τ Qe (f ) T τ dτ 0 b v t = v k is a stochastic variable which is constant in each sample interval and has variance Q/T. Q b = 1 T T 0 e f τ dτq T 0 e (f ) T τ dτ c v t is a sequence of Dirac impulses active immediately after a sample is taken. Loosely speaking, we assume ẋ = f (x) + k v kδ kt t where v k is discrete white noise with variance TQ. Q c =Te f T Qe (f ) T T

8 Sensor Fusion, 2014 Lecture 9: 8 d v t is white noise such that its total influence during one sample interval is TQ. Q d =TQ e v t is a discrete white noise sequence with variance TQ. That is, we assume that the noise enters immediately after a sample time, so x(t + T ) = f (x(t) + v(t)). Q e =Tg (x)qg (x) T Recommendation: the simple solution in d works fine, but remember the scaling with T!

9 Sensor Fusion, 2014 Lecture 9: 9 Models Continuous time (physical) and discrete time counterparts ẋ(t) = a(x(t), u(t), w(t); θ), x(t + T ) = f (x(t), u(t), w(t); θ, T ). Kinematic models do not attempt to model forces. Black-box multi-purpose. Translation kinematics describes position, often based on F = ma Rotational kinematics describes orientation. Rigid body kinematics combines translational and rotational kinematics. Constrained kinematics. Coordinated turns (circular path motion). Application specific force models. Gray-box models, where θ has to be calibrated (estimated, identified) from data.

10 Sensor Fusion, 2014 Lecture 9: 10 Translational motion with n integrators Translational kinematics models in nd, where p(t) denotes the position X (1D), X, Y (2D) and X, Y, Z (3D), respectively. Another interpretation is p(t) = ψ(t) or p(t) = (φ(t), θ(t), ψ(t)) T. The signal w(t) is process noise for a pure kinematic model and a motion input signal in position, velocity and acceleration, respectively, for the case of using sensed motion as an input rather than as a measurement. State Continuous time ẋ = Discrete time x(t + T ) = x = p w x + Tw ( ) ( ) ( ) ( ) ( ) p 0n I x = n 0n In TI T 2 x + w n x + 2 In w v 0 n 0 n I n 0 n I n TI n x = p 0n In 0n v 0 n 0 n I n x + 0n 0 n w In TIn 2 T 2 In T 3 0 n I n TI n 6 In x + T 2 2 a 0 n 0 n 0 n I In w n 0 n 0 n I n TI n

11 Sensor Fusion, 2014 Lecture 9: 11 Different sampled models of a double integrator State x(t) = (p(t), v(t)) ( ) 0n I n Continuous time A = 0 n 0 ( n ) In TI n ZOH F = 0 n I ( n ) In TI n FOH F = 0 n I ( n ) In TI n BIL F = 0 n I n ( ) 0n B = I ( n T 2 ) G = 2 In ( TI n ) T 2 I n G = TI n ) G = ( T 2 4 In T 2 In C = (I n, 0 n) H = (I n, 0 n) D = 0 n J = 0 n H = (I n, 0 n) J = T 2 6 In H = ( I n, ) T 2 In J = T 2 2 In

12 Sensor Fusion, 2014 Lecture 9: 12 Navigation models Navigation models have access to inertial information. 2D orientation (course, or yaw rate) much easier than 3D orientation

13 Sensor Fusion, 2014 Lecture 9: 13 Rotational kinematics in 2D The course, or yaw, in 2D can be modeled as integrated white noise ψ(t) = w(t), or any higher order of integration. Compare to the tables for translational kinematics with p(t) = ψ and n = 1.

14 Sensor Fusion, 2014 Lecture 9: 14 Coordinated turns in 2D body coordinates Basic motion equations ψ = v x R = v xr 1, a y = v 2 x R = v 2 x R 1 = v x ψ, a x = v x v y v x R = v x v y v x R 1 = v x v y ψ. can be combined to a model suitable for the sensor configuration at hand. For instance, ( ) ψ x = R 1, u = v x, y = R 1 ( vx R ẋ = f (x, u) + w = 1 ) + w 0 is useful when speed is measured, and a vision system delivers a local estimate of (inverse) curve radius.

15 Sensor Fusion, 2014 Lecture 9: 15 Wheel speed sensor Ideal Toothed wheel Unideal Toothed Wheel α δ i Sensor Each tooth passing the sensor (electromagnetic or Hall) gives a pulse. The number n of clock cycles between a number m of teeth are registered within each sample interval. ω(t k ) = 2π N cog (t k t k 1 ) = 2π m N cog T c n. Problems: Angle and time quantization. Synchronization. Angle offsets δ in sensor teeth.

16 Sensor Fusion, 2014 Lecture 9: 16 Virtual sensors Longitudinal velocity, yaw rate and slip on left and right driven wheel (front wheel driven assumed) can be computed from wheel angular speeds if the radii are known: v x = v 3 + v 4 = ω 3r 3 + ω 4 r 4, 2 2 Ψ = ω 3r 3 ω 4 r 4, B s 1 = ω 1r 1 1, s 2 = ω 2r 2 1, v 1 v 2 ) 2 + (R 1 L) 2, ( v 1 = v x 1 + R 1 B 2 ( ) v 2 = v x 1 R 1 B 2 + (R 2 1 L) 2.

17 Sensor Fusion, 2014 Lecture 9: 17 Geometry The formulas are based on geometry, the relation ψ = v x R 1 and notation below. δ 2 α v 2 2 ω 1 ω 2 L ψ R1 R2 B ω 3 R 3 ω 4 R 4

18 Sensor Fusion, 2014 Lecture 9: 18 Odometry Odometry is based on the virtual sensors and the model vx m = ω 3r 3 + ω 4 r 4 2 ω 3 r 3 ψ m =vx m 2 ω 4 r4 1 ω B 3 r 3 ω 4 r t ψ t = ψ 0 + ψ tdt, 0 t X t = X 0 + vt x cos(ψt)dt, 0 t Y t = Y 0 + vt x sin(ψt)dt. 0 to dead-reckon the wheel speeds to a relative position in the global frame. The position (X t (r 3, r 4 ), Y t (r 3, r 4 )) depends on the values of wheel radii r 3 and r 4. Further sources of error come from wheel slip in longitudinal and lateral direction. More sensors needed for navigation.

19 Sensor Fusion, 2014 Lecture 9: 19 Rotational kinematics in 3D Much more complicated in 3D than 2D! Could be a course in itself. Coordinate notation for rotations of a body in local coordinate system (x, y, z) relative to an earth fixed coordinate system: Motion components Rotation Euler angle Angular speed Longitudinal forward motion x Roll φ ω x Lateral motion y Pitch θ ω y Vertical motion z Yaw ψ ω z

20 Sensor Fusion, 2014 Lecture 9: 20 Euler orientation in 3D An earth fixed vector g (for instance the gravitational force) is in the body system oriented as Qg, where Q = Qφ x Qy θ Qz ψ = cos θ 0 sin θ cos ψ sin ψ 0 0 cos φ sin φ sin ψ cos ψ 0 0 sin φ cos φ sin θ 0 cos θ cos θ cos ψ cos θ sin ψ sin θ = sin φ sin θ cos ψ cos φ sin ψ sin φ sin θ sin ψ + cos φ cos ψ sin φ cos θ. cos φ sin θ cos ψ + sin φ sin ψ cos φ sin θ sin ψ sin φ cos ψ cos φ cos θ Note: this result depends on the order of rotations Q x φ Qy θ Qz ψ. Here, the xyz rule is used, but there are other options.

21 Sensor Fusion, 2014 Lecture 9: 21 Euler rotation in 3D When the body rotate with ω, the Euler angles change according to ω x φ 0 0 ω y = 0 + Qφ x θ + Qφ x Qy θ 0 ω z 0 0 ψ The dynamic equation for Euler angles can be derived from this as φ 1 sin(φ) tan(θ) cos(φ) tan(θ) ω x ψ = 0 cos(φ) sin(φ) ω y θ 0 sin(φ) sec(θ) cos(φ) sec(θ) ω z Singularities when θ = ±π/2, can cause numeric divergence!

22 Sensor Fusion, 2014 Lecture 9: 22 Unit quaternions Vector representation: q = (q 0, q 1, q 2, q 3 ) T. Norm constraint of unit quaternion: q T q = 1. Then, the quaternion is defined from the Euler angles as q 0 = cos(φ/2) cos(θ/2) cos(ψ/2) + sin(φ/2) sin(θ/2) sin(ψ/2), q 1 = sin(φ/2) cos(θ/2) cos(ψ/2) cos(φ/2) sin(θ/2) sin(ψ/2), q 2 = cos(φ/2) sin(θ/2) cos(ψ/2) + sin(φ/2) cos(θ/2) sin(ψ/2), q 3 = cos(φ/2) cos(θ/2) sin(ψ/2) sin(φ/2) sin(θ/2) cos(ψ/2). Pros: no singularity, no 2π ambiguity. Cons: more complex and non-intuitive algebra, the norm constraint is a separate challenge. Norm constraint can be handled by projection or as a virtual measurement with small noise.

23 Sensor Fusion, 2014 Lecture 9: 23 Quaternion orientation in 3D The orientation of the vector g in body system is Qg, where q0 2 + q2 1 q2 2 q2 3 2q 1 q 2 2q 0 q 3 2q 0 q 2 + 2q 1 q 3 Q = 2q 0 q 3 + 2q 1 q 2 q0 2 q2 1 + q2 2 q2 3 2q 0 q 1 + 2q 2 q 3 2q 0 q 2 + 2q 1 q 3 2q 2 q 3 + 2q 0 q 1 q0 2 q2 1 q2 2 + q2 3 2q q q 1q 2 2q 0 q 3 2q 1 q 3 + 2q 0 q 2 = 2q 1 q 2 + 2q 0 q 3 2q q q 2q 3 2q 0 q 1. 2q 1 q 3 2q 0 q 2 2q 2 q 3 + 2q 0 q 1 2q q2 3 1

24 Sensor Fusion, 2014 Lecture 9: 24 Quaternion rotation in 3D Rotation with ω gives a dynamic equation for q which can be written in two equivalent forms: q = 1 2 S(ω)q = 1 2 S(q)ω, 0 ω x ω y ω z S(ω) = ω x 0 ω z ω y ω y ω z 0 ω x, ω z ω y ω x 0 q 1 q 2 q 3 S(q) = q 0 q 3 q 2 q 3 q 0 q 1. q 2 q 1 q 0

25 Sensor Fusion, 2014 Lecture 9: 25 Sampled form of quaternion dynamics The ZOH sampling formula q(t + T ) = e 1 2 S(ω(t))T q(t). has actually a closed form solution ( ω(t)t q(t + T ) = cos 2 ) I 4 + T sin 2 (I 4 + T2 S(ω(t)) ) q(t). ( ) ω(t) T 2 ω(t) T 2 S(ω(t)) q(t) The approximation coincides with Euler forward sampling approximation, and has to be used in more complex models where e.g. ω is part of the state vector.

26 Sensor Fusion, 2014 Lecture 9: 26 Double integrated quaternion ( ) q(t) = ω(t) ( 1 2 S(ω(t))q(t) ). w(t) There is no known closed form discretized model. However, the approximate form can be discretized using the chain rule to ( ) (( q(t + T ) T I4 2 S(ω(t))) T S(q(t)) ) ( ) 2 q(t) ω(t + T ) I 3 ω(t) }{{} F (t) ( T S(ω(t))I ) 4 v(t). TI 3

27 Sensor Fusion, 2014 Lecture 9: 27 Rigid body kinematics A multi-purpose model for all kind of navigation problems in 3D (22 states). ṗ v ȧ q ω ḃ acc ḃ gyro 0 I I = S(ω) p v a q ω b acc b gyro v a v ω v acc v gyro Bias states for the accelerometer and gyro have been added as well.

28 Sensor Fusion, 2014 Lecture 9: 28 Sensor model for kinematic model Inertial sensors (gyro, accelerometer, magnetometer) are used as sensors. y acc t y mag t y gyro t = R(q t )(a t g) + b acc t = R(q t )m + b mag t = ω t + b gyro t + et acc, et acc + e mag t, e mag t + e gyro t, e gyro t N ( 0, Rt acc ), N ( 0, Rt mag ), ), N ( 0, R gyro t Bias observable, but special calibration routines are recommended: Stand-still detection. When yt acc g and/or yt gyro 0, the gyro and acc bias is readily read off. Can decrease drift in dead-reckoning from cubic to linear. Ellipse fitting. When waving the sensor over short time intervals, the gyro can be integrated to give accurate orientation, and acc and magnetometer measurements can be transformed to a sphere from an ellipse.

29 Sensor Fusion, 2014 Lecture 9: 29 Tracking models Navigation models have access to inertial information, tracking models have not. Orientation mainly the direction of the velocity vector. Course (yaw rate) critical parameter. Not so big difference of 2D and 3D cases.

30 Sensor Fusion, 2014 Lecture 9: 30 Coordinated turns in 2D world coordinates Cartesian velocity Ẋ = v X Ẏ = v Y v X = ωv Y v Y = ωv X ω = ω v Y 0 0 ω 0 v X X t+t = X + v X ω sin(ωt ) v Y (1 cos(ωt )) ω Y t+t = Y + v X ω (1 cos(ωt )) + v Y ω sin(ωt ) vt+t X = v X cos(ωt ) v Y sin(ωt ) vt+t Y = v X sin(ωt ) + v Y cos(ωt ) ω t+t = ω Polar velocity Ẋ = v cos(h) Ẏ = v sin(h) v = 0 ḣ = ω ω = cos(h) v sin(h) sin(h) v cos(h) X t+t = X + 2v ω sin( ωt 2 ) cos(h + ωt 2 ) Y t+t = Y 2v ω sin( ωt 2 ) sin(h + ωt 2 ) v t+t = v h t+t = h + ωt ω t+t = ω

31 Sensor Fusion, 2014 Lecture 9: 31 Sounding rocket Navigation grade IMU gives accurate dead-reckoning, but drift may cause return at bad places. GPS is restricted for high speeds and high accelerations. Fusion of IMU and GPS when pseudo-ranges are available, with IMU support to tracking loops inside GPS. Loose integration: direct fusion approach y k = p k + e k. Tight integration: TDOA fusion approach y i k = p k p i k /c + t k + e k.

32 Sensor Fusion, 2014 Lecture 9: 32 MC leaning angle Headlight steering, ABS and anti-spin systems require leaning angle. Gyro very expensive for this application. Combination of accelerometers investigated, lateral and downward acc worked fine in EKF. Model, where z y, z z, a 1, a 2, J are constants relating to geometry and inertias of the motorcycle, u = v x x = (ϕ, ϕ, ϕ, ψ, ψ, δ ay, δ az, δ ϕ ) T, y = h(x) = ay ux 4 z y x 3 + z y x4 2 tan(x ( 1) + g sin(x 1 ) + x 6 a ż = ux 4 tan(x 1 ) z z x x4 2 tan2 (x 1 ) ) + g cos(x 1 ) + x 7 ϕ a 1 x 3 + a 2 x4 2 tan(x 1) ux 4 J + x 6

33 Sensor Fusion, 2014 Lecture 9: 33 Virtual yaw rate sensor Yaw rate subject to bias, orientation error increases linearly in time. Wheel speeds also give a gyro, where the orientation error grows linearly in distance, Model, with state vector x k = ( ψ k, ψ k, b k, r ) k,3 r k,4, y 1 k = ψ k + b k + e 1 k, y 2 k = ω 3r nom + ω 4 r nom 2 2 B ω 3 ω 4 r k,3 r k,4 1 ω 3 ω 4 r k,3 r k, e2 k.

34 Sensor Fusion, 2014 Lecture 9: 34 Friction estimation Friction model y k = 1/sµ k + δ k + e k, where y k is the slip, s is the friction dependent slip slope, µ k is the normalized traction force from the engine, δ k a tire radius dependent offset and e k is measurement noise. Kalman filter estimated s adaptively. When s decreases under a threshold, a friction alarm is issued.

35 Sensor Fusion, 2014 Lecture 9: 35 Tire Pressure Monitoring System TPMS required in US since 2007, and in EU from Direct systems (with pressure sensors inside tire) most common, but indirect systems based on wheel speeds (ABS sensors) also on the market. The TPMS by NIRA Dynamics is installed in 4.75 (may 2013) million cars (Audi, VW, Skoda, Seat). Based on many different physical principles and EKF s, including the two ones above!

36 Sensor Fusion, 2014 Lecture 9: 36 Shooter localization Network with 10 microphones around a camp. Shooter aiming inside the camp. Supersonic bullet injects a shock wave followed by an acoustic muzzle blast. Fusion of time differences give shooter position and aiming point. Model, with x being the position of the shooter, y MB k = t 0 + b k + 1 c p k x + e MB k, y SW k = t 0 + b k + 1 r log v 0 v 0 r d k x + 1 c d k p k + e SW k. where d k is an implicit function of the state.

37 Sensor Fusion, 2014 Lecture 9: 37 Shooter localization results WLS loss function illustrates the information in yk MB yk SW, k = 1, 2,..., N = 10. Both shooter position and aiming direction α well estimated for each shot. Also bullet s muzzle speed and ammunition length can be estimated!

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

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

More information

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

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

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

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

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

3 Space curvilinear motion, motion in non-inertial frames

3 Space curvilinear motion, motion in non-inertial frames 3 Space curvilinear motion, motion in non-inertial frames 3.1 In-class problem A rocket of initial mass m i is fired vertically up from earth and accelerates until its fuel is exhausted. The residual mass

More information

Lecture Notes Multibody Dynamics B, wb1413

Lecture Notes Multibody Dynamics B, wb1413 Lecture Notes Multibody Dynamics B, wb1413 A. L. Schwab & Guido M.J. Delhaes Laboratory for Engineering Mechanics Mechanical Engineering Delft University of Technolgy The Netherlands June 9, 29 Contents

More information

Draft 01PC-73 Sensor fusion for accurate computation of yaw rate and absolute velocity

Draft 01PC-73 Sensor fusion for accurate computation of yaw rate and absolute velocity Draft PC-73 Sensor fusion for accurate computation of yaw rate and absolute velocity Fredrik Gustafsson Department of Electrical Engineering, Linköping University, Sweden Stefan Ahlqvist, Urban Forssell,

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

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

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

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

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

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

Lecture 2: Controllability of nonlinear systems

Lecture 2: Controllability of nonlinear systems DISC Systems and Control Theory of Nonlinear Systems 1 Lecture 2: Controllability of nonlinear systems Nonlinear Dynamical Control Systems, Chapter 3 See www.math.rug.nl/ arjan (under teaching) for info

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

CHAPTER 1. Introduction

CHAPTER 1. Introduction CHAPTER 1 Introduction Linear geometric control theory was initiated in the beginning of the 1970 s, see for example, [1, 7]. A good summary of the subject is the book by Wonham [17]. The term geometric

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

DIFFERENTIAL KINEMATICS. Geometric Jacobian. Analytical Jacobian. Kinematic singularities. Kinematic redundancy. Inverse differential kinematics

DIFFERENTIAL KINEMATICS. Geometric Jacobian. Analytical Jacobian. Kinematic singularities. Kinematic redundancy. Inverse differential kinematics DIFFERENTIAL KINEMATICS relationship between joint velocities and end-effector velocities Geometric Jacobian Analytical Jacobian Kinematic singularities Kinematic redundancy Inverse differential kinematics

More information

Linear System Theory

Linear System Theory Linear System Theory Wonhee Kim Chapter 6: Controllability & Observability Chapter 7: Minimal Realizations May 2, 217 1 / 31 Recap State space equation Linear Algebra Solutions of LTI and LTV system Stability

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

Classical Mechanics Comprehensive Exam Solution

Classical Mechanics Comprehensive Exam Solution Classical Mechanics Comprehensive Exam Solution January 31, 011, 1:00 pm 5:pm Solve the following six problems. In the following problems, e x, e y, and e z are unit vectors in the x, y, and z directions,

More information

AB-267 DYNAMICS & CONTROL OF FLEXIBLE AIRCRAFT

AB-267 DYNAMICS & CONTROL OF FLEXIBLE AIRCRAFT FLÁIO SILESTRE DYNAMICS & CONTROL OF FLEXIBLE AIRCRAFT LECTURE NOTES LAGRANGIAN MECHANICS APPLIED TO RIGID-BODY DYNAMICS IMAGE CREDITS: BOEING FLÁIO SILESTRE Introduction Lagrangian Mechanics shall be

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

Control Systems Design

Control Systems Design ELEC4410 Control Systems Design Lecture 14: Controllability Julio H. Braslavsky julio@ee.newcastle.edu.au School of Electrical Engineering and Computer Science Lecture 14: Controllability p.1/23 Outline

More information

Question 1: A particle starts at rest and moves along a cycloid whose equation is. 2ay y a

Question 1: A particle starts at rest and moves along a cycloid whose equation is. 2ay y a Stephen Martin PHYS 10 Homework #1 Question 1: A particle starts at rest and moves along a cycloid whose equation is [ ( ) a y x = ± a cos 1 + ] ay y a There is a gravitational field of strength g in the

More information

TSRT14: Sensor Fusion Lecture 9

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

More information

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

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

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

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

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

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

More information

Rotational & Rigid-Body Mechanics. Lectures 3+4

Rotational & Rigid-Body Mechanics. Lectures 3+4 Rotational & Rigid-Body Mechanics Lectures 3+4 Rotational Motion So far: point objects moving through a trajectory. Next: moving actual dimensional objects and rotating them. 2 Circular Motion - Definitions

More information

Rigid body simulation. Once we consider an object with spatial extent, particle system simulation is no longer sufficient

Rigid body simulation. Once we consider an object with spatial extent, particle system simulation is no longer sufficient Rigid body dynamics Rigid body simulation Once we consider an object with spatial extent, particle system simulation is no longer sufficient Rigid body simulation Unconstrained system no contact Constrained

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

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

PLANAR KINETIC EQUATIONS OF MOTION (Section 17.2)

PLANAR KINETIC EQUATIONS OF MOTION (Section 17.2) PLANAR KINETIC EQUATIONS OF MOTION (Section 17.2) We will limit our study of planar kinetics to rigid bodies that are symmetric with respect to a fixed reference plane. As discussed in Chapter 16, when

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

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

ROBOTICS 01PEEQW. Basilio Bona DAUIN Politecnico di Torino

ROBOTICS 01PEEQW. Basilio Bona DAUIN Politecnico di Torino ROBOTICS 01PEEQW Basilio Bona DAUIN Politecnico di Torino Kinematic Functions Kinematic functions Kinematics deals with the study of four functions(called kinematic functions or KFs) that mathematically

More information

Robot Dynamics II: Trajectories & Motion

Robot Dynamics II: Trajectories & Motion Robot Dynamics II: Trajectories & Motion Are We There Yet? METR 4202: Advanced Control & Robotics Dr Surya Singh Lecture # 5 August 23, 2013 metr4202@itee.uq.edu.au http://itee.uq.edu.au/~metr4202/ 2013

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

Dynamics and Control of the GyroPTO Wave Energy Point Absorber under Sea Waves

Dynamics and Control of the GyroPTO Wave Energy Point Absorber under Sea Waves Available online at www.sciencedirect.com ScienceDirect Procedia Engineering 99 (7) 88 8 X International Conference on Structural Dynamics, EURODYN 7 Dynamics and Control of the GyroPTO Wave Energy Point

More information

Chapter 3 Numerical Methods

Chapter 3 Numerical Methods Chapter 3 Numerical Methods Part 3 3.4 Differential Algebraic Systems 3.5 Integration of Differential Equations 1 Outline 3.4 Differential Algebraic Systems 3.4.1 Constrained Dynamics 3.4.2 First and Second

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

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

CP1 REVISION LECTURE 3 INTRODUCTION TO CLASSICAL MECHANICS. Prof. N. Harnew University of Oxford TT 2017

CP1 REVISION LECTURE 3 INTRODUCTION TO CLASSICAL MECHANICS. Prof. N. Harnew University of Oxford TT 2017 CP1 REVISION LECTURE 3 INTRODUCTION TO CLASSICAL MECHANICS Prof. N. Harnew University of Oxford TT 2017 1 OUTLINE : CP1 REVISION LECTURE 3 : INTRODUCTION TO CLASSICAL MECHANICS 1. Angular velocity and

More information

CIS 4930/6930: Principles of Cyber-Physical Systems

CIS 4930/6930: Principles of Cyber-Physical Systems CIS 4930/6930: Principles of Cyber-Physical Systems Chapter 2: Continuous Dynamics Hao Zheng Department of Computer Science and Engineering University of South Florida H. Zheng (CSE USF) CIS 4930/6930:

More information

Real-time Attitude Estimation Techniques Applied to a Four Rotor Helicopter

Real-time Attitude Estimation Techniques Applied to a Four Rotor Helicopter 43rd IEEE Conference on Decision and Control December 14-17, 4 Atlantis, Paradise Island, Bahamas ThC9.3 Real- Attitude Estimation Techniques Applied to a Four Rotor Helicopter Matthew G. Earl and Raffaello

More information

Controller Design and Position Estimation of a Unicycle Type Robot

Controller Design and Position Estimation of a Unicycle Type Robot Department of Mathematics and Computer Science Architecture of Information Systems Research Group Controller Design and Position Estimation of a Unicycle Type Robot Internship report Aniket Sharma DC 2017.015

More information

Consistent Triangulation for Mobile Robot Localization Using Discontinuous Angular Measurements

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

More information

Distance travelled time taken and if the particle is a distance s(t) along the x-axis, then its instantaneous speed is:

Distance travelled time taken and if the particle is a distance s(t) along the x-axis, then its instantaneous speed is: Chapter 1 Kinematics 1.1 Basic ideas r(t) is the position of a particle; r = r is the distance to the origin. If r = x i + y j + z k = (x, y, z), then r = r = x 2 + y 2 + z 2. v(t) is the velocity; v =

More information

Circular motion. Aug. 22, 2017

Circular motion. Aug. 22, 2017 Circular motion Aug. 22, 2017 Until now, we have been observers to Newtonian physics through inertial reference frames. From our discussion of Newton s laws, these are frames which obey Newton s first

More information

13 Path Planning Cubic Path P 2 P 1. θ 2

13 Path Planning Cubic Path P 2 P 1. θ 2 13 Path Planning Path planning includes three tasks: 1 Defining a geometric curve for the end-effector between two points. 2 Defining a rotational motion between two orientations. 3 Defining a time function

More information

Nonlinear Control Systems 1. - Introduction to Nonlinear Systems

Nonlinear Control Systems 1. - Introduction to Nonlinear Systems Nonlinear Control Systems 1. - Introduction to Nonlinear Systems Dept. of Electrical Engineering Department of Electrical Engineering University of Notre Dame, USA EE658-1 Nonlinear Control Systems 1.

More information

ELEC4631 s Lecture 2: Dynamic Control Systems 7 March Overview of dynamic control systems

ELEC4631 s Lecture 2: Dynamic Control Systems 7 March Overview of dynamic control systems ELEC4631 s Lecture 2: Dynamic Control Systems 7 March 2011 Overview of dynamic control systems Goals of Controller design Autonomous dynamic systems Linear Multi-input multi-output (MIMO) systems Bat flight

More information

Digital Communications

Digital Communications Digital Communications Chapter 5 Carrier and Symbol Synchronization Po-Ning Chen, Professor Institute of Communications Engineering National Chiao-Tung University, Taiwan Digital Communications Ver 218.7.26

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

Chapters 10 & 11: Rotational Dynamics Thursday March 8 th

Chapters 10 & 11: Rotational Dynamics Thursday March 8 th Chapters 10 & 11: Rotational Dynamics Thursday March 8 th Review of rotational kinematics equations Review and more on rotational inertia Rolling motion as rotation and translation Rotational kinetic energy

More information

Assignments VIII and IX, PHYS 301 (Classical Mechanics) Spring 2014 Due 3/21/14 at start of class

Assignments VIII and IX, PHYS 301 (Classical Mechanics) Spring 2014 Due 3/21/14 at start of class Assignments VIII and IX, PHYS 301 (Classical Mechanics) Spring 2014 Due 3/21/14 at start of class Homeworks VIII and IX both center on Lagrangian mechanics and involve many of the same skills. Therefore,

More information

Optimization-Based Control

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

More information

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

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

More information

Nonholonomic Constraints Examples

Nonholonomic Constraints Examples Nonholonomic Constraints Examples Basilio Bona DAUIN Politecnico di Torino July 2009 B. Bona (DAUIN) Examples July 2009 1 / 34 Example 1 Given q T = [ x y ] T check that the constraint φ(q) = (2x + siny

More information

Linearization problem. The simplest example

Linearization problem. The simplest example Linear Systems Lecture 3 1 problem Consider a non-linear time-invariant system of the form ( ẋ(t f x(t u(t y(t g ( x(t u(t (1 such that x R n u R m y R p and Slide 1 A: f(xu f(xu g(xu and g(xu exist and

More information

CONTROL OF THE NONHOLONOMIC INTEGRATOR

CONTROL OF THE NONHOLONOMIC INTEGRATOR June 6, 25 CONTROL OF THE NONHOLONOMIC INTEGRATOR R. N. Banavar (Work done with V. Sankaranarayanan) Systems & Control Engg. Indian Institute of Technology, Bombay Mumbai -INDIA. banavar@iitb.ac.in Outline

More information

EE 565: Position, Navigation, and Timing

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

More information

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

Lecture 19 Observability and state estimation

Lecture 19 Observability and state estimation EE263 Autumn 2007-08 Stephen Boyd Lecture 19 Observability and state estimation state estimation discrete-time observability observability controllability duality observers for noiseless case continuous-time

More information

Lecture 13 REVIEW. Physics 106 Spring What should we know? What should we know? Newton s Laws

Lecture 13 REVIEW. Physics 106 Spring What should we know? What should we know? Newton s Laws Lecture 13 REVIEW Physics 106 Spring 2006 http://web.njit.edu/~sirenko/ What should we know? Vectors addition, subtraction, scalar and vector multiplication Trigonometric functions sinθ, cos θ, tan θ,

More information

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

(W: 12:05-1:50, 50-N202) 2016 School of Information Technology and Electrical Engineering at the University of Queensland Schedule of Events Week Date Lecture (W: 12:05-1:50, 50-N202) 1 27-Jul Introduction 2 Representing Position

More information

EN Nonlinear Control and Planning in Robotics Lecture 2: System Models January 28, 2015

EN Nonlinear Control and Planning in Robotics Lecture 2: System Models January 28, 2015 EN53.678 Nonlinear Control and Planning in Robotics Lecture 2: System Models January 28, 25 Prof: Marin Kobilarov. Constraints The configuration space of a mechanical sysetm is denoted by Q and is assumed

More information

Dynamic - Engineering Mechanics 131

Dynamic - Engineering Mechanics 131 Dynamic - Engineering Mechanics 131 Stefan Damkjar Winter of 2012 2 Contents 1 General Principles 7 1.1 Mechanics..................................... 7 1.2 Fundamental Concepts..............................

More information

Simple Car Dynamics. Outline. Claude Lacoursière HPC2N/VRlab, Umeå Universitet, Sweden, May 18, 2005

Simple Car Dynamics. Outline. Claude Lacoursière HPC2N/VRlab, Umeå Universitet, Sweden, May 18, 2005 Simple Car Dynamics Claude Lacoursière HPC2N/VRlab, Umeå Universitet, Sweden, and CMLabs Simulations, Montréal, Canada May 18, 2005 Typeset by FoilTEX May 16th 2005 Outline basics of vehicle dynamics different

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

Robotics & Automation. Lecture 25. Dynamics of Constrained Systems, Dynamic Control. John T. Wen. April 26, 2007

Robotics & Automation. Lecture 25. Dynamics of Constrained Systems, Dynamic Control. John T. Wen. April 26, 2007 Robotics & Automation Lecture 25 Dynamics of Constrained Systems, Dynamic Control John T. Wen April 26, 2007 Last Time Order N Forward Dynamics (3-sweep algorithm) Factorization perspective: causal-anticausal

More information

EEE 187: Take Home Test #2

EEE 187: Take Home Test #2 EEE 187: Take Home Test #2 Date: 11/30/2017 Due : 12/06/2017 at 5pm 1 Please read. Two versions of the exam are proposed. You need to solve one only. Version A: Four problems, Python is required for some

More information

Final Exam Spring 2014 May 05, 2014

Final Exam Spring 2014 May 05, 2014 95.141 Final Exam Spring 2014 May 05, 2014 Section number Section instructor Last/First name Last 3 Digits of Student ID Number: Answer all questions, beginning each new question in the space provided.

More information

Hamiltonian. March 30, 2013

Hamiltonian. March 30, 2013 Hamiltonian March 3, 213 Contents 1 Variational problem as a constrained problem 1 1.1 Differential constaint......................... 1 1.2 Canonic form............................. 2 1.3 Hamiltonian..............................

More information

Calculus of Variations Summer Term 2015

Calculus of Variations Summer Term 2015 Calculus of Variations Summer Term 2015 Lecture 14 Universität des Saarlandes 24. Juni 2015 c Daria Apushkinskaya (UdS) Calculus of variations lecture 14 24. Juni 2015 1 / 20 Purpose of Lesson Purpose

More information

Dynamics. Basilio Bona. Semester 1, DAUIN Politecnico di Torino. B. Bona (DAUIN) Dynamics Semester 1, / 18

Dynamics. Basilio Bona. Semester 1, DAUIN Politecnico di Torino. B. Bona (DAUIN) Dynamics Semester 1, / 18 Dynamics Basilio Bona DAUIN Politecnico di Torino Semester 1, 2016-17 B. Bona (DAUIN) Dynamics Semester 1, 2016-17 1 / 18 Dynamics Dynamics studies the relations between the 3D space generalized forces

More information

Modeling and Solving Constraints. Erin Catto Blizzard Entertainment

Modeling and Solving Constraints. Erin Catto Blizzard Entertainment Modeling and Solving Constraints Erin Catto Blizzard Entertainment Basic Idea Constraints are used to simulate joints, contact, and collision. We need to solve the constraints to stack boxes and to keep

More information

Vehicle Dynamics of Redundant Mobile Robots with Powered Caster Wheels

Vehicle Dynamics of Redundant Mobile Robots with Powered Caster Wheels Vehicle Dynamics of Redundant Mobile Robots with Powered Caster Wheels Yuan Ping Li * and Teresa Zielinska and Marcelo H. Ang Jr.* and Wei Lin * National University of Singapore, Faculty of Engineering,

More information

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

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

More information

Robotics, Geometry and Control - A Preview

Robotics, Geometry and Control - A Preview Robotics, Geometry and Control - A Preview Ravi Banavar 1 1 Systems and Control Engineering IIT Bombay HYCON-EECI Graduate School - Spring 2008 Broad areas Types of manipulators - articulated mechanisms,

More information

Dynamics and Control of Rotorcraft

Dynamics and Control of Rotorcraft Dynamics and Control of Rotorcraft Helicopter Aerodynamics and Dynamics Abhishek Department of Aerospace Engineering Indian Institute of Technology, Kanpur February 3, 2018 Overview Flight Dynamics Model

More information

Observability and state estimation

Observability and state estimation EE263 Autumn 2015 S Boyd and S Lall Observability and state estimation state estimation discrete-time observability observability controllability duality observers for noiseless case continuous-time observability

More information

ω avg [between t 1 and t 2 ] = ω(t 1) + ω(t 2 ) 2

ω avg [between t 1 and t 2 ] = ω(t 1) + ω(t 2 ) 2 PHY 302 K. Solutions for problem set #9. Textbook problem 7.10: For linear motion at constant acceleration a, average velocity during some time interval from t 1 to t 2 is the average of the velocities

More information

Lecture 5 Least-squares

Lecture 5 Least-squares EE263 Autumn 2008-09 Stephen Boyd Lecture 5 Least-squares least-squares (approximate) solution of overdetermined equations projection and orthogonality principle least-squares estimation BLUE property

More information

Development of an Extended Operational States Observer of a Power Assist Wheelchair

Development of an Extended Operational States Observer of a Power Assist Wheelchair Development of an Extended Operational States Observer of a Power Assist Wheelchair Sehoon Oh Institute of Industrial Science Universit of Toko 4-6-, Komaba, Meguro, Toko, 53-855 Japan sehoon@horilab.iis.u-toko.ac.jp

More information

Lecture 13 Visual Inertial Fusion

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

More information

MAE 142 Homework #5 Due Friday, March 13, 2009

MAE 142 Homework #5 Due Friday, March 13, 2009 MAE 142 Homework #5 Due Friday, March 13, 2009 Please read through the entire homework set before beginning. Also, please label clearly your answers and summarize your findings as concisely as possible.

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

Lecture Schedule Week Date Lecture (M: 2:05p-3:50, 50-N202)

Lecture Schedule Week Date Lecture (M: 2:05p-3:50, 50-N202) J = x θ τ = J T F 2018 School of Information Technology and Electrical Engineering at the University of Queensland Lecture Schedule Week Date Lecture (M: 2:05p-3:50, 50-N202) 1 23-Jul Introduction + Representing

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

Mobile Robots Localization

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

More information

Physics 106b/196b Problem Set 9 Due Jan 19, 2007

Physics 106b/196b Problem Set 9 Due Jan 19, 2007 Physics 06b/96b Problem Set 9 Due Jan 9, 2007 Version 3: January 8, 2007 This problem set focuses on dynamics in rotating coordinate systems (Section 5.2), with some additional early material on dynamics

More information

Robotics. Dynamics. Marc Toussaint U Stuttgart

Robotics. Dynamics. Marc Toussaint U Stuttgart Robotics Dynamics 1D point mass, damping & oscillation, PID, dynamics of mechanical systems, Euler-Lagrange equation, Newton-Euler recursion, general robot dynamics, joint space control, reference trajectory

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

Sinusoids. Amplitude and Magnitude. Phase and Period. CMPT 889: Lecture 2 Sinusoids, Complex Exponentials, Spectrum Representation

Sinusoids. Amplitude and Magnitude. Phase and Period. CMPT 889: Lecture 2 Sinusoids, Complex Exponentials, Spectrum Representation Sinusoids CMPT 889: Lecture Sinusoids, Complex Exponentials, Spectrum Representation Tamara Smyth, tamaras@cs.sfu.ca School of Computing Science, Simon Fraser University September 6, 005 Sinusoids are

More information