Search results for: Robot Operating System.
Commenced in January 2007
Frequency: Monthly
Edition: International
Paper Count: 9123

Search results for: Robot Operating System.

9123 An Experimental Multi-Agent Robot System for Operating in Hazardous Environments

Authors: Y. J. Huang, J. D. Yu, B. W. Hong, C. H. Tai, T. C. Kuo

Abstract:

In this paper, a multi-agent robot system is presented. The system consists of four robots. The developed robots are able to automatically enter and patrol a harmful environment, such as the building infected with virus or the factory with leaking hazardous gas. Further, every robot is able to perform obstacle avoidance and search for the victims. Several operation modes are designed: remote control, obstacle avoidance, automatic searching, and so on.

Keywords: autonomous robot, field programmable gate array, obstacle avoidance, ultrasonic sensor, wireless communication.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1747
9122 A Simulator for Robot Navigation Algorithms

Authors: Michael A. Folcik, Bijan Karimi

Abstract:

A robot simulator was developed to measure and investigate the performance of a robot navigation system based on the relative position of the robot with respect to random obstacles in any two dimensional environment. The presented simulator focuses on investigating the ability of a fuzzy-neural system for object avoidance. A navigation algorithm is proposed and used to allow random navigation of a robot among obstacles when the robot faces an obstacle in the environment. The main features of this simulator can be used for evaluating the performance of any system that can provide the position of the robot with respect to obstacles in the environment. This allows a robot developer to investigate and analyze the performance of a robot without implementing the physical robot.

Keywords: Applications of Fuzzy Logic and Neural Networksin Robotics, Artificial Intelligence, Embedded Systems, MobileRobots, Robot Navigation, Robotics.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1718
9121 An Example of Open Robot Controller Architecture - For Power Distribution Line Maintenance Robot System -

Authors: Yingxin He, Kyouichi Tatsuno

Abstract:

In this paper, we propose an architecture for easily constructing a robot controller. The architecture is a multi-agent system which has eight agents: the Man-machine interface, Task planner, Task teaching editor, Motion planner, Arm controller, Vehicle controller, Vision system and CG display. The controller has three databases: the Task knowledge database, the Robot database and the Environment database. Based on this controller architecture, we are constructing an experimental power distribution line maintenance robot system and are doing the experiment for the maintenance tasks, for example, “Bolt insertion task".

Keywords: Robot controller, Software library, Maintenance robot, Robot language, Agent system.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1376
9120 The Framework of BeeBot: Binus Multi-Client of Intelligent Telepresence Robot

Authors: Widod Budiharto, Muhsin Shodiq, Bayu Kanigoro, Jurike V. Moniaga Hutomo

Abstract:

We present a BeeBot, Binus Multi-client Intelligent Telepresence Robot, a custom-build robot system specifically designed for teleconference with multiple person using omni directional actuator. The robot is controlled using a computer networks, so the manager/supervisor can direct the robot to the intended person to start a discussion/inspection. People tracking and autonomous navigation are intelligent features of this robot. We build a web application for controlling the multi-client telepresence robot and open-source teleconference system used. Experimental result presented and we evaluated its performance.

Keywords: Telepresence robot, robot vision, intelligent robot.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1529
9119 An Approach for Integration of Industrial Robot with Vision System and Simulation Software

Authors: Ahmed Sh. Khusheef, Ganesh Kothapalli, Majid Tolouei-Rad

Abstract:

Utilization of various sensors has made it possible to extend capabilities of industrial robots. Among these are vision sensors that are used for providing visual information to assist robot controllers. This paper presents a method of integrating a vision system and a simulation program with an industrial robot. The vision system is employed to detect a target object and compute its location in the robot environment. Then, the target object-s information is sent to the robot controller via parallel communication port. The robot controller uses the extracted object information and the simulation program to control the robot arm for approaching, grasping and relocating the object. This paper presents technical details of system components and describes the methodology used for this integration. It also provides a case study to prove the validity of the methodology developed.

Keywords: industrial robot, integration, simulation, vision system

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 2190
9118 Vision Based Robot Experiment: Measurement of Path Related Characteristics

Authors: M. H. Korayem, K. Khoshhal, H. Aliakbarpour

Abstract:

In this paper, a vision based system has been used for controlling an industrial 3P Cartesian robot. The vision system will recognize the target and control the robot by obtaining images from environment and processing them. At the first stage, images from environment are changed to a grayscale mode then it can diverse and identify objects and noises by using a threshold objects which are stored in different frames and then the main object will be recognized. This will control the robot to achieve the target. A vision system can be an appropriate tool for measuring errors of a robot in a situation where the experimental test is conducted for a 3P robot. Finally, the international standard ANSI/RIA R15.05-2 is used for evaluating the path-related characteristics of the robot. To evaluate the performance of the proposed method experimental test is carried out.

Keywords: Robot, Vision, Experiment, Standard.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1229
9117 Design of an Artificial Intelligence Based Automatic Task Planner or a Robotic System

Authors: T. C. Manjunath, C. Ardil

Abstract:

This paper deals with the design and the implementation of an automatic task planner for a robot, irrespective of whether it is a stationary robot or a mobile robot. The aim of the task planner nothing but, they are planning systems which are used to plan a particular task and do the robotic manipulation. This planning system is embedded into the system software in the computer, which is interfaced to the computer. When the instructions are given using the computer, this is transformed into real time application using the robot. All the AI based algorithms are written and saved in the control software, which acts as the intelligent task planning system.

Keywords: AI, Robot, Task Planner, RT, Algorithm, Specs, Controller.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 590
9116 Robot Operating System-Based SLAM for a Gazebo-Simulated Turtlebot2 in 2d Indoor Environment with Cartographer Algorithm

Authors: Wilayat Ali, Li Sheng, Waleed Ahmed

Abstract:

The ability of the robot to make simultaneously map of the environment and localize itself with respect to that environment is the most important element of mobile robots. To solve SLAM many algorithms could be utilized to build up the SLAM process and SLAM is a developing area in Robotics research. Robot Operating System (ROS) is one of the frameworks which provide multiple algorithm nodes to work with and provide a transmission layer to robots. Manyof these algorithms extensively in use are Hector SLAM, Gmapping and Cartographer SLAM. This paper describes a ROS-based Simultaneous localization and mapping (SLAM) library Google Cartographer mapping, which is open-source algorithm. The algorithm was applied to create a map using laser and pose data from 2d Lidar that was placed on a mobile robot. The model robot uses the gazebo package and simulated in Rviz. Our research work's primary goal is to obtain mapping through Cartographer SLAM algorithm in a static indoor environment. From our research, it is shown that for indoor environments cartographer is an applicable algorithm to generate 2d maps with LIDAR placed on mobile robot because it uses both odometry and poses estimation. The algorithm has been evaluated and maps are constructed against the SLAM algorithms presented by Turtlebot2 in the static indoor environment.

Keywords: SLAM, ROS, navigation, localization and mapping, Gazebo, Rviz, Turtlebot2, SLAM algorithms, 2d Indoor environment, Cartographer.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1178
9115 Enhancement Approaches for Supporting Default Hierarchies Formation for Robot Behaviors

Authors: Saeed Mohammed Baneamoon, Rosalina Abdul Salam

Abstract:

Robotic system is an important area in artificial intelligence that aims at developing the performance techniques of the robot and making it more efficient and more effective in choosing its correct behavior. In this paper the distributed learning classifier system is used for designing a simulated control system for robot to perform complex behaviors. A set of enhanced approaches that support default hierarchies formation is suggested and compared with each other in order to make the simulated robot more effective in mapping the input to the correct output behavior.

Keywords: Learning Classifier System, Default Hierarchies, Robot Behaviors.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1393
9114 The Control of a Highly Nonlinear Two-wheels Balancing Robot: A Comparative Assessment between LQR and PID-PID Control Schemes

Authors: A. N. K. Nasir, M. A. Ahmad, R. M. T. Raja Ismail

Abstract:

The research on two-wheels balancing robot has gained momentum due to their functionality and reliability when completing certain tasks. This paper presents investigations into the performance comparison of Linear Quadratic Regulator (LQR) and PID-PID controllers for a highly nonlinear 2–wheels balancing robot. The mathematical model of 2-wheels balancing robot that is highly nonlinear is derived. The final model is then represented in statespace form and the system suffers from mismatched condition. Two system responses namely the robot position and robot angular position are obtained. The performances of the LQR and PID-PID controllers are examined in terms of input tracking and disturbances rejection capability. Simulation results of the responses of the nonlinear 2–wheels balancing robot are presented in time domain. A comparative assessment of both control schemes to the system performance is presented and discussed.

Keywords: PID, LQR, Two-wheels balancing robot.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 5228
9113 An Artificial Immune System for a Multi Agent Robotics System

Authors: Chingtham Tejbanta Singh, Shivashankar B. Nair

Abstract:

This paper explores an application of an adaptive learning mechanism for robots based on the natural immune system. Most of the research carried out so far are based either on the innate or adaptive characteristics of the immune system, we present a combination of these to achieve behavior arbitration wherein a robot learns to detect vulnerable areas of a track and adapts to the required speed over such portions. The test bed comprises of two Lego robots deployed simultaneously on two predefined near concentric tracks with the outer robot capable of helping the inner one when it misaligns. The helper robot works in a damage-control mode by realigning itself to guide the other robot back onto its track. The panic-stricken robot records the conditions under which it was misaligned and learns to detect and adapt under similar conditions thereby making the overall system immune to such failures.

Keywords: Adaptive, AIS, Behavior Arbitration, ClonalSelection, Immune System, Innate, Robot, Self Healing.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1318
9112 Development of Tools for Multi Vehicles Simulation with Robot Operating System and ArduPilot

Authors: Pierre Kancir, Jean-Philippe Diguet, Marc Sevaux

Abstract:

One of the main difficulties in developing multi-robot systems (MRS) is related to the simulation and testing tools available. Indeed, if the differences between simulations and real robots are too significant, the transition from the simulation to the robot won’t be possible without another long development phase and won’t permit to validate the simulation. Moreover, the testing of different algorithmic solutions or modifications of robots requires a strong knowledge of current tools and a significant development time. Therefore, the availability of tools for MRS, mainly with flying drones, is crucial to enable the industrial emergence of these systems. This research aims to present the most commonly used tools for MRS simulations and their main shortcomings and presents complementary tools to improve the productivity of designers in the development of multi-vehicle solutions focused on a fast learning curve and rapid transition from simulations to real usage. The proposed contributions are based on existing open source tools as Gazebo simulator combined with ROS (Robot Operating System) and the open-source multi-platform autopilot ArduPilot to bring them to a broad audience.

Keywords: ROS, ArduPilot, MRS, simulation, drones, Gazebo.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 888
9111 Robotics System Design for Assembly and Disassembly Process

Authors: Nina Danišová, Roman Ružarovský, Karol Velíšek

Abstract:

In this paper is described a new conception of the Cartesian robot for automated assembly and also disassembly process. The advantage of this conception is the utilization the Cartesian assembly robot with its all peripheral automated devices for assembly of the assembled product. The assembly product in the end of the lifecycle can be disassembled with the same Cartesian disassembly robot with the use of the same peripheral automated devices and equipment. It is a new approach to problematic solving and development of the automated assembly systems with respect to lifecycle management of the assembly product and also assembly system with Cartesian robot. It is also important to develop the methodical process for design of automated assembly and disassembly system with Cartesian robot. Assembly and disassembly system use the same Cartesian robot input and output devices, assembly and disassembly units in one workplace with different application. Result of design methodology is the verification and proposition of real automated assembly and disassembly workplace with Cartesian robot for known verified model of assembled actuator.

Keywords: Cartesian robot, design methodology, assembly, disassembly, pneumatic

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 2912
9110 Development of Automatic Guided Mobile Robot Using Magnetic Position Meter

Authors: Geun-Mo Kim, Young-Jae Ryoo

Abstract:

In this paper, an automatic guided mobile robot using a new magnetic position meter is described. In order to measure the lateral position of a mobile robot, a new magnetic position meter is developed. The magnetic position meter can detect the position of a magnetic wire on the center of road. A mobile robot in designed with a sensing system, a steering system and a driving system. The designed mobile robot is tested to verify the performance of automatic guidance.

Keywords: Autonomous vehicle, magnetic position meter, steering, magnet.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1622
9109 Development of Autonomous Cable Inspection Robot for Nuclear Power Plant

Authors: Jae-Kyung LEE, Byung-Hak CHO, Kyung-Nam Jang, Sun-Chul Jung, Ki-Yong OH, Joon-Young PARK, Jong-Seog Kim

Abstract:

The cables in a nuclear power plant are designed to be used for about 40 years in safe operation environment. However, the heat and radiation in the nuclear power plant causes the rapid performance deterioration of cables in nuclear vessels and heat exchangers, which requires cable lifetime estimation. The most accurate method of estimating the cable lifetime is to evaluate the cables in a laboratory. However, removing cables while the plant is operating is not allowed because of its safety and cost. In this paper, a robot system to estimate the cable lifetime in nuclear power plants is developed and tested. The developed robot system can calculate a modulus value to estimate the cable lifetime even when the nuclear power plant is in operation.

Keywords: Autonomous robot, Cable Inspection, Indenter, Nuclear Power Plant

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1976
9108 Design and Simulation of a New Self-Learning Expert System for Mobile Robot

Authors: Rabi W. Yousif, Mohd Asri Hj Mansor

Abstract:

In this paper, we present a novel technique called Self-Learning Expert System (SLES). Unlike Expert System, where there is a need for an expert to impart experiences and knowledge to create the knowledge base, this technique tries to acquire the experience and knowledge automatically. To display this technique at work, a simulation of a mobile robot navigating through an environment with obstacles is employed using visual basic. The mobile robot will move through this area without colliding with any obstacle and save the path that it took. If the mobile robot has to go through a similar environment again, then it will apply this experience to help it move through quicker without having to check for collision.

Keywords: Expert system, knowledge base, mobile robot, visual basic.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1498
9107 The Hybrid Dimming Control System for Solar Charging Robot

Authors: A. Won-Yong Chae, B. Hyung-Nam Kim, C. Kyoung-Jun Lee, D. Hee-Je Kim

Abstract:

The renewable energy has been attracting attention as a new alternative energy due to the problem of environmental pollution and resource depletion. In particular, daylighting and PV system are regarded as the solutions. In this paper, the hybrid dimming control system supplied by solar cell and daylighting system was designed. Daylighting system is main source and PV system is spare source. PV system operates the LED lamp which supports daylighting system because daylighting system is unstable due to the variation of irradiance. In addition, PV system has a role charging batteries. Battery charging has a benefit that PV system operate LED lamp in the bad weather. However, LED lamp always can`t turn on that-s why dimming control system was designed. In particular, the solar charging robot was designed to check the interior irradiance intensity. These systems and the application of the solar charging robot are expected to contribute developing alternative energy in the near future.

Keywords: Daylighting system, PV system, LED lamp, Suntracking robot.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1781
9106 Kinematics and Control System Design of Manipulators for a Humanoid Robot

Authors: S. Parasuraman

Abstract:

In this work, a new approach is proposed to control the manipulators for Humanoid robot. The kinematics of the manipulators in terms of joint positions, velocity, acceleration and torque of each joint is computed using the Denavit Hardenberg (D-H) notations. These variables are used to design the manipulator control system, which has been proposed in this work. In view of supporting the development of a controller, a simulation of the manipulator is designed for Humanoid robot. This simulation is developed through the use of the Virtual Reality Toolbox and Simulink in Matlab. The Virtual Reality Toolbox in Matlab provides the interfacing and controls to an environment which is developed based on the Virtual Reality Modeling Language (VRML). Chains of bones were used to represent the robot.

Keywords: Mobile robot, Robot Kinematics, Robot Navigation, MATLAB.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1555
9105 Tracked Robot with Blade Arms to Enhance Crawling Capability

Authors: Jhu-Wei Ji, Fa-Shian Chang, Lih-Tyng Hwang, Chih-Feng Liu, Jeng-Nan Lee, Shun-Min Wang, Kai-Yi Cho

Abstract:

This paper presents a tracked robot with blade arms powered to assist movement in difficult environments. As a result, the tracked robot is able to pass a ramp or climb stairs. The main feature is a pair of blade arms on both sides of the vehicle body working in collaboration with previously validated transformable track system. When the robot encounters an obstacle in a terrain, it enlists the blade arms with power to overcome the obstacle. In disaster areas, there usually will be terrains that are full of broken and complicated slopes, broken walls, rubbles, and ditches. Thereupon, a robot, which is instructed to pass through such disaster areas, needs to have a good off-road capability for such complicated terrains. The robot with crawling-assisting blade arms would overcome the obstacles along the terrains, and possibly become to be a rescue robot. A prototype has been developed and built; experiments were carried out to validate the enhanced crawling capability of the robot.

Keywords: Tracked robot, rescue robot, blade arm, crawling ability, control system.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1381
9104 An AR/VR Based Approach Towards the Intuitive Control of Mobile Rescue Robots

Authors: Jürgen Roßmann, André Kupetz, Roland Wischnewski

Abstract:

An intuitive user interface for the teleoperation of mobile rescue robots is one key feature for a successful exploration of inaccessible and no-go areas. Therefore, we have developed a novel framework to embed a flexible and modular user interface into a complete 3-D virtual reality simulation system. Our approach is based on a client-server architecture to allow for a collaborative control of the rescue robot together with multiple clients on demand. Further, it is important that the user interface is not restricted to any specific type of mobile robot. Therefore, our flexible approach allows for the operation of different robot types with a consistent concept and user interface. In laboratory tests, we have evaluated the validity and effectiveness of our approach with the help of two different robot platforms and several input devices. As a result, an untrained person can intuitively teleoperate both robots without needing a familiarization time when changing the operating robot.

Keywords: Teleoperation of mobile robots, augmented reality, user interface, virtual reality.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1822
9103 Fabrication of Autonomous Wheeled Mobile Robot for Industrial Applications Using Appropriate Technology

Authors: M. M. Islam, Rajib K. Saha, Abdullah A. Amin, M. Z. Haq

Abstract:

The autonomous mobile robot was designed and implemented which was capable of navigating in the industrial environments and did a job of picking objects from variable height and delivering it to another location following a predefined trajectory. In developing country like Bangladesh industrial robotics is not very prevalent yet, due to the high installation cost. The objective of this project was to develop an autonomous mobile robot for industrial application using the available resources in the local market at lower manufacturing cost. The mechanical system of the robot was comprised of locomotion, gripping and elevation system. Grippers were designed to grip objects of a predefined shape. Cartesian elevation system was designed for vertical movement of the gripper. PIC18F452 microcontroller was the brain of the control system. The prototype autonomous robot was fabricated for relatively lower load than the industry and the performance was tested in a virtual industrial environment created within the laboratory to realize the effectiveness.

Keywords: Industrial application, autonomous mobile robot, appropriate technology.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 2484
9102 A Hybrid Distributed Vision System for Robot Localization

Authors: Hsiang-Wen Hsieh, Chin-Chia Wu, Hung-Hsiu Yu, Shu-Fan Liu

Abstract:

Localization is one of the critical issues in the field of robot navigation. With an accurate estimate of the robot pose, robots will be capable of navigating in the environment autonomously and efficiently. In this paper, a hybrid Distributed Vision System (DVS) for robot localization is presented. The presented approach integrates odometry data from robot and images captured from overhead cameras installed in the environment to help reduce possibilities of fail localization due to effects of illumination, encoder accumulated errors, and low quality range data. An odometry-based motion model is applied to predict robot poses, and robot images captured by overhead cameras are then used to update pose estimates with HSV histogram-based measurement model. Experiment results show the presented approach could localize robots in a global world coordinate system with localization errors within 100mm.

Keywords: Distributed Vision System, Localization, Measurement model, Motion model

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1313
9101 Intelligent Control and Modelling of a Micro Robot for In-pipe Application

Authors: Y. Sabzehmeidani, M. Mailah, M. Hussein, A. R. Tavakolpour

Abstract:

In this paper, a worm-like micro robot designed for inpipe application with intelligent active force control (AFC) capability is modelled and simulated. The motion of the micro robot is based on an impact drive mechanism (IDM) that is actuated using piezoelectric device. The trajectory tracking performance of the modelled micro robot is initially experimented via a conventional proportionalintegral- derivative (PID) controller in which the dynamic response of the robot system subjected to different input excitations is investigated. Subsequently, a robust intelligent method known as active force control with fuzzy logic (AFCFL) is later incorporated into the PID scheme to enhance the system performance by compensating the unwanted disturbances due to the interaction of the robot with its environment. Results show that the proposed AFCFL scheme is far superior than the PID control counterpart in terms of the system-s tracking capability in the wake of the disturbances.

Keywords: Active Force Control, Micro Robot, Fuzzy Logic, In-pipe Application.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1695
9100 Visual Tag-based Location-Aware System for Household Robots

Authors: Yen-Chun Lin, Yen-Ting Chen, Szu-Yin Lin, Jen-Hua Wu

Abstract:

This paper proposes a location-aware system for household robots which allows users to paste predefined paper tags at different locations according to users- comprehension of the house. In this system a household robot may be aware of its location and the attributes thereof by visually recognizing the tags when the robot is moving. This paper also presents a novel user interface to define a moving path of the robot, which allows users to draw the path in the air with a finger so as to generate commands for following motions.

Keywords: finger tip tracking, household robot, location awareness, tag recognition

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1276
9099 The Development of Flying Type Moving Robot Using Image Processing

Authors: Suriyon Tansuriyavong, Yuuta Suzuki, Boonmee Choompol

Abstract:

Wheel-running type moving robot has the restriction on the moving range caused by obstacles or stairs. Solving this weakness, we studied the development of moving robot using airship. Our airship robot moves by recognizing arrow marks on the path. To have the airship robot recognize arrow marks, we used edge-based template matching. To control propeller units, we used PID and PD controller. The results of experiments demonstrated that the airship robot can move along the marks and can go up and down the stairs. It is shown the possibility that airship robot can become a robot which can move at wide range facilities.

Keywords: Template matching, moving robot, airship robot, PID control.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1502
9098 Application of Wireless Visual Sensor for Semi- Autonomous Mine Navigation System

Authors: Vinay Kumar Pilania, Debashish Chakravarty

Abstract:

The present paper represent the efforts undertaken for the development of an semi-automatic robot that may be used for various post-disaster rescue operation planning and their subsequent execution using one-way communication of video and data from the robot to the controller and controller to the robot respectively. Wireless communication has been used for the purpose so that the robot may access the unapproachable places easily without any difficulties. It is expected that the information obtained from the robot would be of definite help to the rescue team for better planning and execution of their operations.

Keywords: Mine environment, mine navigation, mine rescue robot, video data transmission.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1700
9097 Design and Implementation of a Control System for a Walking Robot with Color Sensing and Line Following Using PIC and ATMEL Microcontrollers

Authors: Ibraheem K. Ibraheem

Abstract:

The aim of this research is to design and implement line-tracking mobile robot. The robot must follow a line drawn on the floor with different color, avoids hitting moving object like another moving robot or walking people and achieves color sensing. The control system reacts by controlling each of the motors to keep the tracking sensor over the middle of the line. Proximity sensors used to avoid hitting moving objects that may pass in front of the robot. The programs have been written using micro c instructions, then converted into PIC16F887 ATmega48/88/168 microcontrollers counterparts. Practical simulations show that the walking robot accurately achieves line following action and exactly recognizes the colors and avoids any obstacle in front of it.

Keywords: Color sensing, H-bridge, line following, mobile robot, PIC microcontroller, obstacle avoidance, phototransistor.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 3220
9096 Sliding Mode Control of an Internet Teleoperated PUMA 600 Robot

Authors: Abdallah Ghoul, Bachir Ouamri, Ismail Khalil Bousserhane

Abstract:

In this paper, we have developed a sliding mode controller for PUMA 600 manipulator robot, to control the remote robot a teleoperation system was developed. This system includes two sites, local and remote. The sliding mode controller is installed at the remote site. The client asks for a position through an interface and receives the real positions after running of the task by the remote robot. Both sites are interconnected via the Internet. In order to verify the effectiveness of the sliding mode controller, that is compared with a classic PID controller. The developed approach is tested on a virtual robot. The results confirmed the high performance of this approach.

Keywords: Internet, manipulator robot, PID controller, remote control, sliding mode, teleoperation.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 923
9095 Intelligent Path Tracking Hybrid Fuzzy Controller for a Unicycle-Type Differential Drive Robot

Authors: Abdullah M. Almeshal, Mohammad R. Alenezi, Muhammad Moaz

Abstract:

In this paper, we discuss the performance of applying hybrid spiral dynamic bacterial chemotaxis (HSDBC) optimisation algorithm on an intelligent controller for a differential drive robot. A unicycle class of differential drive robot is utilised to serve as a basis application to evaluate the performance of the HSDBC algorithm. A hybrid fuzzy logic controller is developed and implemented for the unicycle robot to follow a predefined trajectory. Trajectories of various frictional profiles and levels were simulated to evaluate the performance of the robot at different operating conditions. Controller gains and scaling factors were optimised using HSDBC and the performance is evaluated in comparison to previously adopted optimisation algorithms. The HSDBC has proven its feasibility in achieving a faster convergence toward the optimal gains and resulted in a superior performance.

Keywords: Differential drive robot, hybrid fuzzy controller, optimization, path tracking, unicycle robot.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 2602
9094 Low-Cost Mechatronic Design of an Omnidirectional Mobile Robot

Authors: S. Cobos-Guzman

Abstract:

This paper presents the results of a mechatronic design based on a 4-wheel omnidirectional mobile robot that can be used in indoor logistic applications. The low-level control has been selected using two open-source hardware (Raspberry Pi 3 Model B+ and Arduino Mega 2560) that control four industrial motors, four ultrasound sensors, four optical encoders, a vision system of two cameras, and a Hokuyo URG-04LX-UG01 laser scanner. Moreover, the system is powered with a lithium battery that can supply 24 V DC and a maximum current-hour of 20Ah.The Robot Operating System (ROS) has been implemented in the Raspberry Pi and the performance is evaluated with the selection of the sensors and hardware selected. The mechatronic system is evaluated and proposed safe modes of power distribution for controlling all the electronic devices based on different tests. Therefore, based on different performance results, some recommendations are indicated for using the Raspberry Pi and Arduino in terms of power, communication, and distribution of control for different devices. According to these recommendations, the selection of sensors is distributed in both real-time controllers (Arduino and Raspberry Pi). On the other hand, the drivers of the cameras have been implemented in Linux and a python program has been implemented to access the cameras. These cameras will be used for implementing a deep learning algorithm to recognize people and objects. In this way, the level of intelligence can be increased in combination with the maps that can be obtained from the laser scanner.

Keywords: Autonomous, indoor robot, mechatronic, omnidirectional robot.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 529