Guidance and Trajectory Following of an Autonomous Vision-Guided Micro QuadRotor

Size: px
Start display at page:

Download "Guidance and Trajectory Following of an Autonomous Vision-Guided Micro QuadRotor"

Transcription

1 Guidance and Trajectory Following of an Autonomous Vision-Guided Micro QuadRotor S. Fernandes Instituto Superior Técnico - Lisboa / Technion - Israel Institute of Technology sofiabat@aero.ist.utl.pt January, 2011 Abstract The present thesis documents the dynamics modelling and control design development for an autonomous visionguided micro-quadrotor. Linear models were determined for Roll, Pitch, Yaw and Altitude and PID controllers for attitude and position were designed and tested. The system identification software CIFER was used to determine the frequency domain models from the previously recorded time-domain flight data. The flight tests were conducted with a human pilot. Matlab and Simulink were used for the development and simulation of the PID attitude, position and altitude controllers. A testbed was built for tests with the QuadRotor platform. The realtime controllers were implemented in Matlab code. A C++ program was developed to handle the communications, close the loop with the QuadRotor platform and manage the experiments. Successful attitude tests were conducted and the results are presented. 1 Introduction The present work was developed in the scope of a project at the Technion - Israel Institute of Technology which aims to develop a fully autonomous micro QuadRotor guided by vision, and with the hability to fly indoors as well as outdoors. The QuadRotor platform, a X-3d-BL [1] was enhanced with an XSens unit, which contains an IMU and a GPS receiver. The QuadRotor is a very agile ship with hover hability. It is propelled by four engines displayed as shown in the diagram of Figure 1 and the attitude can be actuated by creating differentials between the engines velocities. [2] Tilting the vehicle in any direction causes a component of the thrust vector to point in that direction, so commanding pitch and roll is directly analogous to commanding accelerations in the X-Y plane [2]. Position control is cur- Figure 1: QuadRotor MAV scheme [2] rently implemented using a PID controller design which actuates the vehicle s roll and pitch as control inputs. An advantage of QuadRotors in what concerns camera surveillance is that they can fly with any chosen yaw angle, in any given direction. 2 Dynamics Modelling The QuadRotor s dynamic models for attitude were determined using the method of system identification. Given a set of flight data, the CIFER software was used to determine the attitude frequency models of the platform. 2.1 CIFER software overview CIFER receives the recorded time domain flight data series and uses these data to perform spectral analysis and a variety of specialized behavior extractions. The blockdiagram in Figure 2 shows the algorithm structure for system identification in CIFER. CIFER s software structure is organized in functions or software blocks, being FRESPID and COMPOSITE the core ones. CIFER begins with some checks of each sample on the integrity of the data, to find those cases where data corruption has occurred but is not self-evident. Next 1

2 Figure 3: Flight data: attitude measurements for Pitch identification / Figure 2: Frequency response identification process in CIFER [3] FRESPID uses a flexible form of the fast Fourier transform (FFT) that was developed in CIFER facility, known as the Chirp-Z transform (CZT). The COMPOSITE routine does the automatic sliding window processing and optimization. [4] [5] In summary, the capabilities of the CZT allow the extraction of high-resolution spectra in a narrow frequency band and an increase in the identified dynamic range, especially at the low-frequency end [4]. Furthermore this is accomplished with simultaneously more accurate results (because CIFER can interactively narrow the range of interest) at greatly reduced computational cost (because only the needed points are calculated). [5] 2.3 Attitude models Equations 1 to 3 present the attitude linear models obtained with CIFER. TF ψ (s) = TF φ (s) = TF θ (s) = s (1) s s (2) s s (3) Figure 4 shows the coherence data reported by CIFER for the Pitch model. Among other relevant data, it shows the model s bandwidth, which is approximately 10rad/s, and should therefore be enough to include all relevant dynamics of the QuadRotor s motion. 2.2 Data acquisition The dynamics identification flight tests were conducted with a human pilot. Flight test planning requires previous knowledge about the system to be identified. The flight testing for frequency domain data acquisition is designed to provide frequency sweeps for selected input-ouput pairs, about a given trimmed flight condition over a frequency range of interest. [4] No detailed information on rotors, servos or other subsystems was of interest because the desired models should regard the system as a whole. Having in mind these identification objectives, the recorded quantities were the measurements from the XSens unit as well as the pilot inputs. The angle rate measurements were used for attitude (Roll, Pitch and Yaw) together with the respective commands from the remote control (pilot input). Figure 3 shows the recorded attitude angles measured in a flight test for Pitch dynamics identification. Figure 4: Pitch model coherence data The three Euler angles - Roll, Pitch and Yaw - models were considered to be independent due to the fact that during the system identification process no cross-relations were found between the Euler angles dynamic responses. 2.4 Position model According to [6], the translational motion of a quadrotor can be approximated by Equations 4, where the Euler an- 2

3 gles represent the platform s orientation with respect to the inertial reference frame. mẍ = Tsin(θ) mÿ = Tcos(θ)sin(ϕ) m z = Tcos(θ)cos(ϕ) mg Assuming that (θ, ϕ) (0, 0), Equations 4 can be linearized to Equations 5, which coincide with those derived for the flat disk by me. mẍ = Tθ mÿ = Tϕ m z = T mg For the vertical position model a slightly different model formulation was used, in accordance with [7]. The model is shown in Equation 6. ḣ(t) = dh dt = g + cos(φ)cos(θ)t (t) m After linearization for (θ, φ) 10, Equation 6 becomes ḣ(t) = T (t) m g = T n(t) (7) In the frequency domain, the obtained models become: X(s) θ(s) = g 1 s 2 Y (s) φ(s) =g 1 s 2 H(s) T n (s) =1 s This very simple translation model based on Newton s equations served as the basis for the development of the position controllers. 3 Attitude PID Control Digital PID controllers were designed for attitude control following the algorithm described in [8]. This algorithm specifies the set of steps to generate a stable and robust digital PID controller that meets the design specifications for a second order transfer function. The design specifications include phase margin 60deg, minimal settling time, zero SSE and peak overshoot under 10%. The sample time is T s =0, 04s due to restrictions in the wireless communication with the QuadRotor. Matlab implementation of the referred algorithm led to the results summarized on Table 1. (4) (5) (6) (8) Angle Discrete model Discrete controller Roll Pitch Yaw z z z(z 1) z z z z z2 z(z 1) z z z z2 1.85z z(z 1) Table 1: Attitude discrete models and PID controllers 3.1 Fine tunning and simulation results Simulink models were created to simulate and fine tune the designed controllers. The step responses achieved after tunning were quite satisfying, having been adjusted only the global controller gains. Table 2 shows the tunned controller gains and settling times obtained. Angle Tunned gain Settling time Roll 1 0.5s Pitch s Yaw < 2s Table 2: Controller gains and settling times after fine tunning All step responses matched the defined design specifications. As expected, the yaw response is the slower when compared with the other Euler angles - Pitch and Roll. The global gain for Roll s controller was not changed. 3.2 Stability Analysis The values of the stability margins (Gain and Phase margin) and bandwidth after fine tunning are summarized on Table 3. The closed-loop Bode plot for Yaw is shown in Figure 5. The corresponding plots for Roll and Pitch aren t displayed here because they are very similar and the badnwidths are already displayed in Table 3. Please note as well that the Gain and Phase margins computed on the closed-loop Bode plot aren t meaningful; the stability margins are retrieved from the open-loop Bode plot intead. 3

4 Angle Gm (db) Pm (deg) Bandwidth (rad/s) Roll Pitch Yaw > 10 models (T s =0.04s) and the digital phase-lead compensators obtained. Axis Discrete model Phase-lead Inner-loop Table 3: Attitude s stability margins and bandwidth X X(z) θ(z) (z+1) = g (z 1) z 0.64 z 0.56 Pitch Y Y (z) φ(z) = g (z+1) (z 1) z z Roll Table 4: Horizontal position models and controllers Figure 5: Bode plot of the Yaw closed loop system 4 Horizontal position control With an attitude controller of sufficient bandwidth defined, it is possible to develop a path tracker that generates attitude reference commands, ignoring the fast dynamics of the attitude angles [9]. Hence, the simple position models derived in Subsection 2.4 were enhanced by the addition of the corresponding attitude control systems designed in Section 3, according to the block diagram in Figure 6. It should be clear that each horizontal position controller takes the respective position error as input to compute the output, which is the corresponding attitude reference angle. After gainning some insight about the behavior of the system in the simulation environment, it was decided to feed the measurement of the angle rate to the position controller instead of the angle itself. This has shown to improve the response since it basically removes one integrator from the system s transfer function, thus making it faster. The compensators weren t changed. The open-loop for the X axis can thus be written as in Equation 9. X(z) X ref (z) = C θ X(z) lead(z) θ ref θ(z) The Y axis open-loop can be similarly defined, simply substituting θ by φ. 4.1 Stability analysis (9) The values of the stability margins and bandwidth for the horizontal position control systems are shown on Table 5. Axis Gm (db) Pm (deg) Bandwidth (rad/s) X Y Figure 6: Diagram of position control with attitude innerloop A phase-lead design was chosen for the horizontal position (X and Y axes) controllers. Having introduced the full models with the attitude inner-loops in Simulink, the controllers were tunned inside Simulink s environment. The following Table 4 shows the discretized position Table 5: Horizontal position s stability margins and bandwidth Figure 7 shows the step response of the full X axis control system, that is, with the Pitch attitude control system as an inner-loop. Again, since it s very similar to the Y axis response with Roll inner-loop, the later was omitted. 4

5 Figure 7: Simulated position step response 5 Vertical position control The discretized vertical position model is shown in Equation 10. H (z) = 0.04 T n z 1 (10) For this very simple model, a PI controller was developed and tunned in the Simulink environment. The controller obtained can be described as in Equation 11. T (z) g H ref (z) H(z) =5+ 2 z 1 (11) Figure 8: Altitude response to attitude changes 6 Test results The attitude control system was extensively and successfully tested on the testbed developed for that purpose. Figure 9 shows the QuadRotor mounted on the testbed during an experiment. The overall simulation results were satisfying given the simplcity of the models at hand. Unfortunately, the applicability of these simple control systems could not be studied or further developed by means of flight testing for the reasons mentioned in Section Stability analysis The values of the stability margins and bandwidth obtained for the vertical position control system are shown on Table 6. Gm (db) Pm (deg) Bandwidth (rad/s) > 10 Table 6: Vertical position s stability margins and bandwidth The full position control system (horizontal and vertical) with attitude control inner-loop was simulated in Simulink with good results. Figure 8 shows the altitude step response in the presence of attitude step changes, the attitude step responses and the corresponding throttle plot. This shows that the simulated altitude control system is robust to agressive attitude conditions, following it s reference with zero SSE. Figure 9: QuadRotor on the testbed during an attitude test Figures 10 and 11 present examples of attitude test results. The plots show angle (deg) versus time (seconds). It can be observed from the results that the implemented PID controllers are able follow the fast dynamics of the QuadRotor s platform, although only free flight tests can accurately determine that. Improvements in the responses might be achieved with robust control techniques. No satisfactory flight test results could be achieved for the full position control algorithm due to the lack of accuracy of the position sensors. The QuadRotor s autonomous flight should be aided by vision data, which is not yet available. Having the XSens IMU as the only measurement source posed great problems due to the XSens limitations: not only the position readings had above 1000% errors as the attitude measurements 5

6 showed too big drifts. Note that for tethered flight in the testbed the drifts aren t a big problem because the testbed prevents translational movement. Nevertheless the results that were achieved are promising, since the inner-loop, the attitude control system, presents a satisfying behaviour. 7 Concluding remarks and future work Figure 10: Hovering test Figure 11: Very hard conditions: steps on all angles A dynamics model for the attitude and altitude of the QuadRotor was determined. A set of PID controllers for attitude was developed and fully tested in tethered flight. Also position controllers were developed and the full position control system was simulated with the attitude control system as an inner-loop. The attitude flight test results were satisfying, although free flight tests would be advisable, when the vision data is available. However, the current control implementation has little ability to reject disturbances from wind and translational velocity effects. For this scale aircraft, even mild winds can cause disturbances. There is signifant coupling between the velocity and the attitude dynamics, so assuming that free stream velocity and attitude control are decoupled is a key weakness of this approach. [2] Because the QuadRotor is meant to fly in multiple kinds of environments, great flexibility will be required and an important feature of the control system for this project is that it should be robust to changes in the platform s dynamics. This feature wasn t tested, but it should be considered in the future. There are two clear conflicting project design goals: the hability of the algorithms to deal with the fast dynamics of the QuadRotor against the objective of having a controller that is robust to model changes. Regarding the vision algorithms implementation, it is expected that these will have much lower (around 10 to 20 times) sample rates than the common IMU sensors. This poses a challenge to the control algorithms and the development of a dedicated algorithm block to account for the vision positioning data handling should be studied. Another possible subject for future research is the study of correlations between the dynamics about the different axis of the QuadRotor s platform. Since no correlations were detected with the CIFER software, the current control system was built on the assumption that the correlation between axis is neglectible. Although, the experimental results with the tethered QuadRotor suggest otherwise. It is still to determine wether this was an effect produced by the testbed tethering system or an actual feature of the platform s dynamics. 6

7 8 Aknowledgments I would like to express my appreciation to my advisors, Afzal Suleman and Pini Gurfil, and also to Yuval Shalgi, Sergey Danielian, Aram Movsisian and Yair Atzmon for their invaluable help and contributions. 9 Note For extensive information on the work hereby described, please refer to the respective bibliography items or to my MSc thesis: S. Fernandes. Guidance and Trajectory Following of an Autonomous Vision-Guided Micro QuadRotor. Instituto Superior Técnico - Universidade Técnica de Lisboa, This thesis also documents the development of a communication system and realtime code necessary for the experimental tests. References [1] A. T. GmbH. X-3D-BL User s Manual. [2] G. M. Hoffman, H. Huang, S. L. Waslander, and C. J. Tomlin. Quadrotor helicopter flight dynamics and control: Theory and experiment. In AIAA Guidance, Navigation and Control Conference and Exhibit. American Institute of Aeronautics and Astronautics, August [3] CIFER User s Guide, student version edition. [4] M. B. T. Jeffrey N. Williams, Johnie A. Ham. Flight Test Manual - Rotorcraft Frequency Domain Flight Testing. U.S. Army Test and Evaluation Command, U.S. Army Aviation Technical Test Center - Airworthiness Qualification Test Directorate, September [5] CIFER Background and Application. [6] L. Beji and A. Abichou. Streamlined rotors mini rotorcraft: Trajectory generation and tracking. International Journal of Control, Automation and Systems, 3(1):87 99, March [7] S. Bouabdallah and R. Siegwart. Advances in Unmanned Aerial Vehicles, chapter 6 - Design and Control of a Miniature Quadrotor, pages Springer, Netherlands, [8] A. B. J. Hetthéssy, R. Bars. Discrete PID Control. Budapest University of Technology and Economics, [9] G. M. Hoffman, S. L. Waslander, and C. J. Tomlin. Quadrotor helicopter trajectory tracking control. In AIAA Guidance, Navigation and Control Conference and Exhibit. American Institute of Aeronautics and Astronautics, August [10] W. E. Green and P. Y. Oh. A mav that flies like an airplane and hovers like a helicopter. Proceedings of the 2005 IEEE/ASME International Conference on Advanced Intelligent Mechatronics, July [11] K. Ogata. Modern Control Engineering. Prentice Hall International, Inc., 3rd edition, [12] G. C. Goodwin, S. F. Graebe, and M. E. Salgado. Control System Design. Universidad Técnica Federico Santa María, [13] J. Kamman. Me 360 control systems - system type and steady-state error. [14] K. Astrom and B. Wittenmark. Computer Controlled Systems. Prentice Hall International, Inc., [15] S. Bouabdallah, A. Noth, and R. Siegwart. Pid vs lq control techniques applied to an indoor micro quadrotor. In IEEE/RSJ International Conference on Intelligent Robots and Systems, Sendai, Japan,

IMPROVING QUADROTOR 3-AXES STABILIZATION RESULTS USING EMPIRICAL RESULTS AND SYSTEM IDENTIFICATION

IMPROVING QUADROTOR 3-AXES STABILIZATION RESULTS USING EMPIRICAL RESULTS AND SYSTEM IDENTIFICATION IMPROVING QUADROTOR 3-AXES STABILIZATION RESULTS USING EMPIRICAL RESULTS AND SYSTEM IDENTIFICATION Övünç Elbir & Electronics Eng. oelbir@etu.edu.tr Anıl Ufuk Batmaz & Electronics Eng. aubatmaz@etu.edu.tr

More information

Dynamical Modeling and Controlof Quadrotor

Dynamical Modeling and Controlof Quadrotor Dynamical Modeling and Controlof Quadrotor Faizan Shahid NUST PNEC Pakistan engr.faizan_shahid@hotmail.com Muhammad Bilal Kadri, Nasir Aziz Jumani, Zaid Pirwani PAF KIET Pakistan bilal.kadri@pafkiet.edu.pk

More information

Beikrit Samia Falaschini Clara Abdolhosseini Mahyar Capotescu Florin. Qball Quadrotor Helicopter

Beikrit Samia Falaschini Clara Abdolhosseini Mahyar Capotescu Florin. Qball Quadrotor Helicopter Beikrit Samia Falaschini Clara Abdolhosseini Mahyar Capotescu Florin Qball Quadrotor Helicopter Flight Control Systems Project : Objectives for the Qball quadrotor helicopter 1) Develop non linear and

More information

Design and Analysis of Quadcopter Classical Controller Ahmed H. Ahmed*, Ahmed N. Ouda*, Ahmed M.Kamel*, Y. Z. Elhalwagy*

Design and Analysis of Quadcopter Classical Controller Ahmed H. Ahmed*, Ahmed N. Ouda*, Ahmed M.Kamel*, Y. Z. Elhalwagy* 16 th International Conference on AEROSPACE SCIENCES & AVIATION TECHNOLOGY, ASAT - 16 May 26-28, 2015, E-Mail: asat@mtc.edu.eg Military Technical College, Kobry Elkobbah, Cairo, Egypt Tel : +(202) 24025292

More information

Design and Development of Unmanned Tilt T-Tri Rotor Aerial Vehicle

Design and Development of Unmanned Tilt T-Tri Rotor Aerial Vehicle Design and Development of Unmanned Tilt T-Tri Rotor Aerial Vehicle K. Senthil Kumar, Mohammad Rasheed, and T.Anand Abstract Helicopter offers the capability of hover, slow forward movement, vertical take-off

More information

Unmanned Aerial Vehicles

Unmanned Aerial Vehicles Unmanned Aerial Vehicles Embedded Control Edited by Rogelio Lozano WILEY Table of Contents Chapter 1. Aerodynamic Configurations and Dynamic Models 1 Pedro CASTILLO and Alejandro DZUL 1.1. Aerodynamic

More information

Autonomous Landing of an Unmanned Aerial Vehicle

Autonomous Landing of an Unmanned Aerial Vehicle Autonomous Landing of an Unmanned Aerial Vehicle Joel Hermansson, Andreas Gising Cybaero AB SE-581 12 Linköping, Sweden Email: {joel.hermansson, andreas.gising}@cybaero.se Martin Skoglund and Thomas B.

More information

ROBOT TEAMS CH 12. Experiments with Cooperative Aerial-Ground Robots

ROBOT TEAMS CH 12. Experiments with Cooperative Aerial-Ground Robots ROBOT TEAMS CH 12 Experiments with Cooperative Aerial-Ground Robots Gaurav S. Sukhatme, James F. Montgomery, and Richard T. Vaughan Speaker: Jeff Barnett Paper Focus Heterogeneous Teams for Surveillance

More information

Flight Control System Design and Test for Unmanned Rotorcraft

Flight Control System Design and Test for Unmanned Rotorcraft IEEE Santa Clara Valley Control Systems Society Technical Meeting September 2, 2 Flight Control System Design and Test for Unmanned Rotorcraft Chad R. Frost Flight Control and Cockpit Integration Branch

More information

Design & Optimization Fuzzy Logic Controller for General Helicopter Model

Design & Optimization Fuzzy Logic Controller for General Helicopter Model Design & Optimization Fuzzy Logic Controller for General Helicopter Model Hasan A. AbuMeteir Graduated Student of Control Engineering IUG Gaza-Palestine hmeteir@gmail.com Abstract Helicopter aviation is

More information

State Space System Modeling of a Quad Copter UAV

State Space System Modeling of a Quad Copter UAV Indian Journal of Science Technology, Vol 9(27), DOI: 10.17485/ijst/2016/v9i27/95239, July 2016 ISSN (Print) : 0974-6846 ISSN (Online) : 0974-5645 State Space System Modeling of a Quad Copter UAV Zaid

More information

Distributed Vision-Aided Cooperative Navigation Based on Three-View Geometry

Distributed Vision-Aided Cooperative Navigation Based on Three-View Geometry Distributed Vision-Aided Cooperative Navigation Based on hree-view Geometry Vadim Indelman, Pini Gurfil Distributed Space Systems Lab, Aerospace Engineering, echnion Ehud Rivlin Computer Science, echnion

More information

Cascade attitude control of a quadcopter in presence of motor asymmetry

Cascade attitude control of a quadcopter in presence of motor asymmetry Integral-Derivative Control, Ghent, Belgium, May 9-11, 018 WeAT3.4 Cascade attitude control of a quadcopter in presence of motor asymmetry Brice J. Njinwoua Alain Vande Wouwer. University of Mons - Control

More information

EE6102 Multivariable Control Systems

EE6102 Multivariable Control Systems EE612 Multivariable Control Systems Homework Assignments for Part 2 Prepared by Ben M. Chen Department of Electrical & Computer Engineering National University of Singapore April 21, 212 EE612 Multivariable

More information

General model and control of an n rotor helicopter

General model and control of an n rotor helicopter Downloaded from orbit.dtu.dk on: Jun 29, 218 General model and control of an n rotor helicopter Zsurzsan, Adriana Gabriela; Brogaard, Rune Yding; Andersen, Nils Axel; Ravn, Ole Published in: Journal of

More information

CAMERA GIMBAL PERFORMANCE IMPROVEMENT WITH SPINNING-MASS MECHANICAL GYROSCOPES

CAMERA GIMBAL PERFORMANCE IMPROVEMENT WITH SPINNING-MASS MECHANICAL GYROSCOPES 8th International DAAAM Baltic Conference "INDUSTRIAL ENGINEERING 19-21 April 2012, Tallinn, Estonia CAMERA GIMBAL PERFORMANCE IMPROVEMENT WITH SPINNING-MASS MECHANICAL GYROSCOPES Tiimus, K. & Tamre, M.

More information

Control of a quadrotor manipulating a beam (2 projects available)

Control of a quadrotor manipulating a beam (2 projects available) Control of a quadrotor manipulating a beam (2 projects available) Supervisor: Emanuele Garone (egarone@ulb.ac.be), Tam Nguyen, Laurent Catoire General Goal: The goal of this project is to complete from

More information

9 Degrees of Freedom Inertial Measurement Unit with AHRS [RKI-1430]

9 Degrees of Freedom Inertial Measurement Unit with AHRS [RKI-1430] 9 Degrees of Freedom Inertial Measurement Unit with AHRS [RKI-1430] Users Manual Robokits India info@robokits.co.in http://www.robokitsworld.com Page 1 This 9 Degrees of Freedom (DOF) Inertial Measurement

More information

Real-Time Embedded Control System for VTOL Aircrafts: Application to stabilize a quad-rotor helicopter

Real-Time Embedded Control System for VTOL Aircrafts: Application to stabilize a quad-rotor helicopter Proceedings of the 26 IEEE International Conference on Control Applications Munich, Germany, October 4-6, 26 FrA9.4 Real-Time Embedded Control System for VTOL Aircrafts: Application to stabilize a quad-rotor

More information

FUZZY LOGIC BASED QUADROTOR FLIGHT CONTROLLER

FUZZY LOGIC BASED QUADROTOR FLIGHT CONTROLLER FUZZY LOGIC BASED QUADROTOR FLIGHT CONTROLLER Syed Ali Raza and Wail Gueaieb School of Information Technology and Engineering, University of Ottawa 8 King Edward Avenue, Ottawa, ON, Canada syedali.raza@uottawa.ca,

More information

An Affine Parameter Dependent Controller of An Helicopter for Various Forward Velocity Conditions İsmail Hakki Şahin 1,2, a, Coşku Kasnakoğlu 1,b

An Affine Parameter Dependent Controller of An Helicopter for Various Forward Velocity Conditions İsmail Hakki Şahin 1,2, a, Coşku Kasnakoğlu 1,b Applied Mechanics and Materials Vols. 789-79 (215) pp 167-172 (215) Trans Tech Publications, Switzerland doi:1.428/www.scientific.net/amm.789-79.167 An Affine Parameter Dependent Controller of An Helicopter

More information

Adaptive back-stepping control applied on octocopter under recoil disturbance

Adaptive back-stepping control applied on octocopter under recoil disturbance Journal of Engineering Science and Military Technologies ISSN: 2357-0954 DOI: 10.21608/ejmtc.2017.401.1004 Adaptive back-stepping control applied on octocopter under recoil disturbance GuangXue Zhang 1

More information

Non-symmetric membership function for Fuzzy-based visual servoing onboard a UAV

Non-symmetric membership function for Fuzzy-based visual servoing onboard a UAV 1 Non-symmetric membership function for Fuzzy-based visual servoing onboard a UAV M. A. Olivares-Méndez and P. Campoy and C. Martínez and I. F. Mondragón B. Computer Vision Group, DISAM, Universidad Politécnica

More information

Autonomous Indoor Hovering with a Quadrotor

Autonomous Indoor Hovering with a Quadrotor Autonomous Indoor Hovering with a Quadrotor G. Angeletti, J. R. Pereira Valente, L. Iocchi, D. Nardi Sapienza University of Rome, Dept. of Computer and System Science, Via Ariosto 25, 00185 Rome, Italy

More information

Visual Servoing for Tracking Features in Urban Areas Using an Autonomous Helicopter

Visual Servoing for Tracking Features in Urban Areas Using an Autonomous Helicopter Visual Servoing for Tracking Features in Urban Areas Using an Autonomous Helicopter Abstract The use of Unmanned Aerial Vehicles (UAVs) in civilian and domestic applications is highly demanding, requiring

More information

Comparison of PID and LQR controllers on a quadrotor helicopter

Comparison of PID and LQR controllers on a quadrotor helicopter Comparison of PID and LQR controllers on a quadrotor helicopter Demet Canpolat Tosun 1, Yasemin Işık 2, Hakan Korul 3 Abstract This paper focuses on a quadrotor model, named as Qball-X4 developed by Quanser.

More information

Analysis of Extended Movement Models for Autonomous Quadrocopters

Analysis of Extended Movement Models for Autonomous Quadrocopters Otto von Guericke University Magdeburg Chair of Intelligent Systems Institute of Knowledge and Language Engineering Digital Engineering Project Analysis of Extended Movement Models for Autonomous Quadrocopters

More information

Modeling and Control of a Simulated Flight of a Mini Helicopter Using Matlab/Simulink

Modeling and Control of a Simulated Flight of a Mini Helicopter Using Matlab/Simulink International Conference on Computer, Communications and Information Technology (CCIT 2014) Modeling and Control of a Simulated Flight of a Mini Helicopter Using Matlab/Simulink Mohamed Yacine Chachou,

More information

Optimisation of Unmanned Aerial Vehicle Search and Rescue Missions Formalising a Method for Maximising Probability of Target Acquisition

Optimisation of Unmanned Aerial Vehicle Search and Rescue Missions Formalising a Method for Maximising Probability of Target Acquisition Optimisation of Unmanned Aerial Vehicle Search and Rescue Missions Formalising a Method for Maximising Probability of Target Acquisition Hussain Al-Helal (alhelal@email.arizona.edu) Technical Report #008-ECE49-087-01

More information

Modeling and Fuzzy Logic Control of a Quadrotor UAV

Modeling and Fuzzy Logic Control of a Quadrotor UAV Modeling and Fuzzy Logic Control of a Quadrotor UAV Muhammad Awais Sattar 1, Dr Abdulla Ismail 2 1Graduate Student, Dept. of Electrical Engineering, Rochester Institute of Technology, Dubai, UAE 2Professor,

More information

Electronics Design Contest 2016 Wearable Controller VLSI Category Participant guidance

Electronics Design Contest 2016 Wearable Controller VLSI Category Participant guidance Electronics Design Contest 2016 Wearable Controller VLSI Category Participant guidance June 27, 2016 Wearable Controller is a wearable device that can gather data from person that wears it. Those data

More information

Camera Drones Lecture 2 Control and Sensors

Camera Drones Lecture 2 Control and Sensors Camera Drones Lecture 2 Control and Sensors Ass.Prof. Friedrich Fraundorfer WS 2017 1 Outline Quadrotor control principles Sensors 2 Quadrotor control - Hovering Hovering means quadrotor needs to hold

More information

A Control System for an Unmanned Micro Aerial Vehicle

A Control System for an Unmanned Micro Aerial Vehicle 15th International Conference on Mechatronics Technology A Control System for an Unmanned Micro Aerial Vehicle L. Huang 1 and C. Murton 2 1 School of Engineering, Auckland University of Technology, New

More information

Development of a Ground Based Cooperating Spacecraft Testbed for Research and Education

Development of a Ground Based Cooperating Spacecraft Testbed for Research and Education DIPARTIMENTO DI INGEGNERIA INDUSTRIALE Development of a Ground Based Cooperating Spacecraft Testbed for Research and Education Mattia Mazzucato, Sergio Tronco, Andrea Valmorbida, Fabio Scibona and Enrico

More information

Aircraft Stability and Performance 2nd Year, Aerospace Engineering. Dr. M. Turner

Aircraft Stability and Performance 2nd Year, Aerospace Engineering. Dr. M. Turner Aircraft Stability and Performance 2nd Year, Aerospace Engineering Dr. M. Turner Basic Info Timetable 15.00-16.00 Monday ENG LT1 16.00-17.00 Monday ENG LT1 Typical structure of lectures Part 1 Theory Part

More information

UAV Search : Maximising Target Acquisition

UAV Search : Maximising Target Acquisition UAV Search : Maximising Target Acquisition Author: Hussain Al-Helal 39 N Grande Ave. Unit B Tucson, Arizona, 85745 Branch Counselor: Brenda Huettner IEEE Member #90594047 April 10, 009 UAV Search: Maximising

More information

Estimation of Altitude and Vertical Velocity for Multirotor Aerial Vehicle using Kalman Filter

Estimation of Altitude and Vertical Velocity for Multirotor Aerial Vehicle using Kalman Filter Estimation of Altitude and Vertical Velocity for Multirotor Aerial Vehicle using Kalman Filter Przemys law G asior, Stanis law Gardecki, Jaros law Gośliński and Wojciech Giernacki Poznan University of

More information

Quadrotor Control Using Dual Camera Visual Feedback

Quadrotor Control Using Dual Camera Visual Feedback Proceedings of the 3 IEEE International Conference on Robotics & Automation Taipei, Taiwan, September 14-19, 3 Quadrotor Control Using Dual Camera Visual Feedback Erdinç Altuğ, James P. Ostrowski, Camillo

More information

REAL FLIGHT DEMONSTRATION OF PITCH AND ROLL CONTROL FOR UAV CANYON FLIGHTS

REAL FLIGHT DEMONSTRATION OF PITCH AND ROLL CONTROL FOR UAV CANYON FLIGHTS REAL FLIGHT DEMONSTRATION OF PITCH AND ROLL CONTROL FOR UAV CANYON FLIGHTS Cezary KOWNACKI * * Faculty of Mechanical Engineering, Department of Automatics and Robotics, Bialystok University of Technology,

More information

Test Report iµvru. (excerpt) Commercial-in-Confidence. imar Navigation GmbH Im Reihersbruch 3 D St. Ingbert Germany.

Test Report iµvru. (excerpt) Commercial-in-Confidence. imar Navigation GmbH Im Reihersbruch 3 D St. Ingbert Germany. 1 of 11 (excerpt) Commercial-in-Confidence imar Navigation GmbH Im Reihersbruch 3 D-66386 St. Ingbert Germany www.imar-navigation.de sales@imar-navigation.de 2 of 11 CHANGE RECORD Date Issue Paragraph

More information

Navigational Aids 1 st Semester/2007/TF 7:30 PM -9:00 PM

Navigational Aids 1 st Semester/2007/TF 7:30 PM -9:00 PM Glossary of Navigation Terms accelerometer. A device that senses inertial reaction to measure linear or angular acceleration. In its simplest form, it consists of a case-mounted spring and mass arrangement

More information

Motion Analysis of Pitch Rotation Mechanism for Posture Control of Butterfly-style Flapping Robot

Motion Analysis of Pitch Rotation Mechanism for Posture Control of Butterfly-style Flapping Robot 2014 American Transactions on Engineering & Applied Sciences. American Transactions on Engineering & Applied Sciences http://tuengr.com/ateas Motion Analysis of Pitch Rotation Mechanism for Posture Control

More information

Leaderless Formation Control for Multiple Autonomous Vehicles. Wei Ren

Leaderless Formation Control for Multiple Autonomous Vehicles. Wei Ren AIAA Guidance, Navigation, and Control Conference and Exhibit - 4 August 6, Keystone, Colorado AIAA 6-669 Leaderless Formation Control for Multiple Autonomous Vehicles Wei Ren Department of Electrical

More information

Inertial Navigation Systems

Inertial Navigation Systems Inertial Navigation Systems Kiril Alexiev University of Pavia March 2017 1 /89 Navigation Estimate the position and orientation. Inertial navigation one of possible instruments. Newton law is used: F =

More information

Robust Controller Design for an Autonomous Underwater Vehicle

Robust Controller Design for an Autonomous Underwater Vehicle DRC04 Robust Controller Design for an Autonomous Underwater Vehicle Pakpong Jantapremjit 1, * 1 Department of Mechanical Engineering, Faculty of Engineering, Burapha University, Chonburi, 20131 * E-mail:

More information

Control System Design for An Autonomous Helicopter Model in Hovering Using Pole Placement Method

Control System Design for An Autonomous Helicopter Model in Hovering Using Pole Placement Method Control System Design for An Autonomous Helicopter Model in Hovering Using Pole Placement Method Abas Ab. Wahab 1, Rosbi Mamat 2 and Syariful Syafiq Shamsudin 3 Universiti Teknologi Malaysia, 81310 Skudai,

More information

Automatic Pouring Robot. Akilah Harris-Williams Adam Olmstead Philip Pratt-Szeliga Will Roantree

Automatic Pouring Robot. Akilah Harris-Williams Adam Olmstead Philip Pratt-Szeliga Will Roantree Automatic Pouring Robot Akilah Harris-Williams Adam Olmstead Philip Pratt-Szeliga Will Roantree Overview Objective and Motivation Mechanical System Modeling, Simulation and Verification Tilt Pan Pouring

More information

Modeling, Parameter Estimation, and Navigation of Indoor Quadrotor Robots

Modeling, Parameter Estimation, and Navigation of Indoor Quadrotor Robots Brigham Young University BYU ScholarsArchive All Theses and Dissertations 2013-04-29 Modeling, Parameter Estimation, and Navigation of Indoor Quadrotor Robots Stephen C. Quebe Brigham Young University

More information

VISIO -BASED CO TROL OF FIXED-WI G U MA ED AERIAL VEHICLE FOR AUTO OMOUS ROAD-FOLLOWI G

VISIO -BASED CO TROL OF FIXED-WI G U MA ED AERIAL VEHICLE FOR AUTO OMOUS ROAD-FOLLOWI G VISIO -BASED CO TROL OF FIXED-WI G U MA ED AERIAL VEHICLE FOR AUTO OMOUS ROAD-FOLLOWI G João Paulo de Souza, jpsouza@ita.br Elder Moreira Hemerly, hemerly@ita.br Instituto Tecnológico de Aeronáutica, ITA

More information

Dynamic Modeling and Control of Quad Rotor

Dynamic Modeling and Control of Quad Rotor Dynamic Modeling and ontrol of Quad Rotor E.Balasubramanian and R.Vasantharaj Dept. of Mechanical Engg, Dept. of Electronics and ommunication Engg. Vel Tech Dr. RR & Dr. SR Technical University, Vel Tech

More information

Inflight Alignment Simulation using Matlab Simulink

Inflight Alignment Simulation using Matlab Simulink Inflight Alignment Simulation using Matlab Simulink Authors, K. Chandana, Soumi Chakraborty, Saumya Shanker, R.S. Chandra Sekhar, G. Satheesh Reddy. RCI /DRDO.. 2012 The MathWorks, Inc. 1 Agenda with Challenging

More information

Development Of A Quadrotor Testbed For Control And Sensor Development

Development Of A Quadrotor Testbed For Control And Sensor Development Clemson University TigerPrints All Theses Theses 12-2008 Development Of A Quadrotor Testbed For Control And Sensor Development Abhishek Bhargava Clemson University, mailbox.abhi@gmail.com Follow this and

More information

Identification of a UAV and Design of a Hardware-in-the-Loop System for Nonlinear Control Purposes

Identification of a UAV and Design of a Hardware-in-the-Loop System for Nonlinear Control Purposes Identification of a UAV and Design of a Hardware-in-the-Loop System for Nonlinear Control Purposes Myriam Manaï and André Desbiens LOOP, Université Laval, Quebec City, Quebec, G1K 7P4, Canada Eric Gagnon

More information

Construction, Modeling and Automatic Control of a UAV Helicopter

Construction, Modeling and Automatic Control of a UAV Helicopter Construction, Modeling and Automatic Control of a UAV Helicopter BEN M. CHENHEN EN M. C Department of Electrical and Computer Engineering National University of Singapore 1 Outline of This Presentation

More information

Camera gimbal control system for unmanned platforms

Camera gimbal control system for unmanned platforms 8 th International Symposium Topical Problems in the Field of Electrical and Power Engineering Pärnu, Estonia, January 11-16, 2010 Camera gimbal control system for unmanned platforms Kristjan Tiimus, Mart

More information

DESIGN AND IMPLEMENTATION OF VISUAL FEEDBACK FOR AN ACTIVE TRACKING

DESIGN AND IMPLEMENTATION OF VISUAL FEEDBACK FOR AN ACTIVE TRACKING DESIGN AND IMPLEMENTATION OF VISUAL FEEDBACK FOR AN ACTIVE TRACKING Tomasz Żabiński, Tomasz Grygiel, Bogdan Kwolek Rzeszów University of Technology, W. Pola 2, 35-959 Rzeszów, Poland tomz, bkwolek@prz-rzeszow.pl

More information

Vision-Based Control of a Multi-Rotor Helicopter

Vision-Based Control of a Multi-Rotor Helicopter Vision-Based Control of a Multi-Rotor Helicopter Justin Haines CMU-RI-TR-00-00 Submitted in partial fulfillment of the requirements for the degree of Master of Science in Robotics Robotics Institute Carnegie

More information

Development of 3D Positioning Scheme by Integration of Multiple Wiimote IR Cameras

Development of 3D Positioning Scheme by Integration of Multiple Wiimote IR Cameras Proceedings of the 5th IIAE International Conference on Industrial Application Engineering 2017 Development of 3D Positioning Scheme by Integration of Multiple Wiimote IR Cameras Hui-Yuan Chan *, Ting-Hao

More information

CHAPTER 2 SENSOR DATA SIMULATION: A KINEMATIC APPROACH

CHAPTER 2 SENSOR DATA SIMULATION: A KINEMATIC APPROACH 27 CHAPTER 2 SENSOR DATA SIMULATION: A KINEMATIC APPROACH 2.1 INTRODUCTION The standard technique of generating sensor data for navigation is the dynamic approach. As revealed in the literature (John Blakelock

More information

Implementation of Estimation and Control Solutions in Quadcopter Platforms

Implementation of Estimation and Control Solutions in Quadcopter Platforms Implementation of Estimation and Control Solutions in Quadcopter Platforms Flávio de Almeida Justino flavio.justino@tecnico.ulisboa.pt Instituto Superior Técnico, Universidade de Lisboa, Lisboa, Portugal

More information

Tightly-Integrated Visual and Inertial Navigation for Pinpoint Landing on Rugged Terrains

Tightly-Integrated Visual and Inertial Navigation for Pinpoint Landing on Rugged Terrains Tightly-Integrated Visual and Inertial Navigation for Pinpoint Landing on Rugged Terrains PhD student: Jeff DELAUNE ONERA Director: Guy LE BESNERAIS ONERA Advisors: Jean-Loup FARGES Clément BOURDARIAS

More information

Robust Neuro-Control for A Micro Quadrotor

Robust Neuro-Control for A Micro Quadrotor Robust Neuro-Control for A Micro Quadrotor Jack F. Shepherd III Oregon State University Corvallis, OR, USA shepheja@engr.orst.edu Kagan Tumer Oregon State University Corvallis, OR, USA kagan.tumer@oregonstate.edu

More information

FlightGear application for flight simulation of a mini-uav

FlightGear application for flight simulation of a mini-uav FlightGear application for flight simulation of a mini-uav Tomáš Vogeltanz and Roman Jašek Citation: AIP Conference Proceedings 1648, 550014 (2015); doi: 10.1063/1.4912769 View online: http://dx.doi.org/10.1063/1.4912769

More information

Marker Based Localization of a Quadrotor. Akshat Agarwal & Siddharth Tanwar

Marker Based Localization of a Quadrotor. Akshat Agarwal & Siddharth Tanwar Marker Based Localization of a Quadrotor Akshat Agarwal & Siddharth Tanwar Objective Introduction Objective: To implement a high level control pipeline on a quadrotor which could autonomously take-off,

More information

AUTOPILOT DESIGN DOR THE LATERAL-DIRECTIONAL MOTION OF AN UAV

AUTOPILOT DESIGN DOR THE LATERAL-DIRECTIONAL MOTION OF AN UAV SCIENTIFIC RESEARCH AND EDUCATION IN THE AIR FORCE AFASES2017 AUTOPILOT DESIGN DOR THE LATERAL-DIRECTIONAL MOTION OF AN UAV Costin ENE, Adrian-Mihail STOICA, Petrisor-Valentin PARVU University Politehnica

More information

System Identification, State Estimation, and Control of. Unmanned Aerial Robots. Caleb Chamberlain

System Identification, State Estimation, and Control of. Unmanned Aerial Robots. Caleb Chamberlain System Identification, State Estimation, and Control of Unmanned Aerial Robots Caleb Chamberlain A thesis submitted to the faculty of Brigham Young University in partial fulfillment of the requirements

More information

Developing a MATLAB-Based Control System Design and Analysis Tool for Enhanced Learning Environment in Control System Education

Developing a MATLAB-Based Control System Design and Analysis Tool for Enhanced Learning Environment in Control System Education Developing a MATLAB-Based Control System Design and Analysis Tool for Enhanced Learning Environment in Control System Education Frank S. Cheng and Lin Zhao Industrial and Engineering Technology Department

More information

Attitude Control of Multicopter R. Baranek 1, F. Solc 1 1

Attitude Control of Multicopter R. Baranek 1, F. Solc 1 1 Roční Číslo V Attitude Control of ulticopter R. Barane, F. Solc Department of Control and Instrumentation, Faculty of Electrical Engineering and Communication, BU, Kolejni 4, Brno E-mail: xbaran@stud.feec.vutbr.cz,

More information

EFFECT OF YAW-TILTED HINGE AXIS ON DEPLOYMENT ROBUSTNESS OF MARS AIRPLANE

EFFECT OF YAW-TILTED HINGE AXIS ON DEPLOYMENT ROBUSTNESS OF MARS AIRPLANE EFFET OF YAW-TILTED HINGE AXIS ON DEPLOYMENT ROBUSTNESS OF MARS AIRPLANE Koji Fujita* Hiroki Nagai** and Akira Oyama* * Institute of Space and Astronautical Science Japan Aerospace Exploration Agency --

More information

An Experimental Study of the Autonomous Helicopter Landing Problem

An Experimental Study of the Autonomous Helicopter Landing Problem An Experimental Study of the Autonomous Helicopter Landing Problem Srikanth Saripalli 1, Gaurav S. Sukhatme 1, and James F. Montgomery 2 1 Department of Computer Science, University of Southern California,

More information

Learning Helicopter Model Through Examples

Learning Helicopter Model Through Examples Learning Helicopter Model Through Examples TITO G. AMARAL EST-Setúbal, Instituto Politécnico de Setúbal Instituto de Sistemas e Robótica UC, Pólo II Rua Vale de Chaves, Estefanilha 294-508 Setúbal PORTUGAL

More information

STUDY ABOUT THE STABILITY AND CONTROL OF A ROTOR AIRPLANE

STUDY ABOUT THE STABILITY AND CONTROL OF A ROTOR AIRPLANE STUDY ABOUT THE STABILITY AND CONTROL OF A ROTOR AIRPLANE Victor Stafy Aristeu Silveira Neto victorstafy@aero.ufu.br aristeus@ufu.br Fluid Mechanics Laboratory- MFlab, Federal University of Uberlândia-

More information

Design, construction and modelling of a low cost, miniature UAV using machine vision

Design, construction and modelling of a low cost, miniature UAV using machine vision Design, construction and modelling of a low cost, miniature UAV using machine vision Peter Beasley s475445@student.uq.edu.au Phillip Gray s476239@student.uq.edu.au Kane Usher kane.usher@csiro.au CSIRO

More information

Implementation of Decentralized Formation Control on Multi-Quadrotor Systems

Implementation of Decentralized Formation Control on Multi-Quadrotor Systems Implementation of Decentralized Formation Control on Multi-Quadrotor Systems by Nasrettin Koksal A thesis presented to the University of Waterloo in fulfillment of the thesis requirement for the degree

More information

Robust Chattering Free Backstepping Sliding Mode Control Strategy for Autonomous Quadrotor Helicopter

Robust Chattering Free Backstepping Sliding Mode Control Strategy for Autonomous Quadrotor Helicopter International Journal of Mechanical & Mechatronics Engineering IJMME-IJENS Vol:4 No: 6 Robust Chattering Free Backstepping Sliding Mode Control Strategy for Autonomous Quadrotor Helicopter Mohd Ariffanan

More information

Aerodynamic Design Optimization of UAV Rotor Blades using a Genetic Algorithm

Aerodynamic Design Optimization of UAV Rotor Blades using a Genetic Algorithm Aerodynamic Design Optimization of UAV Rotor Blades using a Genetic Algorithm Hak-Min Lee 1), Nahm-Keon Hur 2) and *Oh-Joon Kwon 3) 1), 3) Department of Aerospace Engineering, KAIST, Daejeon 305-600, Korea

More information

Anibal Ollero Professor and head of GRVC University of Seville (Spain)

Anibal Ollero Professor and head of GRVC University of Seville (Spain) Aerial Manipulation Anibal Ollero Professor and head of GRVC University of Seville (Spain) aollero@us.es Scientific Advisor of the Center for Advanced Aerospace Technologies (Seville, Spain) aollero@catec.aero

More information

POTENTIAL ACTIVE-VISION CONTROL SYSTEMS FOR UNMANNED AIRCRAFT

POTENTIAL ACTIVE-VISION CONTROL SYSTEMS FOR UNMANNED AIRCRAFT 26 TH INTERNATIONAL CONGRESS OF THE AERONAUTICAL SCIENCES POTENTIAL ACTIVE-VISION CONTROL SYSTEMS FOR UNMANNED AIRCRAFT Eric N. Johnson* *Lockheed Martin Associate Professor of Avionics Integration, Georgia

More information

Autonomous Navigation for Flying Robots

Autonomous Navigation for Flying Robots Computer Vision Group Prof. Daniel Cremers Autonomous Navigation for Flying Robots Lecture 7.2: Visual Odometry Jürgen Sturm Technische Universität München Cascaded Control Robot Trajectory 0.1 Hz Visual

More information

AUTONOMOUS PLANETARY ROVER CONTROL USING INVERSE SIMULATION

AUTONOMOUS PLANETARY ROVER CONTROL USING INVERSE SIMULATION AUTONOMOUS PLANETARY ROVER CONTROL USING INVERSE SIMULATION Kevin Worrall (1), Douglas Thomson (1), Euan McGookin (1), Thaleia Flessa (1) (1)University of Glasgow, Glasgow, G12 8QQ, UK, Email: kevin.worrall@glasgow.ac.uk

More information

This was written by a designer of inertial guidance machines, & is correct. **********************************************************************

This was written by a designer of inertial guidance machines, & is correct. ********************************************************************** EXPLANATORY NOTES ON THE SIMPLE INERTIAL NAVIGATION MACHINE How does the missile know where it is at all times? It knows this because it knows where it isn't. By subtracting where it is from where it isn't

More information

Model predictive control to autonomous helicopter flight

Model predictive control to autonomous helicopter flight Model predictive control to autonomous helicopter flight Zillinger Molenaar, P.J.H. Published: 01/01/2007 Document Version Publisher s PDF, also known as Version of Record (includes final page, issue and

More information

Dynamic Modelling for MEMS-IMU/Magnetometer Integrated Attitude and Heading Reference System

Dynamic Modelling for MEMS-IMU/Magnetometer Integrated Attitude and Heading Reference System International Global Navigation Satellite Systems Society IGNSS Symposium 211 University of New South Wales, Sydney, NSW, Australia 15 17 November, 211 Dynamic Modelling for MEMS-IMU/Magnetometer Integrated

More information

Pose Estimation and Control of Micro-Air Vehicles

Pose Estimation and Control of Micro-Air Vehicles Pose Estimation and Control of Micro-Air Vehicles IVAN DRYANOVSKI, Ph.D. Candidate, Computer Science ROBERTO G. VALENTI, Ph.D. Candidate, Electrical Engineering Mentor: JIZHONG XIAO, Professor, Electrical

More information

The Effectiveness of Pole Placement Method in Control System Design for an Autonomous Helicopter Model in Hovering Flight

The Effectiveness of Pole Placement Method in Control System Design for an Autonomous Helicopter Model in Hovering Flight The Effectiveness of Pole Placement Method in Control System Design for an Autonomous Helicopter Model in Hovering Flight Abas Ab. Wahab 1,*, Rosbi Mamat 2 and Syariful Syafiq Shamsudin 1 1 Faculty of

More information

MEMS technology quality requirements as applied to multibeam echosounder. Jerzy DEMKOWICZ, Krzysztof BIKONIS

MEMS technology quality requirements as applied to multibeam echosounder. Jerzy DEMKOWICZ, Krzysztof BIKONIS MEMS technology quality requirements as applied to multibeam echosounder Jerzy DEMKOWICZ, Krzysztof BIKONIS Gdansk University of Technology Gdansk, Narutowicza str. 11/12, Poland demjot@eti.pg.gda.pl Small,

More information

CHARACTERIZATION AND CALIBRATION OF MEMS INERTIAL MEASUREMENT UNITS

CHARACTERIZATION AND CALIBRATION OF MEMS INERTIAL MEASUREMENT UNITS CHARACTERIZATION AND CALIBRATION OF MEMS INERTIAL MEASUREMENT UNITS ökçen Aslan 1,2, Afşar Saranlı 2 1 Defence Research and Development Institute (SAE), TÜBİTAK 2 Dept. of Electrical and Electronics Eng.,

More information

UNIVERSAL CONTROL METHODOLOGY DESIGN AND IMPLEMENTATION FOR UNMANNED VEHICLES. 8 th April 2010 Phang Swee King

UNIVERSAL CONTROL METHODOLOGY DESIGN AND IMPLEMENTATION FOR UNMANNED VEHICLES. 8 th April 2010 Phang Swee King UNIVERSAL CONTROL METHODOLOGY DESIGN AND IMPLEMENTATION FOR UNMANNED VEHICLES 8 th April 2010 Phang Swee King OUTLINES Introduction Platform Design Helicopter Avionics System Ground Station Sensors Measurement

More information

Dynamic Modelling and Simulation of a Vectored Thrust Quad-Rotor

Dynamic Modelling and Simulation of a Vectored Thrust Quad-Rotor Dynamic Modelling and Simulation of a Vectored Thrust Quad-Rotor Benjamin Faul School of Mechanical and Manufacturing Engineering University of New South Wales Sydney, NSW 252 Email: benjaminfaul@bigpond.com

More information

Testing the Possibilities of Using IMUs with Different Types of Movements

Testing the Possibilities of Using IMUs with Different Types of Movements 137 Testing the Possibilities of Using IMUs with Different Types of Movements Kajánek, P. and Kopáčik A. Slovak University of Technology, Faculty of Civil Engineering, Radlinského 11, 81368 Bratislava,

More information

Designing Simple Indoor Navigation System for UAVs

Designing Simple Indoor Navigation System for UAVs 19th Mediterranean Conference on Control and Automation Aquis Corfu Holiday Palace, Corfu, Greece June 2-23, 211 ThBT3.1 Designing Simple Indoor Navigation System for UAVs Mohamed Kara Mohamed, Sourav

More information

Motion estimation of unmanned marine vehicles Massimo Caccia

Motion estimation of unmanned marine vehicles Massimo Caccia Motion estimation of unmanned marine vehicles Massimo Caccia Consiglio Nazionale delle Ricerche Istituto di Studi sui Sistemi Intelligenti per l Automazione Via Amendola 122 D/O, 70126, Bari, Italy massimo.caccia@ge.issia.cnr.it

More information

Low Cost solution for Pose Estimation of Quadrotor

Low Cost solution for Pose Estimation of Quadrotor Low Cost solution for Pose Estimation of Quadrotor mangal@iitk.ac.in https://www.iitk.ac.in/aero/mangal/ Intelligent Guidance and Control Laboratory Indian Institute of Technology, Kanpur Mangal Kothari

More information

A NOUVELLE MOTION STATE-FEEDBACK CONTROL SCHEME FOR RIGID ROBOTIC MANIPULATORS

A NOUVELLE MOTION STATE-FEEDBACK CONTROL SCHEME FOR RIGID ROBOTIC MANIPULATORS A NOUVELLE MOTION STATE-FEEDBACK CONTROL SCHEME FOR RIGID ROBOTIC MANIPULATORS Ahmad Manasra, 135037@ppu.edu.ps Department of Mechanical Engineering, Palestine Polytechnic University, Hebron, Palestine

More information

The Study of Integrated Fire/Flight/Propulsion Control (IFFPC) System And Design of Digital Simulation/Design Platform

The Study of Integrated Fire/Flight/Propulsion Control (IFFPC) System And Design of Digital Simulation/Design Platform The Study of Integrated Fire/Flight/Propulsion (IFFPC) System And Design of Digital The Study of Integrated Fire/Flight/Propulsion (IFFPC) System And Design of Digital S.J. Song, Y.Z. Zhang, J.H. Deng

More information

Mobile Robotics. Mathematics, Models, and Methods. HI Cambridge. Alonzo Kelly. Carnegie Mellon University UNIVERSITY PRESS

Mobile Robotics. Mathematics, Models, and Methods. HI Cambridge. Alonzo Kelly. Carnegie Mellon University UNIVERSITY PRESS Mobile Robotics Mathematics, Models, and Methods Alonzo Kelly Carnegie Mellon University HI Cambridge UNIVERSITY PRESS Contents Preface page xiii 1 Introduction 1 1.1 Applications of Mobile Robots 2 1.2

More information

SENSORIC SUBSYSTEM DESIGN FOR SMALL MODEL OF HELICOPTER

SENSORIC SUBSYSTEM DESIGN FOR SMALL MODEL OF HELICOPTER Acta Electrotechnica et Informatica, Vol. 13, No. 3, 2013, 17 21, DOI: 10.2478/aeei-2013-0034 17 SENSORIC SUBSYSTEM DESIGN FOR SMALL MODEL OF HELICOPTER Ján BAČÍK, Pavol FEDOR, Milan LACKO Department of

More information

Dealing with Scale. Stephan Weiss Computer Vision Group NASA-JPL / CalTech

Dealing with Scale. Stephan Weiss Computer Vision Group NASA-JPL / CalTech Dealing with Scale Stephan Weiss Computer Vision Group NASA-JPL / CalTech Stephan.Weiss@ieee.org (c) 2013. Government sponsorship acknowledged. Outline Why care about size? The IMU as scale provider: The

More information

N. Gachadoit 1, A. El Hadri 2, A. Benallegue 2, A. Seba 3, B.Vidalie 1

N. Gachadoit 1, A. El Hadri 2, A. Benallegue 2, A. Seba 3, B.Vidalie 1 Advanced modeling with a Symbolic based approach Application to the modeling, control design and real-time control and HIL simulation of a quadrotor helicopter N. Gachadoit 1, A. El Hadri 2, A. Benallegue

More information

Autonomous navigation in industrial cluttered environments using embedded stereo-vision

Autonomous navigation in industrial cluttered environments using embedded stereo-vision Autonomous navigation in industrial cluttered environments using embedded stereo-vision Julien Marzat ONERA Palaiseau Aerial Robotics workshop, Paris, 8-9 March 2017 1 Copernic Lab (ONERA Palaiseau) Research

More information