Development and Simulation on V-REP of an Algorithm for the BNT

Size: px
Start display at page:

Download "Development and Simulation on V-REP of an Algorithm for the BNT"

Transcription

1 2014 IEEE International Conference on Development and Simulation on V-REP of an Algorithm for the BNT Rui Filipe Teixeira Alen Department of Electrical Engineering, School of Engineering, Polytechnic of Porto, Rua Dr. António Bernardino de Almeida, Porto, Portugal Manuel F. Silva INESC TEC INESC Technology and Science (formerly INESC Porto) and ISEP/IPP School of Engineering, Polytechnic of Porto, Rua Dr. António Bernardino de Almeida, Porto, Portugal Abstract Recently the league emerged in the world's largest robotics competition, intended for competitors wishing to compete in the field of mobile robotics for manipulation tasks in industrial environments. This competition consists of several tasks with one reflected in this work (Basic Navigation Test). This project involves the simulation in Virtual Robot Experimentation Platform (V-REP) of the behavior of a KUKA youbot. The goal is to verify that the robots can navigate in their environment, in a standalone mode, in a robust and secure way. To achieve the proposed objectives, it was necessary to create a program in Lua and test it in simulation. This involved the study of robot kinematics and mechanics, Simultaneous Localization And Mapping (SLAM) and perception from sensors. In this work is introduced an algorithm developed for a KUKA youbot platform to perform the SLAM while reaching for the goal position, which works according to the requirements of this competition BNT. This algorithm also minimizes the errors in the built map and in the path travelled by the robot. Keywords SLAM, youbot, RoCKIn, Robot, RoboCup. I. INTRODUCTION Each year several robotic competitions take place around the world, in order to foster robotics development and to attract young people to this scientific area. Recently, a new league emerged in the largest world robotics competition, called RoboCup@Work, intended to competitors who wish to compete in the field of mobile robotics in industrial environment. This competition is defined by multiple tasks, or tests, namely Basic Manipulation Test (BMT), Basic Transportation Test (BTT), Conveyor Belt Test (CBT), Precision Placement Test (PPT) and Basic Navigation Test (BNT), on which this paper will focus [1]. The main objective of this work is the development of an algorithm to allow the KUKA youbot robot (used by all teams participating in this competition) perform the BNT task and simulate its execution in the V-REP application [2]. This step consists on checking if the robot can navigate in its environment, in an autonomous mode, in a robust and safe way. To achieve the proposed objectives, it was created a program on the Lua [3] programming language, which was tested in the V-REP simulator. This involves the study of the mechanics and kinematics of the robot, its SLAM and perception from sensors. Bearing these ideas in mind, this paper is organized as follows. In Section II is presented the state of the art. The adopted system architecture is introduced in Section III, and Section IV describes the adopted solutions and their implementation. Next, Section V describes the tests performed and the results obtained. Finally, Section VI is devoted to present the main conclusions of this work and presents several ideas for possible future developments. II. STATE OF THE ART In this section, the scientific background of this work is addressed through four sections, namely: mobile robot competitions, mobile robots, simulation in robotics and planning and navigation. A. Mobile robot competitions There are several national and international robotic competitions, among which RoboCup [4]. This is an annual competition, whose aim is the study and development of artificial intelligence and robotics, providing challenges and problems where multiple technologies and methodologies can be combined to obtain the best results. RoboCup@Work is a new RoboCup league in the field of mobile robotics manipulation for industrial environments. Within this competition there are several tasks, performed in an arena (with one or more service areas), each one with a specific purpose for a given job [5]. The BNT serves to check if the robots can navigate correctly within the arena, in an oriented, autonomous and safe way. For its execution, is sent to the robot a line of text (string) specifying the location, orientation and pause duration of the robot on a goal [5]. B. Mobile robots In the past, heavy and expensive computers had to be connected by cable to control mobile robots. Today it is possible to build mobile robots with small dimensions, with numerous low cost actuators and sensors, and with embedded systems. There has been a huge increase of interest in mobile /14/$ IEEE 315

2 2014 IEEE International Conference on robots, not only as toys but also as an excellent tool for education in engineering. Currently mobile robots are used in several courses and post-graduate degrees in Computer Science, Computer Engineering, Information Technology, Cybernetics, Electrotechnical Engineering, Mechanical Engineering and Mechatronics [6]. The participation in the is the final goal of this work, and the organization of the event is very strict in relation to the type of platform to be used by the participants [5]. The choice of the robot for this participation falls on the KUKA youbot [7] platform (Fig. 1), currently recognized and accepted by the organization. The youbot is an omnidirectional mobile platform, with four Swedish wheels with 45º rollers. This means that the robot can move in any direction. Fig. 1. KUKA youbot with the arm/manipulator in home position [7]. C. Simulation in robotics Simulation is a method used to test ideas, theories and, in this case, software and behaviors of the robots. It is advisable, before starting a simulation, to decide what can be simplified and what has necessarily to be realistic. Currently, there are on the market, several open source simulators, among which can be mentioned Gazebo [8], Webots [9], USARSim [10]. V-REP (from Coppelia Robotics) [2] is a simulator with numerous functions, features or APIs. It is used for the development of algorithms, simulations, and in industrial robotics. It was chosen for this work since it currently has a free full license for education purposes, with all the characteristics of the commercial version, and also includes, on its library, the model of the KUKA youbot robot. Also, V-REP is a cross-platform with six programming approaches that are mutually compatible and that can even work hand-in-hand. Other simulation works can be found in the youbot GitHub repositories and contributions [11]. D. Navigation and planning The first thing to do, to perform the navigation in the best possible way, is the decomposition of obstacles in a discrete map. After this step algorithms can be used in order to avoid obstacles in navigation and determine the shortest path/route until the goal. There are three main strategies for decomposing the space or surrounding environment: map of routes, decomposition into cells and potential field. Regardless of the strategy used to obtain reliable results, the robot must not only create a map, but must do so while moving and exploring the surrounding space. This concept is known as SLAM. The implementation of SLAM is difficult due to the interaction between the robot position and its actions of mapping. If the position of the robot is inaccurate, the position of the obstacle on the map is correlated with this imprecision [12]. The approximate cell decomposition is one of the most popular techniques for planning trajectories in mobile robotics. This is in part due to the popularity of environmental representations, based on systems of grids (pixels). The decomposition into fixed-length cells is the most common technique and more currently used in mobile robotics for map representation and navigation planning. The cell size does not depend on the objects in the environment, and possibly, in narrow passages may lose information, due to the inaccuracy of the grid. In practical terms, this is rarely a problem, due to the size of cell used, which is usually very small. The greatest advantage of fixed size cellular decomposition is the low computational burden of navigation planning [12]. The algorithm of the transformation of distance, also known as wave front or methods of forest fires, is widely used in cell decomposition and planning the trajectory/exact path. It is based on a matrix that takes into account the proximity of obstacles and generates continuous interpolations of several directions in a gradual manner, at any point in the array. With this type of planning, the important is the ability of the robot to navigate from its current position (a free cell) to a possible adjacent free cell with the smallest distance value to goal [12]. III. SYSTEM ARCHITECTURE The model of the youbot robot used in the simulations is provided on V-REP, whit several scripts attached. To maintain the software reusable, the code of the robot was kept and, among it, were inserted the blocks: User interface, Kinematic, Perception and location, Planning and navigation and Graph. With the purpose of saving CPU processing time, the blocks of Perception and location, Planning and navigation and Graph, are only handled in case there is any goal or task. Fig. 2 describes this model, and the relationships between the blocks. Fig. 3 is a flowchart of the program implemented in the youbot script, depicting the necessary cycle conditions for the robot to navigate within the main objectives for the task. IV. IMPLEMENTATION In this section (divided into subsections corresponding to each block of Figure 2) a brief approach is presented on how the changes in the script for the youbot were made, for this to be capable of performing the BNT, without deleting the code in the script. A. User interface For the start of the BNT, the user must enter a formatted string or triplet, e.g. <(location, orientation, pause)>, by a command line on a user interface, as depicted in Fig. 4. The location corresponds to one of the specific areas of the arena, e.g. S1. Orientation could be N; S; E or W. The pause is a digit between 1 and 3 and indicates (in seconds) how much time should the robot stay in pause before starting the next task in the string. 316

3 2014 IEEE International Conference on In order to avoid errors, the algorithm that performs the reading of these characters, must convert the entire text to uppercase. The user can send more than one series of triplets. In this case, the information must be stored in a data matrix as depicted in Fig. 5. After a goal is reached, and the pause time ended, the line of the matrix corresponding to the actual goal must be deleted, so the robot can proceed to the next objective. Fig. 5. Matrix to store information of the strings sent to the robot. Fig. 2. Block diagram of the code blocks and their integration into the script of the youbot model. B. Kinematics This block is responsible for determining the speed of the robot in the inertial frame. It is important that the values obtained here, are as accurate as possible. The first step for a kinematic model of the robot is to express restrictions on the movement of individual wheels. Thus, the movement of these can be combined to calculate the movement of the robot as a whole. It is assumed that the plane of the wheel remains always upright, that there is always a single point of contact between the wheel and the ground plane, and that there are no external aids to this [12]. If it is considered the chassis of the robot as depicted in Fig. 6, the equations of velocity are determined according to (1). R is the radius of the wheel (0.05 m), and ω i is the angular velocity obtained from the encoders of the wheels [14]. ] [ ] [ ] Fig. 3. Flowchart of the youbot script in V-REP. Fig. 4. User interface created in V-REP for the string command. Fig. 6. Important dimensions of the youbot in the local and inertial frames. 317

4 2014 IEEE International Conference on The kinematic model determined in (1) is not accurate and presents errors. After performing several tests in V-REP, the linearization of the transversal and longitudinal average velocities, depending on the speed variables, was determined. This is shown in the equations presented on this page footnote. To obtain the corrected longitudinal velocity, substitutions into (2), (3) and (4) are necessary, according to the values previously obtained. The corrected transversal velocity can be found by the replacements of (5), (6) and (7). The inclusion of a gyroscope helps to determine the angular velocity of the robot with greater accuracy. Comparing this velocity with the rotational speed obtained in (1), the gyroscope speed information is better, and for the rest of the simulation this method is used as default. To perform the conversion of the corrected transversal and longitudinal velocities to the inertial frame, it is necessary to determine the angle θ (Fig. 6), according to (8). The integration interval in the simulation is the predefined time step of 0.05 s. Equation (9) gives the model to convert the velocities [12]. It is not necessary to convert the rotational speed because this is the same in the inertial frame. ] [ ] [ ] [ [ C. Perception and location After obtaining the velocities of the robot in the inertial frame, it is necessary to determine its position on a theoretical frame, and determine also the obstacles. The robot position is obtained through integration of its velocities previously determined, according to (10). ] [ ] KUKA sells a youbot model with the Hokuyo URG-04LX- GU01 LASER rangefinder sensor [15] (Fig. 7). The model of this sensor was attached in the front of the simulated youbot, to perform the perception of the surrounding environment. Fig. 7. Hokuyo URG-04LX-GU01 LASER rangefinder sensor [15]. This sensor sends to the youbot script an array with the coordinates of the obstacles detected, in a range of 240º, in relation to the sensor reference. To convert these values to the robot reference (geometric center of the platform) a conversion is required according to (11) and (12). being SL n the distance of the laser to the obstacle along the x- axis, and CL n the distance along the y-axis. As (12) shows, it is necessary to add the distance of the center of the robot to the center of the LASER, dr L, to obtain the correct y-axis distance. After obtaining the position of the obstacles with the Hokuyo LASER sensor, this information is saved in a discrete matrix, where value 1 represents cells with obstacles and free cells are coded as value 0. The coordinates for the insertion of the data, index (i) on the matrix and distance values (n) can be obtained using (13) and (14). The number of columns and rows of the matrix (M) must be two times larger than the absolute map size prediction in cm, because the initial position of the robot is in the middle of the matrix. The map resolution is obtained by the cell size (c) also in cm. ( ) ( ) ( ) With the purpose of saving system processing resources in terms of cells of arrays/maps that have not suffered any type of modification, a reduced size of the matrix is determined, as shown in Fig. 8. For a safe navigation of the robot is added a safe margin in the map, based on a circle [16] around the obstacle, so that when calculating the navigation path it takes into consideration the distance r, the biggest radius of the robot, so it does not collide with obstacles. D. Planning and navigation For the robot to be able to navigate, it is necessary to establish a path (as short as possible) between its initial position and the goal position. Knowing the current position of the robot in the global reference, a new matrix is build, containing the distance of each cell to the destination, in order to bypass the obstacles with the respective margin of safety. This matrix is determined according to the Jarvis distance transform algorithm with a Euclidean scan window [17], as presented in Fig. 9. ( ). ( ) ( ) ( ) ( ) ( ) ( ) ( ). ( ) ( ) ( ) ( ) ( ) ( ) ( ) ( ) ( ) ( ) ( ) ( ) ( ) ( ) ( ) 318 ( ) ( ) ( ).

5 2014 IEEE International Conference on With this transformation, the matrix is reduced to a map as shown in Fig. 10, where each position has the respective distance from its cell to the goal cell. This can be graphically displayed, on a color scale, where the cells are darker as the distance to the goal is greater. In addition, the barriers or the safety area, are presented in black. ] [ ] Fig. 11. Diagram of decision to navigation. Fig. 8. Example of a reduced map with the creation of the security circle. Fig. 9. Scan window used by the Jarvi s distance transform algorithm [17]. Fig. 10. Navigation map represented in color scale. The rotational, longitudinal and transversal velocities are determined by the smaller angular difference between the current position of the robot and the desired orientation. This angle θ is shown in Fig. 11. Here CW corresponds to Clockwise and CCW to Counter Clockwise rotation, respectively. Figure 12 shows the implementation of (15), which is responsible for determining the velocities of the robot according to θ. Fig. 12. Speed curves of the robot according to CW or CCW rotation needed. This expression computes the derivative of the desirable velocity ( ) by the previous velocity sample ( ) by a factor 1.4. According to tests performed, the curves obtained from these equations have a slope similar to the acceleration of the youbot in V-REP, as can be seen in Fig. 13. ] [ [ ( ) ] [ ( ) ] [ ( ) ] ] [ ] The speed change imposed by the algorithm mentioned above is abrupt. To smooth this impulse was used a smoothing function, according to (16). Fig. 13. Example of smoothing the change of speed imposed on the youbot. 319

6 2014 IEEE International Conference on E. Graph Although not critical to the simulation, graphics are an advantage for the user to view the map of obstacles, security margins, and location of the goal position(s). This code is only executed if a goal exists, as depicted in Fig. 3; otherwise there will be an excessive consumption of CPU resources. V. PERFORMED TESTS AND RESULTS OBTAINED Several tests were made in V-REP, mainly regarding the kinematics, location and mapping. For the realization of the experimental tests, was created the scenario presented in Fig. 14, with walls surrounding the useful space, leaving only one opening for the robot to access the arena. study that the determination of the robot accurate position is central to the achievement of a correct mapping and, therefore, for the planning of navigation. Although the construction of the obstacles map has fulfilled the desired requirements, and the robot has achieved the expected objectives, it was found during the experiments performed, that the fixed positions on the map are changing according to the errors of the odometry and errors inherent to the reading of the Hokuyo LASER rangefinder sensor. In the future this situation can be corrected using probabilistic (instead of deterministic) maps. It was also observed that navigation in multiples of 45º is restrictive and requires a greater demand on the processor to perform the computations necessary. This can be improved by applying the Exact Euclidean Distance Transform algorithm [17]. VII. ACKNOWLEDGEMENTS This work is funded (or part-funded) by the ERDF- European Regional Development Fund through the COMPETE Programme (operational programme for competitiveness) and by National Funds through the FCT - Fundação para a Ciência e a Tecnologia (Portuguese Foundation for Science and Technology) within project FCOMP FEDER Fig. 14. Scenario mounted in V-REP. With the implementation of the algorithm for the velocities error correction, it was possible to obtain an improvement around 95%, in relation to the case where the speeds were determined only by kinematics, as shown in Fig. 15, by comparing the curves of with. Fig. 15. Longitudinal velocity comparision. VI. CONCLUSIONS This paper presented an algorithm for the implementation of the RoboCup@Work BNT competition, which allows a KUKA youbot platform to perform this task while minimizing the trajectory errors and performing the SLAM while reaching the goal position. Concerning the calculation of the platform kinematics, although not being accurate, it was found in V-REP that with the correction algorithm described in this paper, there can be a better approximation to reality. It was observed during this REFERENCES [1] RoboCup@Work, available: [2] V-REP, available: [3] Lua, available: [4] RoboCup, available: [5] RoboCup@Work Rule ook, Version 201.1; June 0, 201, available on: -0.pd, [6] R. D. eer, H. J. Chiel, and R. F. Drushel, Using autonomous robotics to teach science and engineering, Communications o the ACM, vol. 42, no. 6, pp , June [7] KUKA, available: [8] Gazebo, available: [9] Webots, available: [10] USARsim, available: [11] GitHub, available: [12] Siegwart, Roland; R. Nourbakhsh, Illah, Introduction to Autonomous Mobile Robots, IS N X. [13] KUKA you ot User Manual, Version 1.02, Locomotec, available: [14] Ioan Doroftei, Victor Grosu and Veaceslav Spinu (2007). Omnidirectional Mobile Robot - Design and Implementation, Bioinspiration and Robotics Walking and Climbing Robots, Maki K. Habib (Ed.), ISBN: , InTech, pp [15] Hokuyo, available: [16] Gustavson, Ste an, An e icient circle drawing algorithm, available: [17] Juan Carlos Elizondo-Leal, Ezra Federico Parra-Gonz lez and Jos Gabriel Ram rez-torres. The Exact Euclidean Distance Transform: A New Algorithm for Universal Path Planning. Int J Adv Robot Syst, 2013, 10:266. doi: /

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

Canny Edge Based Self-localization of a RoboCup Middle-sized League Robot

Canny Edge Based Self-localization of a RoboCup Middle-sized League Robot Canny Edge Based Self-localization of a RoboCup Middle-sized League Robot Yoichi Nakaguro Sirindhorn International Institute of Technology, Thammasat University P.O. Box 22, Thammasat-Rangsit Post Office,

More information

Matching Evaluation of 2D Laser Scan Points using Observed Probability in Unstable Measurement Environment

Matching Evaluation of 2D Laser Scan Points using Observed Probability in Unstable Measurement Environment Matching Evaluation of D Laser Scan Points using Observed Probability in Unstable Measurement Environment Taichi Yamada, and Akihisa Ohya Abstract In the real environment such as urban areas sidewalk,

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

Unit 2: Locomotion Kinematics of Wheeled Robots: Part 3

Unit 2: Locomotion Kinematics of Wheeled Robots: Part 3 Unit 2: Locomotion Kinematics of Wheeled Robots: Part 3 Computer Science 4766/6778 Department of Computer Science Memorial University of Newfoundland January 28, 2014 COMP 4766/6778 (MUN) Kinematics of

More information

COMPARISON OF ROBOT NAVIGATION METHODS USING PERFORMANCE METRICS

COMPARISON OF ROBOT NAVIGATION METHODS USING PERFORMANCE METRICS COMPARISON OF ROBOT NAVIGATION METHODS USING PERFORMANCE METRICS Adriano Flores Dantas, Rodrigo Porfírio da Silva Sacchi, Valguima V. V. A. Odakura Faculdade de Ciências Exatas e Tecnologia (FACET) Universidade

More information

Experimental Verification of Stability Region of Balancing a Single-wheel Robot: an Inverted Stick Model Approach

Experimental Verification of Stability Region of Balancing a Single-wheel Robot: an Inverted Stick Model Approach IECON-Yokohama November 9-, Experimental Verification of Stability Region of Balancing a Single-wheel Robot: an Inverted Stick Model Approach S. D. Lee Department of Mechatronics Engineering Chungnam National

More information

Design and Implementation of a Real-Time Autonomous Navigation System Applied to Lego Robots

Design and Implementation of a Real-Time Autonomous Navigation System Applied to Lego Robots ThBT1.4 Design and Implementation of a Real-Time Autonomous Navigation System Applied to Lego Robots Thi Thoa Mac, Cosmin Copot Clara M. Ionescu Dynamical Systems and Control Research Group, Department

More information

Waypoint Navigation with Position and Heading Control using Complex Vector Fields for an Ackermann Steering Autonomous Vehicle

Waypoint Navigation with Position and Heading Control using Complex Vector Fields for an Ackermann Steering Autonomous Vehicle Waypoint Navigation with Position and Heading Control using Complex Vector Fields for an Ackermann Steering Autonomous Vehicle Tommie J. Liddy and Tien-Fu Lu School of Mechanical Engineering; The University

More information

Localization algorithm using a virtual label for a mobile robot in indoor and outdoor environments

Localization algorithm using a virtual label for a mobile robot in indoor and outdoor environments Artif Life Robotics (2011) 16:361 365 ISAROB 2011 DOI 10.1007/s10015-011-0951-7 ORIGINAL ARTICLE Ki Ho Yu Min Cheol Lee Jung Hun Heo Youn Geun Moon Localization algorithm using a virtual label for a mobile

More information

How to win

How to win How to win RoboCup@Work? The Swarmlab@Work approach revealed Sjriek Alers 1, Daniel Claes 1, Joscha Fossel 1, Daniel Hennes 2, Karl Tuyls 1, and Gerhard Weiss 1 1 Maastricht University, P.O. Box 616, 6200

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

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

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

Autonomous Mobile Robots, Chapter 6 Planning and Navigation Where am I going? How do I get there? Localization. Cognition. Real World Environment

Autonomous Mobile Robots, Chapter 6 Planning and Navigation Where am I going? How do I get there? Localization. Cognition. Real World Environment Planning and Navigation Where am I going? How do I get there?? Localization "Position" Global Map Cognition Environment Model Local Map Perception Real World Environment Path Motion Control Competencies

More information

Indoor Mobile Robot Navigation and Obstacle Avoidance Using a 3D Camera and Laser Scanner

Indoor Mobile Robot Navigation and Obstacle Avoidance Using a 3D Camera and Laser Scanner AARMS Vol. 15, No. 1 (2016) 51 59. Indoor Mobile Robot Navigation and Obstacle Avoidance Using a 3D Camera and Laser Scanner Peter KUCSERA 1 Thanks to the developing sensor technology in mobile robot navigation

More information

Robotics (Kinematics) Winter 1393 Bonab University

Robotics (Kinematics) Winter 1393 Bonab University Robotics () Winter 1393 Bonab University : most basic study of how mechanical systems behave Introduction Need to understand the mechanical behavior for: Design Control Both: Manipulators, Mobile Robots

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

Motion Control in Dynamic Multi-Robot Environments

Motion Control in Dynamic Multi-Robot Environments Motion Control in Dynamic Multi-Robot Environments Michael Bowling mhb@cs.cmu.edu Manuela Veloso mmv@cs.cmu.edu Computer Science Department Carnegie Mellon University Pittsburgh, PA 15213-3890 Abstract

More information

Multi-Robot Planning for Perception of Multiple Regions of Interest

Multi-Robot Planning for Perception of Multiple Regions of Interest Multi-Robot Planning for Perception of Multiple Regions of Interest Tiago Pereira 123, A. Paulo G. M. Moreira 12, and Manuela Veloso 3 1 Faculty of Engineering, University of Porto, Portugal {tiago.raul,

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

Prediction-Based Path Planning with Obstacle Avoidance in Dynamic Target Environment

Prediction-Based Path Planning with Obstacle Avoidance in Dynamic Target Environment 48 Prediction-Based Path Planning with Obstacle Avoidance in Dynamic Target Environment Zahraa Y. Ibrahim Electrical Engineering Department University of Basrah Basrah, Iraq Abdulmuttalib T. Rashid Electrical

More information

Localization, Where am I?

Localization, Where am I? 5.1 Localization, Where am I?? position Position Update (Estimation?) Encoder Prediction of Position (e.g. odometry) YES matched observations Map data base predicted position Matching Odometry, Dead Reckoning

More information

Mobile Robot Path Planning in Static Environments using Particle Swarm Optimization

Mobile Robot Path Planning in Static Environments using Particle Swarm Optimization Mobile Robot Path Planning in Static Environments using Particle Swarm Optimization M. Shahab Alam, M. Usman Rafique, and M. Umer Khan Abstract Motion planning is a key element of robotics since it empowers

More information

Simulation of the pass through the labyrinth as a method of the algorithm development thinking

Simulation of the pass through the labyrinth as a method of the algorithm development thinking Simulation of the pass through the labyrinth as a method of the algorithm development thinking LIBOR MITROVIC, STEPAN HUBALOVSKY Department of Informatics University of Hradec Kralove Rokitanskeho 62,

More information

MODELLING AND MOTION ANALYSIS OF FIVE-BAR 5R MECHANISM

MODELLING AND MOTION ANALYSIS OF FIVE-BAR 5R MECHANISM Int. J. of Applied Mechanics and Engineering, 1, vol.19, No., pp.677-686 DOI: 1.78/ijame-1-6 MODELLING AND MOTION ANALYSIS OF FIVE-BAR 5R MECHANISM Z. BUDNIAK * and T. BIL Faculty of Mechanical Engineering

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

AUV Cruise Path Planning Based on Energy Priority and Current Model

AUV Cruise Path Planning Based on Energy Priority and Current Model AUV Cruise Path Planning Based on Energy Priority and Current Model Guangcong Liu 1, Hainan Chen 1,2, Xiaoling Wu 2,*, Dong Li 3,2, Tingting Huang 1,, Huawei Fu 1,2 1 Guangdong University of Technology,

More information

DYNAMIC POSITIONING OF A MOBILE ROBOT USING A LASER-BASED GONIOMETER. Joaquim A. Batlle*, Josep Maria Font*, Josep Escoda**

DYNAMIC POSITIONING OF A MOBILE ROBOT USING A LASER-BASED GONIOMETER. Joaquim A. Batlle*, Josep Maria Font*, Josep Escoda** DYNAMIC POSITIONING OF A MOBILE ROBOT USING A LASER-BASED GONIOMETER Joaquim A. Batlle*, Josep Maria Font*, Josep Escoda** * Department of Mechanical Engineering Technical University of Catalonia (UPC)

More information

7 3-Sep Localization and Navigation (GPS, INS, & SLAM) 8 10-Sep State-space modelling & Controller Design 9 17-Sep Vision-based control

7 3-Sep Localization and Navigation (GPS, INS, & SLAM) 8 10-Sep State-space modelling & Controller Design 9 17-Sep Vision-based control RoboticsCourseWare Contributor 2012 School of Information Technology and Electrical Engineering at the University of Queensland Schedule Week Date Lecture (M: 12-1:30, 43-102) 1 23-Jul Introduction Representing

More information

Pick and Place Robot Simulation

Pick and Place Robot Simulation Pick and Place Robot Simulation James Beukers Jordan Jacobson ECE 63 Fall 4 December 6, 4 Contents Introduction System Overview 3 3 State Space Model 3 4 Controller Design 6 5 Simulation and Results 7

More information

Vehicle Localization. Hannah Rae Kerner 21 April 2015

Vehicle Localization. Hannah Rae Kerner 21 April 2015 Vehicle Localization Hannah Rae Kerner 21 April 2015 Spotted in Mtn View: Google Car Why precision localization? in order for a robot to follow a road, it needs to know where the road is to stay in a particular

More information

Robots are built to accomplish complex and difficult tasks that require highly non-linear motions.

Robots are built to accomplish complex and difficult tasks that require highly non-linear motions. Path and Trajectory specification Robots are built to accomplish complex and difficult tasks that require highly non-linear motions. Specifying the desired motion to achieve a specified goal is often a

More information

Robotics. Haslum COMP3620/6320

Robotics. Haslum COMP3620/6320 Robotics P@trik Haslum COMP3620/6320 Introduction Robotics Industrial Automation * Repetitive manipulation tasks (assembly, etc). * Well-known, controlled environment. * High-power, high-precision, very

More information

DEVELOPMENT OF POSITION MEASUREMENT SYSTEM FOR CONSTRUCTION PILE USING LASER RANGE FINDER

DEVELOPMENT OF POSITION MEASUREMENT SYSTEM FOR CONSTRUCTION PILE USING LASER RANGE FINDER S17- DEVELOPMENT OF POSITION MEASUREMENT SYSTEM FOR CONSTRUCTION PILE USING LASER RANGE FINDER Fumihiro Inoue 1 *, Takeshi Sasaki, Xiangqi Huang 3, and Hideki Hashimoto 4 1 Technica Research Institute,

More information

Introduction to Robotics

Introduction to Robotics Introduction to Robotics Ph.D. Antonio Marin-Hernandez Artificial Intelligence Department Universidad Veracruzana Sebastian Camacho # 5 Xalapa, Veracruz Robotics Action and Perception LAAS-CNRS 7, av du

More information

MEM380 Applied Autonomous Robots Winter Robot Kinematics

MEM380 Applied Autonomous Robots Winter Robot Kinematics MEM38 Applied Autonomous obots Winter obot Kinematics Coordinate Transformations Motivation Ultimatel, we are interested in the motion of the robot with respect to a global or inertial navigation frame

More information

SVG GRAPHICS LANGUAGE AS A DESCRIPTION OF A 2D PATH IN ROBOT PROGRAMMING TASKS

SVG GRAPHICS LANGUAGE AS A DESCRIPTION OF A 2D PATH IN ROBOT PROGRAMMING TASKS S E L E C T E D E N G I N E E R I N G P R O B L E M S N U M B E R 5 I N S T I T U T E O F E N G I N E E R I N G P R O C E S S E S A U T O M A T I O N A N D I N T E G R A T E D M A N U F A C T U R I N G

More information

(a) (b) (c) Fig. 1. Omnidirectional camera: (a) principle; (b) physical construction; (c) captured. of a local vision system is more challenging than

(a) (b) (c) Fig. 1. Omnidirectional camera: (a) principle; (b) physical construction; (c) captured. of a local vision system is more challenging than An Omnidirectional Vision System that finds and tracks color edges and blobs Felix v. Hundelshausen, Sven Behnke, and Raul Rojas Freie Universität Berlin, Institut für Informatik Takustr. 9, 14195 Berlin,

More information

MOBILE ROBOT LOCALIZATION. REVISITING THE TRIANGULATION METHODS. Josep Maria Font, Joaquim A. Batlle

MOBILE ROBOT LOCALIZATION. REVISITING THE TRIANGULATION METHODS. Josep Maria Font, Joaquim A. Batlle MOBILE ROBOT LOCALIZATION. REVISITING THE TRIANGULATION METHODS Josep Maria Font, Joaquim A. Batlle Department of Mechanical Engineering Technical University of Catalonia (UC) Avda. Diagonal 647, 08028

More information

Object Conveyance Algorithm for Multiple Mobile Robots based on Object Shape and Size

Object Conveyance Algorithm for Multiple Mobile Robots based on Object Shape and Size Object Conveyance Algorithm for Multiple Mobile Robots based on Object Shape and Size Purnomo Sejati, Hiroshi Suzuki, Takahiro Kitajima, Akinobu Kuwahara and Takashi Yasuno Graduate School of Tokushima

More information

Mobile Robot Motion Planning and Multi Objective Optimization Using Improved Approach

Mobile Robot Motion Planning and Multi Objective Optimization Using Improved Approach Mobile Robot Motion Planning and Multi Objective Optimization Using Improved Approach Bashra K. O. ChaborAlwawi and Hubert Roth Automatic Control Engineering, Siegen University, Siegen, Germany Email:

More information

Tracking a Mobile Robot Position Using Vision and Inertial Sensor

Tracking a Mobile Robot Position Using Vision and Inertial Sensor Tracking a Mobile Robot Position Using Vision and Inertial Sensor Francisco Coito, António Eleutério, Stanimir Valtchev, and Fernando Coito Faculdade de Ciências e Tecnologia Universidade Nova de Lisboa,

More information

Manipulator Path Control : Path Planning, Dynamic Trajectory and Control Analysis

Manipulator Path Control : Path Planning, Dynamic Trajectory and Control Analysis Manipulator Path Control : Path Planning, Dynamic Trajectory and Control Analysis Motion planning for industrial manipulators is a challenging task when obstacles are present in the workspace so that collision-free

More information

Testing the Possibilities of Using IMUs with Different Types of Movements

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

More information

Gesture Recognition Aplication based on Dynamic Time Warping (DTW) FOR Omni-Wheel Mobile Robot

Gesture Recognition Aplication based on Dynamic Time Warping (DTW) FOR Omni-Wheel Mobile Robot Gesture Recognition Aplication based on Dynamic Time Warping (DTW) FOR Omni-Wheel Mobile Robot Indra Adji Sulistijono, Gama Indra Kristianto Indra Adji Sulistijono is with the Department of Mechatronics

More information

S-SHAPED ONE TRAIL PARALLEL PARKING OF A CAR-LIKE MOBILE ROBOT

S-SHAPED ONE TRAIL PARALLEL PARKING OF A CAR-LIKE MOBILE ROBOT S-SHAPED ONE TRAIL PARALLEL PARKING OF A CAR-LIKE MOBILE ROBOT 1 SOE YU MAUNG MAUNG, 2 NU NU WIN, 3 MYINT HTAY 1,2,3 Mechatronic Engineering Department, Mandalay Technological University, The Republic

More information

Introduction to Mobile Robotics

Introduction to Mobile Robotics Introduction to Mobile Robotics Olivier Aycard Associate Professor University of Grenoble Laboratoire d Informatique de Grenoble http://membres-liglab.imag.fr/aycard 1/29 Some examples of mobile robots

More information

Manipulator trajectory planning

Manipulator trajectory planning Manipulator trajectory planning Václav Hlaváč Czech Technical University in Prague Faculty of Electrical Engineering Department of Cybernetics Czech Republic http://cmp.felk.cvut.cz/~hlavac Courtesy to

More information

OptimizationOf Straight Movement 6 Dof Robot Arm With Genetic Algorithm

OptimizationOf Straight Movement 6 Dof Robot Arm With Genetic Algorithm OptimizationOf Straight Movement 6 Dof Robot Arm With Genetic Algorithm R. Suryoto Edy Raharjo Oyas Wahyunggoro Priyatmadi Abstract This paper proposes a genetic algorithm (GA) to optimize the straight

More information

CONTRIBUTION TO THE INVESTIGATION OF STOPPING SIGHT DISTANCE IN THREE-DIMENSIONAL SPACE

CONTRIBUTION TO THE INVESTIGATION OF STOPPING SIGHT DISTANCE IN THREE-DIMENSIONAL SPACE National Technical University of Athens School of Civil Engineering Department of Transportation Planning and Engineering Doctoral Dissertation CONTRIBUTION TO THE INVESTIGATION OF STOPPING SIGHT DISTANCE

More information

CS4758: Rovio Augmented Vision Mapping Project

CS4758: Rovio Augmented Vision Mapping Project CS4758: Rovio Augmented Vision Mapping Project Sam Fladung, James Mwaura Abstract The goal of this project is to use the Rovio to create a 2D map of its environment using a camera and a fixed laser pointer

More information

Cinematica dei Robot Mobili su Ruote. Corso di Robotica Prof. Davide Brugali Università degli Studi di Bergamo

Cinematica dei Robot Mobili su Ruote. Corso di Robotica Prof. Davide Brugali Università degli Studi di Bergamo Cinematica dei Robot Mobili su Ruote Corso di Robotica Prof. Davide Brugali Università degli Studi di Bergamo Riferimenti bibliografici Roland SIEGWART, Illah R. NOURBAKHSH Introduction to Autonomous Mobile

More information

A Path Tracking Method For Autonomous Mobile Robots Based On Grid Decomposition

A Path Tracking Method For Autonomous Mobile Robots Based On Grid Decomposition A Path Tracking Method For Autonomous Mobile Robots Based On Grid Decomposition A. Pozo-Ruz*, C. Urdiales, A. Bandera, E. J. Pérez and F. Sandoval Dpto. Tecnología Electrónica. E.T.S.I. Telecomunicación,

More information

Research on time optimal trajectory planning of 7-DOF manipulator based on genetic algorithm

Research on time optimal trajectory planning of 7-DOF manipulator based on genetic algorithm Acta Technica 61, No. 4A/2016, 189 200 c 2017 Institute of Thermomechanics CAS, v.v.i. Research on time optimal trajectory planning of 7-DOF manipulator based on genetic algorithm Jianrong Bu 1, Junyan

More information

Operation Trajectory Control of Industrial Robots Based on Motion Simulation

Operation Trajectory Control of Industrial Robots Based on Motion Simulation Operation Trajectory Control of Industrial Robots Based on Motion Simulation Chengyi Xu 1,2, Ying Liu 1,*, Enzhang Jiao 1, Jian Cao 2, Yi Xiao 2 1 College of Mechanical and Electronic Engineering, Nanjing

More information

Mobile Robot Kinematics

Mobile Robot Kinematics Mobile Robot Kinematics Dr. Kurtuluş Erinç Akdoğan kurtuluserinc@cankaya.edu.tr INTRODUCTION Kinematics is the most basic study of how mechanical systems behave required to design to control Manipulator

More information

ME 597/747 Autonomous Mobile Robots. Mid Term Exam. Duration: 2 hour Total Marks: 100

ME 597/747 Autonomous Mobile Robots. Mid Term Exam. Duration: 2 hour Total Marks: 100 ME 597/747 Autonomous Mobile Robots Mid Term Exam Duration: 2 hour Total Marks: 100 Instructions: Read the exam carefully before starting. Equations are at the back, but they are NOT necessarily valid

More information

Mobile Robots Locomotion

Mobile Robots Locomotion Mobile Robots Locomotion Institute for Software Technology 1 Course Outline 1. Introduction to Mobile Robots 2. Locomotion 3. Sensors 4. Localization 5. Environment Modelling 6. Reactive Navigation 2 Today

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

Proposal of a Low cost Mobile Robot Prototype with On-Board Laser Scanner: Competition Case Study

Proposal of a Low cost Mobile Robot Prototype with On-Board Laser Scanner: Competition Case Study Preprints of the 11th IFAC Symposium on Advances in Control Education, Bratislava, Slovakia, June 1-3, 2016 FrParallel D1.5 Proposal of a Low cost Mobile Robot Prototype with On-Board Laser Scanner: Robot@Factory

More information

MOTION. Feature Matching/Tracking. Control Signal Generation REFERENCE IMAGE

MOTION. Feature Matching/Tracking. Control Signal Generation REFERENCE IMAGE Head-Eye Coordination: A Closed-Form Solution M. Xie School of Mechanical & Production Engineering Nanyang Technological University, Singapore 639798 Email: mmxie@ntuix.ntu.ac.sg ABSTRACT In this paper,

More information

B2B Platform for Media Content Personalisation

B2B Platform for Media Content Personalisation B2B Platform for Media Content Personalisation Benedita Malheiro 1, Jeremy Foss 2 and Juan Carlos Burguillo 3 1 School of Engineering, Polytechnic Institute of Porto and INESC TEC INESC Technology and

More information

Encoder applications. I Most common use case: Combination with motors

Encoder applications. I Most common use case: Combination with motors 3.5 Rotation / Motion - Encoder applications 64-424 Intelligent Robotics Encoder applications I Most common use case: Combination with motors I Used to measure relative rotation angle, rotational direction

More information

Today MAPS AND MAPPING. Features. process of creating maps. More likely features are things that can be extracted from images:

Today MAPS AND MAPPING. Features. process of creating maps. More likely features are things that can be extracted from images: MAPS AND MAPPING Features In the first class we said that navigation begins with what the robot can see. There are several forms this might take, but it will depend on: What sensors the robot has What

More information

AUTOMATIC PARKING OF SELF-DRIVING CAR BASED ON LIDAR

AUTOMATIC PARKING OF SELF-DRIVING CAR BASED ON LIDAR AUTOMATIC PARKING OF SELF-DRIVING CAR BASED ON LIDAR Bijun Lee a, Yang Wei a, I. Yuan Guo a a State Key Laboratory of Information Engineering in Surveying, Mapping and Remote Sensing, Wuhan University,

More information

10/11/07 1. Motion Control (wheeled robots) Representing Robot Position ( ) ( ) [ ] T

10/11/07 1. Motion Control (wheeled robots) Representing Robot Position ( ) ( ) [ ] T 3 3 Motion Control (wheeled robots) Introduction: Mobile Robot Kinematics Requirements for Motion Control Kinematic / dynamic model of the robot Model of the interaction between the wheel and the ground

More information

Exam in DD2426 Robotics and Autonomous Systems

Exam in DD2426 Robotics and Autonomous Systems Exam in DD2426 Robotics and Autonomous Systems Lecturer: Patric Jensfelt KTH, March 16, 2010, 9-12 No aids are allowed on the exam, i.e. no notes, no books, no calculators, etc. You need a minimum of 20

More information

Mobile Robot Navigation Using Omnidirectional Vision

Mobile Robot Navigation Using Omnidirectional Vision Mobile Robot Navigation Using Omnidirectional Vision László Mornailla, Tamás Gábor Pekár, Csaba Gergő Solymosi, Zoltán Vámossy John von Neumann Faculty of Informatics, Budapest Tech Bécsi út 96/B, H-1034

More information

A Genetic Algorithm for Robust Motion Planning

A Genetic Algorithm for Robust Motion Planning A Genetic Algorithm for Robust Motion Planning Domingo Gallardo, Otto Colomina, Francisco Flórez, Ramón Rizo domingo,otto,florez,rizo@dtic.ua.es Grupo i3a: Informatica Industrial e Inteligencia Artificial

More information

Motion Planning. Howie CHoset

Motion Planning. Howie CHoset Motion Planning Howie CHoset Questions Where are we? Where do we go? Which is more important? Encoders Encoders Incremental Photodetector Encoder disk LED Photoemitter Encoders - Incremental Encoders -

More information

A Simple Introduction to Omni Roller Robots (3rd April 2015)

A Simple Introduction to Omni Roller Robots (3rd April 2015) A Simple Introduction to Omni Roller Robots (3rd April 2015) Omni wheels have rollers all the way round the tread so they can slip laterally as well as drive in the direction of a regular wheel. The three-wheeled

More information

Space Robot Path Planning for Collision Avoidance

Space Robot Path Planning for Collision Avoidance Space Robot Path Planning for ollision voidance Yuya Yanoshita and Shinichi Tsuda bstract This paper deals with a path planning of space robot which includes a collision avoidance algorithm. For the future

More information

IMU and Encoders. Team project Robocon 2016

IMU and Encoders. Team project Robocon 2016 IMU and Encoders Team project Robocon 2016 Harsh Sinha, 14265, harshsin@iitk.ac.in Deepak Gangwar, 14208, dgangwar@iitk.ac.in Swati Gupta, 14742, swatig@iitk.ac.in March 17 th 2016 IMU and Encoders Module

More information

NERC Gazebo simulation implementation

NERC Gazebo simulation implementation NERC 2015 - Gazebo simulation implementation Hannan Ejaz Keen, Adil Mumtaz Department of Electrical Engineering SBA School of Science & Engineering, LUMS, Pakistan {14060016, 14060037}@lums.edu.pk ABSTRACT

More information

Part Alignment Identification and Adaptive Pick-andplace Operation for Flat Surfaces

Part Alignment Identification and Adaptive Pick-andplace Operation for Flat Surfaces Part Alignment Identification and Adaptive Pick-andplace Operation for Flat Surfaces Paulo Moreira da Costa 1, Paulo Costa 1,2, Pedro Costa 1,2, José Lima 1,3 Germano Veiga 1 1 INESC TEC (formerly INESC

More information

CANAL FOLLOWING USING AR DRONE IN SIMULATION

CANAL FOLLOWING USING AR DRONE IN SIMULATION CANAL FOLLOWING USING AR DRONE IN SIMULATION ENVIRONMENT Ali Ahmad, Ahmad Aneeque Khalid Department of Electrical Engineering SBA School of Science & Engineering, LUMS, Pakistan {14060006, 14060019}@lums.edu.pk

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

Fast marching methods

Fast marching methods 1 Fast marching methods Lecture 3 Alexander & Michael Bronstein tosca.cs.technion.ac.il/book Numerical geometry of non-rigid shapes Stanford University, Winter 2009 Metric discretization 2 Approach I:

More information

CSE 490R P1 - Localization using Particle Filters Due date: Sun, Jan 28-11:59 PM

CSE 490R P1 - Localization using Particle Filters Due date: Sun, Jan 28-11:59 PM CSE 490R P1 - Localization using Particle Filters Due date: Sun, Jan 28-11:59 PM 1 Introduction In this assignment you will implement a particle filter to localize your car within a known map. This will

More information

Laser Scanner-Based Navigation and Motion Planning for Truck-Trailer Combinations

Laser Scanner-Based Navigation and Motion Planning for Truck-Trailer Combinations Laser Scanner-Based Navigation and Motion Planning for Truck-Trailer Combinations Roland Stahn 1,2, Tobias Stark 1 and Andreas Stopp 1 1 DaimlerChrysler AG, Group Research, Assistance and Safety Systems,

More information

#65 MONITORING AND PREDICTING PEDESTRIAN BEHAVIOR AT TRAFFIC INTERSECTIONS

#65 MONITORING AND PREDICTING PEDESTRIAN BEHAVIOR AT TRAFFIC INTERSECTIONS #65 MONITORING AND PREDICTING PEDESTRIAN BEHAVIOR AT TRAFFIC INTERSECTIONS Final Research Report Luis E. Navarro-Serment, Ph.D. The Robotics Institute Carnegie Mellon University Disclaimer The contents

More information

1 Trajectories. Class Notes, Trajectory Planning, COMS4733. Figure 1: Robot control system.

1 Trajectories. Class Notes, Trajectory Planning, COMS4733. Figure 1: Robot control system. Class Notes, Trajectory Planning, COMS4733 Figure 1: Robot control system. 1 Trajectories Trajectories are characterized by a path which is a space curve of the end effector. We can parameterize this curve

More information

Sensor Modalities. Sensor modality: Different modalities:

Sensor Modalities. Sensor modality: Different modalities: Sensor Modalities Sensor modality: Sensors which measure same form of energy and process it in similar ways Modality refers to the raw input used by the sensors Different modalities: Sound Pressure Temperature

More information

AMR 2011/2012: Final Projects

AMR 2011/2012: Final Projects AMR 2011/2012: Final Projects 0. General Information A final project includes: studying some literature (typically, 1-2 papers) on a specific subject performing some simulations or numerical tests on an

More information

Autonomous Ground Vehicle (AGV) Project

Autonomous Ground Vehicle (AGV) Project utonomous Ground Vehicle (GV) Project Demetrus Rorie Computer Science Department Texas &M University College Station, TX 77843 dmrorie@mail.ecsu.edu BSTRCT The goal of this project is to construct an autonomous

More information

Safe Prediction-Based Local Path Planning using Obstacle Probability Sections

Safe Prediction-Based Local Path Planning using Obstacle Probability Sections Slide 1 Safe Prediction-Based Local Path Planning using Obstacle Probability Sections Tanja Hebecker and Frank Ortmeier Chair of Software Engineering, Otto-von-Guericke University of Magdeburg, Germany

More information

Spring Localization II. Roland Siegwart, Margarita Chli, Juan Nieto, Nick Lawrance. ASL Autonomous Systems Lab. Autonomous Mobile Robots

Spring Localization II. Roland Siegwart, Margarita Chli, Juan Nieto, Nick Lawrance. ASL Autonomous Systems Lab. Autonomous Mobile Robots Spring 2018 Localization II Localization I 16.04.2018 1 knowledge, data base mission commands Localization Map Building environment model local map position global map Cognition Path Planning path Perception

More information

ECE276B: Planning & Learning in Robotics Lecture 5: Configuration Space

ECE276B: Planning & Learning in Robotics Lecture 5: Configuration Space ECE276B: Planning & Learning in Robotics Lecture 5: Configuration Space Lecturer: Nikolay Atanasov: natanasov@ucsd.edu Teaching Assistants: Tianyu Wang: tiw161@eng.ucsd.edu Yongxi Lu: yol070@eng.ucsd.edu

More information

Robotics Project. Final Report. Computer Science University of Minnesota. December 17, 2007

Robotics Project. Final Report. Computer Science University of Minnesota. December 17, 2007 Robotics Project Final Report Computer Science 5551 University of Minnesota December 17, 2007 Peter Bailey, Matt Beckler, Thomas Bishop, and John Saxton Abstract: A solution of the parallel-parking problem

More information

The UTIAS multi-robot cooperative localization and mapping dataset

The UTIAS multi-robot cooperative localization and mapping dataset The UTIAS multi-robot cooperative localization and mapping dataset The International Journal of Robotics Research 30(8) 969 974 The Author(s) 2011 Reprints and permission: sagepub.co.uk/journalspermissions.nav

More information

Interactive Collision Detection for Engineering Plants based on Large-Scale Point-Clouds

Interactive Collision Detection for Engineering Plants based on Large-Scale Point-Clouds 1 Interactive Collision Detection for Engineering Plants based on Large-Scale Point-Clouds Takeru Niwa 1 and Hiroshi Masuda 2 1 The University of Electro-Communications, takeru.niwa@uec.ac.jp 2 The University

More information

Virtual Interaction System Based on Optical Capture

Virtual Interaction System Based on Optical Capture Sensors & Transducers 203 by IFSA http://www.sensorsportal.com Virtual Interaction System Based on Optical Capture Peng CHEN, 2 Xiaoyang ZHOU, 3 Jianguang LI, Peijun WANG School of Mechanical Engineering,

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

Data Association for SLAM

Data Association for SLAM CALIFORNIA INSTITUTE OF TECHNOLOGY ME/CS 132a, Winter 2011 Lab #2 Due: Mar 10th, 2011 Part I Data Association for SLAM 1 Introduction For this part, you will experiment with a simulation of an EKF SLAM

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

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

Planning in Mobile Robotics

Planning in Mobile Robotics Planning in Mobile Robotics Part I. Miroslav Kulich Intelligent and Mobile Robotics Group Gerstner Laboratory for Intelligent Decision Making and Control Czech Technical University in Prague Tuesday 26/07/2011

More information

Available online at ScienceDirect. Marko Švaco*, Bojan Šekoranja, Filip Šuligoj, Bojan Jerbić

Available online at   ScienceDirect. Marko Švaco*, Bojan Šekoranja, Filip Šuligoj, Bojan Jerbić Available online at www.sciencedirect.com ScienceDirect Procedia Engineering 69 ( 2014 ) 459 463 24th DAAAM International Symposium on Intelligent Manufacturing and Automation, 2013 Calibration of an Industrial

More information

Simulation of a mobile robot with a LRF in a 2D environment and map building

Simulation of a mobile robot with a LRF in a 2D environment and map building Simulation of a mobile robot with a LRF in a 2D environment and map building Teslić L. 1, Klančar G. 2, and Škrjanc I. 3 1 Faculty of Electrical Engineering, University of Ljubljana, Tržaška 25, 1000 Ljubljana,

More information