SlideShare a Scribd company logo
International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056
Volume: 04 Issue: 09 | Sep -2017 www.irjet.net p-ISSN: 2395-0072
© 2017, IRJET | Impact Factor value: 5.181 | ISO 9001:2008 Certified Journal | Page 1163
A Global Integrated Artificial Potential Field/Virtual Obstacles Path
Planning Algorithm for Multi-Robot System Applications
Abdelrahman M. Hassan1, Catherine M. Elias1, Omar M. Shehata1 and Elsayed I. Morgan1
1 Multi-Robot Systems (MRS) Research Group, German University in Cairo, 5th Settlement New Cairo, 11432,
Cairo, Egypt
---------------------------------------------------------------------***---------------------------------------------------------------------
Abstract - In this paper, a global off-line path planning
approach is implemented using an energy-based approach
Artificial Potential Field (APF) for Multi-Robot Systems
(MRSs). A 3-D potential map is created by using simplified
potential functions. Both attraction forces between therobots
and the goal, and repulsion forces to repel the robots from the
obstacles and each other, are calculated to generate the 3-D
map. The local minima problem is handled in this paper using
the Virtual Obstacles (VOs) approach. The robot path is
generated starting from the robot initial position to the goal
based on the generated 3D potential map tobefollowed by the
mobile robots. All simulations are done using MATLab and
Virtual Robot Experimental Platform(V-REP). OntheMATLab
side, the APF controller is implemented to build the map and
generate robots paths. The robots are controlled to track the
paths and visualized in the V-REP environment.
Key Words: Multi-Robot Systems, Path Planning,
Artificial Potential Field, V-REP, Local Minima, Virtual
Obstacles
1. INTRODUCTION
Nowadays, Multi-Robot Systems (MRSs) are one of the most
growing areas in Robotics. As result of the technology in our
life and the demand on robots in many tasks and
applications, the challenges of MRS are increasing in a rapid
way every day. Single-Robot Systems (SRSs) tasks are being
more complex and expensive by time that is why MRSs are a
necessity. MRSs added more applications and challenges to
the Robotics field such as pollution monitoring, surveillance
of buildings [1], warehouse management, forest fire
detection and more applications. They evenreplacedSRSsin
many applications as the robustness and reliability can be
increased with more thanonesingle robot[2].Area coverage
and exploration [3] is one of the main applications in
robotics field in general. It was first developed with SRSs.
Simultaneous Localization and Mapping (SLAM) is an
application for robots that they generate a map for the
surrounding environment by locating the obstacles and
represent them in a way that allow the robots to navigate
any uncovered areas [4]. There is advantage in Multi-Robot
team that will improve the positioning accuracy, as every
robot will be scanning or mapping specific area. By
integrating all the maps, there will be a main map for the
whole place [5]. Search and Rescue is another challenge of
MRSs. First, the robot search for an object with specific
characteristics. Then when any robot finds this object, it
sends signals for all other robots.All robotsstandaround the
object and they carry it to a specific goal. This can only be
done through a team of robots, since one robot cannot
handle the object if it is big and heavy [6]. Task Allocation
application is used commonly in robots rescue missions,
where the group of robots has a set of tasks or goals that
must be done. Some tasks need more than one robot and
some tasks can be handled by only one. In order to organize
these tasks for the robots team, the Task allocation problem
is handled [7], [8].
2. PATH PLANNING
Path Planning is the controller of the robot motion,soitisthe
most essential part of the robot program. It is the
determination of a free path starting from the robot position
to the targeted goal. The robot environment consists of three
modules, the robot itself, the goal and the obstacles in
between. Path Planning can be divided in two main
categories, global path planning and local path planning. In
global path planning, the environment of the robot is already
known with all obstacles and their locations. The terrain is
static that is why a map can be generated with the path for
the robot. On the other hand, in local path planning, the
environment is unknown for the robot and can be dynamic.
In that case, the robot must gather information about the
environment in real time, and then update its control laws to
achieve its goal [9].
Artificial Potential Field (APF) is one of the classical
approaches that are used to implement the path-planning
controller. In 1986, Khatib [21] introduced the first APF
approach for real-time obstacle avoidance problem for
manipulators and multi-robot systems. Rimon and
Koditschek adopted in 1992 [10] the APF in as an approach
forexact robot motion planning and control usingnavigation
functions instead of the potential functions to solve the local
minima problem. Then in 2000,GeandCui[11]describedthe
problem of non-reachable goals with obstacle nearby when
using APF using a new repulsive function to solve it. As an
extension for their work, the potential field approach was
proposed as obstacle avoidance methods for robots in
dynamic environments in [12] in 2002. In addition, in 2005,
the authors used queues and formation vertices, besides the
International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056
Volume: 04 Issue: 09 | Sep -2017 www.irjet.net p-ISSN: 2395-0072
© 2017, IRJET | Impact Factor value: 5.181 | ISO 9001:2008 Certified Journal | Page 1164
APF for controlling the formation of group of robots to
improve the flexibility of therobot formationandinthesame
time, the group can avoid the obstacles [13]. Another paper
conducted by Hsieh, Kumar and Chaimowicz in 2008
proposed a decentralized controller for shape generation
with swarm of mobile robots [14]. A paper conducted by
Nagy in 2009 to implement a controller for multi-agent
system using Genetic Algorithm (GA)tobuildapotentialfield
for unknown environments [15]. Saez-Pons, Alboul et. al. in
2010 [16] used the APF forcontrollingthegroupformationof
multi-robot system called (GUARDIANS). Then in 2012 [17],
Valbuena and Tanner suggested new control for differential
mobile robot navigation using APF based on navigation
functions, then a transformationforthemathematicalresults
was introduced to obtain real-time velocities to be tested on
real robot. Also, Hsieh, Kumar and Chaimowicz in 2008 [18]
proposed an APF algorithm for mobile manipulator control
using simplified potential functions. In [19] Rajvanshi,
Islamused et. al. used the APF for controllingmobilerobotsin
both staticanddynamicenvironmentsin2015usingArtificial
Goals approach to solve the local minima problem.Andinthe
same year, Ahmed, Abdalla and Abed [20] proposed Particle
Swarm Optimization (PSO) method to modify the potential
field method used, in order to solve the problem of local
minima and optimize the path resulted by it.
In this Paper, an offline (global) path-planning algorithm
based on a modifiedAPFapproachisproposedforthecontrol
of multi robot system in any cluttered static environment.
The local minima problem is handled using the virtual
obstacle approach. The modification of the APF is for
generating the shortest path for the robots. Simulations are
used to verify the proposed approach using MATLab and V-
REP simulators.
The rest of the paper is organized as follows: Section 3
introduces the APF graphically, mathematically, and
introduces the local minima problem. Section 4 has the
mathematical modeland introduces the V-REPenvironment.
Section 5 has the simulations results. Section 6 is the
conclusion, and finally, Section 7 suggests future
recommendations for further researches.
3. ARTIFITIAL POTENTIAL FIELD
The Artificial PotentialField (APF) is one of the classicalpath
planning approaches that is used in robotics. Itcanbeusedin
global and local path planning. It can be also used in dynamic
or static environments. The concept about APF is to find a
mathematical function to represent the energy of the system
based on the idea of physical rules in potential fields.
Potential functions assume the existence of repulsive and
attractive forces acting on the robot in its world. Using both
repulsive and attractive forces, a path for the robot can be
created to its destination. The attractive force is generated
between the robot andthegoal.Itisresponsibleforattracting
the robot to the goal. The repulsiveforceisbetweentherobot
and the obstacles. Its main functionisforavoidingthem.Both
forces are generated by mathematical functions that are
represented graphically by high and low areas in the robot
space.
The general APF equation as [11], [15], [19] and [21]
introduced is as follows
)()()( qUqUqU repatt  (1)
where )(qUatt is the attractive isfunction,and )(qUrep isthe
repulsion function. By summing both functionstogether,the
total potential function is generated to be used inthecontrol
of the robots.
Fig -1: Total Potential Function
3.1 Attraction Potential Function
The Attractive Potential Function is divided in two terms,
conical potential and Quadratic potential. The conical
potential is used when the robot is far away from the goal.
On the other hand, the quadratic potential is used when the
robot is near the goal. The reference thatwill define whether
the robot is far or near is the term
*
goald .
*
*
2**
2
),(
),(
)(
2
1
),(
),(
2
1
)(
goalgoal
goalgoal
goalgoalgoal
goal
att
dqqdif
dqqdif
dqqdd
qqd
qU











(2)
where q is the position variable, ),( goalqqd is the distance
function, and  is the scaling factor.
This function is representing the potential that affect the
robot while the force that will drive the robot to reach the
goal will be generated from the negative gradient of this
function.
)()( qUqF attatt  (3)
As
*
*
*
),(
),(
)(
)(
)(
)(
goalgoal
goalgoal
goal
goalgoal
goal
att
dqqdif
dqqdif
qqd
qqd
qq
qU










 

(4)
Moreover, in other works, Hargas et. al. [18] used another
simplified version of the potential function. This equation
International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056
Volume: 04 Issue: 09 | Sep -2017 www.irjet.net p-ISSN: 2395-0072
© 2017, IRJET | Impact Factor value: 5.181 | ISO 9001:2008 Certified Journal | Page 1165
has the position of the robot and the goal; X and
Y coordinates, as the equation parameters.
])()[(
2
1
),( 22
FinFinaatt yyxxKyxU  (5)
where x and y are the coordinatesofthecurrentposition
of the robot, Finx and Finy are the goal coordinates, and aK
is the scaling factor.
And the attractive force will be defined as

















)(),(
)(),(
),(
),(
Fina
att
ya
Fina
att
xa
att
yyK
y
U
yxf
xxK
x
U
yxf
yx
yxU
(6)
where ),( yxfxa , ),( yxfya are the attractiveforcesinthex
and y directions respectively.
3.2 Repulsive Potential Function
There is always one goal at a time for the robot but the
obstacles are more than one. That is why the repulsive
potential function consists of all the repulsive fields of every
obstacle exists in the environment. Every obstacle has a
specific limited region that hasa repulsivefield,sothatwhen
the robot comes in that region, it will be repelled from that
obstacle. The term that would define the region for every
obstacle is *
Q . And the repulsive field for only one obstacle
is
*
*2
*
)(
)(
0
)
1
)(
1
(
2
1
)(
QqDif
QqDif
QqDqU
i
i
irepi










(7)
where )(qD is the distance to the obstacle,  is thescaling
factor, and i represent the order number of the current
obstacle.
The repulsive force would be represented as
)()( qUqF ii reprep  (8)
And
*
*
2*
)(
)(
0
)(
)(
1
)
)(
11
(
QqDif
QqDifqD
qDqDQU
i
i
iirepi










(9)
The total repulsive function for n number of obstacles is


n
i
reprep qUqU i
1
)()( (10)
While the simplified function as [18] introduced in their
works is
22
)()(2
1
),(
obiobi
o
rep
yyxx
K
yxU i

 (11)
where x and y are the coordinates of the current
position of the robot, obix and obiy are thi theorderobstacle
coordinates, and oK is the scaling factor.
And the repulsive force is















y
U
yxf
x
U
yxf
yx
yxU
rep
ya
rep
xo
rep
),(
),(
),(
),(
(12)
3.3 Local Minima Problem
As most of the previous works like [10-13], [17] and [19,
20] mentioned, local minima problem is a serious problem
that faces the traditional APF that is implemented by
Equation 2 and 7. This problem is caused when there is a
cavity in the obstacle or when the goal, the robot and the
obstacle are in the same line. This will cause the robot to be
trapped in a local minimum point in the potential field.
Virtual Obstacle technique will be used when the robot is
trapped in the obstacle cavities. The cavities would be filled
with virtual obstacle that would repel the robot out of it.
Virtual obstacles can be used also to solve the local minima
problem in this way as [19] proposed.
4. MODELING
In this model, the APF controller is applied on a multi-robot
system with full considerationoftherobotskinematics.Local
minima problem is handled by Virtual obstacles. The
Simulation is done using V-Rep Simulator and controlled by
MATLab. The robots usedare KheperaIII DifferentialRobots.
The potential function used here are a more simplified
version of Equation 5 and 11.Theapproachisoffline,sothere
is no need forreal-timecalculations,andtheequationscanbe
simplified. The attractive potential function used is:
22
)()( goalgoalaatt XIYJKU  (13)
where aK is the scaling factor, goalX and goalY are the
coordinates of the goal point, I and J are the coordinates of
the current Pixel of the map.
And the repulsive potential function used is:
22
)()( XIYJ
K
U o
repi

 (14)
where oK is the scaling factor, X and Y are the coordinates
of every point that represent an obstacle.
The aim of these two equations is to build a new map but this
map will have the potential form where every pixel of the
map will have specific weight representing the potential of
this pixel as in Figure 2.
International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056
Volume: 04 Issue: 09 | Sep -2017 www.irjet.net p-ISSN: 2395-0072
© 2017, IRJET | Impact Factor value: 5.181 | ISO 9001:2008 Certified Journal | Page 1166
Fig -2: The 3D Potential Map
4.1 Differential Drive Kinematics
The KheperaIII robot is a differential mobile robot. The
differential robot is the robot that depends on only two
wheels to move. Both wheels are mounted on the same axis
but are driven by differentactuators.Byvaryingthespeedsof
the two motors, the robot can perform different types of
motion.
The general requirements for any mobile robot to move
are the linear and the angular velocities. However, the
differential robots have only inputs for the velocity for each
wheel in rpm. So, a controller function is used to change the
required linear and angular velocities into the velocities of
the left and right wheels.
Fig -3: Differential Robot Diagram
Dudek and Jenkin [22] introduced in their book the
kinematics of the differential drive. The angular velocity of
the robot at any instant is rotating around an Instantaneous
Center of Curvature ICC. The radius of curvature R and the
angular velocity of the robot  can be expressed by
)(
)(
2
1
lr
lr
VV
VV
R


 and
l
VV lr )( 
 (15)
where rV and lV are the left and right velocities, l is the
distance between the two wheels and R isthedistancefrom
the ICC to the midpoint of l .
The kinematics model of the differential drive can be
represented as
lr
l
r
r
r
l
r
r
r
y
x






















































)sin(
2
)cos(
2
)sin(
2
)cos(
2



(16)
Where T
yx ][  is the position vector of the mobile
robot, r is the wheel radiusand T
lr ][  istherightandleft
wheels angular velocities.
4.2 V-REP
Virtual Robot Experimentation Platform (V-REP) is a
robotic simulator that is used for the experimentationin this
work. It is an open source software and ithasdirectlink with
MATLab. Its script can be written as MATLab script.Itcanbe
linked to MATLab as a remote API.
The environment used in the simulations consists of
KheperaIII mobile robots, Vertical Vision Sensor, Obstacles,
5mx5m Floor, and the goal will be marked in red point as in
Figure 4.
Fig -4: The V-REP Environment used in the Simulations
5. RESULTS
This model has two sides; MATLab and V-REP. The MATLab
side will generate a 2D and 3D potential map for the
environment while the V-REPwill showreal-timesimulation
for the trajectory tracking of the robots. In the camera
screen, the goal is represented as an orange area, The floor
size is 5m×5m, and the (0,0) is at the left and the (5,5) point
is at the right. In the vision sensor screen, the robot is
represented by a small red circle, the obstacles are gray
International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056
Volume: 04 Issue: 09 | Sep -2017 www.irjet.net p-ISSN: 2395-0072
© 2017, IRJET | Impact Factor value: 5.181 | ISO 9001:2008 Certified Journal | Page 1167
rectangles, the point (0,0) is at the top leftandthepoint(5,5)
is at the bottom right of the vision sensor screen. The first
experiment as in Fig. 5 has only one robot with two
obstacles, to make initial test for the whole simulation. The
robot is positioned at point (2.5,0.5), and the goal is at
(1.5,4). The experiment takes 12 seconds calculating
potentials time, 37 seconds total simulation time and 28
seconds real time (recorded video). The path length is 70
unit length and can be approximated to 4.22 meters. The
samples are taken every 10 seconds as in Figure 5c, 5d, 5e
and 5f. The last experiment as in Figure 6 has three robots
with an obstacle. This obstacle has geometrytocreatea local
minima point. The aim if this experiment is to test the multi-
robot system with solving the local minima problem. The
robots are positioned at points (1.5,0.5), (2.5,0.5) and
(3.5,0.5), and the goal is at (2.5,4.5). The experiment takes
113 seconds calculating potentials time, 158 seconds total
simulation time and 36 seconds real time (recorded video).
The paths lengths are 86, 92 and 93 unit length and can be
approximated to 5.19, 5.55 and 5.61 meters respectively.
The samples are taken every 12 seconds as in Figure 6c, 6d,
6e and 6f.
( c )
( d )
( e )
( f )
Fig -5: First Experiment Results
( a )
( b )
International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056
Volume: 04 Issue: 09 | Sep -2017 www.irjet.net p-ISSN: 2395-0072
© 2017, IRJET | Impact Factor value: 5.181 | ISO 9001:2008 Certified Journal | Page 1168
( a )
( b )
( c )
( d )
( e )
( f )
Fig -6: Second Experiment Results
6. CONCLUSION
Choosing specific path planning approach is a serious
problem in any robotic application. Some applications need
the path planning to be fast without focusing on how
accurate it is. Other applications need the path is to be very
accurate. APF is one of the classic approaches of the path
planning, and it has more than one way to be implemented.
APF concept is built on representing the robot environment
with potential field, where the obstacles have high potential
and the goal has low potential. This causes the robot to be
attracted to the goal and in the same time repelled from the
obstacles. In case of multi-robot system, every robot is an
obstacle for the other robots, so the robots cannot collide
with each other. The proposed approach combinesbothAPF
and Virtual Obstacles approaches. The validity of the
proposed approach is tested and simulated using MATLab
and V-REP as a real-time simulator. The experimentsresults
show the effectiveness of this paper approach.
7. FUTURE WORK
There are many ways to enhance the results of the
simulations and to make it more practical to use in real life.
First, to make the result more practical, the potential field
should be used as on-line path planning approach to make
real-time closed-loop controller for each robot. Second, to
enhance the result of the path generated, an optimization
technique should be used like Genetic Algorithm GA or
Particle Swarm Optimization PSO, that will give optimized
control parameters andgeneratetheshortestpath.Third, for
International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056
Volume: 04 Issue: 09 | Sep -2017 www.irjet.net p-ISSN: 2395-0072
© 2017, IRJET | Impact Factor value: 5.181 | ISO 9001:2008 Certified Journal | Page 1169
using this approach on hardware, KheperaIII or similar
mobile robots are the recommended robots to be used.
REFERENCES
[1] Ibrahim, A.A., Ghareeb, Z.S., Shehata,O.M.,Morgan,E.S.I.:
A robotic surveillance platform based on an on-board
computer vision approach. In: Proceedings of the 4th
International Conference on Control, Mechatronics and
Automation, pp.41-45. ACM (2016)
[2] Lima, P.U., Custodio, L.M.: Multi-robot systems. In:
Innovations in robot mobility and control, pp. 1-64.
Springer (2005)
[3] Samuel, V.M., Shehata, O.M., Morgan, E.S.I.: Chaos
generation for multi-robot 3d-volume coverage
maximization. In: Proceedings of the 4th International
Conference on Control, Mechatronics and Automation,
pp. 36-40. ACM (2016)
[4] Nabil, M., Kassem, M., Bahnasy, A., Shehata, O.M.,
Morgan, E.S.I.: Rescue missions bots using active slam
and map feature extraction. In: Proceedings of the 4th
International Conference on Control, Mechatronics and
Automation, pp. 31-35. ACM (2016)
[5] Kassem, M., Shehata, O.M., Morgan, E.I.: Multi-modal
mobile sensor data fusion for autonomous robot
mapping problem. In: MATEC Web of Conferences, vol.
42. EDP Sciences (2016)
[6] Jennings, J.S., Whelan, G., Evans, W.F.: Cooperative
search and rescue with a team of mobile robots. In:
Advanced Robotics, 1997. ICAR'97. Proceedings., 8th
International Conference on, pp. 193-200. IEEE (1997)
[7] El-Ansary, S., Shehata, O.M., Morgan, E.S.I.: Airport
management controller: A multi-robot task-allocation
approach. In: Proceedings of the 4th International
Conference on Control, Mechatronics and Automation,
pp. 26-30. ACM (2016)
[8] Hussein, A., Adel, M., Bakr, M., Shehata, O.M., Khamis, A.:
Multi-robot task allocation for search and rescue
missions. In: Journal of Physics: Conference Series, vol.
570, p. 052006. IOP Publishing (2014)
[9] Leena, N., Saju, K.: A survey on path planning techniques
for autonomous mobile robots. IOSR Journal of
Mechanical and Civil Engineering (IOSR-JMCE) 8, 76-79
(2014)
[10] Rimon, E., Koditschek, D.E.: Exact robot navigationusing
artificial potential functions. IEEE Transactions on
robotics and automation 8(5), 501-518 (1992)
[11] Ge, S.S., Cui, Y.J.: New potential functions for mobile
robot path planning. IEEE Transactions on robotics and
automation 16(5), 615-620 (2000)
[12] Ge, S.S., Cui, Y.J.: Dynamic motion planning for mobile
robots using potential field method. Autonomousrobots
13(3), 207-222 (2002)
[13] Ge, S.S., Fua, C.H.: Queues and artificial potential
trenches for multirobot formations. IEEE Transactions
on Robotics 21(4), 646-656 (2005)
[14] Hsieh, M.A., Kumar, V., Chaimowicz, L.: Decentralized
controllers for shape generation with robotic swarms.
Robotica 26(5), 691-701 (2008)
[15] Nagy, I.: Behaviour study of a multi-agent mobile robot
system during potential field building.Acta Polytechnica
Hungarica 6(4), 111-136 (2009)
[16] Saez-Pons, J., Alboul, L., Penders, J., Nomdedeu,L.:Multi-
robot team formation control in the guardians project.
Industrial Robot: An International Journal 37(4), 372-
383 (2010)
[17] Valbuena, L., Tanner, H.G.: Hybrid potential field based
control of differential drive mobile robots. Journal of
intelligent & robotic systems pp. 1-16 (2012)
[18] Hargas, Y., Mokrane, A., Hentout, A., Hachour, O.,
Bouzouia, B.: Mobile manipulator path planning based
on artificial potential field: Application on robuter/ulm.
In: Electrical Engineering (ICEE),20154thInternational
Conference on, pp. 1-6. IEEE (2015)
[19] Rajvanshi, A., Islam, S., Majid, H., Atawi, I., Biglerbegian,
M., Mahmud, S.: An efficient potential-function based
path-planning algorithm for mobile robots in dynamic
environments with moving targets (2015)
[20] Ahmed, A.A., Abdalla, T.Y., Abed, A.A.: Path planning of
mobile robot by using modifiedoptimizedpotential field
method. International Journal of ComputerApplications
113(4) (2015)
[21] Khatib, O.: Real-time obstacle avoidance for
manipulators and mobile robots. The international
journal of robotics research 5(1), 90-98 (1986)
[22] Dudek, G., Jenkin, M.: Computational principles of
mobile robotics. Cambridge university press (2010)
Ad

More Related Content

What's hot (20)

Unit-I Robotics
Unit-I RoboticsUnit-I Robotics
Unit-I Robotics
Muthukumar V
 
Fuzzy Logic Controller
Fuzzy Logic ControllerFuzzy Logic Controller
Fuzzy Logic Controller
vinayvickky
 
Jacobian inverse manipulator
Jacobian inverse manipulatorJacobian inverse manipulator
Jacobian inverse manipulator
Hitesh Mohapatra
 
IRJET-Automatic Self-Parking Chair using Nissan Technology
IRJET-Automatic Self-Parking Chair using Nissan TechnologyIRJET-Automatic Self-Parking Chair using Nissan Technology
IRJET-Automatic Self-Parking Chair using Nissan Technology
IRJET Journal
 
Laplace transform: UNIT STEP FUNCTION, SECOND SHIFTING THEOREM, DIRAC DELTA F...
Laplace transform: UNIT STEP FUNCTION, SECOND SHIFTING THEOREM, DIRAC DELTA F...Laplace transform: UNIT STEP FUNCTION, SECOND SHIFTING THEOREM, DIRAC DELTA F...
Laplace transform: UNIT STEP FUNCTION, SECOND SHIFTING THEOREM, DIRAC DELTA F...
saahil kshatriya
 
Extreme values of a function & applications of derivative
Extreme values of a function & applications of derivativeExtreme values of a function & applications of derivative
Extreme values of a function & applications of derivative
Nofal Umair
 
Tree climbing robot 2014 edit
Tree climbing robot 2014 edit Tree climbing robot 2014 edit
Tree climbing robot 2014 edit
chockalingam athilingam
 
fourier transforms
fourier transformsfourier transforms
fourier transforms
Umang Gupta
 
Fundamental of robotic manipulator
Fundamental of robotic manipulatorFundamental of robotic manipulator
Fundamental of robotic manipulator
snkalepvpit
 
Interpolation Methods
Interpolation MethodsInterpolation Methods
Interpolation Methods
Mohammad Tawfik
 
Application of fuzzy logic
Application of fuzzy logicApplication of fuzzy logic
Application of fuzzy logic
Viraj Patel
 
Applications Of Laplace Transforms
Applications Of Laplace TransformsApplications Of Laplace Transforms
Applications Of Laplace Transforms
Ketaki_Pattani
 
Denavit Hartenberg Algorithm
Denavit Hartenberg AlgorithmDenavit Hartenberg Algorithm
Denavit Hartenberg Algorithm
Hitesh Mohapatra
 
False Position Method.pptx
False Position Method.pptxFalse Position Method.pptx
False Position Method.pptx
ChristineTorrepenida1
 
Lecture 23 24-time_response
Lecture 23 24-time_responseLecture 23 24-time_response
Lecture 23 24-time_response
Syed Ali Raza Rizvi
 
signal and system Lecture 1
signal and system Lecture 1signal and system Lecture 1
signal and system Lecture 1
iqbal ahmad
 
Modern Control - Lec 05 - Analysis and Design of Control Systems using Freque...
Modern Control - Lec 05 - Analysis and Design of Control Systems using Freque...Modern Control - Lec 05 - Analysis and Design of Control Systems using Freque...
Modern Control - Lec 05 - Analysis and Design of Control Systems using Freque...
Amr E. Mohamed
 
Sensors for mobile robot navigation based on robotics
Sensors for mobile robot navigation based on roboticsSensors for mobile robot navigation based on robotics
Sensors for mobile robot navigation based on robotics
KRSavinJoseph
 
Navigation and Trajectory Control for Autonomous Robot/Vehicle (mechatronics)
Navigation and Trajectory Control for Autonomous Robot/Vehicle (mechatronics)Navigation and Trajectory Control for Autonomous Robot/Vehicle (mechatronics)
Navigation and Trajectory Control for Autonomous Robot/Vehicle (mechatronics)
Mithun Chowdhury
 
application of differential equation and multiple integral
application of differential equation and multiple integralapplication of differential equation and multiple integral
application of differential equation and multiple integral
divya gupta
 
Fuzzy Logic Controller
Fuzzy Logic ControllerFuzzy Logic Controller
Fuzzy Logic Controller
vinayvickky
 
Jacobian inverse manipulator
Jacobian inverse manipulatorJacobian inverse manipulator
Jacobian inverse manipulator
Hitesh Mohapatra
 
IRJET-Automatic Self-Parking Chair using Nissan Technology
IRJET-Automatic Self-Parking Chair using Nissan TechnologyIRJET-Automatic Self-Parking Chair using Nissan Technology
IRJET-Automatic Self-Parking Chair using Nissan Technology
IRJET Journal
 
Laplace transform: UNIT STEP FUNCTION, SECOND SHIFTING THEOREM, DIRAC DELTA F...
Laplace transform: UNIT STEP FUNCTION, SECOND SHIFTING THEOREM, DIRAC DELTA F...Laplace transform: UNIT STEP FUNCTION, SECOND SHIFTING THEOREM, DIRAC DELTA F...
Laplace transform: UNIT STEP FUNCTION, SECOND SHIFTING THEOREM, DIRAC DELTA F...
saahil kshatriya
 
Extreme values of a function & applications of derivative
Extreme values of a function & applications of derivativeExtreme values of a function & applications of derivative
Extreme values of a function & applications of derivative
Nofal Umair
 
fourier transforms
fourier transformsfourier transforms
fourier transforms
Umang Gupta
 
Fundamental of robotic manipulator
Fundamental of robotic manipulatorFundamental of robotic manipulator
Fundamental of robotic manipulator
snkalepvpit
 
Application of fuzzy logic
Application of fuzzy logicApplication of fuzzy logic
Application of fuzzy logic
Viraj Patel
 
Applications Of Laplace Transforms
Applications Of Laplace TransformsApplications Of Laplace Transforms
Applications Of Laplace Transforms
Ketaki_Pattani
 
Denavit Hartenberg Algorithm
Denavit Hartenberg AlgorithmDenavit Hartenberg Algorithm
Denavit Hartenberg Algorithm
Hitesh Mohapatra
 
signal and system Lecture 1
signal and system Lecture 1signal and system Lecture 1
signal and system Lecture 1
iqbal ahmad
 
Modern Control - Lec 05 - Analysis and Design of Control Systems using Freque...
Modern Control - Lec 05 - Analysis and Design of Control Systems using Freque...Modern Control - Lec 05 - Analysis and Design of Control Systems using Freque...
Modern Control - Lec 05 - Analysis and Design of Control Systems using Freque...
Amr E. Mohamed
 
Sensors for mobile robot navigation based on robotics
Sensors for mobile robot navigation based on roboticsSensors for mobile robot navigation based on robotics
Sensors for mobile robot navigation based on robotics
KRSavinJoseph
 
Navigation and Trajectory Control for Autonomous Robot/Vehicle (mechatronics)
Navigation and Trajectory Control for Autonomous Robot/Vehicle (mechatronics)Navigation and Trajectory Control for Autonomous Robot/Vehicle (mechatronics)
Navigation and Trajectory Control for Autonomous Robot/Vehicle (mechatronics)
Mithun Chowdhury
 
application of differential equation and multiple integral
application of differential equation and multiple integralapplication of differential equation and multiple integral
application of differential equation and multiple integral
divya gupta
 

Similar to A Global Integrated Artificial Potential Field/Virtual Obstacles Path Planning Algorithm for Multi-Robot System Applications (20)

H011114758
H011114758H011114758
H011114758
IOSR Journals
 
High-Speed Neural Network Controller for Autonomous Robot Navigation using FPGA
High-Speed Neural Network Controller for Autonomous Robot Navigation using FPGAHigh-Speed Neural Network Controller for Autonomous Robot Navigation using FPGA
High-Speed Neural Network Controller for Autonomous Robot Navigation using FPGA
iosrjce
 
IRJET- Path Finder with Obstacle Avoidance Robot
IRJET-  	  Path Finder with Obstacle Avoidance RobotIRJET-  	  Path Finder with Obstacle Avoidance Robot
IRJET- Path Finder with Obstacle Avoidance Robot
IRJET Journal
 
Motion of Robots in a Non Rectangular Workspace
Motion of Robots in a Non Rectangular WorkspaceMotion of Robots in a Non Rectangular Workspace
Motion of Robots in a Non Rectangular Workspace
International Journal of Engineering Inventions www.ijeijournal.com
 
IRJET - Robots and their Applications
IRJET - Robots and their ApplicationsIRJET - Robots and their Applications
IRJET - Robots and their Applications
IRJET Journal
 
Research on the mobile robots intelligent path planning based on ant colony a...
Research on the mobile robots intelligent path planning based on ant colony a...Research on the mobile robots intelligent path planning based on ant colony a...
Research on the mobile robots intelligent path planning based on ant colony a...
csandit
 
slam_research_paper
slam_research_paperslam_research_paper
slam_research_paper
Vinit Payal
 
Robocup2006
Robocup2006Robocup2006
Robocup2006
Amir Hossein Mandegar
 
Design of a controller for wheeled mobile robots based on automatic movement ...
Design of a controller for wheeled mobile robots based on automatic movement ...Design of a controller for wheeled mobile robots based on automatic movement ...
Design of a controller for wheeled mobile robots based on automatic movement ...
TELKOMNIKA JOURNAL
 
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
CSCJournals
 
Path Optimization for Mobile Robot Using Genetic Algorithm
Path Optimization for Mobile Robot Using Genetic AlgorithmPath Optimization for Mobile Robot Using Genetic Algorithm
Path Optimization for Mobile Robot Using Genetic Algorithm
IRJET Journal
 
RESEARCH ON THE MOBILE ROBOTS INTELLIGENT PATH PLANNING BASED ON ANT COLONY A...
RESEARCH ON THE MOBILE ROBOTS INTELLIGENT PATH PLANNING BASED ON ANT COLONY A...RESEARCH ON THE MOBILE ROBOTS INTELLIGENT PATH PLANNING BASED ON ANT COLONY A...
RESEARCH ON THE MOBILE ROBOTS INTELLIGENT PATH PLANNING BASED ON ANT COLONY A...
cscpconf
 
A Review On AI Vision Robotic Arm Using Raspberry Pi
A Review On AI Vision Robotic Arm Using Raspberry PiA Review On AI Vision Robotic Arm Using Raspberry Pi
A Review On AI Vision Robotic Arm Using Raspberry Pi
Angela Shin
 
A simulated motion planning algorithm in 2 d
A simulated motion planning algorithm in 2 dA simulated motion planning algorithm in 2 d
A simulated motion planning algorithm in 2 d
ijaia
 
IRJET- Swarm Robotics and their Potential to be Applied in Real Life Problems
IRJET- Swarm Robotics and their Potential to be Applied in Real Life ProblemsIRJET- Swarm Robotics and their Potential to be Applied in Real Life Problems
IRJET- Swarm Robotics and their Potential to be Applied in Real Life Problems
IRJET Journal
 
Intelligent Robotics Navigation System: Problems, Methods, and Algorithm
Intelligent Robotics Navigation System: Problems,  Methods, and Algorithm Intelligent Robotics Navigation System: Problems,  Methods, and Algorithm
Intelligent Robotics Navigation System: Problems, Methods, and Algorithm
IJECEIAES
 
IRJET- Design and Fabrication of PLC and SCADA based Robotic Arm for Material...
IRJET- Design and Fabrication of PLC and SCADA based Robotic Arm for Material...IRJET- Design and Fabrication of PLC and SCADA based Robotic Arm for Material...
IRJET- Design and Fabrication of PLC and SCADA based Robotic Arm for Material...
IRJET Journal
 
Motion planning and controlling algorithm for grasping and manipulating movin...
Motion planning and controlling algorithm for grasping and manipulating movin...Motion planning and controlling algorithm for grasping and manipulating movin...
Motion planning and controlling algorithm for grasping and manipulating movin...
ijscai
 
Review on Development of Industrial Robotic Arm
Review on Development of Industrial Robotic ArmReview on Development of Industrial Robotic Arm
Review on Development of Industrial Robotic Arm
IRJET Journal
 
Swarm Intelligence for Logistics Controlling
Swarm Intelligence for Logistics ControllingSwarm Intelligence for Logistics Controlling
Swarm Intelligence for Logistics Controlling
IRJET Journal
 
High-Speed Neural Network Controller for Autonomous Robot Navigation using FPGA
High-Speed Neural Network Controller for Autonomous Robot Navigation using FPGAHigh-Speed Neural Network Controller for Autonomous Robot Navigation using FPGA
High-Speed Neural Network Controller for Autonomous Robot Navigation using FPGA
iosrjce
 
IRJET- Path Finder with Obstacle Avoidance Robot
IRJET-  	  Path Finder with Obstacle Avoidance RobotIRJET-  	  Path Finder with Obstacle Avoidance Robot
IRJET- Path Finder with Obstacle Avoidance Robot
IRJET Journal
 
IRJET - Robots and their Applications
IRJET - Robots and their ApplicationsIRJET - Robots and their Applications
IRJET - Robots and their Applications
IRJET Journal
 
Research on the mobile robots intelligent path planning based on ant colony a...
Research on the mobile robots intelligent path planning based on ant colony a...Research on the mobile robots intelligent path planning based on ant colony a...
Research on the mobile robots intelligent path planning based on ant colony a...
csandit
 
slam_research_paper
slam_research_paperslam_research_paper
slam_research_paper
Vinit Payal
 
Design of a controller for wheeled mobile robots based on automatic movement ...
Design of a controller for wheeled mobile robots based on automatic movement ...Design of a controller for wheeled mobile robots based on automatic movement ...
Design of a controller for wheeled mobile robots based on automatic movement ...
TELKOMNIKA JOURNAL
 
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
CSCJournals
 
Path Optimization for Mobile Robot Using Genetic Algorithm
Path Optimization for Mobile Robot Using Genetic AlgorithmPath Optimization for Mobile Robot Using Genetic Algorithm
Path Optimization for Mobile Robot Using Genetic Algorithm
IRJET Journal
 
RESEARCH ON THE MOBILE ROBOTS INTELLIGENT PATH PLANNING BASED ON ANT COLONY A...
RESEARCH ON THE MOBILE ROBOTS INTELLIGENT PATH PLANNING BASED ON ANT COLONY A...RESEARCH ON THE MOBILE ROBOTS INTELLIGENT PATH PLANNING BASED ON ANT COLONY A...
RESEARCH ON THE MOBILE ROBOTS INTELLIGENT PATH PLANNING BASED ON ANT COLONY A...
cscpconf
 
A Review On AI Vision Robotic Arm Using Raspberry Pi
A Review On AI Vision Robotic Arm Using Raspberry PiA Review On AI Vision Robotic Arm Using Raspberry Pi
A Review On AI Vision Robotic Arm Using Raspberry Pi
Angela Shin
 
A simulated motion planning algorithm in 2 d
A simulated motion planning algorithm in 2 dA simulated motion planning algorithm in 2 d
A simulated motion planning algorithm in 2 d
ijaia
 
IRJET- Swarm Robotics and their Potential to be Applied in Real Life Problems
IRJET- Swarm Robotics and their Potential to be Applied in Real Life ProblemsIRJET- Swarm Robotics and their Potential to be Applied in Real Life Problems
IRJET- Swarm Robotics and their Potential to be Applied in Real Life Problems
IRJET Journal
 
Intelligent Robotics Navigation System: Problems, Methods, and Algorithm
Intelligent Robotics Navigation System: Problems,  Methods, and Algorithm Intelligent Robotics Navigation System: Problems,  Methods, and Algorithm
Intelligent Robotics Navigation System: Problems, Methods, and Algorithm
IJECEIAES
 
IRJET- Design and Fabrication of PLC and SCADA based Robotic Arm for Material...
IRJET- Design and Fabrication of PLC and SCADA based Robotic Arm for Material...IRJET- Design and Fabrication of PLC and SCADA based Robotic Arm for Material...
IRJET- Design and Fabrication of PLC and SCADA based Robotic Arm for Material...
IRJET Journal
 
Motion planning and controlling algorithm for grasping and manipulating movin...
Motion planning and controlling algorithm for grasping and manipulating movin...Motion planning and controlling algorithm for grasping and manipulating movin...
Motion planning and controlling algorithm for grasping and manipulating movin...
ijscai
 
Review on Development of Industrial Robotic Arm
Review on Development of Industrial Robotic ArmReview on Development of Industrial Robotic Arm
Review on Development of Industrial Robotic Arm
IRJET Journal
 
Swarm Intelligence for Logistics Controlling
Swarm Intelligence for Logistics ControllingSwarm Intelligence for Logistics Controlling
Swarm Intelligence for Logistics Controlling
IRJET Journal
 
Ad

More from IRJET Journal (20)

Explainable AI(XAI) using LIME and Disease Detection in Mango Leaf by Transfe...
Explainable AI(XAI) using LIME and Disease Detection in Mango Leaf by Transfe...Explainable AI(XAI) using LIME and Disease Detection in Mango Leaf by Transfe...
Explainable AI(XAI) using LIME and Disease Detection in Mango Leaf by Transfe...
IRJET Journal
 
BRAIN TUMOUR DETECTION AND CLASSIFICATION
BRAIN TUMOUR DETECTION AND CLASSIFICATIONBRAIN TUMOUR DETECTION AND CLASSIFICATION
BRAIN TUMOUR DETECTION AND CLASSIFICATION
IRJET Journal
 
The Project Manager as an ambassador of the contract. The case of NEC4 ECC co...
The Project Manager as an ambassador of the contract. The case of NEC4 ECC co...The Project Manager as an ambassador of the contract. The case of NEC4 ECC co...
The Project Manager as an ambassador of the contract. The case of NEC4 ECC co...
IRJET Journal
 
"Enhanced Heat Transfer Performance in Shell and Tube Heat Exchangers: A CFD ...
"Enhanced Heat Transfer Performance in Shell and Tube Heat Exchangers: A CFD ..."Enhanced Heat Transfer Performance in Shell and Tube Heat Exchangers: A CFD ...
"Enhanced Heat Transfer Performance in Shell and Tube Heat Exchangers: A CFD ...
IRJET Journal
 
Advancements in CFD Analysis of Shell and Tube Heat Exchangers with Nanofluid...
Advancements in CFD Analysis of Shell and Tube Heat Exchangers with Nanofluid...Advancements in CFD Analysis of Shell and Tube Heat Exchangers with Nanofluid...
Advancements in CFD Analysis of Shell and Tube Heat Exchangers with Nanofluid...
IRJET Journal
 
Breast Cancer Detection using Computer Vision
Breast Cancer Detection using Computer VisionBreast Cancer Detection using Computer Vision
Breast Cancer Detection using Computer Vision
IRJET Journal
 
Auto-Charging E-Vehicle with its battery Management.
Auto-Charging E-Vehicle with its battery Management.Auto-Charging E-Vehicle with its battery Management.
Auto-Charging E-Vehicle with its battery Management.
IRJET Journal
 
Analysis of high energy charge particle in the Heliosphere
Analysis of high energy charge particle in the HeliosphereAnalysis of high energy charge particle in the Heliosphere
Analysis of high energy charge particle in the Heliosphere
IRJET Journal
 
A Novel System for Recommending Agricultural Crops Using Machine Learning App...
A Novel System for Recommending Agricultural Crops Using Machine Learning App...A Novel System for Recommending Agricultural Crops Using Machine Learning App...
A Novel System for Recommending Agricultural Crops Using Machine Learning App...
IRJET Journal
 
Auto-Charging E-Vehicle with its battery Management.
Auto-Charging E-Vehicle with its battery Management.Auto-Charging E-Vehicle with its battery Management.
Auto-Charging E-Vehicle with its battery Management.
IRJET Journal
 
Analysis of high energy charge particle in the Heliosphere
Analysis of high energy charge particle in the HeliosphereAnalysis of high energy charge particle in the Heliosphere
Analysis of high energy charge particle in the Heliosphere
IRJET Journal
 
Wireless Arduino Control via Mobile: Eliminating the Need for a Dedicated Wir...
Wireless Arduino Control via Mobile: Eliminating the Need for a Dedicated Wir...Wireless Arduino Control via Mobile: Eliminating the Need for a Dedicated Wir...
Wireless Arduino Control via Mobile: Eliminating the Need for a Dedicated Wir...
IRJET Journal
 
FIR filter-based Sample Rate Convertors and its use in NR PRACH
FIR filter-based Sample Rate Convertors and its use in NR PRACHFIR filter-based Sample Rate Convertors and its use in NR PRACH
FIR filter-based Sample Rate Convertors and its use in NR PRACH
IRJET Journal
 
Kiona – A Smart Society Automation Project
Kiona – A Smart Society Automation ProjectKiona – A Smart Society Automation Project
Kiona – A Smart Society Automation Project
IRJET Journal
 
Utilizing Biomedical Waste for Sustainable Brick Manufacturing: A Novel Appro...
Utilizing Biomedical Waste for Sustainable Brick Manufacturing: A Novel Appro...Utilizing Biomedical Waste for Sustainable Brick Manufacturing: A Novel Appro...
Utilizing Biomedical Waste for Sustainable Brick Manufacturing: A Novel Appro...
IRJET Journal
 
A Review on Influence of Fluid Viscous Damper on The Behaviour of Multi-store...
A Review on Influence of Fluid Viscous Damper on The Behaviour of Multi-store...A Review on Influence of Fluid Viscous Damper on The Behaviour of Multi-store...
A Review on Influence of Fluid Viscous Damper on The Behaviour of Multi-store...
IRJET Journal
 
Invest in Innovation: Empowering Ideas through Blockchain Based Crowdfunding
Invest in Innovation: Empowering Ideas through Blockchain Based CrowdfundingInvest in Innovation: Empowering Ideas through Blockchain Based Crowdfunding
Invest in Innovation: Empowering Ideas through Blockchain Based Crowdfunding
IRJET Journal
 
DESIGN AND DEVELOPMENT OF BATTERY THERMAL MANAGEMENT SYSTEM USING PHASE CHANG...
DESIGN AND DEVELOPMENT OF BATTERY THERMAL MANAGEMENT SYSTEM USING PHASE CHANG...DESIGN AND DEVELOPMENT OF BATTERY THERMAL MANAGEMENT SYSTEM USING PHASE CHANG...
DESIGN AND DEVELOPMENT OF BATTERY THERMAL MANAGEMENT SYSTEM USING PHASE CHANG...
IRJET Journal
 
SPACE WATCH YOUR REAL-TIME SPACE INFORMATION HUB
SPACE WATCH YOUR REAL-TIME SPACE INFORMATION HUBSPACE WATCH YOUR REAL-TIME SPACE INFORMATION HUB
SPACE WATCH YOUR REAL-TIME SPACE INFORMATION HUB
IRJET Journal
 
AR Application: Homewise VisionMs. Vaishali Rane, Om Awadhoot, Bhargav Gajare...
AR Application: Homewise VisionMs. Vaishali Rane, Om Awadhoot, Bhargav Gajare...AR Application: Homewise VisionMs. Vaishali Rane, Om Awadhoot, Bhargav Gajare...
AR Application: Homewise VisionMs. Vaishali Rane, Om Awadhoot, Bhargav Gajare...
IRJET Journal
 
Explainable AI(XAI) using LIME and Disease Detection in Mango Leaf by Transfe...
Explainable AI(XAI) using LIME and Disease Detection in Mango Leaf by Transfe...Explainable AI(XAI) using LIME and Disease Detection in Mango Leaf by Transfe...
Explainable AI(XAI) using LIME and Disease Detection in Mango Leaf by Transfe...
IRJET Journal
 
BRAIN TUMOUR DETECTION AND CLASSIFICATION
BRAIN TUMOUR DETECTION AND CLASSIFICATIONBRAIN TUMOUR DETECTION AND CLASSIFICATION
BRAIN TUMOUR DETECTION AND CLASSIFICATION
IRJET Journal
 
The Project Manager as an ambassador of the contract. The case of NEC4 ECC co...
The Project Manager as an ambassador of the contract. The case of NEC4 ECC co...The Project Manager as an ambassador of the contract. The case of NEC4 ECC co...
The Project Manager as an ambassador of the contract. The case of NEC4 ECC co...
IRJET Journal
 
"Enhanced Heat Transfer Performance in Shell and Tube Heat Exchangers: A CFD ...
"Enhanced Heat Transfer Performance in Shell and Tube Heat Exchangers: A CFD ..."Enhanced Heat Transfer Performance in Shell and Tube Heat Exchangers: A CFD ...
"Enhanced Heat Transfer Performance in Shell and Tube Heat Exchangers: A CFD ...
IRJET Journal
 
Advancements in CFD Analysis of Shell and Tube Heat Exchangers with Nanofluid...
Advancements in CFD Analysis of Shell and Tube Heat Exchangers with Nanofluid...Advancements in CFD Analysis of Shell and Tube Heat Exchangers with Nanofluid...
Advancements in CFD Analysis of Shell and Tube Heat Exchangers with Nanofluid...
IRJET Journal
 
Breast Cancer Detection using Computer Vision
Breast Cancer Detection using Computer VisionBreast Cancer Detection using Computer Vision
Breast Cancer Detection using Computer Vision
IRJET Journal
 
Auto-Charging E-Vehicle with its battery Management.
Auto-Charging E-Vehicle with its battery Management.Auto-Charging E-Vehicle with its battery Management.
Auto-Charging E-Vehicle with its battery Management.
IRJET Journal
 
Analysis of high energy charge particle in the Heliosphere
Analysis of high energy charge particle in the HeliosphereAnalysis of high energy charge particle in the Heliosphere
Analysis of high energy charge particle in the Heliosphere
IRJET Journal
 
A Novel System for Recommending Agricultural Crops Using Machine Learning App...
A Novel System for Recommending Agricultural Crops Using Machine Learning App...A Novel System for Recommending Agricultural Crops Using Machine Learning App...
A Novel System for Recommending Agricultural Crops Using Machine Learning App...
IRJET Journal
 
Auto-Charging E-Vehicle with its battery Management.
Auto-Charging E-Vehicle with its battery Management.Auto-Charging E-Vehicle with its battery Management.
Auto-Charging E-Vehicle with its battery Management.
IRJET Journal
 
Analysis of high energy charge particle in the Heliosphere
Analysis of high energy charge particle in the HeliosphereAnalysis of high energy charge particle in the Heliosphere
Analysis of high energy charge particle in the Heliosphere
IRJET Journal
 
Wireless Arduino Control via Mobile: Eliminating the Need for a Dedicated Wir...
Wireless Arduino Control via Mobile: Eliminating the Need for a Dedicated Wir...Wireless Arduino Control via Mobile: Eliminating the Need for a Dedicated Wir...
Wireless Arduino Control via Mobile: Eliminating the Need for a Dedicated Wir...
IRJET Journal
 
FIR filter-based Sample Rate Convertors and its use in NR PRACH
FIR filter-based Sample Rate Convertors and its use in NR PRACHFIR filter-based Sample Rate Convertors and its use in NR PRACH
FIR filter-based Sample Rate Convertors and its use in NR PRACH
IRJET Journal
 
Kiona – A Smart Society Automation Project
Kiona – A Smart Society Automation ProjectKiona – A Smart Society Automation Project
Kiona – A Smart Society Automation Project
IRJET Journal
 
Utilizing Biomedical Waste for Sustainable Brick Manufacturing: A Novel Appro...
Utilizing Biomedical Waste for Sustainable Brick Manufacturing: A Novel Appro...Utilizing Biomedical Waste for Sustainable Brick Manufacturing: A Novel Appro...
Utilizing Biomedical Waste for Sustainable Brick Manufacturing: A Novel Appro...
IRJET Journal
 
A Review on Influence of Fluid Viscous Damper on The Behaviour of Multi-store...
A Review on Influence of Fluid Viscous Damper on The Behaviour of Multi-store...A Review on Influence of Fluid Viscous Damper on The Behaviour of Multi-store...
A Review on Influence of Fluid Viscous Damper on The Behaviour of Multi-store...
IRJET Journal
 
Invest in Innovation: Empowering Ideas through Blockchain Based Crowdfunding
Invest in Innovation: Empowering Ideas through Blockchain Based CrowdfundingInvest in Innovation: Empowering Ideas through Blockchain Based Crowdfunding
Invest in Innovation: Empowering Ideas through Blockchain Based Crowdfunding
IRJET Journal
 
DESIGN AND DEVELOPMENT OF BATTERY THERMAL MANAGEMENT SYSTEM USING PHASE CHANG...
DESIGN AND DEVELOPMENT OF BATTERY THERMAL MANAGEMENT SYSTEM USING PHASE CHANG...DESIGN AND DEVELOPMENT OF BATTERY THERMAL MANAGEMENT SYSTEM USING PHASE CHANG...
DESIGN AND DEVELOPMENT OF BATTERY THERMAL MANAGEMENT SYSTEM USING PHASE CHANG...
IRJET Journal
 
SPACE WATCH YOUR REAL-TIME SPACE INFORMATION HUB
SPACE WATCH YOUR REAL-TIME SPACE INFORMATION HUBSPACE WATCH YOUR REAL-TIME SPACE INFORMATION HUB
SPACE WATCH YOUR REAL-TIME SPACE INFORMATION HUB
IRJET Journal
 
AR Application: Homewise VisionMs. Vaishali Rane, Om Awadhoot, Bhargav Gajare...
AR Application: Homewise VisionMs. Vaishali Rane, Om Awadhoot, Bhargav Gajare...AR Application: Homewise VisionMs. Vaishali Rane, Om Awadhoot, Bhargav Gajare...
AR Application: Homewise VisionMs. Vaishali Rane, Om Awadhoot, Bhargav Gajare...
IRJET Journal
 
Ad

Recently uploaded (20)

22PCOAM16 Unit 3 Session 23 Different ways to Combine Classifiers.pptx
22PCOAM16 Unit 3 Session 23  Different ways to Combine Classifiers.pptx22PCOAM16 Unit 3 Session 23  Different ways to Combine Classifiers.pptx
22PCOAM16 Unit 3 Session 23 Different ways to Combine Classifiers.pptx
Guru Nanak Technical Institutions
 
Slide share PPT of SOx control technologies.pptx
Slide share PPT of SOx control technologies.pptxSlide share PPT of SOx control technologies.pptx
Slide share PPT of SOx control technologies.pptx
vvsasane
 
Control Methods of Noise Pollutions.pptx
Control Methods of Noise Pollutions.pptxControl Methods of Noise Pollutions.pptx
Control Methods of Noise Pollutions.pptx
vvsasane
 
Urban Transport Infrastructure September 2023
Urban Transport Infrastructure September 2023Urban Transport Infrastructure September 2023
Urban Transport Infrastructure September 2023
Rajesh Prasad
 
DeFAIMint | 🤖Mint to DeFAI. Vibe Trading as NFT
DeFAIMint | 🤖Mint to DeFAI. Vibe Trading as NFTDeFAIMint | 🤖Mint to DeFAI. Vibe Trading as NFT
DeFAIMint | 🤖Mint to DeFAI. Vibe Trading as NFT
Kyohei Ito
 
Optimizing Reinforced Concrete Cantilever Retaining Walls Using Gases Brownia...
Optimizing Reinforced Concrete Cantilever Retaining Walls Using Gases Brownia...Optimizing Reinforced Concrete Cantilever Retaining Walls Using Gases Brownia...
Optimizing Reinforced Concrete Cantilever Retaining Walls Using Gases Brownia...
Journal of Soft Computing in Civil Engineering
 
David Boutry - Specializes In AWS, Microservices And Python
David Boutry - Specializes In AWS, Microservices And PythonDavid Boutry - Specializes In AWS, Microservices And Python
David Boutry - Specializes In AWS, Microservices And Python
David Boutry
 
698642933-DdocfordownloadEEP-FAKE-PPT.pptx
698642933-DdocfordownloadEEP-FAKE-PPT.pptx698642933-DdocfordownloadEEP-FAKE-PPT.pptx
698642933-DdocfordownloadEEP-FAKE-PPT.pptx
speedcomcyber25
 
IPC-7711D-7721D_ EN 2023 TOC Rework, Modification and Repair of Electronic As...
IPC-7711D-7721D_ EN 2023 TOC Rework, Modification and Repair of Electronic As...IPC-7711D-7721D_ EN 2023 TOC Rework, Modification and Repair of Electronic As...
IPC-7711D-7721D_ EN 2023 TOC Rework, Modification and Repair of Electronic As...
ssuserd9338b
 
Understand water laser communication using Arduino laser and solar panel
Understand water laser communication using Arduino laser and solar panelUnderstand water laser communication using Arduino laser and solar panel
Understand water laser communication using Arduino laser and solar panel
NaveenBotsa
 
Jacob Murphy Australia - Excels In Optimizing Software Applications
Jacob Murphy Australia - Excels In Optimizing Software ApplicationsJacob Murphy Australia - Excels In Optimizing Software Applications
Jacob Murphy Australia - Excels In Optimizing Software Applications
Jacob Murphy Australia
 
AI-Powered Data Management and Governance in Retail
AI-Powered Data Management and Governance in RetailAI-Powered Data Management and Governance in Retail
AI-Powered Data Management and Governance in Retail
IJDKP
 
Transport modelling at SBB, presentation at EPFL in 2025
Transport modelling at SBB, presentation at EPFL in 2025Transport modelling at SBB, presentation at EPFL in 2025
Transport modelling at SBB, presentation at EPFL in 2025
Antonin Danalet
 
Water Industry Process Automation & Control Monthly May 2025
Water Industry Process Automation & Control Monthly May 2025Water Industry Process Automation & Control Monthly May 2025
Water Industry Process Automation & Control Monthly May 2025
Water Industry Process Automation & Control
 
22PCOAM16 ML Unit 3 Full notes PDF & QB.pdf
22PCOAM16 ML Unit 3 Full notes PDF & QB.pdf22PCOAM16 ML Unit 3 Full notes PDF & QB.pdf
22PCOAM16 ML Unit 3 Full notes PDF & QB.pdf
Guru Nanak Technical Institutions
 
[PyCon US 2025] Scaling the Mountain_ A Framework for Tackling Large-Scale Te...
[PyCon US 2025] Scaling the Mountain_ A Framework for Tackling Large-Scale Te...[PyCon US 2025] Scaling the Mountain_ A Framework for Tackling Large-Scale Te...
[PyCon US 2025] Scaling the Mountain_ A Framework for Tackling Large-Scale Te...
Jimmy Lai
 
Lecture - 7 Canals of the topic of the civil engineering
Lecture - 7  Canals of the topic of the civil engineeringLecture - 7  Canals of the topic of the civil engineering
Lecture - 7 Canals of the topic of the civil engineering
MJawadkhan1
 
Slide share PPT of NOx control technologies.pptx
Slide share PPT of  NOx control technologies.pptxSlide share PPT of  NOx control technologies.pptx
Slide share PPT of NOx control technologies.pptx
vvsasane
 
22PCOAM16_MACHINE_LEARNING_UNIT_IV_NOTES_with_QB
22PCOAM16_MACHINE_LEARNING_UNIT_IV_NOTES_with_QB22PCOAM16_MACHINE_LEARNING_UNIT_IV_NOTES_with_QB
22PCOAM16_MACHINE_LEARNING_UNIT_IV_NOTES_with_QB
Guru Nanak Technical Institutions
 
Dahua Smart Cityyyyyyyyyyyyyyyyyy2025.pdf
Dahua Smart Cityyyyyyyyyyyyyyyyyy2025.pdfDahua Smart Cityyyyyyyyyyyyyyyyyy2025.pdf
Dahua Smart Cityyyyyyyyyyyyyyyyyy2025.pdf
PawachMetharattanara
 
22PCOAM16 Unit 3 Session 23 Different ways to Combine Classifiers.pptx
22PCOAM16 Unit 3 Session 23  Different ways to Combine Classifiers.pptx22PCOAM16 Unit 3 Session 23  Different ways to Combine Classifiers.pptx
22PCOAM16 Unit 3 Session 23 Different ways to Combine Classifiers.pptx
Guru Nanak Technical Institutions
 
Slide share PPT of SOx control technologies.pptx
Slide share PPT of SOx control technologies.pptxSlide share PPT of SOx control technologies.pptx
Slide share PPT of SOx control technologies.pptx
vvsasane
 
Control Methods of Noise Pollutions.pptx
Control Methods of Noise Pollutions.pptxControl Methods of Noise Pollutions.pptx
Control Methods of Noise Pollutions.pptx
vvsasane
 
Urban Transport Infrastructure September 2023
Urban Transport Infrastructure September 2023Urban Transport Infrastructure September 2023
Urban Transport Infrastructure September 2023
Rajesh Prasad
 
DeFAIMint | 🤖Mint to DeFAI. Vibe Trading as NFT
DeFAIMint | 🤖Mint to DeFAI. Vibe Trading as NFTDeFAIMint | 🤖Mint to DeFAI. Vibe Trading as NFT
DeFAIMint | 🤖Mint to DeFAI. Vibe Trading as NFT
Kyohei Ito
 
David Boutry - Specializes In AWS, Microservices And Python
David Boutry - Specializes In AWS, Microservices And PythonDavid Boutry - Specializes In AWS, Microservices And Python
David Boutry - Specializes In AWS, Microservices And Python
David Boutry
 
698642933-DdocfordownloadEEP-FAKE-PPT.pptx
698642933-DdocfordownloadEEP-FAKE-PPT.pptx698642933-DdocfordownloadEEP-FAKE-PPT.pptx
698642933-DdocfordownloadEEP-FAKE-PPT.pptx
speedcomcyber25
 
IPC-7711D-7721D_ EN 2023 TOC Rework, Modification and Repair of Electronic As...
IPC-7711D-7721D_ EN 2023 TOC Rework, Modification and Repair of Electronic As...IPC-7711D-7721D_ EN 2023 TOC Rework, Modification and Repair of Electronic As...
IPC-7711D-7721D_ EN 2023 TOC Rework, Modification and Repair of Electronic As...
ssuserd9338b
 
Understand water laser communication using Arduino laser and solar panel
Understand water laser communication using Arduino laser and solar panelUnderstand water laser communication using Arduino laser and solar panel
Understand water laser communication using Arduino laser and solar panel
NaveenBotsa
 
Jacob Murphy Australia - Excels In Optimizing Software Applications
Jacob Murphy Australia - Excels In Optimizing Software ApplicationsJacob Murphy Australia - Excels In Optimizing Software Applications
Jacob Murphy Australia - Excels In Optimizing Software Applications
Jacob Murphy Australia
 
AI-Powered Data Management and Governance in Retail
AI-Powered Data Management and Governance in RetailAI-Powered Data Management and Governance in Retail
AI-Powered Data Management and Governance in Retail
IJDKP
 
Transport modelling at SBB, presentation at EPFL in 2025
Transport modelling at SBB, presentation at EPFL in 2025Transport modelling at SBB, presentation at EPFL in 2025
Transport modelling at SBB, presentation at EPFL in 2025
Antonin Danalet
 
[PyCon US 2025] Scaling the Mountain_ A Framework for Tackling Large-Scale Te...
[PyCon US 2025] Scaling the Mountain_ A Framework for Tackling Large-Scale Te...[PyCon US 2025] Scaling the Mountain_ A Framework for Tackling Large-Scale Te...
[PyCon US 2025] Scaling the Mountain_ A Framework for Tackling Large-Scale Te...
Jimmy Lai
 
Lecture - 7 Canals of the topic of the civil engineering
Lecture - 7  Canals of the topic of the civil engineeringLecture - 7  Canals of the topic of the civil engineering
Lecture - 7 Canals of the topic of the civil engineering
MJawadkhan1
 
Slide share PPT of NOx control technologies.pptx
Slide share PPT of  NOx control technologies.pptxSlide share PPT of  NOx control technologies.pptx
Slide share PPT of NOx control technologies.pptx
vvsasane
 
Dahua Smart Cityyyyyyyyyyyyyyyyyy2025.pdf
Dahua Smart Cityyyyyyyyyyyyyyyyyy2025.pdfDahua Smart Cityyyyyyyyyyyyyyyyyy2025.pdf
Dahua Smart Cityyyyyyyyyyyyyyyyyy2025.pdf
PawachMetharattanara
 

A Global Integrated Artificial Potential Field/Virtual Obstacles Path Planning Algorithm for Multi-Robot System Applications

  • 1. International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056 Volume: 04 Issue: 09 | Sep -2017 www.irjet.net p-ISSN: 2395-0072 © 2017, IRJET | Impact Factor value: 5.181 | ISO 9001:2008 Certified Journal | Page 1163 A Global Integrated Artificial Potential Field/Virtual Obstacles Path Planning Algorithm for Multi-Robot System Applications Abdelrahman M. Hassan1, Catherine M. Elias1, Omar M. Shehata1 and Elsayed I. Morgan1 1 Multi-Robot Systems (MRS) Research Group, German University in Cairo, 5th Settlement New Cairo, 11432, Cairo, Egypt ---------------------------------------------------------------------***--------------------------------------------------------------------- Abstract - In this paper, a global off-line path planning approach is implemented using an energy-based approach Artificial Potential Field (APF) for Multi-Robot Systems (MRSs). A 3-D potential map is created by using simplified potential functions. Both attraction forces between therobots and the goal, and repulsion forces to repel the robots from the obstacles and each other, are calculated to generate the 3-D map. The local minima problem is handled in this paper using the Virtual Obstacles (VOs) approach. The robot path is generated starting from the robot initial position to the goal based on the generated 3D potential map tobefollowed by the mobile robots. All simulations are done using MATLab and Virtual Robot Experimental Platform(V-REP). OntheMATLab side, the APF controller is implemented to build the map and generate robots paths. The robots are controlled to track the paths and visualized in the V-REP environment. Key Words: Multi-Robot Systems, Path Planning, Artificial Potential Field, V-REP, Local Minima, Virtual Obstacles 1. INTRODUCTION Nowadays, Multi-Robot Systems (MRSs) are one of the most growing areas in Robotics. As result of the technology in our life and the demand on robots in many tasks and applications, the challenges of MRS are increasing in a rapid way every day. Single-Robot Systems (SRSs) tasks are being more complex and expensive by time that is why MRSs are a necessity. MRSs added more applications and challenges to the Robotics field such as pollution monitoring, surveillance of buildings [1], warehouse management, forest fire detection and more applications. They evenreplacedSRSsin many applications as the robustness and reliability can be increased with more thanonesingle robot[2].Area coverage and exploration [3] is one of the main applications in robotics field in general. It was first developed with SRSs. Simultaneous Localization and Mapping (SLAM) is an application for robots that they generate a map for the surrounding environment by locating the obstacles and represent them in a way that allow the robots to navigate any uncovered areas [4]. There is advantage in Multi-Robot team that will improve the positioning accuracy, as every robot will be scanning or mapping specific area. By integrating all the maps, there will be a main map for the whole place [5]. Search and Rescue is another challenge of MRSs. First, the robot search for an object with specific characteristics. Then when any robot finds this object, it sends signals for all other robots.All robotsstandaround the object and they carry it to a specific goal. This can only be done through a team of robots, since one robot cannot handle the object if it is big and heavy [6]. Task Allocation application is used commonly in robots rescue missions, where the group of robots has a set of tasks or goals that must be done. Some tasks need more than one robot and some tasks can be handled by only one. In order to organize these tasks for the robots team, the Task allocation problem is handled [7], [8]. 2. PATH PLANNING Path Planning is the controller of the robot motion,soitisthe most essential part of the robot program. It is the determination of a free path starting from the robot position to the targeted goal. The robot environment consists of three modules, the robot itself, the goal and the obstacles in between. Path Planning can be divided in two main categories, global path planning and local path planning. In global path planning, the environment of the robot is already known with all obstacles and their locations. The terrain is static that is why a map can be generated with the path for the robot. On the other hand, in local path planning, the environment is unknown for the robot and can be dynamic. In that case, the robot must gather information about the environment in real time, and then update its control laws to achieve its goal [9]. Artificial Potential Field (APF) is one of the classical approaches that are used to implement the path-planning controller. In 1986, Khatib [21] introduced the first APF approach for real-time obstacle avoidance problem for manipulators and multi-robot systems. Rimon and Koditschek adopted in 1992 [10] the APF in as an approach forexact robot motion planning and control usingnavigation functions instead of the potential functions to solve the local minima problem. Then in 2000,GeandCui[11]describedthe problem of non-reachable goals with obstacle nearby when using APF using a new repulsive function to solve it. As an extension for their work, the potential field approach was proposed as obstacle avoidance methods for robots in dynamic environments in [12] in 2002. In addition, in 2005, the authors used queues and formation vertices, besides the
  • 2. International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056 Volume: 04 Issue: 09 | Sep -2017 www.irjet.net p-ISSN: 2395-0072 © 2017, IRJET | Impact Factor value: 5.181 | ISO 9001:2008 Certified Journal | Page 1164 APF for controlling the formation of group of robots to improve the flexibility of therobot formationandinthesame time, the group can avoid the obstacles [13]. Another paper conducted by Hsieh, Kumar and Chaimowicz in 2008 proposed a decentralized controller for shape generation with swarm of mobile robots [14]. A paper conducted by Nagy in 2009 to implement a controller for multi-agent system using Genetic Algorithm (GA)tobuildapotentialfield for unknown environments [15]. Saez-Pons, Alboul et. al. in 2010 [16] used the APF forcontrollingthegroupformationof multi-robot system called (GUARDIANS). Then in 2012 [17], Valbuena and Tanner suggested new control for differential mobile robot navigation using APF based on navigation functions, then a transformationforthemathematicalresults was introduced to obtain real-time velocities to be tested on real robot. Also, Hsieh, Kumar and Chaimowicz in 2008 [18] proposed an APF algorithm for mobile manipulator control using simplified potential functions. In [19] Rajvanshi, Islamused et. al. used the APF for controllingmobilerobotsin both staticanddynamicenvironmentsin2015usingArtificial Goals approach to solve the local minima problem.Andinthe same year, Ahmed, Abdalla and Abed [20] proposed Particle Swarm Optimization (PSO) method to modify the potential field method used, in order to solve the problem of local minima and optimize the path resulted by it. In this Paper, an offline (global) path-planning algorithm based on a modifiedAPFapproachisproposedforthecontrol of multi robot system in any cluttered static environment. The local minima problem is handled using the virtual obstacle approach. The modification of the APF is for generating the shortest path for the robots. Simulations are used to verify the proposed approach using MATLab and V- REP simulators. The rest of the paper is organized as follows: Section 3 introduces the APF graphically, mathematically, and introduces the local minima problem. Section 4 has the mathematical modeland introduces the V-REPenvironment. Section 5 has the simulations results. Section 6 is the conclusion, and finally, Section 7 suggests future recommendations for further researches. 3. ARTIFITIAL POTENTIAL FIELD The Artificial PotentialField (APF) is one of the classicalpath planning approaches that is used in robotics. Itcanbeusedin global and local path planning. It can be also used in dynamic or static environments. The concept about APF is to find a mathematical function to represent the energy of the system based on the idea of physical rules in potential fields. Potential functions assume the existence of repulsive and attractive forces acting on the robot in its world. Using both repulsive and attractive forces, a path for the robot can be created to its destination. The attractive force is generated between the robot andthegoal.Itisresponsibleforattracting the robot to the goal. The repulsiveforceisbetweentherobot and the obstacles. Its main functionisforavoidingthem.Both forces are generated by mathematical functions that are represented graphically by high and low areas in the robot space. The general APF equation as [11], [15], [19] and [21] introduced is as follows )()()( qUqUqU repatt  (1) where )(qUatt is the attractive isfunction,and )(qUrep isthe repulsion function. By summing both functionstogether,the total potential function is generated to be used inthecontrol of the robots. Fig -1: Total Potential Function 3.1 Attraction Potential Function The Attractive Potential Function is divided in two terms, conical potential and Quadratic potential. The conical potential is used when the robot is far away from the goal. On the other hand, the quadratic potential is used when the robot is near the goal. The reference thatwill define whether the robot is far or near is the term * goald . * * 2** 2 ),( ),( )( 2 1 ),( ),( 2 1 )( goalgoal goalgoal goalgoalgoal goal att dqqdif dqqdif dqqdd qqd qU            (2) where q is the position variable, ),( goalqqd is the distance function, and  is the scaling factor. This function is representing the potential that affect the robot while the force that will drive the robot to reach the goal will be generated from the negative gradient of this function. )()( qUqF attatt  (3) As * * * ),( ),( )( )( )( )( goalgoal goalgoal goal goalgoal goal att dqqdif dqqdif qqd qqd qq qU              (4) Moreover, in other works, Hargas et. al. [18] used another simplified version of the potential function. This equation
  • 3. International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056 Volume: 04 Issue: 09 | Sep -2017 www.irjet.net p-ISSN: 2395-0072 © 2017, IRJET | Impact Factor value: 5.181 | ISO 9001:2008 Certified Journal | Page 1165 has the position of the robot and the goal; X and Y coordinates, as the equation parameters. ])()[( 2 1 ),( 22 FinFinaatt yyxxKyxU  (5) where x and y are the coordinatesofthecurrentposition of the robot, Finx and Finy are the goal coordinates, and aK is the scaling factor. And the attractive force will be defined as                  )(),( )(),( ),( ),( Fina att ya Fina att xa att yyK y U yxf xxK x U yxf yx yxU (6) where ),( yxfxa , ),( yxfya are the attractiveforcesinthex and y directions respectively. 3.2 Repulsive Potential Function There is always one goal at a time for the robot but the obstacles are more than one. That is why the repulsive potential function consists of all the repulsive fields of every obstacle exists in the environment. Every obstacle has a specific limited region that hasa repulsivefield,sothatwhen the robot comes in that region, it will be repelled from that obstacle. The term that would define the region for every obstacle is * Q . And the repulsive field for only one obstacle is * *2 * )( )( 0 ) 1 )( 1 ( 2 1 )( QqDif QqDif QqDqU i i irepi           (7) where )(qD is the distance to the obstacle,  is thescaling factor, and i represent the order number of the current obstacle. The repulsive force would be represented as )()( qUqF ii reprep  (8) And * * 2* )( )( 0 )( )( 1 ) )( 11 ( QqDif QqDifqD qDqDQU i i iirepi           (9) The total repulsive function for n number of obstacles is   n i reprep qUqU i 1 )()( (10) While the simplified function as [18] introduced in their works is 22 )()(2 1 ),( obiobi o rep yyxx K yxU i   (11) where x and y are the coordinates of the current position of the robot, obix and obiy are thi theorderobstacle coordinates, and oK is the scaling factor. And the repulsive force is                y U yxf x U yxf yx yxU rep ya rep xo rep ),( ),( ),( ),( (12) 3.3 Local Minima Problem As most of the previous works like [10-13], [17] and [19, 20] mentioned, local minima problem is a serious problem that faces the traditional APF that is implemented by Equation 2 and 7. This problem is caused when there is a cavity in the obstacle or when the goal, the robot and the obstacle are in the same line. This will cause the robot to be trapped in a local minimum point in the potential field. Virtual Obstacle technique will be used when the robot is trapped in the obstacle cavities. The cavities would be filled with virtual obstacle that would repel the robot out of it. Virtual obstacles can be used also to solve the local minima problem in this way as [19] proposed. 4. MODELING In this model, the APF controller is applied on a multi-robot system with full considerationoftherobotskinematics.Local minima problem is handled by Virtual obstacles. The Simulation is done using V-Rep Simulator and controlled by MATLab. The robots usedare KheperaIII DifferentialRobots. The potential function used here are a more simplified version of Equation 5 and 11.Theapproachisoffline,sothere is no need forreal-timecalculations,andtheequationscanbe simplified. The attractive potential function used is: 22 )()( goalgoalaatt XIYJKU  (13) where aK is the scaling factor, goalX and goalY are the coordinates of the goal point, I and J are the coordinates of the current Pixel of the map. And the repulsive potential function used is: 22 )()( XIYJ K U o repi   (14) where oK is the scaling factor, X and Y are the coordinates of every point that represent an obstacle. The aim of these two equations is to build a new map but this map will have the potential form where every pixel of the map will have specific weight representing the potential of this pixel as in Figure 2.
  • 4. International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056 Volume: 04 Issue: 09 | Sep -2017 www.irjet.net p-ISSN: 2395-0072 © 2017, IRJET | Impact Factor value: 5.181 | ISO 9001:2008 Certified Journal | Page 1166 Fig -2: The 3D Potential Map 4.1 Differential Drive Kinematics The KheperaIII robot is a differential mobile robot. The differential robot is the robot that depends on only two wheels to move. Both wheels are mounted on the same axis but are driven by differentactuators.Byvaryingthespeedsof the two motors, the robot can perform different types of motion. The general requirements for any mobile robot to move are the linear and the angular velocities. However, the differential robots have only inputs for the velocity for each wheel in rpm. So, a controller function is used to change the required linear and angular velocities into the velocities of the left and right wheels. Fig -3: Differential Robot Diagram Dudek and Jenkin [22] introduced in their book the kinematics of the differential drive. The angular velocity of the robot at any instant is rotating around an Instantaneous Center of Curvature ICC. The radius of curvature R and the angular velocity of the robot  can be expressed by )( )( 2 1 lr lr VV VV R    and l VV lr )(   (15) where rV and lV are the left and right velocities, l is the distance between the two wheels and R isthedistancefrom the ICC to the midpoint of l . The kinematics model of the differential drive can be represented as lr l r r r l r r r y x                                                       )sin( 2 )cos( 2 )sin( 2 )cos( 2    (16) Where T yx ][  is the position vector of the mobile robot, r is the wheel radiusand T lr ][  istherightandleft wheels angular velocities. 4.2 V-REP Virtual Robot Experimentation Platform (V-REP) is a robotic simulator that is used for the experimentationin this work. It is an open source software and ithasdirectlink with MATLab. Its script can be written as MATLab script.Itcanbe linked to MATLab as a remote API. The environment used in the simulations consists of KheperaIII mobile robots, Vertical Vision Sensor, Obstacles, 5mx5m Floor, and the goal will be marked in red point as in Figure 4. Fig -4: The V-REP Environment used in the Simulations 5. RESULTS This model has two sides; MATLab and V-REP. The MATLab side will generate a 2D and 3D potential map for the environment while the V-REPwill showreal-timesimulation for the trajectory tracking of the robots. In the camera screen, the goal is represented as an orange area, The floor size is 5m×5m, and the (0,0) is at the left and the (5,5) point is at the right. In the vision sensor screen, the robot is represented by a small red circle, the obstacles are gray
  • 5. International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056 Volume: 04 Issue: 09 | Sep -2017 www.irjet.net p-ISSN: 2395-0072 © 2017, IRJET | Impact Factor value: 5.181 | ISO 9001:2008 Certified Journal | Page 1167 rectangles, the point (0,0) is at the top leftandthepoint(5,5) is at the bottom right of the vision sensor screen. The first experiment as in Fig. 5 has only one robot with two obstacles, to make initial test for the whole simulation. The robot is positioned at point (2.5,0.5), and the goal is at (1.5,4). The experiment takes 12 seconds calculating potentials time, 37 seconds total simulation time and 28 seconds real time (recorded video). The path length is 70 unit length and can be approximated to 4.22 meters. The samples are taken every 10 seconds as in Figure 5c, 5d, 5e and 5f. The last experiment as in Figure 6 has three robots with an obstacle. This obstacle has geometrytocreatea local minima point. The aim if this experiment is to test the multi- robot system with solving the local minima problem. The robots are positioned at points (1.5,0.5), (2.5,0.5) and (3.5,0.5), and the goal is at (2.5,4.5). The experiment takes 113 seconds calculating potentials time, 158 seconds total simulation time and 36 seconds real time (recorded video). The paths lengths are 86, 92 and 93 unit length and can be approximated to 5.19, 5.55 and 5.61 meters respectively. The samples are taken every 12 seconds as in Figure 6c, 6d, 6e and 6f. ( c ) ( d ) ( e ) ( f ) Fig -5: First Experiment Results ( a ) ( b )
  • 6. International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056 Volume: 04 Issue: 09 | Sep -2017 www.irjet.net p-ISSN: 2395-0072 © 2017, IRJET | Impact Factor value: 5.181 | ISO 9001:2008 Certified Journal | Page 1168 ( a ) ( b ) ( c ) ( d ) ( e ) ( f ) Fig -6: Second Experiment Results 6. CONCLUSION Choosing specific path planning approach is a serious problem in any robotic application. Some applications need the path planning to be fast without focusing on how accurate it is. Other applications need the path is to be very accurate. APF is one of the classic approaches of the path planning, and it has more than one way to be implemented. APF concept is built on representing the robot environment with potential field, where the obstacles have high potential and the goal has low potential. This causes the robot to be attracted to the goal and in the same time repelled from the obstacles. In case of multi-robot system, every robot is an obstacle for the other robots, so the robots cannot collide with each other. The proposed approach combinesbothAPF and Virtual Obstacles approaches. The validity of the proposed approach is tested and simulated using MATLab and V-REP as a real-time simulator. The experimentsresults show the effectiveness of this paper approach. 7. FUTURE WORK There are many ways to enhance the results of the simulations and to make it more practical to use in real life. First, to make the result more practical, the potential field should be used as on-line path planning approach to make real-time closed-loop controller for each robot. Second, to enhance the result of the path generated, an optimization technique should be used like Genetic Algorithm GA or Particle Swarm Optimization PSO, that will give optimized control parameters andgeneratetheshortestpath.Third, for
  • 7. International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056 Volume: 04 Issue: 09 | Sep -2017 www.irjet.net p-ISSN: 2395-0072 © 2017, IRJET | Impact Factor value: 5.181 | ISO 9001:2008 Certified Journal | Page 1169 using this approach on hardware, KheperaIII or similar mobile robots are the recommended robots to be used. REFERENCES [1] Ibrahim, A.A., Ghareeb, Z.S., Shehata,O.M.,Morgan,E.S.I.: A robotic surveillance platform based on an on-board computer vision approach. In: Proceedings of the 4th International Conference on Control, Mechatronics and Automation, pp.41-45. ACM (2016) [2] Lima, P.U., Custodio, L.M.: Multi-robot systems. In: Innovations in robot mobility and control, pp. 1-64. Springer (2005) [3] Samuel, V.M., Shehata, O.M., Morgan, E.S.I.: Chaos generation for multi-robot 3d-volume coverage maximization. In: Proceedings of the 4th International Conference on Control, Mechatronics and Automation, pp. 36-40. ACM (2016) [4] Nabil, M., Kassem, M., Bahnasy, A., Shehata, O.M., Morgan, E.S.I.: Rescue missions bots using active slam and map feature extraction. In: Proceedings of the 4th International Conference on Control, Mechatronics and Automation, pp. 31-35. ACM (2016) [5] Kassem, M., Shehata, O.M., Morgan, E.I.: Multi-modal mobile sensor data fusion for autonomous robot mapping problem. In: MATEC Web of Conferences, vol. 42. EDP Sciences (2016) [6] Jennings, J.S., Whelan, G., Evans, W.F.: Cooperative search and rescue with a team of mobile robots. In: Advanced Robotics, 1997. ICAR'97. Proceedings., 8th International Conference on, pp. 193-200. IEEE (1997) [7] El-Ansary, S., Shehata, O.M., Morgan, E.S.I.: Airport management controller: A multi-robot task-allocation approach. In: Proceedings of the 4th International Conference on Control, Mechatronics and Automation, pp. 26-30. ACM (2016) [8] Hussein, A., Adel, M., Bakr, M., Shehata, O.M., Khamis, A.: Multi-robot task allocation for search and rescue missions. In: Journal of Physics: Conference Series, vol. 570, p. 052006. IOP Publishing (2014) [9] Leena, N., Saju, K.: A survey on path planning techniques for autonomous mobile robots. IOSR Journal of Mechanical and Civil Engineering (IOSR-JMCE) 8, 76-79 (2014) [10] Rimon, E., Koditschek, D.E.: Exact robot navigationusing artificial potential functions. IEEE Transactions on robotics and automation 8(5), 501-518 (1992) [11] Ge, S.S., Cui, Y.J.: New potential functions for mobile robot path planning. IEEE Transactions on robotics and automation 16(5), 615-620 (2000) [12] Ge, S.S., Cui, Y.J.: Dynamic motion planning for mobile robots using potential field method. Autonomousrobots 13(3), 207-222 (2002) [13] Ge, S.S., Fua, C.H.: Queues and artificial potential trenches for multirobot formations. IEEE Transactions on Robotics 21(4), 646-656 (2005) [14] Hsieh, M.A., Kumar, V., Chaimowicz, L.: Decentralized controllers for shape generation with robotic swarms. Robotica 26(5), 691-701 (2008) [15] Nagy, I.: Behaviour study of a multi-agent mobile robot system during potential field building.Acta Polytechnica Hungarica 6(4), 111-136 (2009) [16] Saez-Pons, J., Alboul, L., Penders, J., Nomdedeu,L.:Multi- robot team formation control in the guardians project. Industrial Robot: An International Journal 37(4), 372- 383 (2010) [17] Valbuena, L., Tanner, H.G.: Hybrid potential field based control of differential drive mobile robots. Journal of intelligent & robotic systems pp. 1-16 (2012) [18] Hargas, Y., Mokrane, A., Hentout, A., Hachour, O., Bouzouia, B.: Mobile manipulator path planning based on artificial potential field: Application on robuter/ulm. In: Electrical Engineering (ICEE),20154thInternational Conference on, pp. 1-6. IEEE (2015) [19] Rajvanshi, A., Islam, S., Majid, H., Atawi, I., Biglerbegian, M., Mahmud, S.: An efficient potential-function based path-planning algorithm for mobile robots in dynamic environments with moving targets (2015) [20] Ahmed, A.A., Abdalla, T.Y., Abed, A.A.: Path planning of mobile robot by using modifiedoptimizedpotential field method. International Journal of ComputerApplications 113(4) (2015) [21] Khatib, O.: Real-time obstacle avoidance for manipulators and mobile robots. The international journal of robotics research 5(1), 90-98 (1986) [22] Dudek, G., Jenkin, M.: Computational principles of mobile robotics. Cambridge university press (2010)
  翻译: