The main problem of line follower robot is how to make the mobile robot follows a desired path (which is a line drawn on the floor) smoothly and accurately in shortest time. In this paper, the design and implementation of a complex line follower mission is presented by using Matlab Simulink toolbox. The motion of mobile robot on the complex path is simulated by using the Robot Simulator which is programed in Matlab to design and test the performance of the proposed line follower algorithm and the designed PID controller. Due to the complexity of selection the parameters of PID controller, the Particle Swarm Optimization (PSO) algorithm are used to select and tune the parameters of designed PID controller. Five Infrared Ray (IR) sensors are used to collect the information about the location of mobile robot with respect to the desired path (black line). Depending on the collected information, the steering angle of the mobile robot will be controlled to maintain the robot on the desired path by controlling the speed of actuators (two DC motors). The obtained simulation results show that, the motion of mobile robot is still stable even the complex maneuver is performed. The hardware design of the robot system is perform by using the Arduino Mobile Robot (AMR). The Simulink Support Package for Arduino and control system toolbox are used to program the AMR. The practical results show that the performances of real mobile robot are exactly the same of the performances of simulated mobile robot.
Obstacle avoidance in mobile robot path planning represents an exciting field of robotics systems. There are numerous algorithms available, each with its own set of features. In this paper a Witch of Agnesi curve algorithm is proposed to prevent a collision by the mobile robot’s orientation beyond the obstacles which represents an important problem in path planning, further, to achieve a minimum arrival time by following the shortest path which leads to minimizing power loss. The proposed approach considers the mobile robot’s platform equipped with the LIDAR 360o sensor to detect obstacle positions in any environment of the mobile robot. Obstacles detected in the sensing range of the mobile robot are dealt with by using the Witch of Agnesi curve algorithm, this establishes the obstacle’s apparent vertices’ virtual minimum bounding circle with minimum error. Several Scenarios are implemented and considered based on the identification of obstacles in the mobile robot environment. The proposed system has been simulated by the V-REP platform by designing several scenarios that emulate the behavior of the robot during the path planning model. The simulation and experimental results show the optimal performance of the mobile robot during navigation is obtained as compared to the other methods with minimum power loss and also with minimum error. It’s given 96.3 percent in terms of the average of the total path while the Bezier algorithm gave 94.67 percent. While in experimental results the proposed algorithm gave 93.45 and the Bezier algorithm gave 92.19 percent.
In maze maneuvering, it is needed for a mobile robot to feasibly plan the shortest path from its initial posture to the desired destination in a given environment. To achieve that, the mobile robot is combined with multiple distance sensors to assist the navigation while avoiding obstructing obstacles and following the shortest path toward the target. Additionally, a vision sensor is used to detect and track colored objects. A new algorithm is proposed based on different type of utilized sensors to aid the maneuvering of differential drive mobile robot in an unknown environment. In the proposed algorithm, the robot has the ability to traverse surrounding hindrances and seek for a particular object based on its color. Six infrared sensors are used to detect any located obstacles and one color detection sensor is used to locate the colored object. The Mobile Robotics Simulation Toolbox in Matlab is used to test the proposed algorithm. Three different scenarios are studied to prove the efficiency of the proposed algorithm. The simulation results demonstrate that the mobile robot has successfully accomplished the tracking and locating of a colored object without collision with hurdles.
This paper deals with the navigation of a mobile robot in unknown environment using artificial potential field method. The aim of this paper is to develop a complete method that allows the mobile robot to reach its goal while avoiding unknown obstacles on its path. An approach proposed is introduced in this paper based on combing the artificial potential field method with fuzzy logic controller to solve drawbacks of artificial potential field method such as local minima problems, make an effective motion planner and improve the quality of the trajectory of mobile robot.
As a key type of mobile robot, the two-wheel mobile robot has been developed rapidly for varied domestic, health, and industrial applications due to human-like movement and balancing characteristics based on the inverted pendulum theory. This paper presents a developed Two-Wheel Self-Balanced Robot (TWSBR) model under road disturbance effects and simulated using MATLAB Simscape Multibody. The considered physical-mechanical structure of the proposed TWSBS is connected with a Simulink controller scheme by employing physical signal converters to describe the system dynamics efficiently. Through the Simscape environment, the TWSBR motion is visualized and effectively analyzed without the need for complicated analysis of the associated mathematical model. Besides, 3D visualization of real-time behavior for the implemented TWSBR plant model is displayed by Simulink Mechanics Explorer. Robot balancing and stability are achieved by utilizing Proportional Integral Derivative (PID) and Linear Quadratic Regulator (LQR) controllers' approaches considering specific control targets. A comparative study and evaluation of both controllers are conducted to verify the robustness and road disturbance rejection. The realized performance and robustness of developed controllers are observed by varying object-carrying loaded up on mechanical structure layers during robot motion. In particular, the objective weight is loaded on the robot layers (top, middle, and bottom) during disturbance situations. The achieved findings may have the potential to extend the deployment of using TWSBRs in the varied important application.
This paper presents the designing of path planning system in an environment contains a set of static polygon obstacles localized and distributed randomly by using differential drive mobile robot. In this paper the designed algorithm (two dimensional path planning algorithm) is proposed in order of investigate the path planning of mobile robot with free collision using the visibility binary tree algorithm. The suggested algorithm is compared with the virtual circles tangents algorithm in the time of arrival and the longest of the path to the target. The aim of this paper is to get an algorithm has better performance than the other algorithms and get less time of arrival and shortest path with free collision.
This paper presents the design of a path planning system in an environment that contains a set of static and dynamic polygon obstacles localized randomly. In this paper, an algorithm so-called (Polygon shape tangents algorithm) is proposed to move a mobile robot from a source point to a destination point with no collision with surrounding obstacles using the visibility binary tree algorithm. The methodology of this algorithm is based on predicting the steps of a robot trajectory from the source to the destination point. The polygon shapes tangent algorithm is compared with the virtual circles' tangents algorithm for different numbers of static and dynamic polygon obstacles for the time of arrival and the length of the path to the target. The obtained result shows that the used algorithm has better performance than the other algorithms and gets less time of arrival and shortest path with free collision.
In coordination of a group of mobile robots in a real environment, the formation is an important task. Multi- mobile robot formations in global knowledge environments are achieved using small robots with small hardware capabilities. To perform formation, localization, orientation, path planning and obstacle and collision avoidance should be accomplished. Finally, several static and dynamic strategies for polygon shape formation are implemented. For these formations minimizing the energy spent by the robots or the time for achieving the task, have been investigated. These strategies have better efficiency in completing the formation, since they use the cluster matching algorithm instead of the triangulation algorithm.
Although the Basic RRT algorithm is considered a traditional search method, it has been widely used in the field of robot path planning (manipulator and mobile robot), especially in the past decade. This algorithm has many features that give it superiority over other methods. On the other hand, the Basic RRT suffers from a bad convergence rate (it takes a long time until finding the goal point), especially in environments with cluttered obstacles, or whose targets are located in narrow passages. Many studies have discussed this problem in recent years. This paper introduces an improved method called (Hybrid RRT-A*) to overcome the shortcomings of the original RRT, specifically slow convergence and cost rate. The heuristic function of A-star algorithm is combined with RRT to decrease tree expansion and guide it towards the goal with less nodes and time. Various experiments have been conducted with different environment scenarios to compare the proposed method with the Basic RRT and A-star under the same conditions, which have shown remarkable performance. The time consumed to find the path of the worst one of these scenarios is about 4.9 seconds, whereas it is 18.3 and 34 for A-star and RRT, respectively.
The aim of this paper is to suggest a methodical smooth control method for improving the stability of two wheeled self-balancing robot under effect disturbance. To promote the stability of the robot, the design of linear quadratic regulator using particle swarm optimization (PSO) method and adaptive particle swarm optimization (APSO). The computation of optimal multivariable feedback control is traditionally by LQR approach by Riccati equation. Regrettably, the method as yet has a trial and error approach when selecting parameters, particularly tuning the Q and R elements of the weight matrices. Therefore, an intelligent numerical method to solve this problem is suggested by depending PSO and APSO algorithm. To appraise the effectiveness of the suggested method, The Simulation result displays that the numerical method makes the system stable and minimizes processing time.
The autonomous navigation of robots is an important area of research. It can intelligently navigate itself from source to target within an environment without human interaction. Recently, algorithms and techniques have been made and developed to improve the performance of robots. It’s more effective and has high precision tasks than before. This work proposed to solve a maze using a Flood fill algorithm based on real time camera monitoring the movement on its environment. Live video streaming sends an obtained data to be processed by the server. The server sends back the information to the robot via wireless radio. The robot works as a client device moves from point to point depends on server information. Using camera in this work allows voiding great time that needs it to indicate the route by the robot.
This paper provides a two algorithms for designing robust formation control of multiple robots called Leader- Neighbor algorithm and Neighbor-Leader algorithm in unknown environment. The main function of the robot group is to use the RP lidar sensor attached to each robot to form a static geometric polygon. The algorithms consist of two phases implemented to investigate the formation of polygon shape. In the leading- neighbor algorithm, the first stage is the leader alignment and the adjacent alignment is the second stage. The first step uses the information gathered by the main RP Lidar sensor to determine and compute the direction of each adjacent robot. The adjacent RP Lidar sensors are used to align the adjacent robots of the leader by transferring these adjacent robots to the leader. By performing this stage, the neighboring robots will be far from the leader. The second stage uses the information gathered by adjacent RP sensors to reposition the robots so that the distance between them is equal. On the other hand, in the neighbor-leader algorithm, the adjacent robots are rearranged in a regular distribution by moving in a circular path around the leader, with equal angles between each of the two neighbor robots. A new distribution will be generated in this paper by using one leader and four adjacent robots to approve the suggested leader neighbor algorithm and neighbor-leader algorithm .
A robot is a smart machine that can help people in their daily lives and keep everyone safe. the three general sequences to accomplish any robot task is mapping the environment, the localization, and the navigation (path planning with obstacle avoidance). Since the goal of the robot is to reach its target without colliding, the most important and challenging task of the mobile robot is the navigation. In this paper, the robot navigation problem is solved by proposed two algorithms using low-cost IR receiver sensors arranged as an array, and a robot has been equipped with one IR transmitter. Firstly, the shortest orientation algorithm is proposed, the robot direction is corrected at each step of movement depending on the angle calculation. secondly, an Active orientation algorithm is presented to solve the weakness in the preceding algorithm. A chain of the active sensors in the environment within the sensing range of the virtual path is activated to be scan through the robot movement. In each algorithm, the initial position of the robot is detected using the modified binary search algorithm, various stages are used to avoid obstacles through suitable equations focusing on finding the shortest and the safer path of the robot. Simulation results with multi-resolution environment explained the efficiency of the algorithms, they are compatible with the designed environment, it provides safe movements (without hitting obstacles) and a good system control performance. A Comparison table is also provided.
In modern robotic field, many challenges have been appeared, especially in case of a multi-robot system that used to achieve tasks. The challenges are due to the complexity of the multi-robot system, which make the modeling of such system more difficult. The groups of animals in real world are an inspiration for modeling of a multi- individual system such as aggregation of Artemia. Therefore, in this paper, the multi-robot control system based on external stimuli such as light has been proposed, in which the feature of tracking Artemia to the light has been employed for this purpose. The mathematical model of the proposed design is derived and then Simulated by V-rep software. Several experiments are implemented in order to evaluate the proposed design, which is divided into two scenarios. The first scenario includes simulation of the system in situation of attraction of robot to fixed light spot, while the second scenario is the simulation of the system in the situation of the robots tracking of the movable light spot and formed different patterns like a straight-line, circular, and zigzag patterns. The results of experiments appeared that the mobile robot attraction to high-intensity light, in addition, the multi-robot system can be controlled by external stimuli. Finally, the performance of the proposed system has been analyzed.
In this paper, a new algorithm called the virtual circle tangents is introduced for mobile robot navigation in an environment with polygonal shape obstacles. The algorithm relies on representing the polygonal shape obstacles by virtual circles, and then all the possible trajectories from source to target is constructed by computing the visible tangents between the robot and the virtual circle obstacles. A new method for searching the shortest path from source to target is suggested. Two states of the simulation are suggested, the first one is the off-line state and the other is the on-line state. The introduced method is compared with two other algorithms to study its performance.
The demand for application of mobile robots in performing boring and extensive tasks are increasing rapidly due to unavailability of human workforce. Navigation by humans within the warehouse is one among such repetitive and exhaustive task. Autonomous navigation of mobile robots for picking and dropping the shelves within the warehouse will save time and money for the warehousing business. Proposing an optimization model for automated storage and retrieval systems by the goals of its planning is investigated to minimize travel time in multi-robot systems. This paper deals with designing a system for storing and retrieving a group of materials within an environment arranged in rows and columns. Its intersections represent storage locations. The title of any subject is indicated by the row number and the column in it. A method was proposed to store and retrieve a set of requests (materials) using a number of robots as well as one receiving and delivery port. Several simulation results are tested to show this improvement in length of path and time of arrival.