The ARCUS Planning Framework for UAV Surveillance with EO/IR Sensors

Size: px
Start display at page:

Download "The ARCUS Planning Framework for UAV Surveillance with EO/IR Sensors"

Transcription

1 Technical report from Automatic Control at Linköpings universitet The ARCUS Planning Framework for UAV Surveillance with EO/IR Sensors Per Skoglar Division of Automatic Control 31st March 2009 Report no.: LiTH-ISY-R-2885 Address: Department of Electrical Engineering Linköpings universitet SE Linköping, Sweden WWW: AUTOMATIC CONTROL REGLERTEKNIK LINKÖPINGS UNIVERSITET Technical reports from the Automatic Control group in Linköping are available from

2 Abstract This report gives an overview of the planner framework developed in the Arcus project. The framework consists of a number of planning modules and planning modes that are introduced. Keywords: ARCUS, UAV Surveillance, Planning

3 Contents 1 Introduction The Arcus project Background Discussion Autonomous Planning of a UAV with EO/IR Sensors Planning Hierarchy Objective and Outline Software Framework Matlab Simulation Framework Scenario Engine World Simulator Target Tracking Filters Planner Monitor User Interface Interactions MSSLab Planning Module Introduction to MSSLab The MSSLab Planner Federate Planning Architecture Receding Horizon Planning Sequential Planner Structure Sequential Planner Structure with Modes Planning Modes Mode A; Uncertain Target in View Update Mode B; Track Update Request Mode C; Multi Target Search and Update Mode D; Search and Exploration Planning Modules Planner Module 1; Optimal Estimation Performance (OEP) Planner Planner Module 2; Information Exploration Planner Module 3; Aim Planning of Gimballed EO/IR Sensor for Multi Target Tracking (MTT) Planner Module 4; Geo-Tracking with Gimballed EO/IR Sensor

4 4 Simulation Results 13 5 Conclusions 16 2

5 Chapter 1 Introduction The need for autonomous capabilities, such as on-board sensor data processing, sensor management, and path planning, will increase in both manned and unmanned platforms designed for future applications. This arises from the constantly growing quantity of sensors and associated raw data, as well as limitations in communication bandwidth and processing capacity of human sensor operators. Several basic functionalities of autonomous surveillance systems, e.g., target geo-location, robust navigation, collision avoidance, route and viewpoint planning all require advanced visual capabilities like target and landmark recognition, scene topography estimation, and image-motion computation. In order to raise the level of autonomy in these systems, it is necessary to take into account the uncertainty associated with the percepts of a cluttered and rapidly changing environment. These uncertainties arise from sensor noise, navigation errors, matching errors, prior knowledge model errors, and target prediction errors. 1.1 The Arcus project The Arcus project (Autonoma Reaktiva Certifierbara UAV-System) is a project in the TAIS-programme (Teknologier för Autonoma Intelligenta System) that is managed by FMV (Swedish Defence Material Administration) and VINNOVA. ARCUS is headed from FOI and partners are Linköping University (Automatic Control at the department of Electrical Engineering), Saab Aerosystems and Saab Bofors Dynamics. The goal is to demonstrate an enhanced level of surveillance capability including ground target detection, tracking and re-identification of moving objects without the direct control of a human operator. The demonstration will be within a HLA-based simulation environment developed at FOI. 1.2 Background Discussion All planning and control problems are in fact some kind of optimization problem where the goal is to minimize (or maximize) a criterion by choosing the right actions. Planning can be defined as the task of finding a sequence of actions that will achieve a goal [6]. Classical (AI) planning only considers environments 3

6 that are fully observable, deterministic, discrete and static. However, to be able to act in the real world with non-perfect sensors, the planner have to deal with incomplete, uncertain, and incorrect information in a robust manner. In classical control the goal is to control the behavior of a dynamic system. A model of the system is used in the design of a regulator that uses feedback to control the system in a desired way. Control design for linear systems and Gaussian noise is a well understood research area, but the problem is harder for nonlinear and non-gaussian systems. [3] provides a survey of different planning algorithms and [6] is a good introduction to planning as seen from the AI community. Planning and control algorithm suitable for our planning problem can be formulated as an optimal control problem [1, 2]. See the surveys [4] and [7] for more related references Autonomous Planning of a UAV with EO/IR Sensors Autonomous concurrent sensor and path planning of a UAV with EO/IR sensors, taking into account both platform and sensor constraints, as well as threats and environmental conditions, is a very challenging problem. Even more demanding, but still necessary, is the capability to dynamically adapt and replan the sensor utilization and the platform trajectory in response to changes in the environment as well as internal state, given feedback from new sensor data. Realistic models of the environment, sensors and platforms are very complex, due to the non-linear and stochastic properties of the world. Hence, algorithms and methods solving realistic planning problems are computationally very demanding. Furthermore, the optimal solution is in practice impossible to find, but this is not critical since there are, in principle, an infinite number of solutions that are sufficiently good. However, the problem of finding a sufficiently good local optimum is still very hard. Defining the planning problem is not straightforward. There are several objectives with different importance that also may vary from time to time, and from mission to mission. Two different planning algorithms can give completely different solutions to a surveillance and multi target tracking problem, since they focus on different aspects of the problem. In fact, even two identical algorithms can give different solutions depending on the planning horizon and due to the problem discussed above with the problem of finding the optimal solution. Different objectives of the planning problem that needs to be maximized are, among others, the number of simultaneously tracked targets, the number of found targets, the total surveyed area, the estimation performance of each target, the imagery quality for better association, classification and identification, energy-loss, i.e. minimizing fuel consumption, stealth behavior, 4

7 navigation performance. Most of these different utilities are conflicting and it is obvious that depending on the focus, the planning yields completely different results. The focuses in the Arcus project are on multi target tracking, area coverage, and estimation performance. Aspects like energy, stealth and navigation are ignored Planning Hierarchy Since the planning problem is very complex, we are forced to make simplifications. A monolithic planner is probably an unrealistic goal. Even if we could define a suitable objective function, this function has no obvious structure that can be utilized in the optimization and therefore it is also very hard to solve and analyze. Instead a hierarchical decomposition is required, but the question then is how to decompose the problem into sub-problems that guarantee that the overall objective is achieved. 1.3 Objective and Outline The objective of this report is to give an overview of the planner framework developed in the Arcus project. The conclusion of the discussion in Section 1.2 is that a hierarchical decomposition of the planner is needed. The planning architecture used in the project is presented in Chapter 3 and it contains a number of planning modules. The presentation of the modules is very brief, and the reader is directed to the references for details. Chapter 2 presents the software frameworks where the planner is developed and integrated. Finally, Chapter 4 shows the result from a simulation example. 5

8 Chapter 2 Software Framework 2.1 Matlab Simulation Framework A object-oriented simulation framework has been developed in Matlab, Figure 2.1 shows an overview. Important classes are, e.g., a world simulator, a Filter State Monitor Planners Measurements Plan GUI Simulation Nav State Environment Figure 2.1: The Matlab simulation framework. tracking filter module, and a planner. Furthermore, there are two classes for monitoring and controlling the simulations. The most important (super-)classes are presented briefly next. 6

9 2.1.1 Scenario Engine The ScenarioEngine is the heart of the simulation framework. It contains the main loop that drives the whole simulation. Every scenario description or simulation problem that will be run is defined in a subclass to the Scenario Engine World Simulator The world Simulator contains models of the sensor platform and the sensor gimbal simulating the platform and the aim trajectories given the plan. These trajectories together with the target trajectories, generated in the target simulator, and the environmental model are used to simulate measurement of the targets. The targets can be on-road or off-road targets and the environmental model contains information about the road network, the ground elevation and the terrain occlusion Target Tracking Filters The target tracking filter module contains a number of single target tracking filters, in this first version the association problem is simplified and the target identity is assumed to be given by the detection algorithm. The tracking filter can be of different filter types, Extended Kalman filter (EKF) or Unscented Kalman filter for off-road targets and Bootstrap Particle filter (BSPF) and Rao- Blackwellized Particle filter (RBPF) [12] for on-road targets. Furthermore, an Interactive Multiple Module Particle filter (IMM-PF) is developed for handling targets that can be either on-road or off-road [5]. All implemented filters are sub-classes to a general filter class Filter Planner The structure of the planner class Planner is presented in Chapter Monitor The Monitor class is a utility that stores simulation data and shows the result in plots. This class can also run a re-play of the simulation and create AVI-movies User Interface The Graphical User Interface (GUI) is a container for GUI-modules from all main classes. For instance, the GUI of the ScenarioEngine has buttons for running and stopping the simulation. The Monitor-GUI part contains a plot and an interface for selecting what will be shown in the plot. The Planner-GUI contains, e.g. buttons for manually selecting which planning module that should be run, and much more Interactions The data that is transmitted between the classes are called interactions. Several different interaction types are needed, e.g., the plan from the planner is a 7

10 PlanInteraction, the filter states from the tracking filters are FilterInteractions, and so on. 2.2 MSSLab Planning Module Introduction to MSSLab Multi Sensor Simulation Lab (MSSLab) is a framework for simulation of advanced sensor systems developed at Information Systems, FOI (Swedish Defence Research Agency), Linköping. With MSSLab different sensor systems can be assessed in different environments, in various weather conditions and time of day. The framework makes it possible to simulate dynamic scenarios with moving platforms, sensor carriers, targets and so forth. High quality sensor simulations can be made in either IR, visual, laser and radar individually or combined as a multi sensor system. Advanced signal processing, tracking algorithms and data fusion methods are also integrated in the simulation tool. In MSSLab different simulation programs have been integrated in a HLA-environment (High Level Architecture). The simulation programs in MSSLab are not designed for real time simulations but are focused on realism and signal quality The MSSLab Planner Federate A federate is a simulation module in the MSSLab/HLA-framework. The Planner federate is written in Matlab and is essentially the Planner class in the Matlab framework together with an interface MSSLabPlannerInterface including transformation of coordinates and interactions. 8

11 Chapter 3 Planning Architecture A hierarchical decomposition of the planner is needed, due to the complexity of the planning problem. In this chapter we present a planner architecture with different planning modes. This architecture is not the "final solution" to the planning decomposition problem, but serves our needs in the ARCUS project well. The building blocks of the framework are a number of planning modules. The modules solve well-defined subtasks and they are briefly introduced in this report, for the details we refer the interested reader to the given references. 3.1 Receding Horizon Planning The planner is working in a Receding Horizon Control (RHC) manner, i.e., the planning horizon is T plan, but only the first part, with length T exe, are executed before a replanning is performed, and so on. Thus, T exe are less or equal to T plan. This is a rather conservative planning strategy, since in each planning step we assume that no more information will be obtained that can aid the planning in the future. See the discussion in [11] where open-loop-feedback-control (OLFC) [2] is introduced. 3.2 Sequential Planner Structure A simple hierarchy consists of a number of planner modules in a sequence. For instance, the first planner module creates a plan for the trajectory of the sensor platform and a second planner module adds trajectories of the sensor gimbal. However, it is difficult to handle more complex scenarios with this structure if we want the planner modules to be rather "pure". 3.3 Sequential Planner Structure with Modes An extension of the sequential planner can be obtained by having several parallel sequential planners. Each planner sequence is called a mode and the modes are ordered according to priority. Figure 3.1 shows a general sequential planner structure with a number of different modes. Only one mode is active in each planning epoch and which one is determined by a mode function. First the mode 9

12 Figure 3.1: A general sequential planner structure with modes. function of the highest priority mode is evaluated (top left in Figure 3.1). The output is either "yes" or "no", if "yes" then that planner sequence is executed, if "no" the mode function of the next mode is evaluated, and so on. A more concrete example of a sequential planner with modes is shown in Figure 3.2. In this example the first mode is "Track Update Request" and that mode is active if a track update request has been received. If that is the case two planner modules below is executed sequential, if not the planner checks if the next mode is active, and so on. An introduction to the planning modes and the planning modules will follow next. 3.4 Planning Modes In this section we describe the a number of planning modes, of which some are used in the simulation in Chapter 4 or shown in Figure 3.2. Of course, these modes may not be enough for a general surveillance mission, they only cover some basic functionalities that are needed in the presentation given in this report Mode A; Uncertain Target in View Update The Uncertain Target in View Update mode is active if any visible target has a state covariance that is larger than a certain threshold. If that is the case, this mode will facilitate the estimation process of that target Mode B; Track Update Request The Track Update Request mode makes it possible for an operator or other software modules to focus on one particular target/track/trajectory. For example, a (re-)identification module may need imagery data of a target during a 10

13 OEP Path Planner (Single Target) OEP Path Planner (Multiple Targets) Information Exploration Aim Planner for MTT Figure 3.2: Example of one specific sequential planner structure with modes used in Arcus few seconds. The identification module then send a track update request to the planner so the target will stay in the field of view for a number of seconds. A track update request is an interaction containing, among others, a track identity (i.e. the trajectory to track), a priority row vectors and its time vector, and an expiration time Mode C; Multi Target Search and Update The multi target update mode analyzes the current state and if one or more targets are in need of a measurement update, according some measure, then this mode will be active. A target is in need of a measurement update if, e.g., the uncertainty of the target state is above a certain threshold. Furthermore, the uncertainty may have to be below another threshold, otherwise the target is considered as lost Mode D; Search and Exploration The search and exploration mode determines if an area or road needs to be surveyed. If this mode is used as in Figure 3.2, this mode is always active if no one higher priority mode is active since it is the last non-trivial mode in that example. 3.5 Planning Modules Planner Module 1; Optimal Estimation Performance (OEP) Planner The problem of optimal path for bearings-only estimation is described in [11] and [10]. 11

14 Planner Module 1A; OEP of Single Target The planner for the single target case is based on a Information Filter and the Certainty Equivalence Control-strategy and a detailed presentation is given in e.g. [11]. Planner Module 1B; OEP of Multiple Target The planner for the multiple target case is combination of independent single target planners, one for each target Planner Module 2; Information Exploration The information exploration is described in [8] and is related to the problem of optimal path for bearings-only estimation. The exploration approach can also be considered as an approach for searching for new targets. Planner Module 2A; Sensor Platform Path for Exploration The limited field-of-view of the vision sensor ignored and only the sensor platform trajectory is considered. Planner Module 2B; Concurrent Path and Sensor Planning for Exploration The vision sensor has limited field-of-view and the exploration planner optimizes both the sensor platform trajectory and the aiming direction (pan and tilt) of the sensor gimbal Planner Module 3; Aim Planning of Gimballed EO/IR Sensor for Multi Target Tracking (MTT) The aim planning method for tracking of multiple targets is described in [9]. Unlike the methods above that are using some kind of gradient search, this method must use a global optimization method, in this work a genetic algorithm Planner Module 4; Geo-Tracking with Gimballed EO/IR Sensor The geo-tracker is a function for computing the pan and tilt reference signals given the sensor platform trajectory and and a trajectory on ground that should be centered in the sensor view. 12

15 Chapter 4 Simulation Results The simulation example shown in this chapter is based on a multi-target tracking scenario with three moving road targets and three nearly stationary off-road targets. The planner architecture used here is shown in Figure 4.1. Thus, if OEP Path Planner OEP Path Planner Aim Planning for MTT Figure 4.1: The planner structure used in the simulation. a target is detected and its state covariance is above a certain threshold, the planner focuses on estimating the state of that target (Mode A using Planner 2A and 4.). If not the planner tries to get measurements from all targets, with focus on the most uncertain ones (Mode C using Planner 2A and 3). A Bootstrap Particle filter is used for each target. The result of the simulation is illustrated by Figures 4.2 and 4.3 where a number of snapshots, at irregular points, are shown. At time step 1 the Multi Target Search & Update mode (Mode C) is active. The top right subfigure in Figures 4.2 shows an example when the planner focus on a single target (Mode A). In the following snapshots the modes A and C can be seen alternately. Also note the replanning of the sensor platform path. 13

16 Figure 4.2: Simulation result of a multi-target tracking scenario. Snapshots from time steps k = 1, 2, 3, 4, 5, 6. Yellow/black line: sensor platform path. Cyan dotted line: current plan of the path. Green square: current sensor footprint on the ground. Red square: current sensor footprint plan. The roads are shown as thick lines in different colors. 14

17 Figure 4.3: Simulation result of a multi-target tracking scenario. Snapshots from time steps k = 100, 101, 102, 103, 104, 110. Yellow/black line: sensor platform path. Cyan dotted line: current plan of the path. Green square: current sensor footprint on the ground. Red square: current sensor footprint plan. The roads are shown as thick lines in different colors. 15

18 Chapter 5 Conclusions This report gives an introduction to the planner framework developed in the Arcus project. A planner architecture with different planning modes was presented. This architecture is not the "final solution", but it appeared to be a flexible planning decomposition that is easy to handle, but powerful enough for rather complex surveillance missions. The building blocks of the framework are a number of planning modules. The modules solve well-defined subtasks and they are briefly introduced in this report, for the details we refer the interested reader to the given references. 16

19 Bibliography [1] D. P. Bertsekas. Dynamic Programming and Optimal Control, volume 1. Athena Scientific, 2nd edition, [2] D. P. Bertsekas. Dynamic Programming and Optimal Control, volume 2. Athena Scientific, 2nd edition, [3] Steven M. LaValle. Planning Algorithms. Cambridge University Press, [4] J. Nygårds, P. Skoglar, J. Karlholm, M. Ulvklo, and R. Björström. Towards concurrent sensor and path planning - A survey of planning methods applicable to UAV surveillance. Scientific Report FOI-R 1711 SE, ISSN , Swedish Defence Research Agency (FOI), Division of Sensor Technology, SE Linköping, Sweden, [5] Umut Orguner, Thomas B. Schön, and Fredrik Gustafsson. Improved target tracking with road network information. In Proceedings of IEEE Aerospace Conference 2009, Big Sky, Montana, USA, March [6] Stuart J. Russell and Peter Norvig. Artificial Intelligence - A Modern Approach. Prentice Hall; 2nd edition, [7] Per Skoglar. UAV path and sensor planning methods for multiple ground target search and tracking - A literature survey. Technical Report LiTH- ISY-R-2835, Department of Electrical Engineering, Linköping University, SE Linköping, Sweden, December [8] Per Skoglar. Information based aerial exploration with a gimballed EO/IR sensor. Technical Report LiTH-ISY-R-2886, Department of Electrical Engineering, Linköping University, SE Linköping, Sweden, March [9] Per Skoglar. A planning algorithm of a gimballed EO/IR sensor for multi target tracking. Technical Report LiTH-ISY-R-2887, Department of Electrical Engineering, Linköping University, SE Linköping, Sweden, March [10] Per Skoglar and Umut Orguner. On information measures for bearingsonly estimation of a random walk target. Technical Report LiTH-ISY-R- 2888, Department of Electrical Engineering, Linköping University, SE Linköping, Sweden, March

20 [11] Per Skoglar, Umut Orguner, and Fredrik Gustafsson. On information measures based on particle mixture for optimal bearings-only tracking. In Proceedings of IEEE Aerospace Conference 2009, Big Sky, Montana, USA, March [12] Per Skoglar, Umut Orguner, David Törnqvist, and Fredrik Gustafsson. Road target tracking with an approximative Rao-Blackwellized Particle filter. Submitted to the 12th International Conference on Information Fusion,

21 Avdelning, Institution Division, Department Datum Date Division of Automatic Control Department of Electrical Engineering Språk Language Rapporttyp Report category ISBN Svenska/Swedish Licentiatavhandling ISRN Engelska/English Examensarbete C-uppsats D-uppsats Övrig rapport Serietitel och serienummer Title of series, numbering ISSN URL för elektronisk version LiTH-ISY-R-2885 Titel Title The ARCUS Planning Framework for UAV Surveillance with EO/IR Sensors Författare Author Per Skoglar Sammanfattning Abstract This report gives an overview of the planner framework developed in the Arcus project. The framework consists of a number of planning modules and planning modes that are introduced. Nyckelord Keywords ARCUS, UAV Surveillance, Planning

PGT - A path generation toolbox for Matlab (v0.1)

PGT - A path generation toolbox for Matlab (v0.1) PGT - A path generation toolbox for Matlab (v0.1) Maria Nyström, Mikael Norrlöf Division of Automatic Control Department of Electrical Engineering Linköpings universitet, SE-581 83 Linköping, Sweden WWW:

More information

On-line mission planning based on Model Predictive Control

On-line mission planning based on Model Predictive Control On-line mission planning based on Model Predictive Control Zoran Sjanic LiTH-ISY-EX-3221-2001 2001-12-05 On-line mission planning based on Model Predictive Control Master thesis Division of Automatic

More information

UAV Path and Sensor Planning Methods for Multiple Ground Target Search and Tracking - A Literature Survey

UAV Path and Sensor Planning Methods for Multiple Ground Target Search and Tracking - A Literature Survey Technical report from Automatic Control at Linköpings universitet UAV Path and Sensor Planning Methods for Multiple Ground Target Search and Tracking - A Literature Survey Per Skoglar Division of Automatic

More information

Diagnosis System Conceptual Design Utilizing Structural Methods Applied on a UAV s Fuel System

Diagnosis System Conceptual Design Utilizing Structural Methods Applied on a UAV s Fuel System Diagnosis System Conceptual Design Utilizing Structural Methods Applied on a UAV s Fuel System Master s thesis performed at: Division of Vehicular System Department of Electrical Engineering Linköpings

More information

User Interface Design for Analysis of Sensor Systems

User Interface Design for Analysis of Sensor Systems Examensarbete LITH-ITN-KTS-EX 03/002 SE LITH-ITN-MT-EX 03/003 SE User Interface Design for Analysis of Sensor Systems Lisa Jonsson Karin Sallhammar 2003-01-16 Department of Science and Technology Linköpings

More information

Outline. Target Tracking: Lecture 1 Course Info + Introduction to TT. Course Info. Course Info. Course info Introduction to Target Tracking

Outline. Target Tracking: Lecture 1 Course Info + Introduction to TT. Course Info. Course Info. Course info Introduction to Target Tracking REGLERTEKNIK Outline AUTOMATIC CONTROL Target Tracking: Lecture 1 Course Info + Introduction to TT Emre Özkan emre@isy.liu.se Course info Introduction to Target Tracking Division of Automatic Control Department

More information

Institutionen för systemteknik

Institutionen för systemteknik Institutionen för systemteknik Department of Electrical Engineering Examensarbete Design and Implementation of a DMA Controller for Digital Signal Processor Examensarbete utfört i Datorteknik vid Tekniska

More information

A Multiple-Hypothesis Tracking of Multiple Ground Targets from Aerial Video with Dynamic Sensor Control *

A Multiple-Hypothesis Tracking of Multiple Ground Targets from Aerial Video with Dynamic Sensor Control * A Multiple-Hypothesis Tracking of Multiple Ground Targets from Aerial Video with Dynamic Sensor Control * Pablo Arambel, Matthew Antone, Constantino Rago, Herbert Landau ALPHATECH, Inc, 6 New England Executive

More information

Institutionen för systemteknik Department of Electrical Engineering

Institutionen för systemteknik Department of Electrical Engineering Institutionen för systemteknik Department of Electrical Engineering Examensarbete Automatic Parallel Memory Address Generation for Parallel DSP Computing Master thesis performed in Computer Engineering

More information

Institutionen för systemteknik

Institutionen för systemteknik Institutionen för systemteknik Department of Electrical Engineering Examensarbete A Path Following Method with Obstacle Avoidance for UGVs Examensarbete utfört i Reglerteknik vid Tekniska högskolan i Linköping

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

Automatic Ground Modelling using Laser Radar Data. Magnus Elmqvist. LiTH-ISY-EX mars 2000

Automatic Ground Modelling using Laser Radar Data. Magnus Elmqvist. LiTH-ISY-EX mars 2000 Automatic Ground Modelling using Laser Radar Data Magnus Elmqvist LiTH-ISY-EX-3061 6 mars 2000 Titel Automatic Ground Modelling using Laser Radar Data Examensarbete utfört i Reglerteknik vid Tekniska

More information

Navigation methods and systems

Navigation methods and systems Navigation methods and systems Navigare necesse est Content: Navigation of mobile robots a short overview Maps Motion Planning SLAM (Simultaneous Localization and Mapping) Navigation of mobile robots a

More information

Institutionen för systemteknik

Institutionen för systemteknik Institutionen för systemteknik Department of Electrical Engineering Examensarbete Simultaneous Localisation and Mapping of Indoor Environments Using a Stereo Camera and a Laser Camera Examensarbete utfört

More information

Institutionen för systemteknik

Institutionen för systemteknik Institutionen för systemteknik Department of Electrical Engineering Examensarbete GPU Implementation of the Particle Filter Examensarbete utfört i Elektroteknik vid Tekniska högskolan vid Linköpings universitet

More information

Turning an Automated System into an Autonomous system using Model-Based Design Autonomous Tech Conference 2018

Turning an Automated System into an Autonomous system using Model-Based Design Autonomous Tech Conference 2018 Turning an Automated System into an Autonomous system using Model-Based Design Autonomous Tech Conference 2018 Asaf Moses Systematics Ltd., Technical Product Manager aviasafm@systematics.co.il 1 Autonomous

More information

Pedestrian Group Tracking Using the GM-PHD Filter

Pedestrian Group Tracking Using the GM-PHD Filter EUSIPCO 2013, Marrakech, Morocco 1(15) Pedestrian Group Tracking Using the GM-PHD Filter Viktor Edman, Maria Andersson, Karl Granström, Fredrik Gustafsson SAAB AB, Linköping, Sweden Division of Sensor

More information

On path planning and optimization using splines

On path planning and optimization using splines On path planning and optimization using splines Mikael Norrlöf Division of Automatic Control Department of Electrical Engineering Linköpings universitet, SE-58 83 Linköping, Sweden WWW: http://www.control.isy.liu.se

More information

W4. Perception & Situation Awareness & Decision making

W4. Perception & Situation Awareness & Decision making W4. Perception & Situation Awareness & Decision making Robot Perception for Dynamic environments: Outline & DP-Grids concept Dynamic Probabilistic Grids Bayesian Occupancy Filter concept Dynamic Probabilistic

More information

Terrain Rendering using Multiple Optimally Adapting Meshes (MOAM)

Terrain Rendering using Multiple Optimally Adapting Meshes (MOAM) Examensarbete LITH-ITN-MT-EX--04/018--SE Terrain Rendering using Multiple Optimally Adapting Meshes (MOAM) Mårten Larsson 2004-02-23 Department of Science and Technology Linköpings Universitet SE-601 74

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

Fusion of Radar and EO-sensors for Surveillance

Fusion of Radar and EO-sensors for Surveillance of Radar and EO-sensors for Surveillance L.J.H.M. Kester, A. Theil TNO Physics and Electronics Laboratory P.O. Box 96864, 2509 JG The Hague, The Netherlands kester@fel.tno.nl, theil@fel.tno.nl Abstract

More information

A Probabilistic Approach to Conceptual Sensor Modeling

A Probabilistic Approach to Conceptual Sensor Modeling A Probabilistic Approach to Conceptual Sensor Modeling Examensarbete utfört i Bildbehandling vid Totalförsvarets forskningsinstitut och Tekniska Högskolan i Linköping av Mattias Sonesson Reg nr: LiTH-ISY-EX-3428

More information

Passive Multi Target Tracking with GM-PHD Filter

Passive Multi Target Tracking with GM-PHD Filter Passive Multi Target Tracking with GM-PHD Filter Dann Laneuville DCNS SNS Division Toulon, France dann.laneuville@dcnsgroup.com Jérémie Houssineau DCNS SNS Division Toulon, France jeremie.houssineau@dcnsgroup.com

More information

Aerial Robotic Autonomous Exploration & Mapping in Degraded Visual Environments. Kostas Alexis Autonomous Robots Lab, University of Nevada, Reno

Aerial Robotic Autonomous Exploration & Mapping in Degraded Visual Environments. Kostas Alexis Autonomous Robots Lab, University of Nevada, Reno Aerial Robotic Autonomous Exploration & Mapping in Degraded Visual Environments Kostas Alexis Autonomous Robots Lab, University of Nevada, Reno Motivation Aerial robotic operation in GPS-denied Degraded

More information

Space Robotics. Ioannis Rekleitis

Space Robotics. Ioannis Rekleitis Space Robotics Ioannis Rekleitis On-Orbit Servicing of Satellites Work done at the Canadian Space Agency Guy Rouleau, Ioannis Rekleitis, Régent L'Archevêque, Eric Martin, Kourosh Parsa, and Erick Dupuis

More information

Institutionen för systemteknik

Institutionen för systemteknik Institutionen för systemteknik Department of Electrical Engineering Examensarbete Machine Learning for detection of barcodes and OCR Examensarbete utfört i Datorseende vid Tekniska högskolan vid Linköpings

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

Model identification of linear parameter varying aircraft systems

Model identification of linear parameter varying aircraft systems Technical report from Automatic Control at Linköpings universitet Model identification of linear parameter varying aircraft systems Atsushi Fujimori, Lennart Ljung Division of Automatic Control E-mail:

More information

Distribution Unlimited Report ADVANCEMENTS OF PARTICLE FILTERING THEORY AND ITS APPLICATION TO TRACKING

Distribution Unlimited Report ADVANCEMENTS OF PARTICLE FILTERING THEORY AND ITS APPLICATION TO TRACKING ... eapproved MSD T;flIB1UT!1ON STATF-ý7M~T A for Public Release y,.,. Unlimited Distribution Unlimited 2005-2006 Report ADVANCEMENTS OF PARTICLE FILTERING THEORY AND ITS APPLICATION TO TRACKING Petar

More information

Classification of Ground Objects Using Laser Radar Data

Classification of Ground Objects Using Laser Radar Data Classification of Ground Objects Using Laser Radar Data Master s Thesis in Automatic Control Martin Brandin & Roger Hamrén Linköping, 2003-02-04 Department of Electrical Engineering Linköping Institute

More information

Outline. EE793 Target Tracking: Lecture 2 Introduction to Target Tracking. Introduction to Target Tracking (TT) A Conventional TT System

Outline. EE793 Target Tracking: Lecture 2 Introduction to Target Tracking. Introduction to Target Tracking (TT) A Conventional TT System Outline EE793 Target Tracking: Lecture 2 Introduction to Target Tracking Umut Orguner umut@metu.edu.tr room: EZ-12 tel: 4425 Department of Electrical & Electronics Engineering Middle East Technical University

More information

Introduction to Autonomous Mobile Robots

Introduction to Autonomous Mobile Robots Introduction to Autonomous Mobile Robots second edition Roland Siegwart, Illah R. Nourbakhsh, and Davide Scaramuzza The MIT Press Cambridge, Massachusetts London, England Contents Acknowledgments xiii

More information

Vehicle Positioning with Map Matching Using Integration of a Dead Reckoning System and GPS

Vehicle Positioning with Map Matching Using Integration of a Dead Reckoning System and GPS Vehicle Positioning with Map Matching Using Integration of a Dead Reckoning System and GPS Examensarbete utfört i Reglerteknik vid Tekniska Högskolan i Linköping av David Andersson Johan Fjellström Reg

More information

Institutionen för systemteknik

Institutionen för systemteknik Institutionen för systemteknik Department of Electrical Engineering Examensarbete 3D Position Estimation of a Person of Interest in Multiple Video Sequences: Person of Interest Recognition Examensarbete

More information

Institutionen för datavetenskap Department of Computer and Information Science

Institutionen för datavetenskap Department of Computer and Information Science Institutionen för datavetenskap Department of Computer and Information Science Final thesis Load management for a telecom charging system by Johan Bjerre LIU-IDA/LITH-EX-A--08/043--SE 2008-10-13 1 Linköpings

More information

Simultaneous Localization and Mapping

Simultaneous Localization and Mapping Sebastian Lembcke SLAM 1 / 29 MIN Faculty Department of Informatics Simultaneous Localization and Mapping Visual Loop-Closure Detection University of Hamburg Faculty of Mathematics, Informatics and Natural

More information

Crowd Analysis with Target Tracking, K-means Clustering and Hidden Markov Models

Crowd Analysis with Target Tracking, K-means Clustering and Hidden Markov Models Crowd Analysis with Target Tracking, K-means Clustering and Hidden Markov Models Maria Andersson, Joakim Rydell Div of Sensor Informatics, Dept of Sensor & EW Systems Swedish Defence Research Agency SE-581

More information

Tracking Rectangular and Elliptical Extended Targets Using Laser Measurements

Tracking Rectangular and Elliptical Extended Targets Using Laser Measurements FUSION 211, Chicago, IL 1(18) Tracking Rectangular and Elliptical Extended Targets Using Laser Measurements Karl Granström, Christian Lundquist, Umut Orguner Division of Automatic Control Department of

More information

Final Exam Practice Fall Semester, 2012

Final Exam Practice Fall Semester, 2012 COS 495 - Autonomous Robot Navigation Final Exam Practice Fall Semester, 2012 Duration: Total Marks: 70 Closed Book 2 hours Start Time: End Time: By signing this exam, I agree to the honor code Name: Signature:

More information

Structural Algorithms for Diagnostic System Design Using Simulink Models

Structural Algorithms for Diagnostic System Design Using Simulink Models Structural Algorithms for Diagnostic System Design Using Simulink Models Master s thesis performed in Vehicular Systems by Lars Eriksson Reg nr: LiTH-ISY-EX-3601-2004 10th January 2005 Structural Algorithms

More information

GNSS Multipath Signals: Mitigation or Constructive Use for Robust Navigation in Urban Canyons?

GNSS Multipath Signals: Mitigation or Constructive Use for Robust Navigation in Urban Canyons? Space Reflecto 2013, Brest, 04 November 2013 GNSS Multipath Signals: Mitigation or Constructive Use for Robust Navigation in Urban Canyons? Mohamed SAHMOUDI 1,2 1 ISAE, University of Toulouse, France 2

More information

Particle Filter in Brief. Robot Mapping. FastSLAM Feature-based SLAM with Particle Filters. Particle Representation. Particle Filter Algorithm

Particle Filter in Brief. Robot Mapping. FastSLAM Feature-based SLAM with Particle Filters. Particle Representation. Particle Filter Algorithm Robot Mapping FastSLAM Feature-based SLAM with Particle Filters Cyrill Stachniss Particle Filter in Brief! Non-parametric, recursive Bayes filter! Posterior is represented by a set of weighted samples!

More information

COS Lecture 13 Autonomous Robot Navigation

COS Lecture 13 Autonomous Robot Navigation COS 495 - Lecture 13 Autonomous Robot Navigation Instructor: Chris Clark Semester: Fall 2011 1 Figures courtesy of Siegwart & Nourbakhsh Control Structure Prior Knowledge Operator Commands Localization

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

Extended target tracking using PHD filters

Extended target tracking using PHD filters Ulm University 2014 01 29 1(35) With applications to video data and laser range data Division of Automatic Control Department of Electrical Engineering Linöping university Linöping, Sweden Presentation

More information

Optimal Path Finding for Direction, Location and Time Dependent Costs, with Application to Vessel Routing

Optimal Path Finding for Direction, Location and Time Dependent Costs, with Application to Vessel Routing 1 Optimal Path Finding for Direction, Location and Time Dependent Costs, with Application to Vessel Routing Irina S. Dolinskaya Department of Industrial Engineering and Management Sciences Northwestern

More information

Authentication in peer-to-peer systems

Authentication in peer-to-peer systems By Jonas Åslund LiTH-ISY-EX-3153-2002 2002-05-16 Titel Authentication in peer-to-peer systems Examensarbete utfört i informationsteori Vid Linköpings tekniska högskola av Jonas Åslund Reg.nr: LiTH-ISY-EX-3153-2002

More information

Institutionen för systemteknik

Institutionen för systemteknik Institutionen för systemteknik Department of Electrical Engineering Examensarbete Baseband Processing Using the Julia Language Examensarbete utfört i Elektroteknik vid Tekniska högskolan vid Linköpings

More information

Idle Object Detection in Video for Banking ATM Applications

Idle Object Detection in Video for Banking ATM Applications Research Journal of Applied Sciences, Engineering and Technology 4(24): 5350-5356, 2012 ISSN: 2040-7467 Maxwell Scientific Organization, 2012 Submitted: March 18, 2012 Accepted: April 06, 2012 Published:

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

Institutionen för systemteknik

Institutionen för systemteknik Institutionen för systemteknik Department of Electrical Engineering Examensarbete Automated Fault Tree Generation from Requirement Structures Examensarbete utfört i Fordonssystem vid Tekniska högskolan

More information

Car tracking in tunnels

Car tracking in tunnels Czech Pattern Recognition Workshop 2000, Tomáš Svoboda (Ed.) Peršlák, Czech Republic, February 2 4, 2000 Czech Pattern Recognition Society Car tracking in tunnels Roman Pflugfelder and Horst Bischof Pattern

More information

Evaluation of Moving Object Tracking Techniques for Video Surveillance Applications

Evaluation of Moving Object Tracking Techniques for Video Surveillance Applications International Journal of Current Engineering and Technology E-ISSN 2277 4106, P-ISSN 2347 5161 2015INPRESSCO, All Rights Reserved Available at http://inpressco.com/category/ijcet Research Article Evaluation

More information

V-Sentinel: A Novel Framework for Situational Awareness and Surveillance

V-Sentinel: A Novel Framework for Situational Awareness and Surveillance V-Sentinel: A Novel Framework for Situational Awareness and Surveillance Suya You Integrated Media Systems Center Computer Science Department University of Southern California March 2005 1 Objective Developing

More information

Dynamic Model Based Diagnosis for Combustion Engines in RODON

Dynamic Model Based Diagnosis for Combustion Engines in RODON Dynamic Model Based Diagnosis for Combustion Engines in RODON Master Thesis performed at Vehicular Systems and Sörman Information & Media AB by Joella Lundkvist Stina Wahnström Reg nr: LiTH-ISY-EX -- 07/4003

More information

COMPARISION OF AERIAL IMAGERY AND SATELLITE IMAGERY FOR AUTONOMOUS VEHICLE PATH PLANNING

COMPARISION OF AERIAL IMAGERY AND SATELLITE IMAGERY FOR AUTONOMOUS VEHICLE PATH PLANNING 8th International DAAAM Baltic Conference "INDUSTRIAL ENGINEERING 19-21 April 2012, Tallinn, Estonia COMPARISION OF AERIAL IMAGERY AND SATELLITE IMAGERY FOR AUTONOMOUS VEHICLE PATH PLANNING Robert Hudjakov

More information

Spring Localization II. Roland Siegwart, Margarita Chli, Martin Rufli. ASL Autonomous Systems Lab. Autonomous Mobile Robots

Spring Localization II. Roland Siegwart, Margarita Chli, Martin Rufli. ASL Autonomous Systems Lab. Autonomous Mobile Robots Spring 2016 Localization II Localization I 25.04.2016 1 knowledge, data base mission commands Localization Map Building environment model local map position global map Cognition Path Planning path Perception

More information

DUAL MODE SCANNER for BROKEN RAIL DETECTION

DUAL MODE SCANNER for BROKEN RAIL DETECTION DUAL MODE SCANNER for BROKEN RAIL DETECTION ROBERT M. KNOX President; Epsilon Lambda Electronics Dr. BENEDITO FONSECA Northern Illinois University Presenting a concept for improved rail safety; not a tested

More information

MULTI-AGENT UAV PLANNING USING BELIEF SPACE HIERARCHICAL PLANNING IN THE NOW. Caris Moses. A thesis submitted for the degree of Master of.

MULTI-AGENT UAV PLANNING USING BELIEF SPACE HIERARCHICAL PLANNING IN THE NOW. Caris Moses. A thesis submitted for the degree of Master of. MULTI-AGENT UAV PLANNING USING BELIEF SPACE HIERARCHICAL PLANNING IN THE NOW Caris Moses A thesis submitted for the degree of Master of Science December 2015 Contents 1 Introduction 4 2 Background 7 2.1

More information

IROS 05 Tutorial. MCL: Global Localization (Sonar) Monte-Carlo Localization. Particle Filters. Rao-Blackwellized Particle Filters and Loop Closing

IROS 05 Tutorial. MCL: Global Localization (Sonar) Monte-Carlo Localization. Particle Filters. Rao-Blackwellized Particle Filters and Loop Closing IROS 05 Tutorial SLAM - Getting it Working in Real World Applications Rao-Blackwellized Particle Filters and Loop Closing Cyrill Stachniss and Wolfram Burgard University of Freiburg, Dept. of Computer

More information

Institutionen för systemteknik

Institutionen för systemteknik Institutionen för systemteknik Department of Electrical Engineering Examensarbete Implementation of LTE baseband algorithms for a highly parallel DSP platform Examensarbete utfört i Datorteknik vid Tekniska

More information

Chapter 12 3D Localisation and High-Level Processing

Chapter 12 3D Localisation and High-Level Processing Chapter 12 3D Localisation and High-Level Processing This chapter describes how the results obtained from the moving object tracking phase are used for estimating the 3D location of objects, based on the

More information

Artificial Intelligence for Real Airplanes

Artificial Intelligence for Real Airplanes Artificial Intelligence for Real Airplanes FAA-EUROCONTROL Technical Interchange Meeting / Agency Research Team Machine Learning and Artificial Intelligence Chip Meserole Sherry Yang Airspace Operational

More information

Parameterized Optimal Trajectory Generation for Target Localization

Parameterized Optimal Trajectory Generation for Target Localization Guidance, Navigation and Control Conference, August 6-9 7, Hilton Head, South Carolina Parameterized Optimal Trajectory Generation for Target Localization Jeffrey B. Corbets Jack W. Langelaan The Pennsylvania

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

Outline of Presentation. Introduction to Overwatch Geospatial Software Feature Analyst and LIDAR Analyst Software

Outline of Presentation. Introduction to Overwatch Geospatial Software Feature Analyst and LIDAR Analyst Software Outline of Presentation Automated Feature Extraction from Terrestrial and Airborne LIDAR Presented By: Stuart Blundell Overwatch Geospatial - VLS Ops Co-Author: David W. Opitz Overwatch Geospatial - VLS

More information

3D Fusion of Infrared Images with Dense RGB Reconstruction from Multiple Views - with Application to Fire-fighting Robots

3D Fusion of Infrared Images with Dense RGB Reconstruction from Multiple Views - with Application to Fire-fighting Robots 3D Fusion of Infrared Images with Dense RGB Reconstruction from Multiple Views - with Application to Fire-fighting Robots Yuncong Chen 1 and Will Warren 2 1 Department of Computer Science and Engineering,

More information

Nonlinear Filtering with IMM Algorithm for Coastal Radar Target Tracking System

Nonlinear Filtering with IMM Algorithm for Coastal Radar Target Tracking System TELKOMNIKA, Vol.13, No.1, March 2015, pp. 211~220 ISSN: 1693-6930, accredited A by DIKTI, Decree No: 58/DIKTI/Kep/2013 DOI: 10.12928/TELKOMNIKA.v13i1.791 211 Nonlinear Filtering with IMM Algorithm for

More information

Institutionen för datavetenskap Department of Computer and Information Science

Institutionen för datavetenskap Department of Computer and Information Science Institutionen för datavetenskap Department of Computer and Information Science Final thesis Implementation of a Delay-Tolerant Routing Protocol in the Network Simulator NS-3 by Fredrik Herbertsson LIU-IDA/LITH-EX-A--10/046--SE

More information

Methodology of context-dependent recognition of ground objects aboard unmanned aerial vehicle

Methodology of context-dependent recognition of ground objects aboard unmanned aerial vehicle Methodology of context-dependent recognition of ground objects aboard unmanned aerial vehicle Mukhina Maryna, Barkulova Iryna, Prymak Artem Abstract Two approaches were combined into one algorithm in order

More information

Robot Motion Planning

Robot Motion Planning Robot Motion Planning slides by Jan Faigl Department of Computer Science and Engineering Faculty of Electrical Engineering, Czech Technical University in Prague lecture A4M36PAH - Planning and Games Dpt.

More information

UNIVERSITÀ DEGLI STUDI DI GENOVA MASTER S THESIS

UNIVERSITÀ DEGLI STUDI DI GENOVA MASTER S THESIS UNIVERSITÀ DEGLI STUDI DI GENOVA MASTER S THESIS Integrated Cooperative SLAM with Visual Odometry within teams of autonomous planetary exploration rovers Author: Ekaterina Peshkova Supervisors: Giuseppe

More information

Map-Based Strategies for Robot Navigation in Unknown Environments

Map-Based Strategies for Robot Navigation in Unknown Environments Map-Based trategies for Robot Navigation in Unknown Environments Anthony tentz Robotics Institute Carnegie Mellon University Pittsburgh, Pennsylvania 15213 U.. A. Abstract Robot path planning algorithms

More information

Planning and Control: Markov Decision Processes

Planning and Control: Markov Decision Processes CSE-571 AI-based Mobile Robotics Planning and Control: Markov Decision Processes Planning Static vs. Dynamic Predictable vs. Unpredictable Fully vs. Partially Observable Perfect vs. Noisy Environment What

More information

Synthesis-driven Derivation of Process Graphs from Functional Blocks for Time-Triggered Embedded Systems. Ghennadii Sivatki

Synthesis-driven Derivation of Process Graphs from Functional Blocks for Time-Triggered Embedded Systems. Ghennadii Sivatki Master Thesis Synthesis-driven Derivation of Process Graphs from Functional Blocks for Time-Triggered Embedded Systems by Ghennadii Sivatki LITH-IDA/DS-EX--05/010--SE 2005-11-25 Avdelning, institution

More information

Model-Based Facial Feature Extraction

Model-Based Facial Feature Extraction Model-Based Facial Feature Extraction Master s Thesis Project done at the Image Coding Group Linköping University by Anna Nordgren Johan Scott Reg.nr. LiTH-ISY-EX-1926 Examiner: Robert Forchheimer Advisor:

More information

Three-Dimensional Off-Line Path Planning for Unmanned Aerial Vehicle Using Modified Particle Swarm Optimization

Three-Dimensional Off-Line Path Planning for Unmanned Aerial Vehicle Using Modified Particle Swarm Optimization Three-Dimensional Off-Line Path Planning for Unmanned Aerial Vehicle Using Modified Particle Swarm Optimization Lana Dalawr Jalal Abstract This paper addresses the problem of offline path planning for

More information

Institutionen för systemteknik

Institutionen för systemteknik Institutionen för systemteknik Department of Electrical Engineering Examensarbete Real-Time Multi-Dimensional Fast Fourier Transforms on FPGAs Examensarbete utfört i Datorteknik vid Tekniska högskolan

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

Institutionen för systemteknik

Institutionen för systemteknik Institutionen för systemteknik Department of Electrical Engineering Examensarbete Bus System for Coresonic SIMT DSP Examensarbete utfört i Elektroteknik vid Tekniska högskolan vid Linköpings universitet

More information

Localization and Map Building

Localization and Map Building Localization and Map Building Noise and aliasing; odometric position estimation To localize or not to localize Belief representation Map representation Probabilistic map-based localization Other examples

More information

Unmanned Vehicle Technology Researches for Outdoor Environments. *Ju-Jang Lee 1)

Unmanned Vehicle Technology Researches for Outdoor Environments. *Ju-Jang Lee 1) Keynote Paper Unmanned Vehicle Technology Researches for Outdoor Environments *Ju-Jang Lee 1) 1) Department of Electrical Engineering, KAIST, Daejeon 305-701, Korea 1) jjlee@ee.kaist.ac.kr ABSTRACT 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

Motion Detection Algorithm

Motion Detection Algorithm Volume 1, No. 12, February 2013 ISSN 2278-1080 The International Journal of Computer Science & Applications (TIJCSA) RESEARCH PAPER Available Online at http://www.journalofcomputerscience.com/ Motion Detection

More information

Generate Digital Elevation Models Using Laser Altimetry (LIDAR) Data

Generate Digital Elevation Models Using Laser Altimetry (LIDAR) Data Generate Digital Elevation Models Using Laser Altimetry (LIDAR) Data Literature Survey Christopher Weed October 2000 Abstract Laser altimetry (LIDAR) data must be processed to generate a digital elevation

More information

Institutionen för systemteknik

Institutionen för systemteknik Institutionen för systemteknik Department of Electrical Engineering Examensarbete Implementations of the FFT algorithm on GPU Examensarbete utfört i Elektroniksystem vid Tekniska högskolan vid Linköpings

More information

ME 555: Distributed Optimization

ME 555: Distributed Optimization ME 555: Distributed Optimization Duke University Spring 2015 1 Administrative Course: ME 555: Distributed Optimization (Spring 2015) Instructor: Time: Location: Office hours: Website: Soomin Lee (email:

More information

From vision to prototype - Virtual road racing. Eric Chung Anders Östlund

From vision to prototype - Virtual road racing. Eric Chung Anders Östlund Examensarbete utfört i Bildkodning vid Linköping tekniska högskola av Eric Chung Anders Östlund Rapport nummer: LITH-ISY-EX--05/3613--SE Handledare: Jonas Blom Examinator: Ingemar Ragnemalm Linköping:

More information

Stable Trajectory Design for Highly Constrained Environments using Receding Horizon Control

Stable Trajectory Design for Highly Constrained Environments using Receding Horizon Control Stable Trajectory Design for Highly Constrained Environments using Receding Horizon Control Yoshiaki Kuwata and Jonathan P. How Space Systems Laboratory Massachusetts Institute of Technology {kuwata,jhow}@mit.edu

More information

Software Architecture--Continued. Another Software Architecture Example

Software Architecture--Continued. Another Software Architecture Example Software Architecture--Continued References for Software Architecture examples: Software Architecture, Perspectives on an Emerging Discipline, by Mary Shaw and David Garlin, Prentice Hall, 1996. B. Hayes-Roth,

More information

Connected Component Analysis and Change Detection for Images

Connected Component Analysis and Change Detection for Images Connected Component Analysis and Change Detection for Images Prasad S.Halgaonkar Department of Computer Engg, MITCOE Pune University, India Abstract Detection of the region of change in images of a particular

More information

Learning how to combine sensory-motor functions into a robust behavior

Learning how to combine sensory-motor functions into a robust behavior Artificial Intelligence 172 (2008) 392 412 www.elsevier.com/locate/artint Learning how to combine sensory-motor functions into a robust behavior Benoit Morisset a,, Malik Ghallab b a SRI International,

More information

Information-Driven Dynamic Sensor Collaboration for Tracking Applications

Information-Driven Dynamic Sensor Collaboration for Tracking Applications Information-Driven Dynamic Sensor Collaboration for Tracking Applications Feng Zhao, Jaewon Shin and James Reich IEEE Signal Processing Magazine, March 2002 CS321 Class Presentation Fall 2005 Main Points

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

CS 460/560 Introduction to Computational Robotics Fall 2017, Rutgers University. Course Logistics. Instructor: Jingjin Yu

CS 460/560 Introduction to Computational Robotics Fall 2017, Rutgers University. Course Logistics. Instructor: Jingjin Yu CS 460/560 Introduction to Computational Robotics Fall 2017, Rutgers University Course Logistics Instructor: Jingjin Yu Logistics, etc. General Lectures: Noon-1:20pm Tuesdays and Fridays, SEC 118 Instructor:

More information

Louis Fourrier Fabien Gaie Thomas Rolf

Louis Fourrier Fabien Gaie Thomas Rolf CS 229 Stay Alert! The Ford Challenge Louis Fourrier Fabien Gaie Thomas Rolf Louis Fourrier Fabien Gaie Thomas Rolf 1. Problem description a. Goal Our final project is a recent Kaggle competition submitted

More information

Small-scale objects extraction in digital images

Small-scale objects extraction in digital images 102 Int'l Conf. IP, Comp. Vision, and Pattern Recognition IPCV'15 Small-scale objects extraction in digital images V. Volkov 1,2 S. Bobylev 1 1 Radioengineering Dept., The Bonch-Bruevich State Telecommunications

More information

A Novel Image Super-resolution Reconstruction Algorithm based on Modified Sparse Representation

A Novel Image Super-resolution Reconstruction Algorithm based on Modified Sparse Representation , pp.162-167 http://dx.doi.org/10.14257/astl.2016.138.33 A Novel Image Super-resolution Reconstruction Algorithm based on Modified Sparse Representation Liqiang Hu, Chaofeng He Shijiazhuang Tiedao University,

More information

Institutionen för systemteknik

Institutionen för systemteknik Institutionen för systemteknik Department of Electrical Engineering Examensarbete Water simulation for cell based sandbox games Examensarbete utfört i Datateknik vid Tekniska högskolan vid Linköpings universitet

More information