SlideShare a Scribd company logo
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM FOR WHEELED
MOBILE ROBOT IN A KNOWN DYNAMIC ENVIRONMENT
BY
NITISH KOYYALAMUDI
K-ID: K00346319
INSTRUCTOR
DR. LIFFORD MCLAUCHLAN
DEPARTMENT OF ELECTRICAL ENGINEERING AND COMPUTER SCIENCE
ABSTRACT
Must ensure an optimal path for mobile robot path planning. Best possible paths, time, energy
consumption, etc. Path planning of robots also depends on static or dynamic operating environment
such as a known or unknown. This article uses A * algorithm and genetic algorithm research on global
path planning. Known as a dynamic environment, and communicate the control station will calculate
the shortest path to mobile robots and a robot will traverse the path to achieving the goal.
Trace the path traversed by the robot control station. The shortest path for mobile robot navigation, if
robots detect doomed any obstacle in your path, mobile robots will update the information relating to
the environment, and place this information will be sent to the control station. Then the control station,
with updated maps and new starting position and recalculate the new shortest path of destination, if
any, and move to the robot, it can reach its destination. This technology has been implemented and in
the real world of experiment and simulation of a wide range of test run. Results show that technology
effectively calculates the known the shortest path in your environment in dynamic and allows robots to
complete tasks quickly.
Key Words: A* algorithm, path planning, mobile robot
1. INTRODUCTION
Path Planning of Mobile robot is usually stated as given the description of mobile robots and
environments, planned two specified locations, between start and end points of the path. Paths should
be free of bumps and some optimization condition is met (that is, minimum cost paths). According to
this definition, the path planning is classified as a problem of optimization. Researchers defined
different techniques as the solution for the path planning based on various factors like:
1. Environment type (i.e., static or dynamic),
2. Path Planning Algorithms (i.e., global or local).
The environment doesn’t contain any moving object is known as the static environment, in addition to
the navigation of robot moving dynamic environment with dynamic objects (that is, human beings,
mobile machines, and other mobile robots). Path Planning of the global algorithm requires all
environment is fully aware of the static environment. While, path planning of local refers to
implementing the path planning while the robot is on the move; other words, A* algorithm is having an
ability of new path-finding accordingly to the changes in the environment.
1. SYSTEM ARCHITECTURE
Wheeled mobile robot composed of an infrared range finder, position encoder, and communication
module soon. 3 Infrared range finder detects obstacles were placed on the RIGHT side, FRONT side
and LEFT side of the robot, as in Figure.1. Position encoders allow a robot to measures itself from the
location how it is passed from one location. With Communication unit, (Xbee) allows robots to give
and take information.
Figure1: Wheeled Mobile Robot
Grand Central Terminal by the PC desktop and the (Xbee) wireless unit. Path planning algorithm for
central train station will be running will be wirelessly transmitted to a robot. The environment is
assumed to be known as grid environment, here the robot's position expressed in a Cartesian coordinate
system of two-dimensional. The motion of Robot is assumed to be in horizontal and vertical direction
isn't considered to be the movement of diagonal.
The site and assumptions are given below:
 Mobile robot is assuming as a point in time and size occupies only one cell
 A series of sensors are equipped, position encoders and communications set
 4- directions means NORTH, EAST, SOUTH, WEST are movable
1. DESIGN AND IMPLEMENTATION
3.1 Central Station
Desktop as a central control station, A* algorithm for the calculation of the shortest path. The algorithm
output is moving (forward, backward, left, right, etc) sequences were communicated through wireless
communication (Xbee) mobile robot. RS-232 serial port is applied where the pins will Transmit (Tx)
and Receive (Rx). Both Coded algorithm and serial port are accessed with “C++”. Serial port is joined
by a serial cable to the (Xbee) communication unit.
3.2 Mobile Robot
Embedded in “C” programming for mobile robots, navigation using the position encoder the desired
path. Distance or angle of rotation can accurately control by the position encoder. Commands that can
be received wirelessly with the Xbee from the central train station. Once get on to the target, mobile
robots will give to the Central unit.
3.2.1 Localization of Robot
Initial direction is EAST assumes for that robot. Mobile robot and then calculate its position using an
algorithm in the grid. I and j represent the x and y axis movement respectively. Figure.2 shows the
position values for j and i if it has changed, and to move in various directions.
Robots initial direction is assumed as EAST. The mobile robot will then calculate its position in the
grid using an algorithm. Let i and j represent the movement in x and y axis’s respectively. Figure.2
shows the change in location values i and j, while moving in different directions.
Figure.2: Robots Orientation
ORTN values, N, S, E and W said the direction of the robot in the North, South, East and West,
respectively. ROTN on behalf of the robot spin around and F, R, L, the robot movement. Assuming the
initial orientation of the robot to the East is the ORTN = E. Robot localization pseudo code is as below
1) If ROTN=F and ORTN=E, then ORTN=E and i++;
2) If ROTN=R and ORTN=E, then ORTN=S and j++;
3) If ROTN=L and ORTN=E, then ORTN=N and j-- ;
Robot motion every time it updates its value orientation and position values in the x and y axis. Robots
continue to look for obstacles in the path. Figure.4 shows Setup flow chart.
Figure.3: Flow chart
1. EXPERIMENTAL SETUP
Size of the mesh (20x20) cm arrangements, which obstacles are saved and fed to the central station.
Central station will calculate the shortest route, which would communicate wirelessly to the robot and
begin by specifying the path for mobile robots. If the robot detects obstacles in the specified path, the
robot stops moving; their location and obstacle location. Such information and directions will be sent to
the central unit. Update of table's central railway station, assigns the current robot position as a starting
point. Central station rerun algorithms and smallest path if one robot will be notified. The 5×3 grid is
applied. Obstacles matrix provides information of current obstacles in a known environment. Nodes of
start and destination nodes are given.
Central station inputs contain:
1. Source location
2. Destination location
3. Giving the obstacle location in the Obstacle table
Figure.5: Output window at central station
The output central station has:
1. Time to Computation
2. Routing movement and
3. Commands
Figure.6: Shortest path planning scenario in static environment
Path planning algorithm in Figure.6 a dynamic environment with known experimental devices. Setting
the start position is supply as a source to a central unit. Hurdles table, namely the size 5 x 3 are
initialized to 0 or 1 according to the obstacles. In addition, to initializing destination point.
Figure.7: Shortest path planning scenario in dynamic environment
Experimental setup in Figure.7 of path planning algorithm in dynamic environments, also in the third
obstacle placed on a grid. To the target process, the robot detected the third obstacle, then it will be
localized, and unobstructed location. This communication is transmitted to the central unit, runs
programming algorithm of the shortest path using the updated information, which will enable the
destination smallest path traversal for mobile robots.
1. CONCLUSIONS
Path planning in a familiar environment is constructed and executed. The robot can travel to the target
by the smallest path. It was found to have deviated from the actual and desired paths. This is because of
the wheel slip position measuring system fault, battery charge fluctuation differences and friction in
between the wheel and the path, use of position while avoiding and mapping technology as the
extended Kalman filter, from the path of deviation, particulate filters, can predict the probability and
statistics methods, it can be amended accordingly.
REFERENCES
[1]. Masehian, Ellips, and Davoud Sedighizadeh., Classic and heuristic approaches in robot motion
planning-a chronological review, World Academy of Science, Engineering and Technology 29 (2007):
101-106.
[2]. Park, Sujin, Jin Hong Jung, and Seong-Lyun Kim., Cooperative path-finding of multi-robots with
wireless multihop communications, Modeling and Optimization in Mobile, Ad Hoc, and Wireless
Networks and Workshops, 2008, WiOPT 2008, 6th International Symposium on. IEEE, 2008.
[3]. Cui, Shi-Gang, Hui Wang, and Li Yang, A Simulation Study of A-star Algorithm for Robot Path
Planning, 16th international conference on mechatronics technology,PP: 506 – 510, 2012
[4]. Sedighi, Kamran H., Kaveh Ashenayi, Theodore W. Manikas, Roger L. Wainwright, and Heng-
Ming Tai., Autonomous local path planning for a mobile robot using a genetic algorithm, In
Evolutionary Computation, 2004, CEC2004, Congress on, vol. 2, pp. 1338-1345. IEEE, 2004.
[5] T. Akimoto and N. Hagita "Introduction to a Network Robot System", Proc. intl Symp. Intelligent
Sig. Processing and Communication, 2006
[6]. A. Stentz, "Optimal and efficient path planning for unknown and dynamic enviroments," Technical
report, CMU- RI-TR-93-20, The Robotics Institute, Carnegie Mellon University, PA, USA, 1993.
[7]. H. Noborio, K. Fujimura and Y. Horiuchi, "A comparative study of sensor-based path-planning
algorithms in an unknown maze," Proc. IEEE/RSJ Int. Conf. Intelligent Robots and Systems, pp. 909-
916, 2000.
[8] L. Podsedkowski, J. Nowakowski, M. Idzikowski and I. Vizvary, "A new solution method for path
planning in partially known or unkonwn environment for nonholonomic mobile robots," Elsevier
Robotics and Autonomous Systems, Vol. 34, pp. 145-152, 2001.
[9] M. Szymanski, T. Breitling, J. Seyfried and H . Wörn, "Distributed shortest-path finding by a mirco-
robot swarm," Springer Ant Colony Optimization and Swarm Intelligence, LNCS 4150, pp. 404-411,
2006.

More Related Content

What's hot (19)

PPT
Robot motion planning
AJAL A J
 
ODP
Exact Cell Decomposition of Arrangements used for Path Planning in Robotics
Umair Amjad
 
PPT
Path Planning And Navigation
guest90654fd
 
PDF
Motion Planning
Alaa Khamis, PhD, SMIEEE
 
PDF
Iaetsd modified artificial potential fields algorithm for mobile robot path ...
Iaetsd Iaetsd
 
PDF
Ultimate Goals In Robotics
Farzad Nozarian
 
PDF
Mobile robot path planning using ant colony optimization
eSAT Publishing House
 
PDF
Driving Behavior for ADAS and Autonomous Driving V
Yu Huang
 
PPTX
Trajectory Planning Through Polynomial Equation
gummaavinash7
 
PDF
Pedestrian behavior/intention modeling for autonomous driving II
Yu Huang
 
PDF
GENERATION AND DEPARTABILITY OF GVG FOR CAR-LIKE ROBOT
cscpconf
 
PDF
Driving Behavior for ADAS and Autonomous Driving VIII
Yu Huang
 
PDF
Robotics Navigation
cairo university
 
PDF
Simulation for autonomous driving at uber atg
Yu Huang
 
PDF
A Hough Transform Implementation for Line Detection for a Mobile Robot Self-N...
iosrjce
 
PDF
Driving behaviors for adas and autonomous driving XIII
Yu Huang
 
DOCX
artifical intelligence final paper
shiva karthik reddy koyya
 
PDF
Driving Behavior for ADAS and Autonomous Driving X
Yu Huang
 
PDF
Help the Genetic Algorithm to Minimize the Urban Traffic on Intersections
IJORCS
 
Robot motion planning
AJAL A J
 
Exact Cell Decomposition of Arrangements used for Path Planning in Robotics
Umair Amjad
 
Path Planning And Navigation
guest90654fd
 
Motion Planning
Alaa Khamis, PhD, SMIEEE
 
Iaetsd modified artificial potential fields algorithm for mobile robot path ...
Iaetsd Iaetsd
 
Ultimate Goals In Robotics
Farzad Nozarian
 
Mobile robot path planning using ant colony optimization
eSAT Publishing House
 
Driving Behavior for ADAS and Autonomous Driving V
Yu Huang
 
Trajectory Planning Through Polynomial Equation
gummaavinash7
 
Pedestrian behavior/intention modeling for autonomous driving II
Yu Huang
 
GENERATION AND DEPARTABILITY OF GVG FOR CAR-LIKE ROBOT
cscpconf
 
Driving Behavior for ADAS and Autonomous Driving VIII
Yu Huang
 
Robotics Navigation
cairo university
 
Simulation for autonomous driving at uber atg
Yu Huang
 
A Hough Transform Implementation for Line Detection for a Mobile Robot Self-N...
iosrjce
 
Driving behaviors for adas and autonomous driving XIII
Yu Huang
 
artifical intelligence final paper
shiva karthik reddy koyya
 
Driving Behavior for ADAS and Autonomous Driving X
Yu Huang
 
Help the Genetic Algorithm to Minimize the Urban Traffic on Intersections
IJORCS
 

Similar to DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM (20)

PDF
Design and implementation of path planning algorithm for wheeled mobile robot...
eSAT Publishing House
 
PDF
Design and implementation of path planning algorithm for wheeled mobile robot...
eSAT Journals
 
PDF
A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...
JaresJournal
 
PDF
Autonomous Path Planning and Navigation of a Mobile Robot with Multi-Sensors ...
CSCJournals
 
PDF
Wall follower autonomous robot development applying fuzzy incremental controller
Yousef Moh. Abueejela
 
PDF
Wall follower autonomous robot development applying fuzzy incremental controller
rajabco
 
PDF
Autonomous laser guided vehicle for book deposition in a library
Pushkar Limaye
 
PDF
Design of Mobile Robot Navigation system using SLAM and Adaptive Tracking Con...
iosrjce
 
PDF
K017655963
IOSR Journals
 
PDF
Stairs Detection Algorithm for Tri-Star Wheeled Robot and Experimental Valida...
Premier Publishers
 
PDF
Trajectory reconstruction for robot programming by demonstration
IJECEIAES
 
PDF
Bauldree_Hui_ATAV_Report
Benjamin Bauldree
 
PPT
Path Planning And Navigation
guest90654fd
 
PDF
Modelling of Walking Humanoid Robot With Capability of Floor Detection and Dy...
ijfcstjournal
 
PDF
Modelling of walking humanoid robot with capability of floor detection and dy...
ijfcstjournal
 
PDF
Wmr obstacle avoidance using compass and ultrasonic
Yousef Moh. Abueejela
 
PDF
IRJET- Survey Paper on Human Following Robot
IRJET Journal
 
PPTX
Seminer-Merve AYDIN-4802220035-SUNUM.pptx
ssuserf6b378
 
PPTX
Artificial Neural Network based Mobile Robot Navigation
Mithun Chowdhury
 
PDF
Medical robots history
Shadi Nabil Albarqouni
 
Design and implementation of path planning algorithm for wheeled mobile robot...
eSAT Publishing House
 
Design and implementation of path planning algorithm for wheeled mobile robot...
eSAT Journals
 
A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...
JaresJournal
 
Autonomous Path Planning and Navigation of a Mobile Robot with Multi-Sensors ...
CSCJournals
 
Wall follower autonomous robot development applying fuzzy incremental controller
Yousef Moh. Abueejela
 
Wall follower autonomous robot development applying fuzzy incremental controller
rajabco
 
Autonomous laser guided vehicle for book deposition in a library
Pushkar Limaye
 
Design of Mobile Robot Navigation system using SLAM and Adaptive Tracking Con...
iosrjce
 
K017655963
IOSR Journals
 
Stairs Detection Algorithm for Tri-Star Wheeled Robot and Experimental Valida...
Premier Publishers
 
Trajectory reconstruction for robot programming by demonstration
IJECEIAES
 
Bauldree_Hui_ATAV_Report
Benjamin Bauldree
 
Path Planning And Navigation
guest90654fd
 
Modelling of Walking Humanoid Robot With Capability of Floor Detection and Dy...
ijfcstjournal
 
Modelling of walking humanoid robot with capability of floor detection and dy...
ijfcstjournal
 
Wmr obstacle avoidance using compass and ultrasonic
Yousef Moh. Abueejela
 
IRJET- Survey Paper on Human Following Robot
IRJET Journal
 
Seminer-Merve AYDIN-4802220035-SUNUM.pptx
ssuserf6b378
 
Artificial Neural Network based Mobile Robot Navigation
Mithun Chowdhury
 
Medical robots history
Shadi Nabil Albarqouni
 
Ad

DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM

  • 1. DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM FOR WHEELED MOBILE ROBOT IN A KNOWN DYNAMIC ENVIRONMENT BY NITISH KOYYALAMUDI K-ID: K00346319 INSTRUCTOR DR. LIFFORD MCLAUCHLAN DEPARTMENT OF ELECTRICAL ENGINEERING AND COMPUTER SCIENCE
  • 2. ABSTRACT Must ensure an optimal path for mobile robot path planning. Best possible paths, time, energy consumption, etc. Path planning of robots also depends on static or dynamic operating environment such as a known or unknown. This article uses A * algorithm and genetic algorithm research on global path planning. Known as a dynamic environment, and communicate the control station will calculate the shortest path to mobile robots and a robot will traverse the path to achieving the goal. Trace the path traversed by the robot control station. The shortest path for mobile robot navigation, if robots detect doomed any obstacle in your path, mobile robots will update the information relating to the environment, and place this information will be sent to the control station. Then the control station, with updated maps and new starting position and recalculate the new shortest path of destination, if any, and move to the robot, it can reach its destination. This technology has been implemented and in the real world of experiment and simulation of a wide range of test run. Results show that technology effectively calculates the known the shortest path in your environment in dynamic and allows robots to complete tasks quickly. Key Words: A* algorithm, path planning, mobile robot
  • 3. 1. INTRODUCTION Path Planning of Mobile robot is usually stated as given the description of mobile robots and environments, planned two specified locations, between start and end points of the path. Paths should be free of bumps and some optimization condition is met (that is, minimum cost paths). According to this definition, the path planning is classified as a problem of optimization. Researchers defined different techniques as the solution for the path planning based on various factors like: 1. Environment type (i.e., static or dynamic), 2. Path Planning Algorithms (i.e., global or local). The environment doesn’t contain any moving object is known as the static environment, in addition to the navigation of robot moving dynamic environment with dynamic objects (that is, human beings, mobile machines, and other mobile robots). Path Planning of the global algorithm requires all environment is fully aware of the static environment. While, path planning of local refers to implementing the path planning while the robot is on the move; other words, A* algorithm is having an ability of new path-finding accordingly to the changes in the environment.
  • 4. 1. SYSTEM ARCHITECTURE Wheeled mobile robot composed of an infrared range finder, position encoder, and communication module soon. 3 Infrared range finder detects obstacles were placed on the RIGHT side, FRONT side and LEFT side of the robot, as in Figure.1. Position encoders allow a robot to measures itself from the location how it is passed from one location. With Communication unit, (Xbee) allows robots to give and take information. Figure1: Wheeled Mobile Robot Grand Central Terminal by the PC desktop and the (Xbee) wireless unit. Path planning algorithm for central train station will be running will be wirelessly transmitted to a robot. The environment is assumed to be known as grid environment, here the robot's position expressed in a Cartesian coordinate system of two-dimensional. The motion of Robot is assumed to be in horizontal and vertical direction isn't considered to be the movement of diagonal. The site and assumptions are given below:  Mobile robot is assuming as a point in time and size occupies only one cell  A series of sensors are equipped, position encoders and communications set  4- directions means NORTH, EAST, SOUTH, WEST are movable
  • 5. 1. DESIGN AND IMPLEMENTATION 3.1 Central Station Desktop as a central control station, A* algorithm for the calculation of the shortest path. The algorithm output is moving (forward, backward, left, right, etc) sequences were communicated through wireless communication (Xbee) mobile robot. RS-232 serial port is applied where the pins will Transmit (Tx) and Receive (Rx). Both Coded algorithm and serial port are accessed with “C++”. Serial port is joined by a serial cable to the (Xbee) communication unit. 3.2 Mobile Robot Embedded in “C” programming for mobile robots, navigation using the position encoder the desired path. Distance or angle of rotation can accurately control by the position encoder. Commands that can be received wirelessly with the Xbee from the central train station. Once get on to the target, mobile robots will give to the Central unit. 3.2.1 Localization of Robot Initial direction is EAST assumes for that robot. Mobile robot and then calculate its position using an algorithm in the grid. I and j represent the x and y axis movement respectively. Figure.2 shows the position values for j and i if it has changed, and to move in various directions. Robots initial direction is assumed as EAST. The mobile robot will then calculate its position in the grid using an algorithm. Let i and j represent the movement in x and y axis’s respectively. Figure.2 shows the change in location values i and j, while moving in different directions. Figure.2: Robots Orientation
  • 6. ORTN values, N, S, E and W said the direction of the robot in the North, South, East and West, respectively. ROTN on behalf of the robot spin around and F, R, L, the robot movement. Assuming the initial orientation of the robot to the East is the ORTN = E. Robot localization pseudo code is as below 1) If ROTN=F and ORTN=E, then ORTN=E and i++; 2) If ROTN=R and ORTN=E, then ORTN=S and j++; 3) If ROTN=L and ORTN=E, then ORTN=N and j-- ; Robot motion every time it updates its value orientation and position values in the x and y axis. Robots continue to look for obstacles in the path. Figure.4 shows Setup flow chart. Figure.3: Flow chart
  • 7. 1. EXPERIMENTAL SETUP Size of the mesh (20x20) cm arrangements, which obstacles are saved and fed to the central station. Central station will calculate the shortest route, which would communicate wirelessly to the robot and begin by specifying the path for mobile robots. If the robot detects obstacles in the specified path, the robot stops moving; their location and obstacle location. Such information and directions will be sent to the central unit. Update of table's central railway station, assigns the current robot position as a starting point. Central station rerun algorithms and smallest path if one robot will be notified. The 5×3 grid is applied. Obstacles matrix provides information of current obstacles in a known environment. Nodes of start and destination nodes are given. Central station inputs contain: 1. Source location 2. Destination location 3. Giving the obstacle location in the Obstacle table Figure.5: Output window at central station The output central station has: 1. Time to Computation 2. Routing movement and 3. Commands
  • 8. Figure.6: Shortest path planning scenario in static environment Path planning algorithm in Figure.6 a dynamic environment with known experimental devices. Setting the start position is supply as a source to a central unit. Hurdles table, namely the size 5 x 3 are initialized to 0 or 1 according to the obstacles. In addition, to initializing destination point. Figure.7: Shortest path planning scenario in dynamic environment
  • 9. Experimental setup in Figure.7 of path planning algorithm in dynamic environments, also in the third obstacle placed on a grid. To the target process, the robot detected the third obstacle, then it will be localized, and unobstructed location. This communication is transmitted to the central unit, runs programming algorithm of the shortest path using the updated information, which will enable the destination smallest path traversal for mobile robots.
  • 10. 1. CONCLUSIONS Path planning in a familiar environment is constructed and executed. The robot can travel to the target by the smallest path. It was found to have deviated from the actual and desired paths. This is because of the wheel slip position measuring system fault, battery charge fluctuation differences and friction in between the wheel and the path, use of position while avoiding and mapping technology as the extended Kalman filter, from the path of deviation, particulate filters, can predict the probability and statistics methods, it can be amended accordingly.
  • 11. REFERENCES [1]. Masehian, Ellips, and Davoud Sedighizadeh., Classic and heuristic approaches in robot motion planning-a chronological review, World Academy of Science, Engineering and Technology 29 (2007): 101-106. [2]. Park, Sujin, Jin Hong Jung, and Seong-Lyun Kim., Cooperative path-finding of multi-robots with wireless multihop communications, Modeling and Optimization in Mobile, Ad Hoc, and Wireless Networks and Workshops, 2008, WiOPT 2008, 6th International Symposium on. IEEE, 2008. [3]. Cui, Shi-Gang, Hui Wang, and Li Yang, A Simulation Study of A-star Algorithm for Robot Path Planning, 16th international conference on mechatronics technology,PP: 506 – 510, 2012 [4]. Sedighi, Kamran H., Kaveh Ashenayi, Theodore W. Manikas, Roger L. Wainwright, and Heng- Ming Tai., Autonomous local path planning for a mobile robot using a genetic algorithm, In Evolutionary Computation, 2004, CEC2004, Congress on, vol. 2, pp. 1338-1345. IEEE, 2004. [5] T. Akimoto and N. Hagita "Introduction to a Network Robot System", Proc. intl Symp. Intelligent Sig. Processing and Communication, 2006 [6]. A. Stentz, "Optimal and efficient path planning for unknown and dynamic enviroments," Technical report, CMU- RI-TR-93-20, The Robotics Institute, Carnegie Mellon University, PA, USA, 1993. [7]. H. Noborio, K. Fujimura and Y. Horiuchi, "A comparative study of sensor-based path-planning algorithms in an unknown maze," Proc. IEEE/RSJ Int. Conf. Intelligent Robots and Systems, pp. 909- 916, 2000. [8] L. Podsedkowski, J. Nowakowski, M. Idzikowski and I. Vizvary, "A new solution method for path planning in partially known or unkonwn environment for nonholonomic mobile robots," Elsevier Robotics and Autonomous Systems, Vol. 34, pp. 145-152, 2001. [9] M. Szymanski, T. Breitling, J. Seyfried and H . Wörn, "Distributed shortest-path finding by a mirco- robot swarm," Springer Ant Colony Optimization and Swarm Intelligence, LNCS 4150, pp. 404-411, 2006.