Pose Estimation and Control of Micro-Air Vehicles

Size: px
Start display at page:

Download "Pose Estimation and Control of Micro-Air Vehicles"

Transcription

1 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 Engineering ABSTRACT This paper presents a state estimation and control system for a Micro-Air Vehicles (MAV). The system is designed to provide high frequency 9-state (position, orientation and linear velocity in x-y-z coordinate) estimates in unknown, GPS-denied indoor environments. It requires a minimal set of sensors including a planar laser range-finder and an inertial measurement unit. The algorithms are designed to run entirely onboard, so no wireless link and ground station are explicitly needed. A major focus in our work is modularity, allowing each component to be benchmarked individually, or swapped out for a different implementation, without change to the rest of the system. We demonstrate how the state estimation can be used for simultaneous localization and mapping (SLAM) experiments. Furthermore we use the estimated pose to autonomously control the position of the MAV. KEYWORDS: Micro-air- vehicle, Pose estimation, Mapping, SLAM, Control I. INTRODUCTION Micro aerial vehicles (MAVs), such as quadrotor helicopters, are emerging as popular platforms for unmanned aerial vehicle (UAV) research due to their structural simplicity, small form factor, their vertical take-off and landing (VTOL) capability and high maneuverability. They have many military and civilian applications, such as target localization and tracking, 3D mapping, terrain and utilities inspection, disaster monitoring, environmental surveillance, search and rescue, traffic surveillance, deployment of instrumentation, and cinematography. In recent years, numerous research efforts have been made in this field, ranging from MAV test-bed and flight control design and path planning to 3D SLAM and multi-robot coordination. As a result, today s MAVs have improved in autonomy to the level that they can achieve autonomous exploration in structured indoor environments, waypoint following and openspace navigation. In this paper, we present a system for 9-degree-offreedom pose estimation and control, in GPS-denied, indoor environments (Fig. 1). The system makes the assumptions that the floors are piecewise linear and that the walls and obstacles are mostly rectilinear. These assumptions hold in typical indoor spaces. Our work was tested with the CityFlyer (Fig. 2), a research project at The City College of New York to develop a MAV that is capable of autonomous flight in a variety of threedimensional environments. A good estimation for the pose of the robot as it is moving is essential for many navigation tasks, including localization, mapping, and control. In the case of Figure 1. MAV quadrotor in an indoor mapping experiment. Figure 2. The CityFlyer research MAV based on Pelican AscTec quadrotor. 30 JOURNAL OF STUDENT RESEARCH

2 STUDENT AUTHOR: IVAN DRYANOVSKI developed an interest in science, and in particular engineering and computing, at an early age. I obtained a Bachelor s Degree in Physics at Franklin and Marshall College, Pennsylvania, with a minor in Computer Science, in The undergraduate program offered me a great deal of flexibility in academic interests to explore. After joining a team working on a mobile robot project for a competition, I discovered the field of Robotics, which provided a great intersection point for my focus in software and electronics. I completed a Master s degree in Computing Science in Imperial College, London, UK, in My Master s Thesis work focused on map-building and localization for mobile ground robots. I decided to pursue this field further and enrolled in the Computer Science Ph.D. program at the Graduate Center of the City University of New York. I have had the pleasure to do research in the Robotics Lab of The City College of New York, under the mentorship of Prof. Jizhong Xiao. My work includes 3D mapping and localization for Micro-Aerial-Vehicle using range-finder sensors such as laser scanners and RGB-D cameras. ROBERTO G. VALENTI Passion for robotics and science in general is something I always had and cultivated. This is why I followed a scientific schooling from the time of high school. I chose to take my Bachelor s and Master s Degrees in Electronics Engineering at the University of Catania, Italy, with emphasis in the Control theory which I applied in several robotics projects and in my Master Thesis. These experiences made me love Robotics and research therefore, after my graduation, I followed my inclinations and I joined The Robotics and Intelligent Systems Lab at The City College of New York where I am currently a Ph.D. student under the mentoring of Prof. Jizhong Xiao. Here I found an exciting environment and an outstanding team and I started working on a very interesting, innovative and challenging project: autonomous navigation of Micro-Aerial Vehicles (MAV) and its applications. I had the pleasure to team up with my colleague as well as friend Ivan, and in this paper we briefly explain some recent results of our research. My current research includes state estimation, modeling, sensor fusion and Control, but I am going to improve my knowledge and skills in mapping and Computer Vision in order to have a wider knowledge and more tools to conduct a more competitive research in this area. DR. JIZHONG XIAO is an associate professor of Electrical Engineering at The City College of New York, CUNY. He received his Ph.D. degree from Michigan State University in 2002; Master of engineering degree from Nanyang Technological University, Singapore, and MS, BS degrees from East China Institute of Technology in 1999, 1993, and 1990 respectively. He started the robotics research program at CCNY in 2002 as the founding director of CCNY Robotics Lab. He is a recipient of the U.S. National Science Foundation (NSF) CAREER award in 2007 and the CCNY Mentoring award in His research interests include robotics and control, mobile sensor networks, robotic navigation, and multi-agent systems. His innovative design of wall-climbing robot was reported on the JSR Vol.1, 2008, Page 40. From Left to right: Roberto G. Valenti, Ivan Dryanovski, Dr. Jizhong Xiao. VOLUME 5, AUGUST

3 ground robots, a good estimate for the robot s pose can be obtained by odometric sensors such as wheel encoders. However, no such direct approach is available for micro-air vehicles. The system works in the following way: an on-board IMU provides reasonably accurate information about the roll, pitch and yaw angles. The altitude is obtained by a laser altimeter. We present a method to obtain the displacement in the horizontal x and y directions through registration of scans from a horizontallymounted laser scanner. As a preliminary step, we project the laser scans onto the xy-plane, to make them independent of the roll and pitch motion of the vehicle. Then the position from the laser is fused together with the acceleration values from the IMU to get a fast and better estimate of position and linear velocity which are used to control the robot position. This paper is an extension of the authors own previous work [1]. The notable additions include the augmented velocity estimation and full autonomous position control. II. PLATFORM DESCRIPTION The Micro-aerial vehicle we use for our project is a quadrotor, a particular kind of helicopter which has 4 identical rotors symmetrically positioned with respect to the center of mass, rotating in 2 pairs in opposite direction to balance the total torque. For our experiments we use a Pelican quadrotor from Ascending Technologies (ASCTEC) [2] equipped with rotors which allow a total payload of about 500g. The high payload of the platform permits us to mount devices like computer board and/or sensors like a camera and a laser. In our helicopter we have an embedded computer (already included in the Asctec product) and an external laser scanner Hokuyo UTM-30LX. The embedded computer is based on a 1.6 GHz Intel Atom processor used for the computationally more expensive software. Important component of the Pelican quadrocopter is the Asctec Autopilot board composed of two ARM-7 microcontrollers and embedded sensors such as IMU (Inertial Measurement Unit) which gives reading of the roll, pitch and yaw angles, angular velocities and linear accelerations. The Microcontrollers are called Low level Processor (LLP) and High Level Processor (HLP), the LLP is responsible for the hardware management and IMU sensor data fusion and it is delivered as a black box with defined interfaces to additional components. To operate the quadrocopter, only the LLP is necessary. Therefore, the HLP is dedicated for custom code [3]. Our software runs on the Atom board (Pose estimation and Mapping) and on the HLP Figure 3. System overview. (Sensor fusion and Control). On the Atom computer is installed Linux Ubuntu in order to avoid potential driver issues and to provide maximum portability of the code, further we use ROS (Robot Operating system) framework [4] which provides many tools commonly used in Robotics and an easy way to communicate among several running nodes (programs). III. POSE ESTIMATION The entire system is presented in detail in Fig. 3. During the scan projection step, laser data is orthogonally projected onto the xy plane by using the roll and pitch IMU readings. The projected data is then passed to a scan matcher. The scan matcher uses the IMU s yaw angle reading as an initial guess for the orientation of the vehicle. The output of the scan matcher includes x, y, and yaw angle pose components. A laser altimeter uses the laser scan readings of the floor (by a mirror which deflects few laser beams to the floor), as well as the roll and pitch orientation of the MAV, to estimate the altitude (z) of the vehicle. A threshold filter is applied to detect discontinuities in the floor, assuming the floor is piecewise-linear. The estimates from the various components are 32 JOURNAL OF STUDENT RESEARCH

4 Figure 4. An overview of the laser projection step. sent by serial communication to the HLP of the autopilot where they are fused together with the IMU reading by a Kalman Filter (KF) to produce the final state, which contains the 6DoF pose in the fixed (inertial) frame, as well as the linear velocities of the MAV in reference to the body frame (vx, vy, vz). In indoor environments, obstacles usually look the same regardless of the height, due to the rectilinear property. This means that changes in the altitude of the vehicle do not affect the accuracy of the scan matcher. However, changes in the pitch and roll angle affect the laser readings, and need to be accounted for. If we know the 3D orientation of the laser scanner, we can project the scans onto the xy-plane, and perform scan matching on sequences of projected scans instead of raw scans. An overview of the projection is presented in Figure 4. The orthogonally projected scans can be used to estimate the motion of the MAV in the xy- plane. This is accomplished through the use of a laser scan matcher, based on the work of Censi [5]. A scan matcher operates in the following manner. We are given two laser scan readings, at time t and t-1. Assuming that the environment is static, the scans should look the same, except rotated and translated by a certain amount. The rotation and translation corresponds to the motion of the vehicle between time t and t-1. If we compute the transformation which best aligns the two scans, we can recover the change of pose of the MAV. The computation of the transformation usually is done using the ICP (Iterative Closest Point) algorithm, or any of its variations. By applying the scan registration step between consecutive laser scans, we can keep track of the global pose of the quadrotor in the fixed frame and then compute the map of the environment. Differentiating the pose with respect to time can also provide us with x-, y-, and yaw-velocity estimates. IV. SENSOR FUSION Referring to the pose estimation described in Figure 3, a Kalman Filter (KF) was developed in order to fuse the data from the scan matcher with the IMU data and reduce the noise. The Kalman Filter is a recursive algorithm which estimates the state of a process that minimizes the mean-square error (the optimal estimates) by knowing the statistical system model, the available measurements which represent the input of the system, and their noise that is supposed to be white Gaussian. The discrete time Kalman Filter dynamics results from two consecutive step: prediction and correction. The prediction step uses the system dynamic model to produce a prediction of the state evolution between consecutive measurements. The correction step uses the measurements to combine along with the prediction in order to refine the state estimate. The filter characterizes the stochastic disturbance input through its spectral density matrix and through the measurement error by Figure 5. Plots of the estimated translational velocities of the MAV during 3 separate test runs. The derivative of the position is shown in red. The output of the KF is shown in blue. The z- velocity graph includes a simulated laser failure during which the filter maintains the estimation using data from the IMU. VOLUME 5, AUGUST

5 its covariance. A more detailed explanation can be found in [6]. The Kalman Filter is an important element because it provides a fast pose estimation which is needed for position control. Further, since no velocity sensor is available for low velocity indoor flight, its estimation becomes necessary whereas a simple position derivative would produce an inaccurate and noisy valuation (Figure. 5). V. POSITION CONTROL The quadrotor helicopter translates on the x-,y- axis by varying its pitch and roll angle respectively. Thus the idea to control the position is using a cascade structure where the outer position loop generates an angle as reference of the inner attitude loop controller. The attitude controller is provided by the LLP of the autopilot and the outer position controller is implemented in the HLP based on a PID control. The PID controller is a linear controller which does not require the knowledge of the system model. It uses the feedback loop to calculate the error as difference between the measured controlled variable and the desired value (setpoint) and attempts to minimize the error by adjusting the control input. The calculation of the control input involves three constant parameters (Kp, Ki, Kd) used to accomplish the three control terms called: Proportional (P), Integrative (I) and Derivative (D), where P depends on the error, or in term of time, on the present error, I depends on the integral of the error, or in term of time, on the accumulation of the past errors, and D depends on the derivative of the error or in term of time is a prediction of future error. The weighted sum of these three terms will be the control input as showed below. Figure 6. 3D plot of a hovering experiment of 3 minutes duration. Figure 7. Top view of the 3D plot where the position of the quadrotor is always inside a circle of 20 cm radius. For more explanation about the PID refer to [7]. The dynamic of the quadrotor is non linear but for our purpose we can consider it with discrete approximation linear since for indoor mapping experiment we fly at low velocity with small values of roll and pitch, allowing us to decouple the states and then apply the linear PID controller to control the position. In Fig. 6, 7 and 8 we can see the plot position of the quadrotor in a hover experiment where the helicopter maintains a position around the desired point (x=0,y=0) with oscillations smaller than 20 cm for x- and y- axis and around 5 cm Figure 8. Plot of the 3 coordinate values of the position in the same experiment: in red x, in blue y and in green z. 34 JOURNAL OF STUDENT RESEARCH

6 Figure 9. Left: the 2D map of the first floor of Steinman Hall at CCNY created by autonomously flying the MAV and running the pose estimation system in conjunction with gmapping on board. Right: the same map (in red line) overlaid on the real floor plan. for z after more than 3 minutes. VI. EXPERIMENTAL APPLICATIONS A. 3D Mapping We performed experiments in which the MAV was flown autonomously in indoor environments: The MAV was flown at varying altitudes, in order to obtain data from different crosssection. B. 2D SLAM with 3D Mapping Our pose estimation system can easily be used in conjunction with existing mapping tools. The pose estimation is used as an Figure 10. 3D map of the first floor of Steinman Hall at The City College of New York. The map was created by autonomously flying the MAV and running the pose estimation system in conjunction with gmapping. odometric estimate to a 2D SLAM (simultaneous Localization and Mapping) algorithm (gmapping) running onboard the vehicle in real time. The map is constructed by passing all the projected laser scan to gmapping. The 2D step performs additional alignment of the data and guarantees loop closure and global consistency. The 2D point cloud is built on top of the 2D-refined data. REFERENCES [1] Ivan Dryanovski*, William Morris and Jizhong Xiao, An Open- Source Pose Estimation System for Micro-Air Vehicles In. IEEE International Conference on Robotics and Automation Shanghai International Conference Center May 9-13, 2011, Shanghai, China. [2] Ascending Technologies GmbH, website, [3] M. Achtelik, M. Achtelik, S. Weiss, R. Siegwart, Onboard IMU and Monocular Vision Based Control for MAVs in Unknown In- and Outdoor Environments, Proc. of the IEEE International Conference on Robotics and Automation (ICRA), [4] M. Quigley, K. Conley, B. P. Gerkey, J. Faust, T. Foote, J. Leibs, R. Wheeler, and A. Y. Ng, ROS: an open-source Robot Operating System, in ICRA Workshop on Open Source Software, [5] Andrea Censi, An ICP variant using a point-to-line metric In: Robotics and Automation, ICRA IEEE International Conference on. IEEE, New York, NY. [6] A New Approach to Linear Filtering and Prediction Problems, by R. E. Kalman, [7] Bennett, Stuart. A history of control engineering, IET. p. p. 48. ISBN VOLUME 5, AUGUST

An open-source navigation system for micro aerial vehicles

An open-source navigation system for micro aerial vehicles Auton Robot (2013) 34:177 188 DOI 10.1007/s10514-012-9318-8 An open-source navigation system for micro aerial vehicles Ivan Dryanovski Roberto G. Valenti Jizhong Xiao Received: 29 May 2012 / Accepted:

More information

Autonomous Navigation in Complex Indoor and Outdoor Environments with Micro Aerial Vehicles

Autonomous Navigation in Complex Indoor and Outdoor Environments with Micro Aerial Vehicles Autonomous Navigation in Complex Indoor and Outdoor Environments with Micro Aerial Vehicles Shaojie Shen Dept. of Electrical and Systems Engineering & GRASP Lab, University of Pennsylvania Committee: Daniel

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

Lecture: Autonomous micro aerial vehicles

Lecture: Autonomous micro aerial vehicles Lecture: Autonomous micro aerial vehicles Friedrich Fraundorfer Remote Sensing Technology TU München 1/41 Autonomous operation@eth Zürich Start 2/41 Autonomous operation@eth Zürich 3/41 Outline MAV system

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

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

Autonomous Corridor Flight of a UAV Using alow-costandlight-weightrgb-dcamera

Autonomous Corridor Flight of a UAV Using alow-costandlight-weightrgb-dcamera Autonomous Corridor Flight of a UAV Using alow-costandlight-weightrgb-dcamera Sven Lange, Niko Sünderhauf,Peer Neubert,Sebastian Drews, and Peter Protzel Abstract. We describe the first application of

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

Robot Mapping. SLAM Front-Ends. Cyrill Stachniss. Partial image courtesy: Edwin Olson 1

Robot Mapping. SLAM Front-Ends. Cyrill Stachniss. Partial image courtesy: Edwin Olson 1 Robot Mapping SLAM Front-Ends Cyrill Stachniss Partial image courtesy: Edwin Olson 1 Graph-Based SLAM Constraints connect the nodes through odometry and observations Robot pose Constraint 2 Graph-Based

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

Computationally Efficient Visual-inertial Sensor Fusion for GPS-denied Navigation on a Small Quadrotor

Computationally Efficient Visual-inertial Sensor Fusion for GPS-denied Navigation on a Small Quadrotor Computationally Efficient Visual-inertial Sensor Fusion for GPS-denied Navigation on a Small Quadrotor Chang Liu & Stephen D. Prior Faculty of Engineering and the Environment, University of Southampton,

More information

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

Unscented Kalman Filter for Vision Based Target Localisation with a Quadrotor

Unscented Kalman Filter for Vision Based Target Localisation with a Quadrotor Unscented Kalman Filter for Vision Based Target Localisation with a Quadrotor Jos Alejandro Dena Ruiz, Nabil Aouf Centre of Electronic Warfare, Defence Academy of the United Kingdom Cranfield University,

More information

Graph-based SLAM (Simultaneous Localization And Mapping) for Bridge Inspection Using UAV (Unmanned Aerial Vehicle)

Graph-based SLAM (Simultaneous Localization And Mapping) for Bridge Inspection Using UAV (Unmanned Aerial Vehicle) Graph-based SLAM (Simultaneous Localization And Mapping) for Bridge Inspection Using UAV (Unmanned Aerial Vehicle) Taekjun Oh 1), Sungwook Jung 2), Seungwon Song 3), and Hyun Myung 4) 1), 2), 3), 4) Urban

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

LOAM: LiDAR Odometry and Mapping in Real Time

LOAM: LiDAR Odometry and Mapping in Real Time LOAM: LiDAR Odometry and Mapping in Real Time Aayush Dwivedi (14006), Akshay Sharma (14062), Mandeep Singh (14363) Indian Institute of Technology Kanpur 1 Abstract This project deals with online simultaneous

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

Build and Test Plan: IGV Team

Build and Test Plan: IGV Team Build and Test Plan: IGV Team 2/6/2008 William Burke Donaldson Diego Gonzales David Mustain Ray Laser Range Finder Week 3 Jan 29 The laser range finder will be set-up in the lab and connected to the computer

More information

UAV Autonomous Navigation in a GPS-limited Urban Environment

UAV Autonomous Navigation in a GPS-limited Urban Environment UAV Autonomous Navigation in a GPS-limited Urban Environment Yoko Watanabe DCSD/CDIN JSO-Aerial Robotics 2014/10/02-03 Introduction 2 Global objective Development of a UAV onboard system to maintain flight

More information

Intelligent Outdoor Navigation of a Mobile Robot Platform Using a Low Cost High Precision RTK-GPS and Obstacle Avoidance System

Intelligent Outdoor Navigation of a Mobile Robot Platform Using a Low Cost High Precision RTK-GPS and Obstacle Avoidance System Intelligent Outdoor Navigation of a Mobile Robot Platform Using a Low Cost High Precision RTK-GPS and Obstacle Avoidance System Under supervision of: Prof. Dr. -Ing. Klaus-Dieter Kuhnert Dipl.-Inform.

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

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

Implementation of UAV Localization Methods for a Mobile Post-Earthquake Monitoring System

Implementation of UAV Localization Methods for a Mobile Post-Earthquake Monitoring System Implementation of UAV Localization Methods for a Mobile Post-Earthquake Monitoring System Mitsuhito Hirose, Yong Xiao, Zhiyuan Zuo, Vineet R. Kamat, Dimitrios Zekkos and Jerome Lynch, Member, IEEE Department

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

AN INCREMENTAL SLAM ALGORITHM FOR INDOOR AUTONOMOUS NAVIGATION

AN INCREMENTAL SLAM ALGORITHM FOR INDOOR AUTONOMOUS NAVIGATION 20th IMEKO TC4 International Symposium and 18th International Workshop on ADC Modelling and Testing Research on Electric and Electronic Measurement for the Economic Upturn Benevento, Italy, September 15-17,

More information

A Novel Marker Based Tracking Method for Position and Attitude Control of MAVs

A Novel Marker Based Tracking Method for Position and Attitude Control of MAVs A Novel Marker Based Tracking Method for Position and Attitude Control of MAVs A. Masselli and A. Zell Abstract In this paper we present a novel method for pose estimation for micro aerial vehicles (MAVs),

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

Citation for the original published paper (version of record):

Citation for the original published paper (version of record): http://www.diva-portal.org Preprint This is the submitted version of a paper published in Lecture Notes in Computer Science. Citation for the original published paper (version of record): Fan, Y., Aramrattana,

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

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

Onboard IMU and Monocular Vision Based Control for MAVs in Unknown In- and Outdoor Environments

Onboard IMU and Monocular Vision Based Control for MAVs in Unknown In- and Outdoor Environments Research Collection Conference Paper Onboard IMU and Monocular Vision Based Control for MAVs in Unknown In- and Outdoor Environments Author(s): Achtelik, Markus W.; Achtelik, Michael; Weiss, Stephan; Siegwart,

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

Robot Localization based on Geo-referenced Images and G raphic Methods

Robot Localization based on Geo-referenced Images and G raphic Methods Robot Localization based on Geo-referenced Images and G raphic Methods Sid Ahmed Berrabah Mechanical Department, Royal Military School, Belgium, sidahmed.berrabah@rma.ac.be Janusz Bedkowski, Łukasz Lubasiński,

More information

Humanoid Robotics. Monte Carlo Localization. Maren Bennewitz

Humanoid Robotics. Monte Carlo Localization. Maren Bennewitz Humanoid Robotics Monte Carlo Localization Maren Bennewitz 1 Basis Probability Rules (1) If x and y are independent: Bayes rule: Often written as: The denominator is a normalizing constant that ensures

More information

Autonomous Mobile Robot Design

Autonomous Mobile Robot Design Autonomous Mobile Robot Design Topic: EKF-based SLAM Dr. Kostas Alexis (CSE) These slides have partially relied on the course of C. Stachniss, Robot Mapping - WS 2013/14 Autonomous Robot Challenges Where

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

AUTONOMOUS NAVIGATION IN COMPLEX INDOOR AND OUTDOOR ENVIRONMENTS WITH MICRO AERIAL VEHICLES. Shaojie Shen A DISSERTATION

AUTONOMOUS NAVIGATION IN COMPLEX INDOOR AND OUTDOOR ENVIRONMENTS WITH MICRO AERIAL VEHICLES. Shaojie Shen A DISSERTATION AUTONOMOUS NAVIGATION IN COMPLEX INDOOR AND OUTDOOR ENVIRONMENTS WITH MICRO AERIAL VEHICLES Shaojie Shen A DISSERTATION in Electrical and Systems Engineering Presented to the Faculties of the University

More information

Attack Resilient State Estimation for Vehicular Systems

Attack Resilient State Estimation for Vehicular Systems December 15 th 2013. T-SET Final Report Attack Resilient State Estimation for Vehicular Systems Nicola Bezzo (nicbezzo@seas.upenn.edu) Prof. Insup Lee (lee@cis.upenn.edu) PRECISE Center University of Pennsylvania

More information

SIMULTANEOUS LOCALLZATION AND MAPPING USING UAVS EQUIPPED WITH INEXPENSIVE SENSORS

SIMULTANEOUS LOCALLZATION AND MAPPING USING UAVS EQUIPPED WITH INEXPENSIVE SENSORS SIMULTANEOUS LOCALLZATION AND MAPPING USING UAVS EQUIPPED WITH INEXPENSIVE SENSORS Ou Zheng Department of Math and Computer Science Stetson University 421 woodland Blvd Deland, FL, USA ozheng@stetson.edu

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

IEEE/CAA JOURNAL OF AUTOMATICA SINICA, VOL. 2, NO. 1, JANUARY Robust and Accurate Monocular Visual Navigation Combining IMU for a Quadrotor

IEEE/CAA JOURNAL OF AUTOMATICA SINICA, VOL. 2, NO. 1, JANUARY Robust and Accurate Monocular Visual Navigation Combining IMU for a Quadrotor IEEE/CAA JOURNAL OF AUTOMATICA SINICA, VOL. 2, NO. 1, JANUARY 2015 33 Robust and Accurate Monocular Visual Navigation Combining IMU for a Quadrotor Wei Zheng, Fan Zhou, and Zengfu Wang Abstract In this

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

MULTI-MODAL MAPPING. Robotics Day, 31 Mar Frank Mascarich, Shehryar Khattak, Tung Dang

MULTI-MODAL MAPPING. Robotics Day, 31 Mar Frank Mascarich, Shehryar Khattak, Tung Dang MULTI-MODAL MAPPING Robotics Day, 31 Mar 2017 Frank Mascarich, Shehryar Khattak, Tung Dang Application-Specific Sensors Cameras TOF Cameras PERCEPTION LiDAR IMU Localization Mapping Autonomy Robotic Perception

More information

Visual-Inertial Localization and Mapping for Robot Navigation

Visual-Inertial Localization and Mapping for Robot Navigation Visual-Inertial Localization and Mapping for Robot Navigation Dr. Guillermo Gallego Robotics & Perception Group University of Zurich Davide Scaramuzza University of Zurich - http://rpg.ifi.uzh.ch Mocular,

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

Building Reliable 2D Maps from 3D Features

Building Reliable 2D Maps from 3D Features Building Reliable 2D Maps from 3D Features Dipl. Technoinform. Jens Wettach, Prof. Dr. rer. nat. Karsten Berns TU Kaiserslautern; Robotics Research Lab 1, Geb. 48; Gottlieb-Daimler- Str.1; 67663 Kaiserslautern;

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

Efficient SLAM Scheme Based ICP Matching Algorithm Using Image and Laser Scan Information

Efficient SLAM Scheme Based ICP Matching Algorithm Using Image and Laser Scan Information Proceedings of the World Congress on Electrical Engineering and Computer Systems and Science (EECSS 2015) Barcelona, Spain July 13-14, 2015 Paper No. 335 Efficient SLAM Scheme Based ICP Matching Algorithm

More information

Pervasive Computing. OpenLab Jan 14 04pm L Institute of Networked and Embedded Systems

Pervasive Computing. OpenLab Jan 14 04pm L Institute of Networked and Embedded Systems Pervasive Computing Institute of Networked and Embedded Systems OpenLab 2010 Jan 14 04pm L4.1.01 MISSION STATEMENT Founded in 2007, the Pervasive Computing Group at Klagenfurt University is part of the

More information

A Reactive Bearing Angle Only Obstacle Avoidance Technique for Unmanned Ground Vehicles

A Reactive Bearing Angle Only Obstacle Avoidance Technique for Unmanned Ground Vehicles Proceedings of the International Conference of Control, Dynamic Systems, and Robotics Ottawa, Ontario, Canada, May 15-16 2014 Paper No. 54 A Reactive Bearing Angle Only Obstacle Avoidance Technique for

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

Final Project Report: Mobile Pick and Place

Final Project Report: Mobile Pick and Place Final Project Report: Mobile Pick and Place Xiaoyang Liu (xiaoyan1) Juncheng Zhang (junchen1) Karthik Ramachandran (kramacha) Sumit Saxena (sumits1) Yihao Qian (yihaoq) Adviser: Dr Matthew Travers Carnegie

More information

Zürich. Roland Siegwart Margarita Chli Martin Rufli Davide Scaramuzza. ETH Master Course: L Autonomous Mobile Robots Summary

Zürich. Roland Siegwart Margarita Chli Martin Rufli Davide Scaramuzza. ETH Master Course: L Autonomous Mobile Robots Summary Roland Siegwart Margarita Chli Martin Rufli Davide Scaramuzza ETH Master Course: 151-0854-00L Autonomous Mobile Robots Summary 2 Lecture Overview Mobile Robot Control Scheme knowledge, data base mission

More information

Visual SLAM for small Unmanned Aerial Vehicles

Visual SLAM for small Unmanned Aerial Vehicles Visual SLAM for small Unmanned Aerial Vehicles Margarita Chli Autonomous Systems Lab, ETH Zurich Simultaneous Localization And Mapping How can a body navigate in a previously unknown environment while

More information

Evaluating the Performance of a Vehicle Pose Measurement System

Evaluating the Performance of a Vehicle Pose Measurement System Evaluating the Performance of a Vehicle Pose Measurement System Harry Scott Sandor Szabo National Institute of Standards and Technology Abstract A method is presented for evaluating the performance of

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

ENY-C2005 Geoinformation in Environmental Modeling Lecture 4b: Laser scanning

ENY-C2005 Geoinformation in Environmental Modeling Lecture 4b: Laser scanning 1 ENY-C2005 Geoinformation in Environmental Modeling Lecture 4b: Laser scanning Petri Rönnholm Aalto University 2 Learning objectives To recognize applications of laser scanning To understand principles

More information

UAV Position and Attitude Sensoring in Indoor Environment Using Cameras

UAV Position and Attitude Sensoring in Indoor Environment Using Cameras UAV Position and Attitude Sensoring in Indoor Environment Using Cameras 1 Peng Xu Abstract There are great advantages of indoor experiment for UAVs. Test flights of UAV in laboratory is more convenient,

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

Computer Vision Based General Object Following for GPS-denied Multirotor Unmanned Vehicles

Computer Vision Based General Object Following for GPS-denied Multirotor Unmanned Vehicles Computer Vision Based General Object Following for GPS-denied Multirotor Unmanned Vehicles Jesús Pestana, Jose Luis Sanchez-Lopez, Srikanth Saripalli and Pascual Campoy I. INTRODUCTION This research showcases

More information

Implementation of Odometry with EKF for Localization of Hector SLAM Method

Implementation of Odometry with EKF for Localization of Hector SLAM Method Implementation of Odometry with EKF for Localization of Hector SLAM Method Kao-Shing Hwang 1 Wei-Cheng Jiang 2 Zuo-Syuan Wang 3 Department of Electrical Engineering, National Sun Yat-sen University, Kaohsiung,

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

Range Sensing Based Autonomous Canal Following Using a Simulated Multi-copter. Ali Ahmad

Range Sensing Based Autonomous Canal Following Using a Simulated Multi-copter. Ali Ahmad Range Sensing Based Autonomous Canal Following Using a Simulated Multi-copter Ali Ahmad MS Student of Electrical Engineering Laboratory for Cyber Physical Networks and Systems LUMS School of Science &

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

3D Terrain Sensing System using Laser Range Finder with Arm-Type Movable Unit

3D Terrain Sensing System using Laser Range Finder with Arm-Type Movable Unit 3D Terrain Sensing System using Laser Range Finder with Arm-Type Movable Unit 9 Toyomi Fujita and Yuya Kondo Tohoku Institute of Technology Japan 1. Introduction A 3D configuration and terrain sensing

More information

E80. Experimental Engineering. Lecture 9 Inertial Measurement

E80. Experimental Engineering. Lecture 9 Inertial Measurement Lecture 9 Inertial Measurement http://www.volker-doormann.org/physics.htm Feb. 19, 2013 Christopher M. Clark Where is the rocket? Outline Sensors People Accelerometers Gyroscopes Representations State

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

Where s the Boss? : Monte Carlo Localization for an Autonomous Ground Vehicle using an Aerial Lidar Map

Where s the Boss? : Monte Carlo Localization for an Autonomous Ground Vehicle using an Aerial Lidar Map Where s the Boss? : Monte Carlo Localization for an Autonomous Ground Vehicle using an Aerial Lidar Map Sebastian Scherer, Young-Woo Seo, and Prasanna Velagapudi October 16, 2007 Robotics Institute Carnegie

More information

Onboard Monocular Vision for Landing of an MAV on a Landing Site Specified by a Single Reference Image

Onboard Monocular Vision for Landing of an MAV on a Landing Site Specified by a Single Reference Image Onboard Monocular Vision for Landing of an MAV on a Landing Site Specified by a Single Reference Image Shaowu Yang, Sebastian A. Scherer, Konstantin Schauwecker and Andreas Zell Abstract This paper presents

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

Towards Optimal 3D Point Clouds

Towards Optimal 3D Point Clouds By Andreas Nüchter, Jan Elseberg and Dorit Borrmann, Germany feature Automation in 3D Mobile Laser Scanning Towards Optimal 3D Point Clouds Motivated by the increasing need for rapid characterisation of

More information

Construction and Calibration of a Low-Cost 3D Laser Scanner with 360º Field of View for Mobile Robots

Construction and Calibration of a Low-Cost 3D Laser Scanner with 360º Field of View for Mobile Robots Construction and Calibration of a Low-Cost 3D Laser Scanner with 360º Field of View for Mobile Robots Jorge L. Martínez, Jesús Morales, Antonio, J. Reina, Anthony Mandow, Alejandro Pequeño-Boter*, and

More information

AIR FORCE INSTITUTE OF TECHNOLOGY

AIR FORCE INSTITUTE OF TECHNOLOGY Two Dimensional Positioning and Heading Solution for Flying Vehicles using a Line-Scanning Laser Radar (LADAR) THESIS Brady Christel AFIT/GE/ENG/11-04 DEPARTMENT OF THE AIR FORCE AIR UNIVERSITY AIR FORCE

More information

Uncertainties: Representation and Propagation & Line Extraction from Range data

Uncertainties: Representation and Propagation & Line Extraction from Range data 41 Uncertainties: Representation and Propagation & Line Extraction from Range data 42 Uncertainty Representation Section 4.1.3 of the book Sensing in the real world is always uncertain How can uncertainty

More information

GPS denied Navigation Solutions

GPS denied Navigation Solutions GPS denied Navigation Solutions Krishnraj Singh Gaur and Mangal Kothari ksgaur@iitk.ac.in, mangal@iitk.ac.in https://www.iitk.ac.in/aero/mangal/ Intelligent Guidance and Control Laboratory Indian Institute

More information

Jo-Car2 Autonomous Mode. Path Planning (Cost Matrix Algorithm)

Jo-Car2 Autonomous Mode. Path Planning (Cost Matrix Algorithm) Chapter 8.2 Jo-Car2 Autonomous Mode Path Planning (Cost Matrix Algorithm) Introduction: In order to achieve its mission and reach the GPS goal safely; without crashing into obstacles or leaving the lane,

More information

Mapping Contoured Terrain Using SLAM with a Radio- Controlled Helicopter Platform. Project Proposal. Cognitive Robotics, Spring 2005

Mapping Contoured Terrain Using SLAM with a Radio- Controlled Helicopter Platform. Project Proposal. Cognitive Robotics, Spring 2005 Mapping Contoured Terrain Using SLAM with a Radio- Controlled Helicopter Platform Project Proposal Cognitive Robotics, Spring 2005 Kaijen Hsiao Henry de Plinval Jason Miller Introduction In the context

More information

Accurate Figure Flying with a Quadrocopter Using Onboard Visual and Inertial Sensing

Accurate Figure Flying with a Quadrocopter Using Onboard Visual and Inertial Sensing Accurate Figure Flying with a Quadrocopter Using Onboard Visual and Inertial Sensing Jakob Engel, Jürgen Sturm, Daniel Cremers Abstract We present an approach that enables a low-cost quadrocopter to accurately

More information

GNSS-aided INS for land vehicle positioning and navigation

GNSS-aided INS for land vehicle positioning and navigation Thesis for the degree of Licentiate of Engineering GNSS-aided INS for land vehicle positioning and navigation Isaac Skog Signal Processing School of Electrical Engineering KTH (Royal Institute of Technology)

More information

SLAM with SIFT (aka Mobile Robot Localization and Mapping with Uncertainty using Scale-Invariant Visual Landmarks ) Se, Lowe, and Little

SLAM with SIFT (aka Mobile Robot Localization and Mapping with Uncertainty using Scale-Invariant Visual Landmarks ) Se, Lowe, and Little SLAM with SIFT (aka Mobile Robot Localization and Mapping with Uncertainty using Scale-Invariant Visual Landmarks ) Se, Lowe, and Little + Presented by Matt Loper CS296-3: Robot Learning and Autonomy Brown

More information

GPS-Aided Inertial Navigation Systems (INS) for Remote Sensing

GPS-Aided Inertial Navigation Systems (INS) for Remote Sensing GPS-Aided Inertial Navigation Systems (INS) for Remote Sensing www.inertiallabs.com 1 EVOLUTION OF REMOTE SENSING The latest progress in Remote sensing emerged more than 150 years ago, as balloonists took

More information

Calibration of a rotating multi-beam Lidar

Calibration of a rotating multi-beam Lidar The 2010 IEEE/RSJ International Conference on Intelligent Robots and Systems October 18-22, 2010, Taipei, Taiwan Calibration of a rotating multi-beam Lidar Naveed Muhammad 1,2 and Simon Lacroix 1,2 Abstract

More information

Geometrical Feature Extraction Using 2D Range Scanner

Geometrical Feature Extraction Using 2D Range Scanner Geometrical Feature Extraction Using 2D Range Scanner Sen Zhang Lihua Xie Martin Adams Fan Tang BLK S2, School of Electrical and Electronic Engineering Nanyang Technological University, Singapore 639798

More information

William E. Dietrich Professor 313 McCone Phone Fax (fax)

William E. Dietrich Professor 313 McCone Phone Fax (fax) February 13, 2007. Contact information William E. Dietrich Professor 313 McCone Phone 510-642-2633 Fax 510-643-9980 (fax) bill@eps.berkeley.edu Project location: Northwest of the Golden Gate Bridge, San

More information

ALGORITHMS FOR DETECTING DISORDERS OF THE BLDC MOTOR WITH DIRECT CONTROL

ALGORITHMS FOR DETECTING DISORDERS OF THE BLDC MOTOR WITH DIRECT CONTROL Journal of KONES Powertrain and Transport, Vol. 23, No. 4 2016 ALGORITHMS FOR DETECTING DISORDERS OF THE BLDC MOTOR WITH DIRECT CONTROL Marcin Chodnicki, Przemysław Kordowski Mirosław Nowakowski, Grzegorz

More information

Indoor UAV Positioning Using Stereo Vision Sensor

Indoor UAV Positioning Using Stereo Vision Sensor Available online at www.sciencedirect.com Procedia Engineering 41 (2012 ) 575 579 International Symposium on Robotics and Intelligent Sensors 2012 (IRIS 2012) Indoor UAV Positioning Using Stereo Vision

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

Sensor Fusion: Potential, Challenges and Applications. Presented by KVH Industries and Geodetics, Inc. December 2016

Sensor Fusion: Potential, Challenges and Applications. Presented by KVH Industries and Geodetics, Inc. December 2016 Sensor Fusion: Potential, Challenges and Applications Presented by KVH Industries and Geodetics, Inc. December 2016 1 KVH Industries Overview Innovative technology company 600 employees worldwide Focused

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

Basics of Localization, Mapping and SLAM. Jari Saarinen Aalto University Department of Automation and systems Technology

Basics of Localization, Mapping and SLAM. Jari Saarinen Aalto University Department of Automation and systems Technology Basics of Localization, Mapping and SLAM Jari Saarinen Aalto University Department of Automation and systems Technology Content Introduction to Problem (s) Localization A few basic equations Dead Reckoning

More information

A Robust Two Feature Points Based Depth Estimation Method 1)

A Robust Two Feature Points Based Depth Estimation Method 1) Vol.31, No.5 ACTA AUTOMATICA SINICA September, 2005 A Robust Two Feature Points Based Depth Estimation Method 1) ZHONG Zhi-Guang YI Jian-Qiang ZHAO Dong-Bin (Laboratory of Complex Systems and Intelligence

More information

Elective in Robotics. Quadrotor Modeling (Marilena Vendittelli)

Elective in Robotics. Quadrotor Modeling (Marilena Vendittelli) Elective in Robotics Quadrotor Modeling (Marilena Vendittelli) Introduction Modeling Control Problems Models for control Main control approaches Elective in Robotics - Quadrotor Modeling (M. Vendittelli)

More information

Team Description Paper Team AutonOHM

Team Description Paper Team AutonOHM Team Description Paper Team AutonOHM Jon Martin, Daniel Ammon, Helmut Engelhardt, Tobias Fink, Tobias Scholz, and Marco Masannek University of Applied Science Nueremberg Georg-Simon-Ohm, Kesslerplatz 12,

More information

Autonomous Flight in Unstructured Environment using Monocular Image

Autonomous Flight in Unstructured Environment using Monocular Image Autonomous Flight in Unstructured Environment using Monocular Image Saurav Kumar 1, Ashutosh Saxena 2 Department of Computer Science, Cornell University 1 sk2357@cornell.edu 2 asaxena@cs.cornell.edu I.

More information

Dense Tracking and Mapping for Autonomous Quadrocopters. Jürgen Sturm

Dense Tracking and Mapping for Autonomous Quadrocopters. Jürgen Sturm Computer Vision Group Prof. Daniel Cremers Dense Tracking and Mapping for Autonomous Quadrocopters Jürgen Sturm Joint work with Frank Steinbrücker, Jakob Engel, Christian Kerl, Erik Bylow, and Daniel Cremers

More information

Tracking and Control of a Small Unmanned Aerial Vehicle using a Ground-Based 3D Laser Scanner

Tracking and Control of a Small Unmanned Aerial Vehicle using a Ground-Based 3D Laser Scanner Tracking and Control of a Small Unmanned Aerial Vehicle using a Ground-Based 3D Laser Scanner Ryan Arya Pratama and Akihisa Ohya Abstract In this work, we describe a method to measure the position and

More information

A HIGHLY EXPANDABLE LOW-COST OPEN-SOURCE UAV SYSTEM WITH HIGH ON-BOARD PROCESSING POWER

A HIGHLY EXPANDABLE LOW-COST OPEN-SOURCE UAV SYSTEM WITH HIGH ON-BOARD PROCESSING POWER A HIGHLY EXPANDABLE LOW-COST OPEN-SOURCE UAV SYSTEM WITH HIGH ON-BOARD PROCESSING POWER Marcin Kmiecik, Krzysztof Sibilski, Wieslaw Wroblewski Wroclaw University of Technology, Poland marcin.kmiecik@pwr.wroc.pl;

More information

Construction Progress Management and Interior Work Analysis Using Kinect 3D Image Sensors

Construction Progress Management and Interior Work Analysis Using Kinect 3D Image Sensors 33 rd International Symposium on Automation and Robotics in Construction (ISARC 2016) Construction Progress Management and Interior Work Analysis Using Kinect 3D Image Sensors Kosei Ishida 1 1 School of

More information

Disturbance Rejection in Multi-Rotor Unmanned Aerial Vehicles Using a Novel Rotor Geometry

Disturbance Rejection in Multi-Rotor Unmanned Aerial Vehicles Using a Novel Rotor Geometry Proceedings of the 4 th International Conference of Control, Dynamic Systems, and Robotics (CDSR'17) Toronto, Canada August 21 23, 2017 Paper No. 130 DOI: 10.11159/cdsr17.130 Disturbance Rejection in Multi-Rotor

More information

MAPPING ALGORITHM FOR AUTONOMOUS NAVIGATION OF LAWN MOWER USING SICK LASER

MAPPING ALGORITHM FOR AUTONOMOUS NAVIGATION OF LAWN MOWER USING SICK LASER MAPPING ALGORITHM FOR AUTONOMOUS NAVIGATION OF LAWN MOWER USING SICK LASER A thesis submitted in partial fulfillment of the requirements for the degree of Master of Science in Engineering By SHASHIDHAR

More information