Progress_in_Construction_Robot_Path-Planning_Algor
Progress_in_Construction_Robot_Path-Planning_Algor
1 School of Mechanical-Electronic and Vehicle Engineering, Beijing University of Civil Engineering and
Architecture, Beijing 102616, China; [email protected] (D.Y.);
[email protected] (Z.M.)
2 Key Laboratory for Thermal Science and Power Engineering of Ministry of Education, Department of Energy
and Power Engineering, Tsinghua University, Beijing 100089, China; [email protected]
* Correspondence: [email protected]
Abstract: Construction robots are increasingly becoming a significant force in the digital
transformation and intelligent upgrading of the construction industry. Path planning is
crucial for the advancement of building robot technology. Based on the understanding of
construction site information, this paper categorizes path-planning algorithms into two
types: global path-planning and local path-planning. Local path planning is further divided
into classical algorithms, intelligent algorithms, and reinforcement learning algorithms.
Using this classification framework, this paper summarizes the latest research develop-
ments in path-planning algorithms, analyzes the advantages and disadvantages of various
algorithms, introduces several optimization strategies, and presents the results of these
optimizations. Furthermore, common environmental modeling methods, path quality
evaluation criteria, commonly used sensors for robots, and the future development of
path-planning technologies in swarm-based construction robots are also discussed. Finally,
this paper explores future development trends in the field. The aim is to provide references
for related research, enhance the path-planning capabilities of construction robots, and
promote the intelligent development of the construction industry.
processes, necessitating the use of integrated intelligent equipment such as robots. In recent
years, mechanized and automated construction models have been progressively adopted
in the industry, leading to the development and deployment of specialized construction
robots. These robots are defined as machines capable of executing construction tasks
either autonomously or semi-autonomously, following pre-defined programming. By
addressing labor shortages, construction robots not only enhance operational efficiency but
also improve the quality of work within the construction industry [11,12]. Compared to
industrial robots, the history of construction robots is relatively short. The development
of construction robots originated in Japan in the 1970s. In 1982, a fire-resistant material
spraying robot (Shimizu Corporation, Tokyo, Japan) developed by the Japanese Shimizu
Corporation (Tokyo, Japan) was successfully used on a construction site, marking the
world’s first construction robot to be successfully applied. From the 1980s to the 1990s, with
the development of robotic technology and increased investment from the United States,
Europe, and others, the types of construction robots began to diversify and evolve towards
automation and intelligence. In the 21st century, the scope of work for construction robots
has expanded, gradually moving from traditional construction and construction fields
towards demolition, building maintenance, and other areas. After 2010, the development
and application of technologies such as artificial intelligence, machine vision, and 3D
printing significantly advanced the field of construction robotics. This progress led to
the emergence of new types of construction robots capable of autonomous navigation,
decision-making, and precise construction tasks—for example, the exterior wall cleaning
robot called GEKKO (GEKKO GmbH, Ostfildern, Germany) by the (Ostfildern, Germany).
The development and application of these construction robots have made it possible for
humans to be relieved from hard and dangerous construction work. Figure 1 shows the
development process of construction robots.
Construction robots are divided into two categories: construction robots in the field
of civil engineering (CRCE) and construction robots in the field of building construction
(CRBE). The primary difference between the two lies in their construction scenarios. CRCE
is mainly used for infrastructure projects, such as roads, bridges, tunnels, and dams. In
contrast, CRBE is applied to housing construction, including residential buildings, office
buildings, and commercial complexes.
CRCE typically handles large-scale operations, such as earthmoving, foundation
treatment, concrete pouring, and steel structure installation. These robots require powerful
performance and stability to operate in complex terrains and harsh environments. However,
the degree of automation in CRCE is relatively lower compared to CRBE, often relying
more on manual control. Common examples of CRCE include excavation robots, concrete
spraying robots, and tunnel boring machines.
On the other hand, CRBE focuses on indoor precision tasks, such as bricklaying,
wall treatment, decoration, and pipe installation. These robots demand high precision
and flexibility to adapt to complex building structures and diverse construction needs.
As a result, CRBE often achieves fully automated operations. Typical examples include
bricklaying robots, wall spraying robots, and 3D printing construction robots.
Path planning is crucial for advancing autonomous navigation technology in construc-
tion robots and has become a significant topic in academic research. When constructing
roads, bridges, and other large structures, CRCE robots often operate in environments with
narrow roads, steep slopes, and many curves. Additionally, many remote areas have weak
or no mobile communication signals, although the on-site environment remains relatively
stable. Therefore, these robots can rely on offline global path-planning algorithms, such as
A* and Dijkstra, for autonomous navigation.
Appl. Sci. 2025, 15, x FOR PEER REVIEW 3 of 28
Appl. Sci. 2025, 15, 1165 3 of 27
2000–2010s 2010–
1970–1980s The application of artificial
Construction robots are
Architectural robots were extending from traditional intelligence, machine vision ,and
construction to areas such other technologies has promoted
first developed by Japan, Hilti Jaibot Construction as demolition and the development of construction
with Shimizu Corporation Drilling Robot robots in the direction of
maintenance, with
applying the world's first companies in China, intelligence, and construction
construction robot SSR-1 nLink
Singapore, and other robots that can make
Drilling
in 1982. countries beginning to independent decisions and adapt
Robot
develop in this field. to complex environments.
1990–2000s
During this period,
construction robots
developed towards
diversification and
specialization. At the same
time, many companies in Shanghai Construction Hadrian X bricklaying robot
Europe and America are Machinery Masonry Robot
Facade coating Robot
joining the race for
research and development
and manufacturing of
construction robots,such
as American Construction
Robotics, Australian
Shimizu Corporation Fastbrick Robotics, Suzhou Fangshi Technology HC1018 Intelligent Building
Material Spraying Robot Norwegian nLink, etc. floor leveling robot 3D Printing Robot
In contrast, CRBE robots working in residential and office buildings face different
Construction robots are divided into two categories: construction robots in the field
room layouts, significant structural variations, and the presence of moving workers. These
of civil engineering (CRCE) and construction robots in the field of building construction
factors make it challenging to obtain a stable and reliable map in advance. However, since
(CRBE). The primary difference between the two lies in their construction scenarios. CRCE
these work sites are usually located near urban areas, mobile communication resources are
is mainly used for infrastructure projects, such as roads, bridges, tunnels, and dams. In
readily available. As a result, CRBE robots can use sensors to gather real-time environmental
contrast, CRBE is applied to housing construction, including residential buildings, office
information and plan their next moves using local path-planning algorithms.
buildings, and commercial complexes.
Local path-planning algorithms are further divided into classical and intelligent algo-
CRCE typically handles large-scale operations, such as earthmoving, foundation
rithms based on their principles. Classical algorithms, such as the Artificial Potential Field
treatment, concrete pouring, and steel structure installation. These robots require power-
(APF) and Dynamic Window Approach (DWA), use mathematical models or predefined
ful performance and stability to operate in complex terrains and harsh environments.
rules for path planning. These algorithms are suitable for helping construction robots
However, the degree of automation in CRCE is relatively lower compared to CRBE, often
complete simple path-planning tasks.
relying more on manual control. Common examples of CRCE include excavation robots,
Intelligent algorithms, compared to classical algorithms, integrate technologies related
concrete spraying robots, and tunnel boring machines.
to artificial intelligence and machine learning. These algorithms offer superior learning and
On the other hand, CRBE focuses on indoor precision tasks, such as bricklaying, wall
adaptability, making them suitable for high-dimensional and complex environments. How-
treatment, decoration, and pipe installation. These robots demand high precision and flex-
ever, they are more complex to implement and require significant computational resources.
ibility to adapt to complex building structures and diverse construction needs. As a result,
Common examples include Genetic Algorithm (GA), Particle Swarm Optimization (PSO),
CRBE often achieves fully automated operations. Typical examples include bricklaying
and Ant Colony Optimization (ACO).
robots, wall spraying robots, and 3D printing construction robots.
Alternatively, Deep Reinforcement Learning (DRL) techniques can be employed,
Path planning is crucial for advancing autonomous navigation technology in con-
enabling robots to learn and adapt to their surroundings autonomously without the need
struction robots and has become a significant topic in academic research. When construct-
for a pre-defined map. These algorithms, however, demand a large amount of raw data
ing roads, bridges, and other large structures, CRCE robots often operate in environments
and substantial computational power. Examples of DRL algorithms include Q-learning
with narrow roads, steep slopes, and many curves. Additionally, many remote areas have
and Monte Carlo Methods.
weak or no mobile communication signals, although the on-site environment remains rel-
This article categorizes the surveyed path-planning algorithms, as illustrated in
atively stable. Therefore, these robots can rely on offline global path-planning algorithms,
Figure 2, based on the aforementioned rationale. It reviews commonly used algorithms in
such as A* and Dijkstra, for autonomous navigation.
for a pre-defined map. These algorithms, however, demand a large amount of raw data
and substantial computational power. Examples of DRL algorithms include Q-learning
Appl. Sci. 2025, 15, 1165 and Monte Carlo Methods. 4 of 27
This article categorizes the surveyed path-planning algorithms, as illustrated in Fig-
ure 2, based on the aforementioned rationale. It reviews commonly used algorithms in the
field
the of of
field pathpathplanning
planning from
fromrecent
recentyears,
years,analyzes
analyzestheir
their advantages disadvantages,
advantages and disadvantages,
andsummarizes
and summarizesimprovement
improvementstrategies.
strategies. Additionally,
Additionally, itit provides
providesinsights
insightsinto
intofuture
future
trendsininbuilding
trends buildingrobot
robotpath-planning.
path-planning.TheTheaim
aimofofthis
thisstudy
studyisisto
tooffer
offeraacomprehensive
comprehensive
referencefor
reference forrelated
related research,
research, enhance
enhance thethe path-planning
path-planning capabilities
capabilities of construction
of construction ro-
robots,
bots,
and and promote
promote the intelligent
the intelligent development
development of the construction
of the construction industry.
industry.
A* Algorithm
Gobal
path Djikstra
planning
RRT algorithm
APF Algorithm
Classic
Construction algorithms Dynamic Window Approach
robots
Path Genetic Algorithm
planning
Intelligent Particle Swarm
algorithm Optimization
Ant Colony Algorithm
Local Deep
path Reinforcement Q-learning
planning Learning
Algorithm Monte Carlo Methods
Figure2.2.Path
Figure Pathplanning
planningalgorithm
algorithmclassification.
classification.
The data sources for this article include the library database of Beijing University
The data sources for this article include the library database of Beijing University of
of Civil Engineering and Architecture and Google Scholar. The search keywords were:
Civil Engineering and Architecture and Google Scholar. The search keywords were: “al-
“algorithm name”, “robot path-planning”, and “specific improvement strategies” (e.g., path
gorithm name”, “robot path-planning”, and “specific improvement strategies” (e.g., path
quality, obstacle avoidance), with a publication year range of 2018–2024. The primary goal
of construction robot path planning is to ensure safety, encompassing both the robot itself
and personnel, followed by improving work efficiency to reduce costs.
The inclusion criteria for this study are as follows: Articles published between 2018
and 2024 that focus on improving mobile robot path-planning algorithms in terms of search
speed, path smoothness, and obstacle avoidance. Additionally, articles addressing inherent
defects of the algorithms were included, with preference given to those incorporating
mathematical foundations and experimental results. Comparative studies were prioritized
during the selection process.
The screening process involved two main steps. First, relevant research papers were
collected through keyword searches. Second, the articles were screened based on the
aforementioned criteria, prioritizing those with higher impact factors or those utilizing a
combination of multiple algorithms. The final selection was based on full-text reading to
ensure relevance and quality.
The structure of this article is as follows: Section 2 introduces common methods for
environmental modeling and path quality evaluation criteria. Section 3 presents global path-
planning algorithms, and Section 4 introduces local path-planning algorithms. Section 5
summarizes the algorithms mentioned above in a table, Section 6 discusses the future
development of path-planning technology in swarm construction robots, and Section 7 is
the conclusion.
Appl. Sci. 2025, 15, 1165 5 of 27
free point
site points
(Nucleus)
Cell wall
Voronoi
Cell
Figure 3. Voronoi
Figure 3. Voronoidiagram.
diagram.
2.1.3.
2.1.3. Geometric
Geometric Characteristic
Characteristic Method
Method (GCM)
(GCM)
GCM
GCM is a technique that enables robots to
is a technique that enables robots to derive
derive abstract
abstract geometric
geometric features
features from
from the
the
observed environment, including elements such as lines, arcs, and circles, to characterize
observed environment, including elements such as lines, arcs, and circles, to characterize the
surroundings. ThisThis
the surroundings. methodology results
methodology in a relatively
results compact
in a relatively representation,
compact facilitating
representation, facili-
the process of position estimation. Nonetheless, the challenge of reliably extracting stable
tating the process of position estimation. Nonetheless, the challenge of reliably extracting
features from raw data is considerable, which limits the applicability of this approach
stable features from raw data is considerable, which limits the applicability of this ap-
primarily to structured operational environments.
proach primarily to structured operational environments.
2.1.4. Mixed Representation (MR)
2.1.4. Mixed Representation (MR)
The earliest hybrid representation was introduced by Thrun as a technique for extract-
The earliest hybrid representation was introduced by Thrun as a technique for ex-
ing topological features from a comprehensive metric map with the aid of sonar sensors,
tracting topological features from a comprehensive metric map with the aid of sonar sen-
facilitating the acquisition of feature data during robot navigation. A new node is created
sors, facilitating the acquisition of feature data during robot navigation. A new node is
when the sonar-derived feature data significantly differs from those of established nodes.
created when the sonar-derived feature data significantly differs from those of established
Conversely, if the feature data closely match that of known nodes, probabilistic localization
nodes. Conversely, if the feature data closely match that of known nodes, probabilistic
is executed through Markov decision processes, concurrently generating a topological
localization is executed through Markov decision processes, concurrently generating a
representation of the environment. Nevertheless, this approach encounters challenges
topological representation of the environment. Nevertheless, this approach encounters
in creating topological maps in areas where the obstacle feature data are ambiguous. To
challenges in creating topological maps in areas where the obstacle feature data are am-
address this, Yeap and Jefferies put forth a method for deriving a global topological map
biguous. To address this, Yeap and Jefferies put forth a method for deriving a global top-
from local metric maps. In this methodology, the local map is depicted using a grid and a
ological map from local metric maps. In this methodology, the local map is depicted using
collection of edges that resemble a topology that connects various existing local maps. A
dual-level planning strategy, incorporating both local and global planning, is utilized for
path planning.
Relative Standard
Deviation of Path Length
(RD)
Path Quality
Assessment Path curvature (RC)
Criteria
Figure4.4.Introduction
Figure Introductiontotoevaluation
evaluationcriteria
criteriachart.
chart.
3.3.Global
GlobalPath-Planning
Path-PlanningAlgorithms
Algorithms
3.1.
3.1.A*
A*Algorithm
Algorithm
The
TheA*A*algorithm
algorithm is is
a map-based
a map-based search method
search methodwidely usedused
widely in various robots.
in various In theIn
robots.
construction
the constructionfield,field,
it canitbe canapplied to construction
be applied robots
to construction working
robots in places
working withwith
in places weak or
weak
even no mobile communication signals, such as material transport
or even no mobile communication signals, such as material transport robots and earth-robots and earthmoving
robots
moving working
robots in mininginareas.
working miningThe algorithm
areas. was initially
The algorithm was proposed and elaborated
initially proposed by
and elabo-
researchers Peter Hart, Nils Nilsson, and Bertrand Raphael in 1968 [22].
rated by researchers Peter Hart, Nils Nilsson, and Bertrand Raphael in 1968 [22]. The core The core concept
ofconcept
the algorithm is its heuristic
of the algorithm is itsevaluation strategy, where
heuristic evaluation the heuristic
strategy, where the function
heuristicis defined
function
(n) = has
asis fdefined (n) +f (n ) = h(n ) + g (n ) , g (n ) represents the actual cost incurred from the
g ( n ) , g ( n ) represents the actual cost incurred from the start node to start
the
current
node tonode, and h(node,
the current n) denotes and hthe(n)heuristic
denotesestimated costestimated
the heuristic from the cost
current
fromnode to the
the current
goal node. The total estimated cost from the start node to the goal node is represented
node to the goal node. The total estimated cost from the start node to the goal node is
by f (n). By evaluating
represented by f (n ) . By theevaluating
potential cost of each node
the potential cost on the path,
of each nodethe search
on the direction
path, is
the search
guided to reach the goal node with the shortest path or optimal cost. The estimated cost is
direction is guided to reach the goal node with the shortest path or optimal cost. The esti-
commonly
Appl. Sci. 2025, 15, x FOR PEER calculated
REVIEW using Euclidean distance or Manhattan distance. This article uses
mated cost is commonly calculated using Euclidean distance or Manhattan distance. This
Manhattan distance as an example, and Figure 5 illustrates its working principle.
article uses Manhattan distance as an example, and Figure 5 illustrates its working prin-
ciple.
Manhattan
distance
Obstacle
Euclidean
distance
Figure
Figure 5. A* algorithm 5. A* algorithm diagram.
diagram.
However, the A* algorithm faces limitations such as long computation times, low
efficiency, and rough path planning. To address these challenges, researchers have proposed
various improvements.
Wang F. adopted the Octile Distance formula, replacing traditional Manhattan or
Euclidean distances, which better adapts to complex paths [23]. Huang H. utilized the
Jump Point Search method to identify and skip unnecessary nodes, reducing the number of
nodes expanded during the search process and improving the algorithm’s efficiency [24].
Xiang D. combined the A* algorithm with a greedy algorithm, achieving a multi-
objective path-planning strategy. This approach also enables the algorithm to find multiple
high-quality paths that meet the problem requirements in complex environments [25].
Wang H. proposed the EBS-A* algorithm by incorporating extended distance, bidirec-
tional search, and path smoothing techniques, significantly improving search speed [26].
Fu B. integrated the A* algorithm with local path-planning technology, enabling dynamic
path adjustment and obstacle avoidance, thereby enhancing the practicality and safety of
path-planning [27].
3.2. Dijkstra
The Dijkstra algorithm is a graph-based data structure algorithm primarily used to
solve the shortest path problem in maps. It was proposed by Dutch computer scientist
Edsger W. Dijkstra in 1959. The algorithm works by progressively expanding the node
with the known shortest path. Through this process, it finds the shortest path from the
starting node to all other nodes. In large-scale construction, the Dijkstra algorithm can
assist construction robots in obtaining the shortest path from one construction point to
another. For example, it can help mobile concrete robots quickly distribute concrete to
various target points during large-scale construction projects.
The Dijkstra algorithm often faces challenges in dynamic environments, primarily
due to low efficiency, high computational resource consumption, and the inability to
handle negative weight edges. To address these issues, experts have proposed numerous
improvements.
Alshammrei S designed an optimal collision-free offline Dijkstra algorithm. In this
approach, robots follow the algorithm to generate the shortest path from the starting point
to the destination. At each node, the robot stops to test if there is an obstacle between
the current node and the next node. If an obstacle is detected, the robot excludes the
corresponding node and updates its directed graph. This process repeats until the target
point is reached. The improved Dijkstra algorithm can effectively solve the optimal path-
planning problem in environments with obstacles [28].
Bing H proposed a method to reduce computational effort by considering the distance
to the destination while calculating the shortest distance from a node to the starting point.
This causes the exploration process to generally progress towards the destination. By
comparing the computational complexity of traditional algorithms, the effectiveness of the
improved method was proven, reducing the complexity of the Dijkstra algorithm [29].
Li X solved the problem of planning a collision-free and approximately optimal path
for mobile robots in large-scale and densely obstacle-filled environments. This was achieved
by combining the Dijkstra algorithm with four-neighborhood search, eight-neighborhood
search, and reverse search algorithms [30].
Szczepanski R proposed a hybrid path-planning method based on the artificial bee
colony algorithm and the Dijkstra algorithm. This method combines the advantages of
offline global path optimization and online local path planning, successfully reducing the
time for robot path planning while ensuring path quality [31].
Appl. Sci. 2025, 15, 1165 9 of 27
Sundarraj S introduced an inertia weight to control the global and local search ca-
pabilities of the particle swarm, optimizing the path-planning problem. This method
significantly enhanced various capabilities of the Dijkstra algorithm, such as obstacle
avoidance, path-planning speed, and computation time [32].
A system combining the Dijkstra algorithm and the Dynamic Window Approach
(DWA) was proposed, enabling intelligent vehicle robots to navigate autonomously and
avoid obstacles in unknown indoor environments [33].
An improved Dijkstra algorithm was proposed for the path-planning of track-based
logistics robots. This algorithm introduced a real-time node occupancy factor into the path
weight function and established a time window model within the algorithm to improve
computational efficiency. Additionally, the improved algorithm can solve the problem of
robot conflicts in multi-robot systems [34].
Goal
Xrand(2)
Obstacle
Obstacle
Resampling
Branch
Node Xnew Obstacle
Xnear Xrand(1)
Obstacle
Tree
Obstacle
Figure 6. Schematic
Figure 6. Schematic diagram
diagram of
of the
the RRT
RRT algorithm.
algorithm.
The
In a RRT algorithm
parallel is characterized
effort, Jun G proposed a by its ability approach
data-driven to quicklyknown
find a as
feasible
UPPHE, path but
which
not necessarily the optimal path [35]. Xin P and Zhang W introduced a heuristic
incorporates the Feedback Rapidly Exploring Random Tree Star algorithm (FRRT*). This function
to guide themethod
innovative selection of sampling
features points, reducing
a risk network invalidmodules,
with feedback sampling and thus
allowing it improving
to leverage
search efficiency [36,37].
information derived from case data. By utilizing this data, FRRT* effectively constrains
Connell D of
the expansion implemented
the randoma two-way
tree and RRT
makes method, where the
adjustments algorithm
skewed draws
towards samples
optimizing
from bothefficiency,
planning the starting and ending
significantly points simultaneously,
enhancing aiming
the traditional RRT* to link [40].
approach the two trees
Wang H recognized the unpredictable nature of tree growth in the original RRT* al-
gorithm and sought to improve its performance by integrating the Attractive Potential
Field (APF) method with RRT*. This combination refines the targeting of the sampling
process, making it more focused. Additionally, in scenarios where RRT* encounters nar-
row channels or dense environments, Wang H’s approach employs adaptive step size ad-
justments facilitated by fuzzy control mechanisms, enhancing search efficiency in chal-
Appl. Sci. 2025, 15, 1165 10 of 27
together in the center. This bidirectional extension significantly improves search coverage
and speed, especially in high-dimensional spaces [38].
Qi J developed a modified version of the Rapidly Exploring Random Tree Star (RRT*)
algorithm to establish an initial path and create a state tree structure. Furthermore, he
introduced a rapid optimization technique for this initial path. This modified algorithm
stands out from other static planning methods due to its ability to produce higher-quality
initial paths, enhancing the effectiveness of path planning in various applications [39].
In a parallel effort, Jun G proposed a data-driven approach known as UPPHE, which
incorporates the Feedback Rapidly Exploring Random Tree Star algorithm (FRRT*). This
innovative method features a risk network with feedback modules, allowing it to leverage
information derived from case data. By utilizing this data, FRRT* effectively constrains the
expansion of the random tree and makes adjustments skewed towards optimizing planning
efficiency, significantly enhancing the traditional RRT* approach [40].
Wang H recognized the unpredictable nature of tree growth in the original RRT*
algorithm and sought to improve its performance by integrating the Attractive Potential
Field (APF) method with RRT*. This combination refines the targeting of the sampling
process, making it more focused. Additionally, in scenarios where RRT* encounters narrow
channels or dense environments, Wang H’s approach employs adaptive step size adjust-
ments facilitated by fuzzy control mechanisms, enhancing search efficiency in challenging
areas [41].
Qie T introduced a refined sampling and tree growth mechanism that concentrates
on the forward area near the target point during the sampling and growth phases. By
restricting the sampling and tree development to this region, the method significantly
accelerates the path-planning process, offering a more efficient solution to navigation
problems in complex environments [42].
Chen J introduced an enhanced RRT-Connect algorithm for mobile robot path-
planning, generating a third node within the space to allow for the algorithm to greedily
expand with a quadtree [43]. Cui Xi proposed a sparse sampling mechanism to improve
global search efficiency by reducing redundant sampling. Additionally, Cui proposed a
dynamic target bias strategy that provides directional guidance for the expansion of the
random tree [44].
Liao B optimized the cost of each sampling point using the triangle inequality, which
outperforms normal algorithms in terms of both the quality of the initial solution and the
speed of convergence [45]. Zhang W introduced a memory strategy to avoid over-sampling
or getting stuck in local minima during the expansion of the random tree in non-convex
environments [37]. Li Y combined the advantages of P-RRT* and Quick-RRT*, ensuring the
rapid capture of optimal solutions and the formation of more effective initial solutions [46].
electromagnetic field. As the robot moves within this field, it is simultaneously affected
by the combined force of the target’s gravitational attraction and the repulsive force from
allows
obstacles.for This
the adjustment
enables theofrobot
the robot’s path-planning
to effectively strategies.
avoid obstacles andThis
moveinnovation
towards the in-
creases the efficiency
target point of obstacle
[53,54]. The avoidance and
focus of algorithmic strengthens
research the to
is on how robot’s adaptabilityand
use “attraction” in
intricate environments
“repulsion” to guide the[56].
robot. The APF algorithm is illustrated in Figure 7.
Goal
Obstacle
Fg
F robot
Fo
Start
APF is an algorithm widely used in the field of autonomous navigation. In the field of
Wu Z introduced a temperature parameter into the potential field function, which
construction robotics, it can help robots such as tile-laying robots, floor treatment robots,
can effectively prevent the robot from being trapped by local minima. This method allows
and on-site logistics robots to effectively avoid obstacles, ensuring their safety during
the influence range and direction of the potential field to be dynamically adjusted, thereby
operation. However, APF has several obvious drawbacks. Firstly, it tends to fall into
improving the flexibility and adaptability of path planning [57].
local optimal solutions. Secondly, when the target point is surrounded by obstacles or the
Wenlin Y addressed the issue of local optima by adding virtual targets and evalua-
distribution of obstacles is uneven, the algorithm may become stuck. Thirdly, in narrow
tion functions to change the direction and influence range of gravity and resolved the sit-
passages and similar situations, APF may cause path oscillation. Construction robots
uation of robot deadlock by increasing the gravitational force [58]. Szczepanski R em-
frequently encounter scenarios with these conditions when working indoors. These issues
ployed an adaptive local path-planning based on the Widrow–Hoff rule, which enables
can significantly impact the efficiency and safety of the robots.
robots to maintain a safe distance from obstacles during movement and achieve smooth
and collision-free path-planning by limiting the scaling factor of the repulsive potential
field. This adaptive algorithm performs well in dynamic environments [59].
Xing T combined deep learning with APF, using a feedback mechanism to continu-
ously optimize the reward function, thereby finding more efficient paths and enhancing
the robot’s adaptability to changing environments [60]. Zhang Y proposed an improved
APF (FV-APF) method, specifically designed for corridor environments, which better
Appl. Sci. 2025, 15, 1165 12 of 27
A* algorithm with DWA, and the hybrid algorithm successfully integrates the advantages
of both, enabling robots to dynamically avoid obstacles while navigating globally [66].
Zhou R introduced an innovative way that integrates three algorithms. In this en-
hanced approach, the traditional obstacle distance evaluation function of the dynamic
window algorithm was substituted with an artificial repulsive field function, effectively
improving the algorithm’s response to nearby obstacles. Additionally, the introduction
of an end distance evaluation function further refines the path optimization process. Fur-
thermore, the improved dynamic window method was synergistically combined with a
gradient descent-smoothed version of the A* algorithm. This integration effectively tackles
the limitations associated with poor global planning found in conventional algorithms,
ultimately resulting in paths that are not only safer but also smoother [67].
Appl. Sci. 2025, 15, x FOR PEER REVIEW 14 of 28
Bird
Food
Bird Particle
Feeding area Solution space
The quantity of food Fitness
Position of the bird
Figure9.9.Bird
Figure Birdflock
flockfeeding
feedingbehavior
behaviorrepresents
representsthe
theParticle
ParticleSwarm
SwarmOptimization
Optimizationprocess.
process.
PSOhas
PSO hasstrong
strongdynamic
dynamicenvironmental
environmentaladaptability,
adaptability,whichwhichmakes
makesititwidely
widelyused
usedin in
pathplanning
path planningbased basedon onhigh-dimensional
high-dimensionalmaps. maps. In In the
thefield
fieldofofconstruction,
construction,ititcancanhelp
help
withpath-planning
with path-planningfor forinspection
inspectiondrones,drones,fireproof
fireproofcoating
coatingrobots,
robots,etc.
etc. PSO
PSO has
hassome
some
drawbacks,including
drawbacks, includinggetting
gettingstuck
stuckin inlocal
localoptimal
optimalsolutions
solutionsin in multi-dimensional
multi-dimensionalspaces,spaces,
slowconvergence
slow convergencespeed speedin inthe
thelate
latestages
stagesofofoptimization,
optimization,and andsensitivity
sensitivityto toparameter
parameter
settings. To
settings. To address
address these
these issues,
issues, researchers
researchers havehave proposed
proposed many manyimproved
improvedParticle
Particle
SwarmOptimization
Swarm Optimization(PSO) (PSO)algorithms.
algorithms.
YangZZproposed
Yang proposedan anImproved
ImprovedParticleParticleSwarm
SwarmOptimization
Optimizationalgorithm
algorithm(IPSO)
(IPSO)thatthat
enhancesthe
enhances thealgorithm’s
algorithm’sexploration
explorationability
ability
andand search
search accuracy
accuracy byby improving
improving thethe veloc-
velocity
ity update
update methodmethodandand inertia
inertia weight.
weight. It also
It also employs
employs a aparticle
particleinitialization
initializationstrategy
strategyto to
increasepopulation
increase populationdiversity
diversityand andintroduces
introducesstrategies
strategiesto todeal
dealwith
withlocal
localoptima,
optima,thereby
thereby
shortening
shorteningthe theconvergence
convergence path length.
path Experimental
length. Experimental datadata
indicate that IPSO
indicate outperforms
that IPSO outper-
other
formsalgorithms in termsinofterms
other algorithms average path length
of average path and shortest
length path length
and shortest path[76].
length [76].
Yuan
YuanQQaddressed
addressed thetheshortcomings
shortcomings of traditional Particle
of traditional SwarmSwarm
Particle Optimization (PSO)
Optimization
algorithms in pathin
(PSO) algorithms planning, such assuch
path planning, slowasconvergence
slow convergencespeed and
speed a tendency to get stuck
and a tendency to get
in localinoptima,
stuck by proposing
local optima, an improved
by proposing ParticleParticle
an improved SwarmSwarm Optimization algorithm
Optimization based
algorithm
on Differential
based Evolution
on Differential (IPSO-IDE).
Evolution This algorithm
(IPSO-IDE). enhancesenhances
This algorithm the convergence speed of
the convergence
traditional PSO by introducing
speed of traditional adaptive adjustments
PSO by introducing to the weights
adaptive adjustments and
to the acceleration
weights coeffi-
and acceler-
cients. It also adds aItleader
ation coefficients. particle
also adds to theparticle
a leader swarm, to selected through
the swarm, a voting
selected mechanism
through to
a voting
guide the group
mechanism towards
to guide the optimal
the group towards position. To overcome
the optimal position.theTodeficiencies
overcome the of deficiencies
traditional
Differential
of traditional Evolution algorithms,
Differential Yuan Q
Evolution proposed an
algorithms, Yuanoptimization
Q proposed methodan for the adap-
optimization
tive scaling factor F and the crossover probability factor CR to improve the convergence
performance and iteration accuracy of the algorithm. Combining the improved Particle
Swarm Optimization algorithm with Differential Evolution, a new hybrid optimization
mechanism was proposed. This mechanism incorporates the concept of “mutual benefit
and win-win”, meaning that the two algorithms are in a cooperative relationship, optimiz-
ing each other to enhance their performance, thereby improving the overall performance of
the swarm [77].
Zheng L introduced an innovative Particle Swarm algorithm that incorporates the
principles of artificial potential fields, referred to as the apfrPSO. This advanced method
focuses on generating optimal planning paths for robotic systems by fine-tuning the inertia
weight parameter. Additionally, it employs a technique for sorting the position vectors of
overall performance of the swarm [77].
Zheng L introduced an innovative Particle Swarm algorithm that incorporates the
Appl. Sci. 2025, 15, 1165 principles of artificial potential fields, referred to as the apfrPSO. This advanced method 16 of 27
focuses on generating optimal planning paths for robotic systems by fine-tuning the iner-
tia weight parameter. Additionally, it employs a technique for sorting the position vectors
of particles,
particles, known
known as rPSO.
as rPSO. Through
Through thesethese enhancements,
enhancements, the apfrPSO
the apfrPSO significantly
significantly improves im-
proves
the the capacity
capacity for robots fortorobots
adapttoto adapt to different
different operatingoperating
conditionsconditions
while also while also in-
increasing
creasing
the the precision
precision and overall andefficiency
overall efficiency of their path-planning
of their path-planning processesprocesses [78]. H
[78]. Zaman Zaman
RR
H R R modified
modified the mutation
the mutation and crossover
and crossover operatorsoperators
of BSA byof neighborhood
BSA by neighborhood to improve
to improve conver-
convergence
gence rates. Additionally,
rates. Additionally, a novel mutation
a novel mutation factor wasfactor was
joined tojoined
enhanceto the
enhance the con-
convergence
vergenceofprecision
precision avoidingoflocal
avoiding local
optima optima [79].
[79].
4.3.3.
4.3.3.Ant
AntColony
ColonyOptimization
Optimization(ACO)
(ACO)
Ant
Ant colony Optimization is heuristic
colony Optimization is a optimization
a heuristic optimization algorithm inspired
algorithm inspiredby the foraging
by the forag-
behavior
ing behavior of ants in nature. In nature, ants release pheromones to mark their paths,and
of ants in nature. In nature, ants release pheromones to mark their paths, and
when
whenants
antsfind
findfood
foodwhile
whilewalking
walkingalong
alongaapath,
path,they
theyrelease
releasemore
morepheromones
pheromoneson onthat
that
path.
path.The
Theconcentration
concentrationof ofpheromones
pheromonesdecreases
decreasesoverovertime,
time,creating
creatingaanegative
negativefeedback
feedback
mechanism. When choosing paths, ants tend to select those with higher
mechanism. When choosing paths, ants tend to select those with higher concentrations concentrationsof
ofpheromones,
pheromones, thus
thus forming
forming a form
a form of of collective
collective intelligence.
intelligence. This
This mechanism
mechanism ensures
ensures that
that the algorithm explores new paths and avoids converging prematurely
the algorithm explores new paths and avoids converging prematurely on suboptimal so- on suboptimal
solutions,
lutions, asasshown
shown inin Figure
Figure 10.10.
ThisThis algorithm
algorithm has has
beenbeen applied
applied in field
in the the field of path
of path plan-
planning for construction
ning for construction robots.robots.
pheromone
Figure10.
Figure 10.Schematic
Schematicdiagram
diagramofofACO
ACOalgorithm
algorithmmechanism.
mechanism.
When ants
When ants choose paths,
paths,they
theydodonotnot
simply optopt
simply for the
for one
the with
one the
withhighest phero-
the highest
mone concentration;
pheromone instead,
concentration; they make
instead, choices
they make basedbased
choices on a certain probability.
on a certain This prob-
probability. This
ability is generally
probability related
is generally to both
related the pheromone
to both concentration
the pheromone and the
concentration andheuristic infor-
the heuristic
mation of the
information ofpath. The Ant
the path. TheColony Optimization
Ant Colony (ACO) (ACO)
Optimization algorithm, which simulates
algorithm, evo-
which simu-
lutionary
lates algorithms,
evolutionary has clear
algorithms, advantages
has over traditional
clear advantages algorithms,
over traditional including
algorithms, strong
including
strong robustness, good global optimization capabilities, efficiency when facing complex
problems, good readability, and a wide range of applications. If, in large-scale construc-
tion projects, a large number of construction robots need to work collaboratively, the Ant
Colony Algorithm can be used to optimize swarm control strategies, achieving efficient task
allocation and path-planning and avoiding conflicts between robots. However, it also has
some limitations: a lack of effective search strategies in the early stages of search can lead to
significant blindness in complex problems; convergence speed is usually slow, especially in
larger-scale problems; the algorithm needs multiple iterations to capture optimal solution;
and ants can be trapped in local optima easily [80,81].
Appl. Sci. 2025, 15, 1165 17 of 27
Luo Q proposed an improved algorithm aimed at optimizing issues such as low search
efficiency, slow convergence speed, and the tendency to fall into local optimal solutions
in the Ant Colony Algorithm. By providing unevenly distributed initial pheromones, it
avoids the blind search of the Ant Colony Algorithm in its initial stages. By introducing
a damping coefficient into the heuristic function, the convergence speed of the algorithm
is accelerated. Combining the advantages of the MMAS algorithm model and the elite
ant algorithm, the pheromone update rules were improved to prevent the algorithm from
converging too early. A pseudo-random state transition rule is used to determine the next
path, enhancing the algorithm’s global search capability and convergence speed [82].
Zhang S proposed an innovative method called the Improved Ant Colony Algorithm
based on Population Information Entropy (AIACSE). This algorithm describes the diversity
of the population during the iteration process through information entropy and constructs
a non-uniform initial pheromone distribution to reduce the blindness in the early stages of
search; it adopts a non-uniform distribution initialization strategy based on the A algorithm,
avoiding the blindness in the evolutionary phase and improving the convergence speed.
The adaptive parameter adjustment strategy based on population information entropy
automatically adjusts the values of parameters according to the changes in population en-
tropy, maintaining the balance between exploration and exploitation. Through comparative
experiments, this improved algorithm performs excellently in terms of convergence speed
and success rate [83].
Wu L proposed an improved ACO algorithm. First, a directional factor is added to the
heuristic function to improve the convergence speed of the algorithm. Second, an improved
function is proposed to reduce the frequency of turn in the planned path; then, a new state
transition probability rule is added to the algorithm for increasing search efficiency and
population diversity; finally, a method for inhomogeneous distribution of initial pheromone
is proposed to avoid blind searching [84]. Miao C introduced an enhanced version of the
adaptive Ant Colony Algorithm. This innovative algorithm incorporates angle guidance
factors and obstacle exclusion factors into the transition probability of the traditional Ant
Colony Optimization (ACO). Doing so significantly enhances the real-time responsiveness
and safety of path planning. Moreover, the IAACO further refines the pheromone update
rules within the ACO framework by including heuristic information, adaptive adjustment
factors, and pheromone evaporation factors. This dual adjustment serves to create a more
effective balance between the algorithm’s convergence speed and its ability to conduct a
thorough global search, thus improving overall performance in optimization tasks [85].
Wang L proposed enhancements to the traditional Ant Colony Algorithm by imple-
menting an improved pheromone update mechanism. This updated approach incorporates
a safety value heuristic function that serves to optimize the overall efficiency of the algo-
rithm. One of the significant advantages of this innovation is its ability to minimize the
frequency with which the Ant Colony Algorithm becomes trapped in the local optima, a
common challenge faced during complex problem-solving. Additionally, this improve-
ment effectively decreases the search time required for 3D path planning, making the
algorithm more robust and effective for such applications [86]. Hengyi Huang integrated
ACO and DWA algorithms, proposing an algorithm for multi-robots that effectively avoids
the potential collision between real-time path planning and obstacles for multiple moving
robots [87].
Ronghua M enhanced the pheromone reinforcement for high-quality paths, making
these paths more attractive to the Ant Colony in subsequent searches, and thus improving
the quality of path-planning [88]. Wang H proposed an improved Ant Colony Algorithm.
By combining APF attraction to enhance the heuristic function, this modification accelerated
convergence. Additionally, during the pheromone update process, an extra pheromone
Appl. Sci. 2025, 15, 1165 18 of 27
increment was introduced, which enhanced the optimality of path length. [89]. Yu X com-
bined ACO with A* to develop a two-layer algorithm, which enables AUVs to successfully
navigate through multiple targets in environments with dense obstacles [90].
4.4.1. Q-Learning
Q-learning is a model-free reinforcement learning algorithm that is widely applied
in the field of construction robotics. The algorithm aims to determine the optimal policy
by learning the state-action value function (Q function). The Q function represents the
expected return of taking a certain action in a particular state. The learning process mainly
relies on the Bellman equation, which provides the theoretical basis for updating Q values.
Through continuous exploration and exploitation of the environment, Q-learning can find
the optimal policy within a limited time, thereby maximizing cumulative rewards. The
algorithm has many advantages, such as simplicity, model independence, and wide appli-
cability. However, its poor scalability, slow convergence, and the challenge of balancing
exploration and exploitation have always constrained its development. Scholars have made
many efforts to address these issues. Yu Z proposed the Double Q-learning method to
address the slow convergence rate, which involves two independent Q-value estimations.
Double Q-learning can more accurately estimate state values, thereby increasing conver-
gence speed and learning efficiency [91]. Low E S used the Flower Pollination Algorithm
(FPA) to improve the initialization of Q-learning, accelerating its convergence [92], and
also utilized a modified version of Q-learning, the Improved Q-learning (IQL), to speed
up machine learning [93]. Zhou Q introduced an enhanced version of the Q-learning
algorithm, referred to as optimized Q-learning (O-QL). This refined approach incorporates
a novel technique for initializing the Q-table, which plays a crucial role in setting the
foundation for the learning process. Additionally, it presents a fresh strategy for selecting
actions, aiming to improve decision-making during the learning phase. Furthermore, a
redefined reward function is implemented to better align with the specific objectives of the
task at hand. To optimize learning rate adjustments, the Root Mean Square Propagation
method is utilized, ensuring that updates to the learning parameters are both effective and
efficient. Collectively, these modifications lead to a significant acceleration in the learning
process, enhancing the overall efficiency of path planning [94]. Gharbi A introduced a
dynamic rewards factor to Q-learning for improving the efficiency of path planning and the
capacity of obstacle avoidance [95]. Du H used artificial potential fields to prevent random
exploration to avoid the slow convergence of Q-learning and provide basic information
about the environment for mobile robots. Du also proposed a dynamic reward factor to
accelerate algorithm convergence [96].
the famous casino in Monaco. The core idea of the Monte Carlo method is to use random
number generators to estimate a mathematical function or simulate the behavior of complex
systems through a large number of random samples. T. Dam proposed a new algorithm
based on the Monte Carlo Tree Search (MCTS) algorithm for robot path planning, which
increases the probability of the integrity of finding the best path and the convergence speed
in complex environments [97]. Wang T proposed an improved Ant Colony Optimization
(MC-IACO) based on Monte Carlo to address the issue of slow convergence at the initial
stage of robots [98]. Castellini A introduced a novel approach that extends the principles of
Partially Observable Monte Carlo Planning (POMCP) to address the challenge of regulating
robot speed in environments reminiscent of industrial settings. These environments often
present uncertain motion difficulties that can complicate the operational efficiency of
robotic systems. By employing this method, it becomes possible to better navigate the
complexities associated with varying levels of uncertainty in motion, ultimately leading
to enhanced performance and reliability for robots functioning in such contexts [99]. A
novel approach known as the sliding MCTS method was introduced by Xu P that builds
upon the principles of the Monte Carlo Tree Search (MCTS) algorithm. In this innovative
framework, Xu P adeptly achieved an effective equilibrium between the optimization
and search functionalities inherent in the algorithm. This was accomplished through
the implementation of a dynamic moving root node, which allows for more adaptable
search strategies. Additionally, the method incorporates a mechanism for regulating the
sampling duration, thereby enhancing the overall efficiency and effectiveness of the search
process [100]. Mohseni A deployed a particle filter using the Monte Carlo localization
method to resolve a Hidden Markov Process based on Recursive Bayesian Estimation using
information entropy to identify outliers and probabilistic methods to remove detected
outliers. Additionally, a new mutation process was added to the localization algorithm
to actively detect high-likelihood areas using the posterior probability density function.
The improved Monte Carlo localization algorithm was applied to mobile robots, and
experiments demonstrated an improvement in the accuracy of path planning [101].
5. Summary
Architectural robots are now advancing to the forefront of digital transformation and
intelligent upgrading in the construction industry. Path planning, as a core element in
this technological evolution, has increasingly highlighted its strategic position. Based on
detailed considerations of the information richness of construction sites, path-planning
algorithms are divided into two major categories: global path-planning and local path-
planning. Within this framework, this paper comprehensively reviews the path-planning
algorithms applied in recent years and summarizes the advantages and limitations as well
as the improvement directions of various algorithms, as shown in Table 1.
Table 1. Cont.
7. Conclusions
The primary goal of the path optimization of construction robot planning is to ensure
safety and the second is to improve work efficiency to save cost. This paper reviews the
commonly used algorithms in the path-planning of construction robots and collects the
current optimization algorithms in the field of various robots, including ground robots,
underwater robots, aerial robots, etc. The main optimization directions of the algorithm
include search speed, path smoothing, and obstacle avoidance. At the same time, according
to the mastery of the construction site information, the path-planning algorithm is divided
into two categories: global path-planning and local path-planning. Local path planning
can further be divided into the classical algorithm, intelligent algorithm, and reinforcement
Appl. Sci. 2025, 15, 1165 22 of 27
Author Contributions: Conceptualization, S.F., D.Y. and Z.M.; formal analysis, S.F., D.Y. and Z.M.; in-
vestigation, S.F. and D.Y.; resources, S.F. and D.Y.; data curation, S.F., D.Y. and Z.M.; writing—original
draft preparation, D.Y. and Z.M.; writing—review and editing, S.F., D.Y. and Z.M.; supervision, S.F.
and Z.M.; project administration, S.F., Z.M. and W.Z.; funding acquisition, S.F. and Z.M. All authors
have read and agreed to the published version of the manuscript.
Funding: This research was funded by the National Natural Science Foundation of China General
Program (51874308), the China Postdoctoral Science Foundation Project (2019M660860), and Basic
Research Operating Expenses of Universities under Beijing Municipality (Youth Scientific Research
and Innovation Special Project X21051).
References
1. Ren, H.; Chen, L. Research on the problems and countermeasures of construction labor system reform in China. China Mark. 2023,
29, 70–75.
2. Tang, W.; Li, J.; Dong, Y. Development status and research prospect of path planning algorithm for construction robots. Technol.
Innov. 2024, 2, 60–62.
3. Yan, J.; Tan, Z.; Gao, Y.; Ren, C.; Han, A. Research and application of coal mine robot cluster collaborative scheduling and control
platform. Ind. Min. Autom. 2024, 1–11. [CrossRef]
4. Wang, L.; Sun, R.; Zhai, G.; Zhang, J.; Xu, H.; Zhao, J.; Hua, Y. Pway planning of coal mine foot robot combined with improved A*
algorithm and dynamic window method. Ind. Min. Autom. 2024, 50, 112–119.
5. Shao, X.; Liu, M.; Ma, B.; Li, H.; Lv, Z.; Han, Z. Path planning of coal mine rescue robot based on blocked grid map. Coal Sci.
Technol. 2024, 50, 1–13.
6. Xie, J.; Liu, L.; Yang, X.; Wang, X.; Wang, X.; Chen, N. Orchard mower operation path planning for improved particle swarm
optimization algorithm. J. China Agric. Univ. 2023, 28, 182–191.
7. Li, W.; Xu, L.; Yang, L.; Liu, W.; Pan, K.; Li, C. Method and experiment of multi-block path planning for agricultural robots based
on improved ant colony algorithm. J. Nanjing Agric. Univ. 2024, 47, 823–834.
8. Huang, X.; Cao, Q.; Zhu, X. Mixed path planning for multi-robots in structured hospital environment. J. Eng. 2019, 2019, 512–516.
[CrossRef]
9. Sun, B.; Shan, Z. AUV cluster against target assignment based on improved wolf pack algorithm. Control Eng. 2024, 1–9.
[CrossRef]
10. Wang, X.; Shi, H.; Zhang, C. Path planning for intelligent parking system based on improved ant colony optimization. IEEE
Access 2020, 8, 65267–65273. [CrossRef]
11. Yu, J.; Chen, Y.; Feng, C.; Su, Y.; Guo, J. Summary of local path planning research for intelligent construction robots. Comput. Eng.
Appl. 2024, 60, 16–29.
12. Li, Z.; Luo, S.; Jia, Y. Summary of path planning algorithms for mobile robots. Mod. Inf. Technol. 2024, 8, 184–188.
13. Song, S.; Marks, E. Construction site path planning optimization through BIM. In Proceedings of the ASCE International
Conference on Computing in Civil Engineering 2019, Atlanta, GA, USA, 17–19 June 2019; American Society of Civil Engineers:
Reston, VA, USA, 2019; pp. 369–376.
Appl. Sci. 2025, 15, 1165 24 of 27
14. Hamieh, A.; Ben Makhlouf, A.; Louhichi, B.; Deneux, D. A BIM-based method to plan indoor paths. Autom. Constr. 2020, 113,
103120. [CrossRef]
15. Song, C.; Wang, K.; Cheng, J.C.P. BIM-aided scanning path planning for autonomous surveillance UAVs with LiDAR. In In
Proceedings of the International Symposium on Automation and Robotics in Construction, ISARC, Kitakyushu, Japan, 27–28
October 2020; IAARC Publications: Edinburgh, UK, 2020; Volume 37, pp. 1195–1202.
16. Liu, L.; Wang, X.; Yang, X.; Liu, H.; Li, J.; Wang, P. Path planning techniques for mobile robots: Review and prospect. Expert Syst.
Appl. 2023, 227, 120254. [CrossRef]
17. Lai, T. A review on visual-slam: Advancements from geometric modelling to learning-based semantic scene understanding using
multi-modal sensor fusion. Sensors 2022, 22, 7265. [CrossRef] [PubMed]
18. Muravyev, K.; Yakovlev, K. NavTopo: Leveraging Topological Maps for Autonomous Navigation of a Mobile Robot. In
Proceedings of the International Conference on Interactive Collaborative Robotics, New Mexico, Mexico, 14–18 October 2024;
Springer Nature: Cham, Switzerland, 2024; pp. 144–157.
19. Shi, Y.; Jiang, K.; Li, J.; Qian, Z.; Wen, J.; Yang, M.; Wang, K.; Yang, D. Grid-Centric Traffic Scenario Perception for Autonomous
Driving: A Comprehensive Review. IEEE Trans. Neural Netw. Learn. Syst. 2024. [CrossRef]
20. Mohamed, B. Metric dimension of graphs and its application to robotic navigation. Int. J. Comput. Appl. 2022, 184, 1–3. [CrossRef]
21. Gomez, C.; Fehr, M.; Millane, A.; Hernandez, A.C.; Nieto, J.; Barber, R.; Siegwart, R. Hybrid topological and 3d dense mapping
through autonomous exploration for large indoor environments. In Proceedings of the 2020 IEEE International Conference on
Robotics and Automation (ICRA), Paris, France, 31 May–31 August 2020; IEEE: Piscataway, NJ, USA, 2020; pp. 9673–9679.
22. Hart, P.E.; Nilsson, N.J.; Raphael, B. A formal basis for the heuristic determination of minimum cost paths. IEEE Trans. Syst. Sci.
Cybern. 1968, 4, 100–107. [CrossRef]
23. Wang, F.; Sun, W.; Yan, P.; Wei, H.; Lu, H. Research on Path Planning for Robots with Improved A* Algorithm under Bidirectional
JPS Strategy. Appl. Sci. 2024, 14, 5622. [CrossRef]
24. Huang, H.; Li, Y.; Bai, Q. An improved A star algorithm for wheeled robots path planning with jump points search and pruning
method. Complex Eng. Syst. 2022, 2, 11. [CrossRef]
25. Xiang, D.; Lin, H.; Ouyang, J.; Huang, D. Combined improved A* and greedy algorithm for path planning of multi-objective
mobile robot. Sci. Rep. 2022, 12, 13273. [CrossRef] [PubMed]
26. Wang, H.; Lou, S.; Jing, J.; Wang, Y.; Liu, W.; Liu, T. The EBS-A* algorithm: An improved A* algorithm for path planning. PLoS
ONE 2022, 17, e0263841. [CrossRef]
27. Fu, B.; Chen, L.; Zhou, Y.; Zheng, D.; Wei, Z.; Dai, J.; Pan, H. An improved A* algorithm for the industrial robot path planning
with high success rate and short length. Robot. Auton. Syst. 2018, 106, 26–37. [CrossRef]
28. Alshammrei, S.; Boubaker, S.; Kolsi, L. Improved Dijkstra algorithm for mobile robot path planning and obstacle avoidance.
Comput. Mater. Contin 2022, 72, 5939–5954. [CrossRef]
29. Bing, H.; Lai, L. Improvement and application of Dijkstra algorithms. Acad. J. Comput. Inf. Sci. 2022, 5, 97–102.
30. Li, X. Path planning of intelligent mobile robot based on Dijkstra algorithm. In Journal of Physics: Conference Series; IOP Publishing:
Bristol, UK, 2021; Volume 2083, p. 042034.
31. Szczepanski, R.; Tarczewski, T. Global path planning for mobile robot based on Artificial Bee Colony and Dijkstra’s algorithms.
In Proceedings of the 2021 IEEE 19th International Power Electronics and Motion Control Conference (PEMC), Gliwice, Poland,
25–29 April 2021; IEEE: Piscataway, NJ, USA, 2021; pp. 724–730.
32. Sundarraj, S.; Reddy, R.V.K.; Basam, M.B.; Lokesh, G.H.; Flammini, F.; Natarajan, R. Route planning for an autonomous
robotic vehicle employing a weight-controlled particle swarm-optimized Dijkstra algorithm. IEEE Access 2023, 11, 92433–92442.
[CrossRef]
33. Liu, L.; Lin, J.; Yao, J.; He, D.; Zheng, J.; Huang, J.; Shi, P. Path planning for smart car based on Dijkstra algorithm and dynamic
window approach. Wirel. Commun. Mob. Comput. 2021, 2021, 8881684. [CrossRef]
34. Zhou, X.; Yan, J.; Yan, M.; Mao, K.; Yang, R.; Liu, W. Path planning of rail-mounted logistics robots based on the improved dijkstra
algorithm. Appl. Sci. 2023, 13, 9955. [CrossRef]
35. Wang, X.; Wei, J.; Zhou, X.; Xia, Z.; Gu, X. AEB-RRT*: An adaptive extension bidirectional RRT* algorithm. Auton. Robot. 2022, 46,
685–704. [CrossRef]
36. Xin, P.; Wang, X.; Liu, X.; Wang, Y.; Zhai, Z.; Ma, X. Improved bidirectional RRT* algorithm for robot path planning. Sensors 2023,
23, 1041. [CrossRef] [PubMed]
37. Zhang, W.; Yi, C.; Gao, S.; Zhang, Z.; He, X. Improve RRT algorithm for path planning in complex environments. In Proceedings
of the 2020 39th Chinese Control Conference (CCC), Shenyang, China, 27–29 July 2020; IEEE: Piscataway, NJ, USA, 2020;
pp. 3777–3782.
38. Connell, D.; Manh La, H. Extended rapidly exploring random tree–based dynamic path planning and replanning for mobile
robots. Int. J. Adv. Robot. Syst. 2018, 15, 1729881418773874. [CrossRef]
Appl. Sci. 2025, 15, 1165 25 of 27
39. Qi, J.; Yang, H.; Sun, H. MOD-RRT*: A sampling-based algorithm for robot path planning in dynamic environment. IEEE Trans.
Ind. Electron. 2020, 68, 7244–7251. [CrossRef]
40. Guo, J.; Xia, W.; Hu, X.; Ma, H. Feedback RRT* algorithm for UAV path planning in a hostile environment. Comput. Ind. Eng.
2022, 174, 108771. [CrossRef]
41. Wang, H.; Zhou, X.; Li, J.; Yang, Z.; Cao, L. Improved RRT* Algorithm for Disinfecting Robot Path Planning. Sensors 2024, 24,
1520. [CrossRef] [PubMed]
42. Qie, T.; Wang, W.; Yang, C.; Li, Y.; Liu, W.; Xiang, C. A path planning algorithm for autonomous flying vehicles in cross-country
environments with a novel TF-RRT∗ method. Green Energy Intell. Transp. 2022, 1, 100026. [CrossRef]
43. Chen, J.; Zhao, Y.; Xu, X. Improved RRT-connect based path planning algorithm for mobile robots. IEEE Access 2021, 9,
145988–145999. [CrossRef]
44. Cui, X.; Wang, C.; Xiong, Y.; Mei, L.; Wu, S. More Quickly-RRT*: Improved Quick Rapidly-exploring Random Tree Star algorithm
based on optimized sampling point with better initial solution and convergence rate. Eng. Appl. Artif. Intell. 2024, 133, 108246.
[CrossRef]
45. Liao, B.; Wan, F.; Hua, Y.; Ma, R.; Zhu, S.; Qing, X. F-RRT*: An improved path planning algorithm with improved initial solution
and convergence rate. Expert Syst. Appl. 2021, 184, 115457. [CrossRef]
46. Li, Y.; Wei, W.; Gao, Y.; Wang, D.; Fan, Z. PQ-RRT*: An improved path planning algorithm for mobile robots. Expert Syst. Appl.
2020, 152, 113425. [CrossRef]
47. Roriz, R.; Cabral, J.; Gomes, T. Automotive LiDAR technology: A survey. IEEE Trans. Intell. Transp. Syst. 2021, 23, 6282–6297.
[CrossRef]
48. Schulte-Tigges, J.; Förster, M.; Nikolovski, G.; Reke, M.; Ferrein, A.; Kaszner, D.; Matheis, D.; Walter, T. Benchmarking of various
LiDAR sensors for use in self-driving vehicles in real-world environments. Sensors 2022, 22, 7146. [CrossRef] [PubMed]
49. Elsayed, A.M.; Elshalakani, M.; Hammad, S.A.; Maged, S.A. Decentralized fault-tolerant control of multi-mobile robot system
addressing LiDAR sensor faults. Sci. Rep. 2024, 14, 25713. [CrossRef]
50. Paya, L.; Gil, A.; Reinoso, O. A state-of-the-art review on mapping and localization of mobile robots using omnidirectional vision
sensors. J. Sens. 2017, 2017, 3497650. [CrossRef]
51. Wang, Y. Research on multi-sensor information fusion technology based on driverless vehicle driving platforms. In Proceedings
of the 2024 4th International Conference on Artificial Intelligence, Big Data and Algorithms, Zhengzhou China, 21–23 June 2024;
pp. 1112–1122.
52. Dong, J.; Zhuang, D.; Huang, Y.; Fu, J. Advances in multi-sensor data fusion: Algorithms and applications. Sensors 2009, 9,
7771–7784. [CrossRef]
53. Vadakkepat, P.; Tan, K.C.; Ming-Liang, W. Evolutionary artificial potential fields and their application in real time robot path
planning. In Proceedings of the 2000 Congress on Evolutionary Computation, La Jolla, CA, USA, 16–19 July 2000; CEC00 (Cat.
No. 00TH8512). IEEE: Piscataway, NJ, USA, 2000; Volume 1, pp. 256–263.
54. Khatib, O. Real-time obstacle avoidance system for manipulators and mobile robots. Int. J. Robot. Res. 1986, 5, 90–98. [CrossRef]
55. Ye, H.; Liu, Q.; Zhang, W. Robot obstacle avoidance based on improved artificial potential field method. In Proceedings of the
2021 International Conference on Control, Automation and Information Sciences (ICCAIS), Xi’an, China, 14–17 October 2021;
IEEE: Piscataway, NJ, USA, 2021; pp. 769–775.
56. Cheng, C.; Sha, Q.; He, B.; Li, G. Path planning and obstacle avoidance for AUV: A review. Ocean Eng. 2021, 235, 109355.
[CrossRef]
57. Wu, Z.; Dai, J.; Jiang, B.; Karimi, H.R. Robot path planning based on artificial potential field with deterministic annealing. ISA
Trans. 2023, 138, 74–87. [CrossRef]
58. Yang, W.; Wu, P.; Zhou, X.; Lv, H.; Liu, X.; Zhang, G.; Hou, Z.; Wang, W. Improved Artificial Potential Field and Dynamic Window
Method for Amphibious Robot Fish Path Planning. Appl. Sci. 2021, 11, 2114. [CrossRef]
59. Szczepanski, R.; Gul, F. Local Path Planning Algorithm Based on Artificial Potential Field with Adaptive Scaling Factor.
In Proceedings of the 2024 28th International Conference on Methods and Models in Automation and Robotics (MMAR),
Miedzyzdroje, Poland, 27–30 August 2024; IEEE: Piscataway, NJ, USA, 2024; pp. 229–234.
60. Xing, T.; Wang, X.; Ding, K.; Ni, K.; Zhou, Q. Improved artificial potential field algorithm assisted by multisource data for AUV
path planning. Sensors 2023, 23, 6680. [CrossRef] [PubMed]
61. Zhang, Y. Improved Artificial Potential Field Method for Mobile Robots Path Planning in a Corridor Environment. In Proceedings
of the 2022 IEEE International Conference on Mechatronics and Automation (ICMA), Guilin, China, 7–10 August 2022; IEEE:
Piscataway, NJ, USA, 2022; pp. 185–190.
62. Qin, H.; Shao, S.; Wang, T.; Yu, X.; Jiang, Y.; Cao, Z. Review of autonomous path planning algorithms for mobile robots. Drones
2023, 7, 211. [CrossRef]
63. Gao, Y.; Han, Q.; Feng, S.; Wang, Z.; Meng, T.; Yang, J. Improvement and Fusion of D* Lite Algorithm and Dynamic Window
Approach for Path Planning in Complex Environments. Machines 2024, 12, 525. [CrossRef]
Appl. Sci. 2025, 15, 1165 26 of 27
64. Mai, X.; Li, D.; Ouyang, J.; Luo, Y. An improved dynamic window approach for local trajectory planning in the environment with
dense objects. In Journal of Physics: Conference Series; IOP Publishing: Bristol, UK, 2021; Volume 1884, p. 012003.
65. Liao, T.; Chen, F.; Wu, Y.; Zeng, H.; Ouyang, S.; Guan, J. Research on Path Planning with the Integration of Adaptive A-Star
Algorithm and Improved Dynamic Window Approach. Electronics 2024, 13, 455. [CrossRef]
66. Li, Y.; Jin, R.; Xu, X.; Qian, Y.; Wang, H.; Xu, S.; Wang, Z. A mobile robot path planning algorithm based on improved A* algorithm
and dynamic window approach. IEEE Access 2022, 10, 57736–57747. [CrossRef]
67. Zhou, R.; Zhou, K.; Wang, L.; Wang, B. An Improved Dynamic Window Path Planning Algorithm Using Multi-algorithm Fusion.
International Journal of Control. Autom. Syst. 2024, 22, 1005–1020. [CrossRef]
68. Katoch, S.; Chauhan, S.S.; Kumar, V. A review on genetic algorithm: Past, present, and future. Multimed. Tools Appl. 2021, 80,
8091–8126. [CrossRef] [PubMed]
69. Hu, Y.; Yang, S.X. A novel knowledge-based genetic algorithm for robot path planning in complex environments. arXiv 2022,
arXiv:2209.01482.
70. Li, Y.; Zhao, J.; Chen, Z.; Xiong, G.; Liu, S. A robot path planning method based on improved genetic algorithm and improved
dynamic window approach. Sustainability 2023, 15, 4656. [CrossRef]
71. Suresh, K.S.; Venkatesan, R.; Venugopal, S. Mobile robot path planning using multi-objective genetic algorithm in industrial
automation. Soft Comput. 2022, 26, 7387–7400. [CrossRef]
72. Liu, C.; Liu, A.; Wang, R.; Zhao, H.; Lu, Z. Path planning algorithm for multi-locomotion robot based on multi-objective genetic
algorithm with elitist strategy. Micromachines 2022, 13, 616. [CrossRef] [PubMed]
73. Freitas, D.; Lopes, L.G.; Morgado-Dias, F. Particle swarm optimisation: A historical review up to the current developments.
Entropy 2020, 22, 362. [CrossRef] [PubMed]
74. Shi, Y. Particle swarm optimization: Developments, applications and resources. In Proceedings of the 2001 Congress on
Evolutionary Computation (IEEE Cat. No. 01TH8546), Seoul, Republic of Korea, 27–30 May 2001; IEEE: Piscataway, NJ, USA,
2001; Volume 1, pp. 81–86.
75. Sengupta, S.; Basak, S.; Peters, R.A. Particle Swarm Optimization: A survey of historical and recent developments with
hybridization perspectives. Mach. Learn. Knowl. Extr. 2018, 1, 157–191. [CrossRef]
76. Yang, Z.; Li, N.; Zhang, Y.; Li, J. Mobile Robot Path Planning Based on Improved Particle Swarm Optimization and Improved
Dynamic Window Approach. J. Robot. 2023, 2023, 6619841. [CrossRef]
77. Yuan, Q.; Sun, R.; Du, X. Path planning of mobile robots based on an improved particle swarm optimization algorithm. Processes
2022, 11, 26. [CrossRef]
78. Zheng, L.; Yu, W.; Li, G.; Qin, G.; Luo, Y. Particle swarm algorithm path-planning method for mobile robots based on artificial
potential fields. Sensors 2023, 23, 6082. [CrossRef]
79. Zaman, H.R.R.; Gharehchopogh, F.S. An improved particle swarm optimization with backtracking search optimization algorithm
for solving continuous optimization problems. Eng. Comput. 2022, 38 (Suppl. S4), 2797–2831. [CrossRef]
80. Wang, R.; Wang, J.; Wang, N. Research on improved strategy of ant colony optimization algorithm. In Proceedings of the 3rd
International Conference on Material, Mechanical and Manufacturing Engineering (IC3ME 2015), Guangzhou, China, 27–28 June
2015; Atlantis Press: Amsterdam, The Netherlands, 2015; pp. 942–945.
81. Wang, M.; Li, Z.; Zhao, Q.; Si, F.; Huang, D. Path planning based on an improved ant colony algorithm. MATEC Web of
Conferences. EDP Sci. 2018, 228, 01010.
82. Luo, Q.; Wang, H.; Zheng, Y.; He, J. Research on path planning of mobile robot based on improved ant colony algorithm. Neural
Comput. Appl. 2020, 32, 1555–1566. [CrossRef]
83. Zhang, S.; Pu, J.; Si, Y. An adaptive improved ant colony system based on population information entropy for path planning of
mobile robot. IEEE Access 2021, 9, 24933–24945. [CrossRef]
84. Wu, L.; Huang, X.; Cui, J.; Liu, C.; Xiao, W. Modified adaptive ant colony optimization algorithm and its application for solving
path planning of mobile robot. Expert Syst. Appl. 2023, 215, 119410. [CrossRef]
85. Miao, C.; Chen, G.; Yan, C.; Wu, Y. Path planning optimization of indoor mobile robot based on adaptive ant colony algorithm.
Comput. Ind. Eng. 2021, 156, 107230. [CrossRef]
86. Wang, L.; Kan, J.; Guo, J.; Wang, C. 3D path planning for the ground robot with improved ant colony optimization. Sensors 2019,
19, 815. [CrossRef] [PubMed]
87. Huang, H.; Fu, S. Research on Multi-Robot Path Planning Technology Based on Ant Algorithm and DWA Algorithm; PREPRINT (Version
1); Research Square: Durham, NC, USA, 2024.
88. Meng, R.; Cheng, X.; Wu, Z. Improved ant colony optimization for safe path planning of AUV. Heliyon 2024, 10, e27753.
89. Wang, H.; Wang, S.; Yu, T. Path Planning of Inspection Robot Based on Improved Ant Colony Algorithm. Appl. Sci. 2024, 14, 9511.
[CrossRef]
90. Yu, X.; Chen, W.-N.; Gu, T.; Yuan, H.; Zhang, H.; Zhang, J. ACO-A*: Ant colony optimization plus A* for 3-D traveling in
environments with dense obstacles. IEEE Trans. Evol. Comput. 2018, 23, 617–631. [CrossRef]
Appl. Sci. 2025, 15, 1165 27 of 27
91. Yu, Z.; Mao, J.; Qi, W. Path Planning Algorithm of Mobile Robot Based on Improved Q-Learning. In Proceedings of the 2024 7th
International Conference on Advanced Algorithms and Control Engineering (ICAACE), Shanghai, China, 21–23 March 2024;
IEEE: Piscataway, NJ, USA, 2024; pp. 1450–1453.
92. Low, E.S.; Ong, P.; Cheah, K.C. Solving the optimal path planning of a mobile robot using improved Q-learning. Robot. Auton.
Syst. 2019, 115, 143–161. [CrossRef]
93. Low, E.S.; Ong, P.; Low, C.Y.; Omar, R. Modified Q-learning with distance metric and virtual target on path planning of mobile
robot. Expert Syst. Appl. 2022, 199, 117191. [CrossRef]
94. Zhou, Q.; Lian, Y.; Wu, J.; Zhu, M.; Wang, H.; Cao, J. An optimized Q-Learning algorithm for mobile robot local path planning.
Knowl.-Based Syst. 2024, 286, 111400. [CrossRef]
95. Gharbi, A. A dynamic reward-enhanced Q-learning approach for efficient path planning and obstacle avoidance in mobile
robotics. Appl. Comput. Inform. 2024. [CrossRef]
96. Du, H.; Hao, B.; Zhao, J.; Zhang, J.; Wang, Q.; Yuan, Q. A path planning approach for mobile robots using short and safe
Q-learning. PLoS ONE 2022, 17, e0275100. [CrossRef] [PubMed]
97. Dam, T.; Chalvatzaki, G.; Peters, J.; Pajarinen, J. Monte-carlo robot path planning. IEEE Robot. Autom. Lett. 2022, 7, 11213–11220.
[CrossRef]
98. Wang, T.; Wang, L.; Li, D.; Cai, J.; Wang, Y. Monte Carlo-based improved ant colony optimization for path planning of welding
robot. J. King Saud Univ.-Comput. Inf. Sci. 2023, 35, 101603. [CrossRef]
99. Castellini, A.; Marchesini, E.; Farinelli, A. Partially Observable Monte Carlo Planning with state variable constraints for mobile
robot navigation. Eng. Appl. Artif. Intell. 2021, 104, 104382. [CrossRef]
100. Xu, P.; Ding, L.; Wang, Z.; Gao, H.; Zhou, R.; Gong, Z.; Liu, G. Contact sequence planning for hexapod robots in sparse foothold
environment based on Monte-Carlo tree. IEEE Robot. Autom. Lett. 2021, 7, 826–833. [CrossRef]
101. Mohseni, A.; Duchaine, V.; Wong, T. Improvement in Monte Carlo localization using information theory and statistical approaches.
Eng. Appl. Artif. Intell. 2024, 131, 107897. [CrossRef]
102. Tavares, P.; Costa, C.M.; Rocha, L.; Malaca, P.; Costa, P.; Moreira, A.P.; Sousa, A.; Veiga, G. Collaborative welding system using
BIM for robotic reprogramming and spatial augmented reality. Autom. Constr. 2019, 106, 102825. [CrossRef]
103. Tsuruta, T.; Miura, K.; Miyaguchi, M. Mobile robot for marking free access floors at construction sites. Autom. Constr. 2019, 107,
102912. [CrossRef]
Disclaimer/Publisher’s Note: The statements, opinions and data contained in all publications are solely those of the individual
author(s) and contributor(s) and not of MDPI and/or the editor(s). MDPI and/or the editor(s) disclaim responsibility for any injury to
people or property resulting from any ideas, methods, instructions or products referred to in the content.