Time Optimal Flight of a Hexacopter

Size: px
Start display at page:

Download "Time Optimal Flight of a Hexacopter"

Transcription

1 Time Optimal Flight of a Hexacopter Johan Vertens an Fabian Fischer Abstract This project presents a way to calculate a time optimal control path of a hexacopter using irect multiple shooting in Matlab an the coe generate integrators from the ACADO toolkit The path is along some waypoints an within constraints A physical moel of the hexacopter an some example trajectories are also presente The trajectory was simulate in Matlab an visualize with RViz from ROS T T T T6 T T I INTRODUCTION In this project we calculate an optimal control of a hexacopter using irect Multiple Shooting The goal was to let a multi-rotor system with 6 rotors fly along some waypoints an within some given constraints, eg on angle an spee We use a physical moel of the hexacopter an Matlab s fmincon in combination with a runge kutta integrator of the orer four for the control an trajectory calculation The trajectory was then visualize using a Matlab-ROS brige an the ROS tool RViz The hexacopter moel is presente in Section II, while the control calculation is presente in Section III In the final Section IV we present two example trajectories II H EXACOPTER M ODE For simulating the hexacopter within Matlab we implemente a moel of the system an p-regulators consisting of orinary ifferential equations (ODE) Movement of the hexacopter can be generate by changing the thrusts of the ifferent motors (T T6, Fig ) which leas to a change of the torques an the velocities In orer to compensate the rotational moment of the motors there are three motors spinning right an three motors spinning left The torques can be escribe with the following equation The motor thrusts are negative here because the z axis is pointing ownwars T Mx M = y Mz T T T () T T T6 T : total thrust T T6 : thrust of each motor Mx, My, Mz : torques of the x, y an z axis : istance between the motor axis an the center of the hexacopter Optimal Control an Estimation Course, Final Project Albert-uwigs University of Freiburg, Faculty of Engineering mg Fig Thrusts of the motors [] With the calculate torques it is easily possible to compute also the velocities an the accelerations of the system Here the translation-velocities are in the coorinate system of the worl, while the angular velocities an angular accelerations are in the coorinate system of the hexacopter We summarize all quantities of interest: v x, v y, v z : Accelerations in x-, y- an z ωx, ωy, ωz : Angular velocities of x-,y- an z x, y, z : Velocities of x-, y- un z Θ : Pitch angle Φ : Roll angle Ψ : Yaw angle Ky : Propeller-yaw ratio : Yaw moment of the motors Jmp : Inertia of a propeller Jx, Jy, Jz : Inertia of the hexacopter For the moel equation part we use the moel from Baranek et al presente in [6] The accelerations in the local coorinate system of the hexacopter can be moele in the following way: v x = vz ωy + vy ωz g sin(θ) v y = vx ωz + vz ωx + g cos(θ) sin(φ) T v z = vy ωx + vx ωy + g cos(θ) cos(φ) m ()

2 x The angular accelerations are moele with: ( ωy ωz (Jz Jy ) + Mx + Ky Jmp Mz ωy ) Jx ω y = ( ωx ωz (Jx Jz ) + My + Ky Jmp Mz ωx ) Jy Mz ω z = Jz z Pitch Θ ω x = () y Roll Φ Yaw Ψ The angular velocities are moele with: Θ = ωy cos(φ) ωz sin(φ) Φ = ωx + ωy sin(φ) tan(θ) + ωz cos(φ) tan(θ) cos(φ) sin(φ) + ωz Ψ = ωy cos(θ) cos(θ) () Fig ocal coorinate system of the hexacopter [] TABE I PARAMETERS The velocities of the hexacopter in the worl coorinate system are moele with: x = cos(φ) cos(θ)vx + ( sin(ψ) cos(φ) + cos(ψ) sin(θ) sin(φ))vy + (sin(ψ) sin(φ) + cos(ψ) sin(θ) cos(φ))vz Parameter Ky Jmp Jx Jy Jz Value 68 kgm s 6 kgm s 6 kgm s 98 kgm s Nm Parameter P P P D D D Value y = sin(φ) cos(θ)vx + ( cos(ψ) cos(φ) + sin(ψ) sin(θ) sin(φ))vy () + ( cos(ψ) sin(φ) + sin(ψ) sin(θ) cos(φ))vz z = sin(θ)vx + cos(θ) sin(φ)vy + cos(θ) cos(φ)vz A PD Regulators The PD-regulators are controlling the motor thrusts with respect to angle inputs in orer to be able to control roll, pitch an yaw (Fig ), while the total thrust is controlle irectly without any regulator The resulting controls from the PD s (Rpitch, Rroll, Ryaw ) are combine in a motor mixer function Eq9 to calculate the esire thrusts of each motor This function is part of the microcopter river [] In conclusion the control inputs of the moel are then upitch, uroll, uyaw an uthrust The parameters given in Tab I were obtaine from Soliworks simulations an experiments A overview of the inputs is represente in Fig epitch (t) Rroll = P eroll (t) + D eroll (t) Ryaw = P eyaw (t) + D eyaw (t) with the equations in (7,8): Rpitch = P epitch (t) + D eyaw (t) = Ψ(t) uyaw (t) T = uthrust + + δyaw T = uthrust + δroll + δyaw T = uthrust + δroll + δyaw T = uthrust δyaw T = uthrust δroll + δyaw T6 = uthrust δroll + δyaw with Eq : (8) (9) (6) ppitch proll δroll = 7 δyaw = pyaw = epitch (t) = Θ(t) upitch (t) eroll (t) = Φ(t) uroll (t) epitch (t) ωx eroll (t) ωy eyaw (t) ωz (7) () ()

3 Controls Desire angles PD Pitch PD Roll PD Yaw subject to: x x = f (s i,q i ) s i+ =,i {,,N } \ {i(),,i(m )} P f (s i,q i ) x i+ =,i {i(),i(),,i(m )} x min x i x max,i {,,N} u min u i u max,i {,,N } T min T i T max,i {,,N} Total thrust Fig Motor mixer ODE Moel structure III OPTIMIZATION MODE The problem is to fin a time optimal trajectory from a starting point x to a terminal point x m via some k = m waypoints x k A Problem escription Because this is a time optimal problem we use the metho in [] by aing a free variable T which is constant between two waypoints to the state x of the system The scaling factor T can be change, but only at a waypoint state s i(k) This way it is possible to fin a time optimal flight path between two waypoints, which then also leas to an overall time optimal flight path The augmente state s an system function f (s,q) can be seen in () The set I(k) := {i(),,i(m )} enotes the set of all inices where a new waypoint starts, with i() = an i(m) = N s i = f (s i,q i ) = [ xi T i ] [ ] Ti f moel (x i,q i ) The continous time optimal problem can be escribe as: min s,q m T i () m T i(k) () k= P = () where P is a projection matrix from s to x In the objective function we sum up all the ifferent T i(k) in the states s i(k) at the waypoints an a the T i() in the initial State s i() This sum ivie by m is the overall flight time of the hexacopter B Solving with fmincon For solving the above problem we use Direct Multiple Shooting [] in combination with the Matlab fmincon solver By choosing a fixe number of controls N we mae a esign variables vector D which contains all the states an controls D = s q s q s N s N s N () As an inital guess x an x N were set to x an x m an all T state variables to some initial flight time T In fmincon we use an upper- an lowerboun vector to constrain D in the following way: control constraints: By constraining the controls like in Table II we avoie negative or excessive thrust an oversteering with too high pitch an roll angle controls state constraints: By constraining all states to the minimal an maximal values in Table III we avoie behaviour which is not supporte by the hexacopter moel Also we exclue flying through the groun plane an a negative time-scaling factor T initial state, terminal state an waypoint constraints: By constraining the minimal an maximal values of the initial state s an terminal state s N to the initial an terminal points x an x N respectivly, we etermine the start an en point The k waypoints were etermine j N k+ in the same manner at every state for j = k This way every path between two points ha the same number of controls For the waypoints an the en point

4 TABE II OWER AND UPPER BOUND OF THE CONTROS Control min max Thrust N N Pitch Roll Yaw 8 8 TABE III OWER AND UPPER BOUND OF THE STATES State min max Velocity in X-irection -6 m/s 6 m/s Velocity in Y-irection -6 m/s 6 m/s Velocity in Z-irection -6 m/s 6 m/s Pitch Roll Yaw 8 8 we also ae, respectivly subtracte, some small elta values to the states, which helps fining a solution The objective function use by fmincon returne the overall flight time calculate in Eq () We moele the system ynamics using the nonlnconstr function provie to fmincon In this function we calculate the vector c eq which can be seen in (6) The integrator function f (s i,q i ) is explaine in etail in Section III-C Since the integrator function provie the sensitivity with respect to s i an q i it was possible to buil the Jacobian G ceq of the nonlnconstr function, which can be seen in (7) By switching the GraConstr option on, fmincon uses the Jacobian for fining a solution faster f (s,q ) s f (s,q ) s c eq = (6) f (s N,q N ) s N G ceq = A B I A B I A N B N I A i = f (s,q) (7) s B i = f q (s,q) We then elete the continuity conition for the T state variable at every waypoint-state s i(k) with k = m in c eq, so the optimizer is allowe to change the time scaling factor T in this state We also elete the respective line in the Jacobian G ceq of the nonlinconstr function The solver fmincon then calculate an optimal solution using the interior-point algorithm Fig C Acao Integrator Flight visualization in RViz To spee up fmincon we use the ACADO Toolkit an its built-in Matlab interface [] ACADO converte the hexacopter moel from Section II to C coe, which was then compile with GCC to a binary MEX-file, callable from Matlab We then use an RK integrator with built-in steps provie by ACADO The integrator step uration was set to N, because our augmente problem formulation was scale from to This integrator function f (s i,q i ), which also provie the sensitivity in s an q irection, was use to compute the nonlinear equality constraints an their Jacobian in Section III-B A Visualization IV RESUTS For visualizing the whole trajectory we implemente a Matlab-ROS brige, which sens the real time motion of the hexacopter to a ROS noe The ROS noe computes the rotation an translation an transfers the ata irectly to RViz On the RViz sie we use a CAD Moel of the hexacopter for showing the trajectory in a D space (Fig ) 6 Thrust Ctrl Pitch Ctrl Roll Ctrl Yaw Ctrl Fig Simple flight controls

5 B Simple flight In Fig an Fig6 we present a simple hexacopter flight from position (,,) to (,-,) via (-,,) In the en point the hexacopter shoul stop with nearly zero velocity The uration of the flight was s 6 z axis in m Thrust Ctrl Pitch Ctrl Roll Ctrl Yaw Ctrl Fig 7 Angular-constraine controls y axis in m x axis in m Fig 6 C Angular-constraine flight Simple flight trajectory In Fig 7 an Fig 8 we present a hexacopter flight along the waypoints given in Tab IV On every waypoints the velocities shoul be nearly zero The uration of the flight was 99 s TABE IV ANGUAR-CONSTRAINED WAYPOINTS Waypoint X Y Z Pitch Roll Yaw S init S - S - S term z axis in m x axis in m Fig 8 y axis in m Angular-constraine trajectory REFERENCES [] Bachelor Thesis: D-Objektkartierung mit Multi-Rotor-Systemen, Johan Vertens, [] wwwmikrokoptere, July 7,, flight-ctrl [] M Diehl, ecture Notes on Optimal Control an Estimation, July,, p 6 [] M Diehl, ecture Notes on Optimal Control an Estimation, July,, pp 6-6 [] wwwacaotoolkitorg, July 7, [6] Baranek, R an Solc, F, Moelling an control of a hexa-copter, May,

DYNAMIC PERFORMANCE OF RELUCTANCE SYNCHRONOUS MACHINES

DYNAMIC PERFORMANCE OF RELUCTANCE SYNCHRONOUS MACHINES Annals of the University of Craiova, Electrical Engineering series, No 33, 9; ISSN 184-485 7 TH INTERNATIONAL CONFERENCE ON ELECTROMECHANICAL AN POWER SYSTEMS October 8-9, 9 - Iaşi, Romania YNAMIC PERFORMANCE

More information

Chapter 2 Lagrangian Modeling

Chapter 2 Lagrangian Modeling Chapter 2 Lagrangian Moeling The basic laws of physics are use to moel every system whether it is electrical, mechanical, hyraulic, or any other energy omain. In mechanics, Newton s laws of motion provie

More information

Department of Physics University of Maryland College Park, Maryland. Fall 2005 Final Exam Dec. 16, u 2 dt )2, L = m u 2 d θ, ( d θ

Department of Physics University of Maryland College Park, Maryland. Fall 2005 Final Exam Dec. 16, u 2 dt )2, L = m u 2 d θ, ( d θ Department of Physics University of arylan College Park, arylan PHYSICS 4 Prof. S. J. Gates Fall 5 Final Exam Dec. 6, 5 This is a OPEN book examination. Rea the entire examination before you begin to work.

More information

G j dq i + G j. q i. = a jt. and

G j dq i + G j. q i. = a jt. and Lagrange Multipliers Wenesay, 8 September 011 Sometimes it is convenient to use reunant coorinates, an to effect the variation of the action consistent with the constraints via the metho of Lagrange unetermine

More information

Lagrangian and Hamiltonian Mechanics

Lagrangian and Hamiltonian Mechanics Lagrangian an Hamiltonian Mechanics.G. Simpson, Ph.. epartment of Physical Sciences an Engineering Prince George s Community College ecember 5, 007 Introuction In this course we have been stuying classical

More information

Free rotation of a rigid body 1 D. E. Soper 2 University of Oregon Physics 611, Theoretical Mechanics 5 November 2012

Free rotation of a rigid body 1 D. E. Soper 2 University of Oregon Physics 611, Theoretical Mechanics 5 November 2012 Free rotation of a rigi boy 1 D. E. Soper 2 University of Oregon Physics 611, Theoretical Mechanics 5 November 2012 1 Introuction In this section, we escribe the motion of a rigi boy that is free to rotate

More information

Practical implementation of Differential Flatness concept for quadrotor trajectory control

Practical implementation of Differential Flatness concept for quadrotor trajectory control Practical implementation of Differential Flatness concept for quarotor trajectory control Abhishek Manjunath 1 an Parwiner Singh Mehrok 2 Abstract This report ocuments how the concept of Differential Flatness

More information

Switching Time Optimization in Discretized Hybrid Dynamical Systems

Switching Time Optimization in Discretized Hybrid Dynamical Systems Switching Time Optimization in Discretize Hybri Dynamical Systems Kathrin Flaßkamp, To Murphey, an Sina Ober-Blöbaum Abstract Switching time optimization (STO) arises in systems that have a finite set

More information

'HVLJQ &RQVLGHUDWLRQ LQ 0DWHULDO 6HOHFWLRQ 'HVLJQ 6HQVLWLYLW\,1752'8&7,21

'HVLJQ &RQVLGHUDWLRQ LQ 0DWHULDO 6HOHFWLRQ 'HVLJQ 6HQVLWLYLW\,1752'8&7,21 Large amping in a structural material may be either esirable or unesirable, epening on the engineering application at han. For example, amping is a esirable property to the esigner concerne with limiting

More information

and from it produce the action integral whose variation we set to zero:

and from it produce the action integral whose variation we set to zero: Lagrange Multipliers Monay, 6 September 01 Sometimes it is convenient to use reunant coorinates, an to effect the variation of the action consistent with the constraints via the metho of Lagrange unetermine

More information

Math Notes on differentials, the Chain Rule, gradients, directional derivative, and normal vectors

Math Notes on differentials, the Chain Rule, gradients, directional derivative, and normal vectors Math 18.02 Notes on ifferentials, the Chain Rule, graients, irectional erivative, an normal vectors Tangent plane an linear approximation We efine the partial erivatives of f( xy, ) as follows: f f( x+

More information

19 Eigenvalues, Eigenvectors, Ordinary Differential Equations, and Control

19 Eigenvalues, Eigenvectors, Ordinary Differential Equations, and Control 19 Eigenvalues, Eigenvectors, Orinary Differential Equations, an Control This section introuces eigenvalues an eigenvectors of a matrix, an iscusses the role of the eigenvalues in etermining the behavior

More information

An inductance lookup table application for analysis of reluctance stepper motor model

An inductance lookup table application for analysis of reluctance stepper motor model ARCHIVES OF ELECTRICAL ENGINEERING VOL. 60(), pp. 5- (0) DOI 0.478/ v07-0-000-y An inuctance lookup table application for analysis of reluctance stepper motor moel JAKUB BERNAT, JAKUB KOŁOTA, SŁAWOMIR

More information

Guidance Control of a Small Unmanned Aerial Vehicle with a Delta Wing

Guidance Control of a Small Unmanned Aerial Vehicle with a Delta Wing Proceeings of Australasian Conference on Robotics an Automation, -4 Dec 13, University of New South Wales, Syney Australia Guiance Control of a Small Unmanne Aerial Vehicle with a Delta Wing Shuichi TAJIMA,

More information

The derivative of a function f(x) is another function, defined in terms of a limiting expression: f(x + δx) f(x)

The derivative of a function f(x) is another function, defined in terms of a limiting expression: f(x + δx) f(x) Y. D. Chong (2016) MH2801: Complex Methos for the Sciences 1. Derivatives The erivative of a function f(x) is another function, efine in terms of a limiting expression: f (x) f (x) lim x δx 0 f(x + δx)

More information

Numerical Integrator. Graphics

Numerical Integrator. Graphics 1 Introuction CS229 Dynamics Hanout The question of the week is how owe write a ynamic simulator for particles, rigi boies, or an articulate character such as a human figure?" In their SIGGRPH course notes,

More information

Optimization of a point-mass walking model using direct collocation and sequential quadratic programming

Optimization of a point-mass walking model using direct collocation and sequential quadratic programming Optimization of a point-mass walking moel using irect collocation an sequential quaratic programming Chris Dembia June 5, 5 Telescoping actuator y Stance leg Point-mass boy m (x,y) Swing leg x Leg uring

More information

The Principle of Least Action and Designing Fiber Optics

The Principle of Least Action and Designing Fiber Optics University of Southampton Department of Physics & Astronomy Year 2 Theory Labs The Principle of Least Action an Designing Fiber Optics 1 Purpose of this Moule We will be intereste in esigning fiber optic

More information

ECE 422 Power System Operations & Planning 7 Transient Stability

ECE 422 Power System Operations & Planning 7 Transient Stability ECE 4 Power System Operations & Planning 7 Transient Stability Spring 5 Instructor: Kai Sun References Saaat s Chapter.5 ~. EPRI Tutorial s Chapter 7 Kunur s Chapter 3 Transient Stability The ability of

More information

CE2253- APPLIED HYDRAULIC ENGINEERING (FOR IV SEMESTER)

CE2253- APPLIED HYDRAULIC ENGINEERING (FOR IV SEMESTER) CE5-APPLIED HYDRAULIC ENGINEERING/UNIT-II/UNIFORM FLOW CE5- APPLIED HYDRAULIC ENGINEERING (FOR IV SEMESTER) UNIT II- UNIFORM FLOW CE5-APPLIED HYDRAULIC ENGINEERING/UNIT-II/UNIFORM FLOW CE5- APPLIED HYDRAULIC

More information

Examining Geometric Integration for Propagating Orbit Trajectories with Non-Conservative Forcing

Examining Geometric Integration for Propagating Orbit Trajectories with Non-Conservative Forcing Examining Geometric Integration for Propagating Orbit Trajectories with Non-Conservative Forcing Course Project for CDS 05 - Geometric Mechanics John M. Carson III California Institute of Technology June

More information

VISUAL SERVOING WITH ORIENTATION LIMITS OF A X4-FLYER

VISUAL SERVOING WITH ORIENTATION LIMITS OF A X4-FLYER VISUAL SERVOING WITH ORIENTATION LIMITS OF A X4-FLYER Najib Metni,Tarek Hamel,Isabelle Fantoni Laboratoire Central es Ponts et Chaussées, LCPC-Paris France, najib.metni@lcpc.fr Cemif-Sc FRE-CNRS 2494,

More information

Mathematical Review Problems

Mathematical Review Problems Fall 6 Louis Scuiero Mathematical Review Problems I. Polynomial Equations an Graphs (Barrante--Chap. ). First egree equation an graph y f() x mx b where m is the slope of the line an b is the line's intercept

More information

Assignment 1. g i (x 1,..., x n ) dx i = 0. i=1

Assignment 1. g i (x 1,..., x n ) dx i = 0. i=1 Assignment 1 Golstein 1.4 The equations of motion for the rolling isk are special cases of general linear ifferential equations of constraint of the form g i (x 1,..., x n x i = 0. i=1 A constraint conition

More information

6. Friction and viscosity in gasses

6. Friction and viscosity in gasses IR2 6. Friction an viscosity in gasses 6.1 Introuction Similar to fluis, also for laminar flowing gases Newtons s friction law hols true (see experiment IR1). Using Newton s law the viscosity of air uner

More information

Analytic Scaling Formulas for Crossed Laser Acceleration in Vacuum

Analytic Scaling Formulas for Crossed Laser Acceleration in Vacuum October 6, 4 ARDB Note Analytic Scaling Formulas for Crosse Laser Acceleration in Vacuum Robert J. Noble Stanfor Linear Accelerator Center, Stanfor University 575 San Hill Roa, Menlo Park, California 945

More information

A Comparison between a Conventional Power System Stabilizer (PSS) and Novel PSS Based on Feedback Linearization Technique

A Comparison between a Conventional Power System Stabilizer (PSS) and Novel PSS Based on Feedback Linearization Technique J. Basic. Appl. Sci. Res., ()9-99,, TextRoa Publication ISSN 9-434 Journal of Basic an Applie Scientific Research www.textroa.com A Comparison between a Conventional Power System Stabilizer (PSS) an Novel

More information

Robot Dynamics - Rotary Wing UAS: Control of a Quadrotor

Robot Dynamics - Rotary Wing UAS: Control of a Quadrotor Robot Dynamics Rotary Wing AS: Control of a Quadrotor 5-85- V Marco Hutter, Roland Siegwart and Thomas Stastny Robot Dynamics - Rotary Wing AS: Control of a Quadrotor 7..6 Contents Rotary Wing AS. Introduction

More information

Appendix: Proof of Spatial Derivative of Clear Raindrop

Appendix: Proof of Spatial Derivative of Clear Raindrop Appenix: Proof of Spatial erivative of Clear Rainrop Shaoi You Robby T. Tan The University of Tokyo {yous,rei,ki}@cvl.iis.u-tokyo.ac.jp Rei Kawakami Katsushi Ikeuchi Utrecht University R.T.Tan@uu.nl Layout

More information

Tutorial Test 5 2D welding robot

Tutorial Test 5 2D welding robot Tutorial Test 5 D weling robot Phys 70: Planar rigi boy ynamics The problem statement is appene at the en of the reference solution. June 19, 015 Begin: 10:00 am En: 11:30 am Duration: 90 min Solution.

More information

Determine Power Transfer Limits of An SMIB System through Linear System Analysis with Nonlinear Simulation Validation

Determine Power Transfer Limits of An SMIB System through Linear System Analysis with Nonlinear Simulation Validation Determine Power Transfer Limits of An SMIB System through Linear System Analysis with Nonlinear Simulation Valiation Yin Li, Stuent Member, IEEE, Lingling Fan, Senior Member, IEEE Abstract This paper extens

More information

Table of Common Derivatives By David Abraham

Table of Common Derivatives By David Abraham Prouct an Quotient Rules: Table of Common Derivatives By Davi Abraham [ f ( g( ] = [ f ( ] g( + f ( [ g( ] f ( = g( [ f ( ] g( g( f ( [ g( ] Trigonometric Functions: sin( = cos( cos( = sin( tan( = sec

More information

Inverting: Representing rotations and translations between coordinate frames of reference. z B. x B x. y B. v = [ x y z ] v = R v B A. y B.

Inverting: Representing rotations and translations between coordinate frames of reference. z B. x B x. y B. v = [ x y z ] v = R v B A. y B. Kinematics Kinematics: Given the joint angles, comute the han osition = Λ( q) Inverse kinematics: Given the han osition, comute the joint angles to attain that osition q = Λ 1 ( ) s usual, inverse roblems

More information

Survey Sampling. 1 Design-based Inference. Kosuke Imai Department of Politics, Princeton University. February 19, 2013

Survey Sampling. 1 Design-based Inference. Kosuke Imai Department of Politics, Princeton University. February 19, 2013 Survey Sampling Kosuke Imai Department of Politics, Princeton University February 19, 2013 Survey sampling is one of the most commonly use ata collection methos for social scientists. We begin by escribing

More information

Quadrotor Modeling and Control

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

More information

Hyperbolic Systems of Equations Posed on Erroneous Curved Domains

Hyperbolic Systems of Equations Posed on Erroneous Curved Domains Hyperbolic Systems of Equations Pose on Erroneous Curve Domains Jan Norström a, Samira Nikkar b a Department of Mathematics, Computational Mathematics, Linköping University, SE-58 83 Linköping, Sween (

More information

ARCH 614 Note Set 5 S2012abn. Moments & Supports

ARCH 614 Note Set 5 S2012abn. Moments & Supports RCH 614 Note Set 5 S2012abn Moments & Supports Notation: = perpenicular istance to a force from a point = name for force vectors or magnitue of a force, as is P, Q, R x = force component in the x irection

More information

Harmonic Modelling of Thyristor Bridges using a Simplified Time Domain Method

Harmonic Modelling of Thyristor Bridges using a Simplified Time Domain Method 1 Harmonic Moelling of Thyristor Briges using a Simplifie Time Domain Metho P. W. Lehn, Senior Member IEEE, an G. Ebner Abstract The paper presents time omain methos for harmonic analysis of a 6-pulse

More information

Lecture 6: Control of Three-Phase Inverters

Lecture 6: Control of Three-Phase Inverters Yoash Levron The Anrew an Erna Viterbi Faculty of Electrical Engineering, Technion Israel Institute of Technology, Haifa 323, Israel yoashl@ee.technion.ac.il Juri Belikov Department of Computer Systems,

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

Design A Robust Power System Stabilizer on SMIB Using Lyapunov Theory

Design A Robust Power System Stabilizer on SMIB Using Lyapunov Theory Design A Robust Power System Stabilizer on SMIB Using Lyapunov Theory Yin Li, Stuent Member, IEEE, Lingling Fan, Senior Member, IEEE Abstract This paper proposes a robust power system stabilizer (PSS)

More information

Experimental Determination of Mechanical Parameters in Sensorless Vector-Controlled Induction Motor Drive

Experimental Determination of Mechanical Parameters in Sensorless Vector-Controlled Induction Motor Drive Experimental Determination of Mechanical Parameters in Sensorless Vector-Controlle Inuction Motor Drive V. S. S. Pavan Kumar Hari, Avanish Tripathi 2 an G.Narayanan 3 Department of Electrical Engineering,

More information

A Novel Decoupled Iterative Method for Deep-Submicron MOSFET RF Circuit Simulation

A Novel Decoupled Iterative Method for Deep-Submicron MOSFET RF Circuit Simulation A Novel ecouple Iterative Metho for eep-submicron MOSFET RF Circuit Simulation CHUAN-SHENG WANG an YIMING LI epartment of Mathematics, National Tsing Hua University, National Nano evice Laboratories, an

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

Multi-robot Formation Control Using Reinforcement Learning Method

Multi-robot Formation Control Using Reinforcement Learning Method Multi-robot Formation Control Using Reinforcement Learning Metho Guoyu Zuo, Jiatong Han, an Guansheng Han School of Electronic Information & Control Engineering, Beijing University of Technology, Beijing

More information

Summary: Differentiation

Summary: Differentiation Techniques of Differentiation. Inverse Trigonometric functions The basic formulas (available in MF5 are: Summary: Differentiation ( sin ( cos The basic formula can be generalize as follows: Note: ( sin

More information

Lecture 2 Lagrangian formulation of classical mechanics Mechanics

Lecture 2 Lagrangian formulation of classical mechanics Mechanics Lecture Lagrangian formulation of classical mechanics 70.00 Mechanics Principle of stationary action MATH-GA To specify a motion uniquely in classical mechanics, it suffices to give, at some time t 0,

More information

AN INTRODUCTION TO AIRCRAFT WING FLUTTER Revision A

AN INTRODUCTION TO AIRCRAFT WING FLUTTER Revision A AN INTRODUCTION TO AIRCRAFT WIN FLUTTER Revision A By Tom Irvine Email: tomirvine@aol.com January 8, 000 Introuction Certain aircraft wings have experience violent oscillations uring high spee flight.

More information

Static Equilibrium. Theory: The conditions for the mechanical equilibrium of a rigid body are (a) (b)

Static Equilibrium. Theory: The conditions for the mechanical equilibrium of a rigid body are (a) (b) LPC Physics A 00 Las Positas College, Physics Department Staff Purpose: To etermine that, for a boy in equilibrium, the following are true: The sum of the torques about any point is zero The sum of forces

More information

Experimental Robustness Study of a Second-Order Sliding Mode Controller

Experimental Robustness Study of a Second-Order Sliding Mode Controller Experimental Robustness Stuy of a Secon-Orer Sliing Moe Controller Anré Blom, Bram e Jager Einhoven University of Technology Department of Mechanical Engineering P.O. Box 513, 5600 MB Einhoven, The Netherlans

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

Unit #6 - Families of Functions, Taylor Polynomials, l Hopital s Rule

Unit #6 - Families of Functions, Taylor Polynomials, l Hopital s Rule Unit # - Families of Functions, Taylor Polynomials, l Hopital s Rule Some problems an solutions selecte or aapte from Hughes-Hallett Calculus. Critical Points. Consier the function f) = 54 +. b) a) Fin

More information

Schrödinger s equation.

Schrödinger s equation. Physics 342 Lecture 5 Schröinger s Equation Lecture 5 Physics 342 Quantum Mechanics I Wenesay, February 3r, 2010 Toay we iscuss Schröinger s equation an show that it supports the basic interpretation of

More information

STABILITY CONTROL FOR SIX-WHEEL DRIVE ARTICULATED VEHICLE BASED ON DIRECT YAW MOMENT CONTROL METHOD

STABILITY CONTROL FOR SIX-WHEEL DRIVE ARTICULATED VEHICLE BASED ON DIRECT YAW MOMENT CONTROL METHOD STABILITY CONTROL FOR SIX-WHEEL DRIVE ARTICULATED VEHICLE BASED ON DIRECT YAW MOMENT CONTROL METHOD 1 YITING KANG, 2 WENMING ZHANG 1 Doctoral Caniate, School of Mechanical Engineering, University of Science

More information

THE ACCURATE ELEMENT METHOD: A NEW PARADIGM FOR NUMERICAL SOLUTION OF ORDINARY DIFFERENTIAL EQUATIONS

THE ACCURATE ELEMENT METHOD: A NEW PARADIGM FOR NUMERICAL SOLUTION OF ORDINARY DIFFERENTIAL EQUATIONS THE PUBISHING HOUSE PROCEEDINGS O THE ROMANIAN ACADEMY, Series A, O THE ROMANIAN ACADEMY Volume, Number /, pp. 6 THE ACCURATE EEMENT METHOD: A NEW PARADIGM OR NUMERICA SOUTION O ORDINARY DIERENTIA EQUATIONS

More information

2.5 SOME APPLICATIONS OF THE CHAIN RULE

2.5 SOME APPLICATIONS OF THE CHAIN RULE 2.5 SOME APPLICATIONS OF THE CHAIN RULE The Chain Rule will help us etermine the erivatives of logarithms an exponential functions a x. We will also use it to answer some applie questions an to fin slopes

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

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

6.003 Homework #7 Solutions

6.003 Homework #7 Solutions 6.003 Homework #7 Solutions Problems. Secon-orer systems The impulse response of a secon-orer CT system has the form h(t) = e σt cos(ω t + φ)u(t) where the parameters σ, ω, an φ are relate to the parameters

More information

Math 342 Partial Differential Equations «Viktor Grigoryan

Math 342 Partial Differential Equations «Viktor Grigoryan Math 342 Partial Differential Equations «Viktor Grigoryan 6 Wave equation: solution In this lecture we will solve the wave equation on the entire real line x R. This correspons to a string of infinite

More information

THE VAN KAMPEN EXPANSION FOR LINKED DUFFING LINEAR OSCILLATORS EXCITED BY COLORED NOISE

THE VAN KAMPEN EXPANSION FOR LINKED DUFFING LINEAR OSCILLATORS EXCITED BY COLORED NOISE Journal of Soun an Vibration (1996) 191(3), 397 414 THE VAN KAMPEN EXPANSION FOR LINKED DUFFING LINEAR OSCILLATORS EXCITED BY COLORED NOISE E. M. WEINSTEIN Galaxy Scientific Corporation, 2500 English Creek

More information

Dynamic Model and Control of Quadrotor in the Presence of Uncertainties

Dynamic Model and Control of Quadrotor in the Presence of Uncertainties University of South Carolina Scholar Commons Theses and Dissertations 5-2017 Dynamic Model and Control of Quadrotor in the Presence of Uncertainties Courage Agho University of South Carolina Follow this

More information

Pitch Attitude Control of a Booster Rocket

Pitch Attitude Control of a Booster Rocket Research Inventy: International Journal Of Engineering An Science Issn: 2278-4721, Vol.2, Issue 7 (March 2013), Pp 8-12 Www.Researchinventy.Com Pitch Attitue Control of a Booster Rocket Mr. Debabrata Roy

More information

for which the garbage will fall within the can. If the range is large, the shot is easy; if the range is small, the target is hard to hit.

for which the garbage will fall within the can. If the range is large, the shot is easy; if the range is small, the target is hard to hit. EN40: Dynamics an Vibrations Homework : Soling equations of motion for particles Due Friay Feb 18 011 School of Engineering Brown Uniersity 1. Suppose that you wish to throw a piece of garbage into a garbage

More information

Dynamic Load Carrying Capacity of Spatial Cable Suspended Robot: Sliding Mode Control Approach

Dynamic Load Carrying Capacity of Spatial Cable Suspended Robot: Sliding Mode Control Approach Int J Avance Design an Manufacturing echnology, Vol. 5/ No. 3/ June - 212 73 Dynamic Loa Carrying Capacity of Spatial Cable Suspene Robot: Sliing Moe Control Approach M. H. Korayem Department of Mechanical

More information

Total Energy Shaping of a Class of Underactuated Port-Hamiltonian Systems using a New Set of Closed-Loop Potential Shape Variables*

Total Energy Shaping of a Class of Underactuated Port-Hamiltonian Systems using a New Set of Closed-Loop Potential Shape Variables* 51st IEEE Conference on Decision an Control December 1-13 212. Maui Hawaii USA Total Energy Shaping of a Class of Uneractuate Port-Hamiltonian Systems using a New Set of Close-Loop Potential Shape Variables*

More information

An Approach for Design of Multi-element USBL Systems

An Approach for Design of Multi-element USBL Systems An Approach for Design of Multi-element USBL Systems MIKHAIL ARKHIPOV Department of Postgrauate Stuies Technological University of the Mixteca Carretera a Acatlima Km. 2.5 Huajuapan e Leon Oaxaca 69000

More information

Moving Charges And Magnetism

Moving Charges And Magnetism AIND SINGH ACADEMY Moving Charges An Magnetism Solution of NCET Exercise Q -.: A circular coil of wire consisting of turns, each of raius 8. cm carries a current of. A. What is the magnitue of the magnetic

More information

Basic Differentiation Rules and Rates of Change. The Constant Rule

Basic Differentiation Rules and Rates of Change. The Constant Rule 460_00.q //04 4:04 PM Page 07 SECTION. Basic Differentiation Rules an Rates of Change 07 Section. The slope of a horizontal line is 0. Basic Differentiation Rules an Rates of Change Fin the erivative of

More information

Designing Information Devices and Systems II Fall 2017 Note Theorem: Existence and Uniqueness of Solutions to Differential Equations

Designing Information Devices and Systems II Fall 2017 Note Theorem: Existence and Uniqueness of Solutions to Differential Equations EECS 6B Designing Information Devices an Systems II Fall 07 Note 3 Secon Orer Differential Equations Secon orer ifferential equations appear everywhere in the real worl. In this note, we will walk through

More information

inflow outflow Part I. Regular tasks for MAE598/494 Task 1

inflow outflow Part I. Regular tasks for MAE598/494 Task 1 MAE 494/598, Fall 2016 Project #1 (Regular tasks = 20 points) Har copy of report is ue at the start of class on the ue ate. The rules on collaboration will be release separately. Please always follow the

More information

Dynamics of the synchronous machine

Dynamics of the synchronous machine ELEC0047 - Power system ynamics, control an stability Dynamics of the synchronous machine Thierry Van Cutsem t.vancutsem@ulg.ac.be www.montefiore.ulg.ac.be/~vct These slies follow those presente in course

More information

The Hamiltonian particle-mesh method for the spherical shallow water equations

The Hamiltonian particle-mesh method for the spherical shallow water equations ATMOSPHERIC SCIENCE LETTERS Atmos. Sci. Let. 5: 89 95 (004) Publishe online in Wiley InterScience (www.interscience.wiley.com). DOI: 10.100/asl.70 The Hamiltonian particle-mesh metho for the spherical

More information

Further Differentiation and Applications

Further Differentiation and Applications Avance Higher Notes (Unit ) Prerequisites: Inverse function property; prouct, quotient an chain rules; inflexion points. Maths Applications: Concavity; ifferentiability. Real-Worl Applications: Particle

More information

Calculus of Variations

Calculus of Variations 16.323 Lecture 5 Calculus of Variations Calculus of Variations Most books cover this material well, but Kirk Chapter 4 oes a particularly nice job. x(t) x* x*+ αδx (1) x*- αδx (1) αδx (1) αδx (1) t f t

More information

Consider for simplicity a 3rd-order IIR filter with a transfer function. where

Consider for simplicity a 3rd-order IIR filter with a transfer function. where Basic IIR Digital Filter The causal IIR igital filters we are concerne with in this course are characterie by a real rational transfer function of or, equivalently by a constant coefficient ifference equation

More information

Basic IIR Digital Filter Structures

Basic IIR Digital Filter Structures Basic IIR Digital Filter Structures The causal IIR igital filters we are concerne with in this course are characterie by a real rational transfer function of or, equivalently by a constant coefficient

More information

TAYLOR S POLYNOMIAL APPROXIMATION FOR FUNCTIONS

TAYLOR S POLYNOMIAL APPROXIMATION FOR FUNCTIONS MISN-0-4 TAYLOR S POLYNOMIAL APPROXIMATION FOR FUNCTIONS f(x ± ) = f(x) ± f ' (x) + f '' (x) 2 ±... 1! 2! = 1.000 ± 0.100 + 0.005 ±... TAYLOR S POLYNOMIAL APPROXIMATION FOR FUNCTIONS by Peter Signell 1.

More information

Lecture XII. where Φ is called the potential function. Let us introduce spherical coordinates defined through the relations

Lecture XII. where Φ is called the potential function. Let us introduce spherical coordinates defined through the relations Lecture XII Abstract We introuce the Laplace equation in spherical coorinates an apply the metho of separation of variables to solve it. This will generate three linear orinary secon orer ifferential equations:

More information

1.4.3 Elementary solutions to Laplace s equation in the spherical coordinates (Axially symmetric cases) (Griffiths 3.3.2)

1.4.3 Elementary solutions to Laplace s equation in the spherical coordinates (Axially symmetric cases) (Griffiths 3.3.2) 1.4.3 Elementary solutions to Laplace s equation in the spherical coorinates (Axially symmetric cases) (Griffiths 3.3.) In the spherical coorinates (r, θ, φ), the Laplace s equation takes the following

More information

Quantum Mechanics in Three Dimensions

Quantum Mechanics in Three Dimensions Physics 342 Lecture 20 Quantum Mechanics in Three Dimensions Lecture 20 Physics 342 Quantum Mechanics I Monay, March 24th, 2008 We begin our spherical solutions with the simplest possible case zero potential.

More information

EE Homework 3 Due Date: 03 / 30 / Spring 2015

EE Homework 3 Due Date: 03 / 30 / Spring 2015 EE 476 - Homework 3 Due Date: 03 / 30 / 2015 Spring 2015 Exercise 1 (10 points). Consider the problem of two pulleys and a mass discussed in class. We solved a version of the problem where the mass was

More information

Lectures - Week 10 Introduction to Ordinary Differential Equations (ODES) First Order Linear ODEs

Lectures - Week 10 Introduction to Ordinary Differential Equations (ODES) First Order Linear ODEs Lectures - Week 10 Introuction to Orinary Differential Equations (ODES) First Orer Linear ODEs When stuying ODEs we are consiering functions of one inepenent variable, e.g., f(x), where x is the inepenent

More information

Optimal Variable-Structure Control Tracking of Spacecraft Maneuvers

Optimal Variable-Structure Control Tracking of Spacecraft Maneuvers Optimal Variable-Structure Control racking of Spacecraft Maneuvers John L. Crassiis 1 Srinivas R. Vaali F. Lanis Markley 3 Introuction In recent years, much effort has been evote to the close-loop esign

More information

Accelerate Implementation of Forwaring Control Laws using Composition Methos Yves Moreau an Roolphe Sepulchre June 1997 Abstract We use a metho of int

Accelerate Implementation of Forwaring Control Laws using Composition Methos Yves Moreau an Roolphe Sepulchre June 1997 Abstract We use a metho of int Katholieke Universiteit Leuven Departement Elektrotechniek ESAT-SISTA/TR 1997-11 Accelerate Implementation of Forwaring Control Laws using Composition Methos 1 Yves Moreau, Roolphe Sepulchre, Joos Vanewalle

More information

Mechanics Physics 151

Mechanics Physics 151 Mechanics Phsics 151 Lecture 8 Rigid Bod Motion (Chapter 4) What We Did Last Time! Discussed scattering problem! Foundation for all experimental phsics! Defined and calculated cross sections! Differential

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

SELF-ERECTING, ROTARY MOTION INVERTED PENDULUM Quanser Consulting Inc.

SELF-ERECTING, ROTARY MOTION INVERTED PENDULUM Quanser Consulting Inc. SELF-ERECTING, ROTARY MOTION INVERTED PENDULUM Quanser Consulting Inc. 1.0 SYSTEM DESCRIPTION The sel-erecting rotary motion inverte penulum consists of a rotary servo motor system (SRV-02) which rives

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

Adjoint Transient Sensitivity Analysis in Circuit Simulation

Adjoint Transient Sensitivity Analysis in Circuit Simulation Ajoint Transient Sensitivity Analysis in Circuit Simulation Z. Ilievski 1, H. Xu 1, A. Verhoeven 1, E.J.W. ter Maten 1,2, W.H.A. Schilers 1,2 an R.M.M. Mattheij 1 1 Technische Universiteit Einhoven; e-mail:

More information

Separation of Variables

Separation of Variables Physics 342 Lecture 1 Separation of Variables Lecture 1 Physics 342 Quantum Mechanics I Monay, January 25th, 2010 There are three basic mathematical tools we nee, an then we can begin working on the physical

More information

4. CONTROL OF ZERO-SEQUENCE CURRENT IN PARALLEL THREE-PHASE CURRENT-BIDIRECTIONAL CONVERTERS

4. CONTROL OF ZERO-SEQUENCE CURRENT IN PARALLEL THREE-PHASE CURRENT-BIDIRECTIONAL CONVERTERS 4. CONRO OF ZERO-SEQUENCE CURREN IN PARAE HREE-PHASE CURREN-BIDIRECIONA CONVERERS 4. A NOVE ZERO-SEQUENCE CURREN CONRO 4.. Zero-Sequence Dynamics he parallel boost rectifier moel in Figure.4 an the parallel

More information

Interpolated Rigid-Body Motions and Robotics

Interpolated Rigid-Body Motions and Robotics Interpolate Rigi-Boy Motions an Robotics J.M. Selig Faculty of Business, Computing an Info. Management. Lonon South Bank University, Lonon SE AA, U.K. seligjm@lsbu.ac.uk Yaunquing Wu Dept. Mechanical Engineering.

More information

Section 2.7 Derivatives of powers of functions

Section 2.7 Derivatives of powers of functions Section 2.7 Derivatives of powers of functions (3/19/08) Overview: In this section we iscuss the Chain Rule formula for the erivatives of composite functions that are forme by taking powers of other functions.

More information

Lecture 3 Basic Feedback

Lecture 3 Basic Feedback Lecture 3 Basic Feeback Simple control esign an analsis Linear moel with feeback control Use simple moel esign control valiate Simple P loop with an integrator Velocit estimation Time scale Cascae control

More information

Optimal Control - Homework Exercise 3

Optimal Control - Homework Exercise 3 Optimal Control - Homework Exercise 3 December 17, 2010 In this exercise two different problems will be considered, first the so called Zermelo problem the problem is to steer a boat in streaming water,

More information

S10.G.1. Fluid Flow Around the Brownian Particle

S10.G.1. Fluid Flow Around the Brownian Particle Rea Reichl s introuction. Tables & proofs for vector calculus formulas can be foun in the stanar textbooks G.Arfken s Mathematical Methos for Physicists an J.D.Jackson s Classical Electroynamics. S0.G..

More information

Introduction to variational calculus: Lecture notes 1

Introduction to variational calculus: Lecture notes 1 October 10, 2006 Introuction to variational calculus: Lecture notes 1 Ewin Langmann Mathematical Physics, KTH Physics, AlbaNova, SE-106 91 Stockholm, Sween Abstract I give an informal summary of variational

More information

Both the ASME B and the draft VDI/VDE 2617 have strengths and

Both the ASME B and the draft VDI/VDE 2617 have strengths and Choosing Test Positions for Laser Tracker Evaluation an Future Stanars Development ala Muralikrishnan 1, Daniel Sawyer 1, Christopher lackburn 1, Steven Phillips 1, Craig Shakarji 1, E Morse 2, an Robert

More information

THE USE OF KIRCHOFF S CURRENT LAW AND CUT-SET EQUATIONS IN THE ANALYSIS OF BRIDGES AND TRUSSES

THE USE OF KIRCHOFF S CURRENT LAW AND CUT-SET EQUATIONS IN THE ANALYSIS OF BRIDGES AND TRUSSES Session TH US O KIRCHO S CURRNT LAW AND CUT-ST QUATIONS IN TH ANALYSIS O BRIDGS AND TRUSSS Ravi P. Ramachanran an V. Ramachanran. Department of lectrical an Computer ngineering, Rowan University, Glassboro,

More information