Next Article in Journal
Kinematic Analysis of Free Vertical Split with 720° Turn in Elite Chinese Rhythmic Gymnastics
Previous Article in Journal
Defect Detection Method of Carbon Fiber Unidirectional Band Prepreg Based on Enhanced YOLOv8s
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Research on 3D Path Optimization for an Inspection Micro-Robot in Oil-Immersed Transformers Based on a Hybrid Algorithm

1
State Grid Tianjin Electric Power Research Institute, Tianjin 300180, China
2
College of Mechanical and Electronic Engineering, Shandong Agricultural University, Tai’an 271018, China
3
School of Electrical Engineering, China University of Mining and Technology, Xuzhou 221116, China
*
Author to whom correspondence should be addressed.
Sensors 2025, 25(9), 2666; https://doi.org/10.3390/s25092666
Submission received: 18 February 2025 / Revised: 14 April 2025 / Accepted: 18 April 2025 / Published: 23 April 2025
(This article belongs to the Section Sensors and Robotics)

Abstract

:
To enhance the efficiency and accuracy of detecting insulation faults such as discharge carbon traces in large oil-immersed transformers, this study employs an inspection micro-robot to replace manual inspection for image acquisition and fault identification. While the micro-robot exhibits compactness and agility, its limited battery capacity necessitates the critical optimization of its 3D inspection path within the transformer. To address this challenge, we propose a hybrid algorithmic framework. First, the task of visiting inspection points is formulated as a Constrained Traveling Salesman Problem (CTSP) and solved using the Ant Colony Optimization (ACO) algorithm to generate an initial sequence of inspection nodes. Once the optimal node sequence is determined, detailed path planning between adjacent points is executed through a synergistic combination of the A algorithm*, Rapidly exploring Random Tree (RRT), and Particle Swarm Optimization (PSO). This integrated strategy ensures robust circumvention of complex 3D obstacles while maintaining path efficiency. Simulation results demonstrate that the hybrid algorithm achieves a 52.6% reduction in path length compared to the unoptimized A* algorithm, with the A*-ACO combination exhibiting exceptional stability. Additionally, post-processing via B-spline interpolation yields smooth trajectories, limiting path curvature and torsion to <0.033 and <0.026, respectively. These advancements not only enhance planning efficiency but also provide substantial practical value and robust theoretical support for advancing key technologies in micro-robot inspection systems for oil-immersed transformer maintenance.

1. Introduction

As critical components in high-voltage, large-capacity power systems, oil-immersed transformers constitute essential infrastructure in modern substations [1]. The transformer contains three primary internal elements, electromagnetic coils, laminated cores, and insulation (dielectric mineral oil, paper, etc.), which collectively enable efficient energy transfer through electromagnetic induction. Routine maintenance encompasses monitoring for structural anomalies including component displacement, core deformation, localized overheating, carbon traces from partial discharges, and dielectric degradation of insulation materials [2]. Conventional inspection methodologies requiring complete oil drainage present significant operational challenges, involving substantial resource expenditure and extended downtime. To address these limitations, micro-inspection robots have emerged as innovative solutions featuring compact dimensions, enhanced mobility, and precise controllability. These robots enable non-invasive internal assessments through onboard visual sensors while maintaining the transformer’s sealed environment. The implementation of such robots demonstrates substantial potential for optimizing maintenance efficiency, reducing operational risks, and improving grid reliability through predictive maintenance strategies.
The substantial spatial dimensions of oil-immersed transformers impose significant operational demands on inspection micro-robots, requiring them to traverse extensive spatial domains over prolonged durations. This necessitates the development of energy-efficient navigation algorithms capable of generating collision-free trajectories through the transformer’s labyrinthine interior.
Current research on robotics trajectory planning strategies often focuses on two-dimensional maps for collision-free shortest path planning from start to end points [3]. However, three-dimensional path planning is computationally complex and challenging to parameterize, making direct application of 2D strategies unfeasible in 3D spaces [4]. Traditional path-planning algorithms are categorized into sampling-based algorithms, such as Rapidly exploring Random Tree (RRT) [5] and Probabilistic Roadmaps (PRM) [6,7], which update paths from asymptotically optimal to globally optimal but suffer from inconsistencies due to randomness. Search-based algorithms, like A* [8] and Dijkstra’s algorithm [9], consistently find the optimal path between start and end points. Swarm intelligence and artificial intelligence algorithms, including genetic algorithms [10], Particle Swarm Optimization (PSO) [11], Ant Colony Optimization (ACO) [12], and Slime Mould Algorithm (SMA) [13], offer global search capabilities but may converge slowly or get trapped in local optima due to parameter sensitivity [14]. Typical algorithms of artificial intelligence are neural network algorithms [15], which have the characteristics of strong adaptive ability and better generalization, and are suitable for real-time decision-making application scenarios, but the large amount of data required and the high demand for computational resources mean these algorithms have a high threshold in applications [16]. In addition, the combination of different types of algorithms [17,18,19] to fully utilize the advantages of each algorithm is also a hot spot in academic research. For example, Zhang et al. [20] integrated the A* algorithm with the RRT algorithm, improving the timeliness and reliability of path planning for obstacle avoidance in driverless cars. Feng et al. [21] combined RRT algorithm and Artificial Potential Field (APF) algorithm to enhance the quality and stability of the optimal path generated by the RRT algorithm. Loc et al. [22] combined RRT algorithm with PSO, utilizing PSO algorithm to refine and enhance the initial paths planned by the RRT algorithm, thereby effectively avoiding falling into the local minimum state. Traditional FastSLAM algorithms suffer from particle degeneracy in environments with high similarity, such as internal oil-immersed transformers. To address this, Li et al. proposed a PSO-optimized FastSLAM framework that enhances localization accuracy by mitigating particle impoverishment [23]. Feng et al. proposed a monocular vision-based localization strategy utilizing multi-scale image enhancement and efficient pose estimation to fulfill real-time positioning requirements in harsh transformer oil environments [24].
The path-planning methods mentioned above primarily focus on optimizing the path between two points. However, the internal inspection micro-robot in the transformer needs to start from the starting point, route through a number of inspection points to capture images in sequence, and finally return to the starting point to complete the task. Therefore, these methods are not suitable for solving this type of problem. This issue is similar to the three-dimensional Traveling Salesman Problem (TSP) [25], which requires starting from a point, visiting multiple nodes and going back to the starting point while minimizing the total path length. Classical TSP solution methods mainly include the Held–Karp algorithm, greedy algorithm, genetic algorithm (GA), simulated annealing algorithm, and ACO [26,27]. Among these, ACO is widely used to solve TSP due to its high adaptability and robustness [28,29]. For example, Yan et al. [30] defined the multipoint planning problem with indoor path constraints as the Indoor Traveling Salesman Problem (ITSP) and solved it by combining Dijkstra’s algorithm and branch and bound (B&B) algorithm. Janoš et al. [31] solved the 2D indoor TSP problem using the SFF* algorithm. However, unlike the classical TSP, the transformer’s inspection points are subject to obstacles, making the inspection micro-robot’s path planning more complex than a classical TSP. When performing path planning for an inspection micro-robot in a transformer, the challenge is not only to optimize the total path length through multiple inspection points, but also to handle a complex three-dimensional environment with obstacles. This makes the problem more akin to a Constrained Traveling Salesman Problem (CTSP) and necessitates the adaptation of classical TSP solving methods to accommodate these environmental constraints. Classical TSP algorithms, such as the Held–Karp algorithm and the greedy algorithm, are usually very effective in solving the shortest path in the obstacle-free environments. However, in the presence of complex obstacles, these methods cannot directly address the issue of path feasibility. Genetic algorithms and simulated annealing algorithms, while possessing some global search capability, are prone to falling into local optimal solutions in high dimensional environments with numerous obstacles and may lack a consideration of path coherence. ACO, with its adaptivity and robustness, has become an effective tool for solving complex TSP problems [32].
Therefore, this paper proposes an innovative hybrid algorithmic framework aimed at solving the path-planning problem in a complex environment inside a large oil-immersed transformer. The task of multipoint traversal inside the transformer is transformed into CTSP and initial path planning is accomplished using ACO to determine the optimal sequence of inspection points. Building on this, a combination of path-planning techniques, including the A* algorithm, RRT and PSO, is constructed to accurately plan the paths between adjacent inspection points, ensuring that the inspection micro-robot’s movement avoids complex obstacles in the three-dimensional environment. This approach provides technical support for the inspection micro-robot to perform high-efficiency and low-consumption inspection tasks in the complex transformer environment.

2. Inspection Micro-Robots and 3D Environments in Transformers

2.1. Inspection Micro-Robots

Oil-immersed transformers account for 89.66% of China’s high-voltage power equipment (2023 industry statistics), demanding specialized inspection tools for internal defects. To address this issue, a 15 × 15 × 26 cm submersible micro-robot (as shown in Figure 1) with three-axis mobility has been developed for internal inspection in constrained transformer environments. It achieves floating/diving, hovering/positioning, and image acquisition functions. Featuring an elliptical titanium alloy shell designed for maneuverability in narrow winding gaps, the robot integrates ultrasonic positioning modules and propeller propulsion modules. When operating inside the transformer, the propeller propulsion modules provide thruster-based motion control, the ultrasonic range module achieves spatial localization, and the image acquisition module captures internal images. A dedicated control platform enables remote manipulation and collects defect images.
Compared to cubic designs (e.g., ABB’s TXplore), the elliptical geometry of the spherical submersible robot reduces hydrodynamic drag. It also enables agile navigation through <20 cm gaps between windings while maintaining stability under turbulent oil flows [33]. The micro-robot’s battery capacity supports continuous operation for 90 min, which has been validated to complete a full inspection cycle covering all 18 predefined inspection points within large oil-immersed transformers (180 MVA, 220 kV). The elliptical sealed structure and corrosion-resistant materials allow adaptable operation in various dielectric fluids such as mineral oil, synthetic esters, and silicone oils, which expands the scope of application scenarios for micro-robots.
Figure 1. The inspection micro-robot for transformer internal inspection [34].
Figure 1. The inspection micro-robot for transformer internal inspection [34].
Sensors 25 02666 g001

2.2. Three-Dimensional Environment Modelling in Transformers

The inspection micro-robot needs to work in the narrow and complex space inside the transformer and it is necessary to carry out reasonable planning for its inspection route. The 3D environment of the transformer is the basis of inspection micro-robot path planning. Therefore, it is very important to accurately construct the internal environment model of the transformer. Currently, there are several methods for environment modeling, such as topology method, visual graph method, free space method, and raster method, etc. This paper defines the internal transformer windings and fixed parts as impassable areas according to the free space method and the oil-filled area is defined as a free area in the 3D space. Path planning of inspection micro-robot is realized by Python (version 3.8.17) programming. The proposed system is validated for large oil-immersed transformers (180 MVA, 220 kV) with internal dimensions 6 × 3 × 3 m, representative of typical grid infrastructure.
In the transformer environment modeling, the O-XYZ coordinate system is constructed, with the dimensions of length, width, and height being (6000, 3000, 3000) mm. The three windings of A, B, and C phases are cylindrical, with radii of 800 mm and heights of 3000 mm, centered at (1100, 1500), (3000, 1500), and (4900, 1500), respectively. The internal 3D map of the transformer is shown in Figure 2.
The path-planning algorithm of inspection micro-robot can be described as follows. The 3D environment can be represented as C = [ x c , y c , z c ] T 3 . Known obstacles, the three-phase windings, can be described as C o b s = [ x o b s , y o b s , z o b s ] T C . C o b s denotes the unreachable obstacle space and C f r e e = C \ C o b s denotes the free space. Based on the start point P s t a r t C , the goal pose P e n d C , and environment C , the path algorithm generates the best path P within a limited duration. Path P consists of a series of feasible discrete ordered pose nodes set { P i } i = 1 n C f r e e , where P 0 = P s t a r t and P n = P e n d .
Let function C o l l i s i o n C h e c k ( P , C o b s ) and B o u n d a r y C h e c k ( P , C ) return the query result of whether the potential pose P C is legal, as shown in (1) and (2).
C o l l i s i o n C h e c k ( P , C o b s ) = t r u e , P i C o b s f a l s e , P i C o b s
B o u n d a r y C h e c k ( P , C ) = t r u e , P i C f a l s e , P i C

3. Path-Planning Algorithms

To solve the challenge of guiding inspection micro-robots to perform inspection tasks efficiently and accurately in complex spaces, this paper explores several common and efficient path-planning algorithms, including the A* algorithm, RRT algorithm, and PSO algorithm. Each of these algorithms has distinct characteristics and can be used individually or in combination to form a more flexible and efficient path-planning strategy to optimize the inspection path inside the transformer.

3.1. A* Algorithm

The A* algorithm is an efficient heuristic search method commonly used in pathfinding and graph traversal problems. It combines the strengths of Dijkstra’s algorithm, which is adept at finding the shortest path, with the heuristic guidance of a greedy algorithm. By integrating the least-cost path search and heuristic evaluation, A* can quickly determine the optimal path between specified nodes.
The A* algorithm maintains two lists: the open list and the closed list. The open list contains nodes to be evaluated, while the closed list holds nodes that have already been processed. Initially, when the map is rasterized, the center of each square is considered a node and each node is classified as either walkable or unwalkable. The algorithm starts by setting point A as the initial node and adding it to the open list. The eight surrounding nodes of A are considered its child nodes and any walkable nodes among them are added to the open list for future examination. If a node is neither in the open list nor in the closed list, it indicates that the node has not yet been evaluated. Once a node has been fully evaluated and its path cost is determined, it is moved to the closed list. The algorithm iteratively processes nodes from the open list, selecting the node with the lowest cost and moving it to the closed list. This process continues until the target node is reached, at which point the path is saved, representing the shortest path found.
The cost function in the A* algorithm is defined as f(n):
f ( n ) = g ( n ) + h ( n )
d i j = ( x i x j ) 2 + ( y i y j ) 2 + ( z i z j ) 2
where g(n) represents the actual cost of moving from the start node to node n (i.e., the length of the path taken) and h(n) is the heuristic estimate of the cost to reach the goal from node n (typically calculated using either Euclidean or Manhattan distance). The total cost of moving from the start node to the goal node is represented by f(n). dij represents the Euclidean distance between node i and j. The A* algorithm works by iteratively expanding the node with the lowest known cost and selecting the unexplored node with the smallest cost for further expansion, until the goal node is reached. This process ensures that the optimal path is found. The search process of the A* algorithm is illustrated in Figure 3 and the corresponding pseudocode is provided in Algorithm 1.
The A* algorithm is a heuristic graph search algorithm designed to find the shortest path between a start point and a goal on a predefined map. It is typically used for problems involving a single start and end point. However, in the case of transformer inspections, multiple waypoints must be visited, ultimately returning to the original start point—a scenario similar to the Constrained Traveling Salesman Problem (CTSP). The A* algorithm is not suited for solving such problems, as it cannot handle the complexities of planning a complete route that includes multiple points. Therefore, to optimize the inspection path that involves visiting several inspection nodes, it is essential to integrate other intelligent algorithms.
Algorithm 1. A* algorithm pseudocode.
Algorithm A*(start, goal)
1: openSet ← {start}           //Initialize the open set with the start node
2: fScore[start] ← HeuristicCostEstimate(start, goal)//Estimated total cost from start to goal
3: while openSet is not empty do     //While there are nodes to process
4:   current ← node in openSet with lowest fScore value//Select node with lowest estimated total cost
5:   if current = goal then      //If goal is reached
6:     return ReconstructPath(cameFrom, current)//Reconstruct and return the path
7:   openSet ← openSet—{current}   //Remove current from open set
8:   for each neighbor of current do  //Explore neighbors
9:     tentative_gScore ← gScore[current] + Dist(current, neighbor)
10:     if tentative_gScore < gScore[neighbor] then//Check if current path is better
11:       cameFrom[neighbor] ← current//Record path
12:       gScore[neighbor] ← tentative_gScore//Update cost
13:       fScore[neighbor] ← gScore[neighbor] + HeuristicCostEstimate(neighbor, goal)//Update fScore
14:       if neighbor not in openSet then//Discover new node
15:         openSet ← openSet ∪ {neighbor}
16:  end for
17: end while
18: return failure            //Return failure if no path is found

3.2. RRT Algorithm

The RRT algorithm is known for its ability to explore three-dimensional spaces. By using random sampling, it quickly generates multiple feasible paths, making it suitable for handling dynamic obstacles and complex spatial distributions. However, due to its random nature, there may be instances where it fails to find a path, and the smoothness and optimization of the path often require further adjustments.
The basic steps of the RRT algorithm are as follows:
1.
Initialization: Create a tree T, with the root q s t a r t as the starting point.
2.
Sampling: Randomly generate a sample point q r a n d , typically through uniform sampling in the space.
q r a n d ~ Uniform ( X )
where X is the search space.
3.
Nearest Neighbor Search: Find the nearest node q n e a r e s t in the tree T to the sampled point q r a n d .
d ( q 1 , q 2 ) = i = 1 n ( q 1 i q 2 i ) 2
4.
Extension: Extend from q n e a r e s t towards q r a n d to generate a new node q n e w . This step is usually constrained by a step size ε , i.e.,:
q n e w = q n e a r e s t + ε q r a n d q n e a r e s t q r a n d q n e a r e s t
5.
Validity Check: Before adding the new node to the tree, check whether the path from q n e a r e s t to q n e w collides with any obstacles, i.e., whether it satisfies the collision test function in Equation (1). If there is no collision, add q n e w to the tree and record q n e a r e s t as its parent.
6.
Termination Condition: Repeat the above steps until a node sufficiently close to the goal region is found or the maximum number of iterations is reached.
7.
Path Generation: Trace back through the parent nodes from the goal node to construct a path from the start to the goal.
The schematic of the search process is illustrated in Figure 4 and the pseudocode for the RRT algorithm is shown in Algorithm 2.
Algorithm 2. RRT algorithm pseudocode.
Algorithm RRT(x_start, x_goal, X_obs, Iter)
1: V ← {x_start}         //Initialize the vertex set with the start node
2: E ← ∅             //Initialize the edge set as empty
3: for i = 1 to Iter do      //Iterate for a given number of iterations
4:   x_rand ← Sample(i)     //Sample a random point in the space
5:   x_nearest ← NearestNode(V, x_rand) //Find the nearest node to the random point
6:   x_new ← Steer(x_rand, x_nearest)  //Move towards the random point from the nearest node
7:   if NoCollision(x_nearest, x_new, X_obs) then//Check if the path to the new node is collision-free
8:     V ← V ∪ {x_new}    //Add the new node to the vertex set
9:     E ← E ∪ {(x_nearest, x_new)} //Add the new edge to the edge set
10:   end if
11: end for
12: Return G = (V, E)       //Return the graph composed of the vertices and edges

3.3. PSO Algorithm

The PSO algorithm simulates swarm behavior for global search and can quickly approach the optimal path solution through the iterative updating of particles, demonstrating excellent performance in path optimization within complex environments. The pseudocode of the PSO algorithm is shown in Algorithm 3.
Algorithm 3. PSO algorithm pseudocode.
Algorithm PSO ( )
1: Initialize swarm of particles with random positions and velocities
2: for each particle do
3:   Calculate fitness of particle //Determine how good the current position is
4:   Update personal best (pBest) if current fitness is better
5: end for
6: Determine global best (gBest) position among all particles//Find the best position found by any particle
7: while stopping criteria not met do //Iterate until stopping condition is met
8:   for each particle do
9:      Update velocity based on pBest and gBest //Calculate new velocity
10:     Update position based on velocity//Move particle to new position
11:     Calculate fitness of particle      //Evaluate new position
12:     Update personal best if current fitness is better
13:   end for
14:   Update global best position if any particle is better//Update gBest
15: end while
16: Return gBest as the best found solution     //Return best solution found

3.4. Transformer Internal Inspection Node Sequencing Optimization

The overall path planning for transformer internal inspection nodes can be considered a variation of the classical TSP. In this context, path planning not only requires determining the order of node visits but also necessitates avoiding obstacles, making it a CTSP. The TSP is a classical optimization problem where a set of n inspection points C = { C 1 , C 2 , , C n } is given and the distance between each pair of points d i j is known. The objective of the multi-point inspection planning problem is to find an optimal solution that minimizes the total path length while traversing all inspection points and returning to the starting point. This problem can be mathematically described by Equation (8):
min L = i = 1 n 1 d ( C i , C i + 1 ) + d ( C n , C 1 )
d ( C i , C i + 1 ) = ( x i x i + 1 ) 2 + ( y i y i + 1 ) 2 + ( z i z i + 1 ) 2
where C 1 is the selected starting inspection point, C i ( i = 1 , 2 , , n ) are the inspection points to be visited, and d ( C i , C i + 1 ) is the path length between inspection points i and i + 1.
The Ant Colony Optimization (ACO) algorithm, proposed by Dorigo M. in 1991, is an effective algorithm for solving TSP. The ACO algorithm is a bio-inspired optimization method. When ants search for food, they release pheromones on the paths they travel. When more ants follow the same path, the accumulation of pheromones increases, attracting more ants to choose that path. Therefore, ACO algorithm is a positive feedback algorithm. In the context of transformer internal multi-target inspection path planning, which can be viewed as a constrained TSP, the ant colony algorithm can be used to initially optimize the sequence of inspection points. Subsequently, algorithms such as A*, RRT, and PSO can be employed to complete the overall path planning.
Assume the number of internal repair points in the transformer is n, and the number of ants is m. The three-dimensional space of the transformer is shown in Figure 1. The path optimization process of the ACO algorithm is as follows:
1.
Pheromone Initialization
τ i j ( t = 0 ) = τ 0
where τ 0 is the initial pheromone concentration on all paths, which is a small constant.
2.
Heuristic Function
η i j = 1 d i j
where d i j is the distance between inspection points i and j, and η i j is the heuristic function of inverse of d i j .
3.
Path Selection Probability
The probability p i j k ( t ) that an ant selects the next inspection point j is determined by the pheromone and heuristic information:
p i j k ( t ) = τ i j ( t ) α η i j β k a l l o w e d τ i k ( t ) α η i k β
where τ i j is the pheromone concentration from node i to node j, α is the pheromone heuristic factor indicating the influence of pheromone on the ant’s decision, β is the heuristic function factor indicating the influence of path length on the ant’s decision, and “allowed” is the search space for the ant.
4.
Pheromone Update
τ i j ( t + 1 ) = ( 1 ρ ) τ i j + Δ τ i j ( t )
Δ τ i j ( t ) = k = 1 m Δ τ ij k ( t )
Δ τ ij k ( t ) = Q L k , if   ant   k   passed   through   the   path   ( i ,   j ) 0 ,   otherwise
where ρ ( 0 , 1 ] is the evaporation rate representing the pheromone decay, Δ τ i j ( t ) is the pheromone increment, Δ τ ij k ( t ) is the pheromone increment of single ant k, Q is pheromone constant, L k is the path length of ant k.
5.
Loop Until Termination Condition is Met
Each ant starts from a random node and selects the next node based on the probability formula until a complete TSP path is constructed. After all iterations, the best path is selected, providing an optimized sequence for node visits. Since the ACO algorithm typically converges quickly for classical TSP problems where nodes are unobstructed, it is less effective at handling obstacles. In real transformers, windings create obstacles along the path, making it impossible to solely rely on the ACO algorithm for effective obstacle avoidance. Therefore, after optimizing the node visit sequence using the ACO algorithm, it is necessary to incorporate the A*, RRT, and PSO algorithms to further optimize the path between nodes for obstacle avoidance.

3.5. Transformer Inspection Path Planning Based on the Hybrid Algorithm

There are two basic modes for inspection of transformers: targeted inspection of specific points and routine inspections involving multiple inspection points. While the A*, RRT, and PSO algorithms excel in single-target path planning from start to end, they have limitations when it comes to multi-target path planning. Therefore, this paper combines the ACO algorithm, which is more adept at handling multi-target planning, to initialize the node sequence for 3D path planning. This forms an initial optimal network that starts from the origin, passes through multiple inspection nodes, and returns to the starting point, thus determining the sequence of inspections. Subsequently, the A*, RRT, and PSO algorithms are employed for local path planning between nodes, ultimately forming a complete inspection path.
The specific steps are as follows:
Whenever two nodes i and j are selected, a path-planning algorithm A*, RRT, or PSO is invoked to calculate the shortest feasible path between i and j, taking obstacles into account. Obstacle avoidance in these algorithms is computed as a cost increment, expressed as:
Δ i j = f ( j ) d i j
This cost increment is then integrated into the ACO algorithm pheromone update and path selection weights to optimize the path while avoiding obstacles.
The increment cost of ant k traveling from path i to j is included in the pheromone update as a path cost adjustment term:
Δ τ ij k ( t ) = Q L k + Δ i j , if   ant   k   passed   through   the   path   ( i ,   j ) 0 ,   otherwise
During each path decision, the dynamic obstacle avoidance path cost is used as an adjustment factor. This adjusted factor influences the selection process, leading to a modification of the traditional ACO algorithm’s probability formula for ants to select the next node, as shown in Equation (18):
p i j k ( t ) = τ i j ( t ) α η i j β e λ Δ l a l l o w e d τ i l ( t ) α η i l β e λ Δ l
The pheromone evaporation term is also adjusted accordingly:
τ i j ( t + 1 ) = ( 1 ρ ) τ i j + k = 1 m Δ τ i j ( t )
Thus, by combining the ACO algorithm for initial node sequence planning and path-planning algorithms (A*, RRT, and PSO) for local obstacle avoidance, each iteration begins with ants starting from the origin. The next node is selected based on probability and then using A*, RRT, or PSO algorithm to compute the shortest obstacle-free path. After completing a path, the pheromone concentration on that path is updated based on the actual path cost. This iterative process continues until the termination condition is met. Finally, the path with the highest pheromone concentration is selected as the optimal solution, with the pseudocode shown in Algorithm 4 and the flowchart combining the ACO algorithm and the A* algorithm is shown in Figure 5. The hybrid algorithm’s 3D obstacle avoidance path planning leverages the advantages of both types of algorithms, enhancing obstacle avoidance capabilities and computational efficiency.
Algorithm 4. Hybrid algorithm pseudocode.
Algorithm Hybrid Algorithm
1: Initialize pheromone matrix with ones
2: for iteration = 1 to n_iterations do
3:    all_paths, all_costs ← empty lists
4:    for ant = 1 to n_ants do
5:      available_nodes ← all nodes except start and end
6:      path, cost ← [start_node], 0
7:      while available_nodes is not empty do
8:        current_node ← last node in path
9:      probabilities ← compute_transition_probabilities
10:       next_node ← select from available_nodes using probabilities
11:     segment_path ← a_star/rrt/pso
12:       if segment_path is not None then
13:          update path and cost with segment_path and its cost
14:      complete path to end using a_star/rrt/pso
15:      store path and cost if valid
16:    update best_path and best_length if a better path is found
17: return best_path, best_length

4. Results and Discussion

The problem of internal transformer inspection can be broadly classified into two categories: specific fault-target detection and routine inspections involving multiple predefined inspection points. This section analyzes the path planning of an inspection micro-robot inside a transformer for both types of inspection problems.

4.1. Specific Fault-Target Detection

When internal faults such as partial discharge, overheating, insulation aging, or short circuits occur in a transformer, they often cause abnormal heat generation, gas production, or vibration changes in specific areas within the transformer. Inspection micro-robots as a novel inspection tool, offer flexibility and autonomy, enabling them to enter the narrow spaces inside the transformer for detailed inspections. By integrating sensors and advanced algorithms, the robot can collect and analyze data in real-time, thereby enabling accurate detection of fault locations.
Given the complex 3D environment and narrow spaces inside the transformer, selecting an appropriate path-planning algorithm is crucial. Different path-planning algorithms have distinct characteristics in terms of efficiency, stability, and adaptability. To comprehensively evaluate the performance of various algorithms in the complex internal environment of transformers, three commonly used 3D space planning algorithms are compared: the search-based A* algorithm, the sampling-based RRT algorithm, and the swarm intelligence-based PSO algorithm.
In a large oil-immersed transformer, an abnormal discharge fault was detected. Based on preliminary acoustic detection, the fault location was estimated to be at coordinates (4900, 2700, 1500) mm. The inspection micro-robot entered the transformer from the entry point at coordinates (100, 100, 2900) mm. The straight-line distance between the start and end points is 5635 mm. The following are the simulation results obtained using the three algorithms.
(1)
A* algorithm path-planning simulation result
The A* algorithm is a classical graph-based path-planning algorithm known for its efficiency and path stability. By combining path cost and heuristic evaluation functions, the A* algorithm can reliably find a low-cost path. For the current task, the A* algorithm demonstrated high stability across multiple trials, consistently finding a successful path with a length that remained around 8800 mm. Figure 6 illustrates the optimized path inside the transformer from different perspectives, where “elev” represents the “Elevation Angle” and “azim” represents the “Azimuth Angle”.
(2)
RRT algorithm path-planning simulation result
The RRT algorithm constructs paths using random sampling. In this project, the RRT algorithm demonstrated a significant speed advantage, capable of quickly generating a feasible path. The simulation results showed that the paths generated by RRT were shorter than those of A*, ranging between 7200 mm and 8348 mm, as in Figure 7. However, the randomness of RRT makes its output paths unstable, sometimes failing to find a path or deviating from the optimal solution.
(3)
PSO algorithm path-planning simulation result
The PSO algorithm is a swarm intelligence optimization algorithm often used for approximating global optimal solutions. Although PSO is theoretically suitable for complex multi-objective optimization problems, in this study, the complexity of the transformer’s internal environment caused PSO to occasionally fail in finding a feasible path. This instability makes the PSO algorithm less suitable for environments with narrow spaces and dense obstacles. As shown in Figure 8, the path generated by the PSO algorithm clearly deviates from the optimal path, with a length of 11,648 mm. Compared to the A* and RRT algorithms, the inconsistent performance of PSO renders it less advantageous in the current task environment.
Based on the above analysis, the A* algorithm has a clear advantage in terms of path stability and reliability, making it suitable for tasks requiring deterministic paths. RRT can be a quick choice for time-sensitive tasks. Although the paths are less stable, most results have relatively shorter path lengths. Due to its unstable performance, the PSO algorithm does not offer significant advantages in the current task environment. Therefore, selecting the appropriate algorithm (or combination of algorithms) based on specific task requirements can significantly enhance the efficiency and accuracy of inspections.

4.2. Multi-Point Inspection Path Planning

Internal faults in oil-immersed transformers are primarily classified into thermal and electrical faults. While there are many specific types, the most common internal faults during operation involve winding and core faults, which account for approximately 60% of total transformer failures. Winding faults are mainly caused by internal short circuits or external impacts during transportation, where the winding coils are subjected to electromagnetic forces or other mechanical stresses. After multiple stress events, the insulation may be damaged, leading to winding deformation or loosening of insulation pads, which in turn reduces the insulation level. This can result in inter-layer or turn-to-turn insulation breakdown. Core faults are mainly caused by debris such as welding slag or loose nuts on the core surface and the long-term operation may cause the insulating paint on the surface of the silicon steel sheets to peel off. This can lead to internal core short circuits, or when there are defects in the transformer’s internal structure or core damage, multiple earthing points in the core can form a closed loop, potentially causing core burnout or melt earthing strips [35].
Based on the above analysis, areas in the transformer where winding and core faults are likely to occur are considered key inspection points. Additionally, historical fault points within the transformer have a relatively higher probability of recurrence. Therefore, 18 mandatory inspection points, including both vulnerable fault points and historical fault points, are designated as path constraints for the transformer’s inspection micro-robot, as in Table 1.
The multi-point inspection problem in transformers is similar to TSP, but with the key difference that obstacles exist between inspection points, preventing the direct application of traditional TSP solutions. Based on the theoretical analysis in Section 3.4, this paper first employs the ACO to optimize the order of inspection points. Further path planning is then conducted using the A*, RRT, and PSO algorithms. The following are the calculation results, which are summarized in Table 2.
(1)
ACO algorithm for pre-planning of the 3D TSP
As shown in Figure 9, the preliminary path planned by the ACO algorithm does not effectively avoid obstacles. Therefore, further planning is required to ensure that the path between nodes is collision-free and avoids the windings.
(2)
Integration of A* algorithm with ACO pre-planning
To illustrate the role of CTSP pre-planning, a comparison is made between paths optimized by A* with and without pre-planning using the ACO algorithm. The simulation results are shown in Figure 10 and Figure 11. It can be seen that the path length with CTSP pre-planning is 34,228 mm, while the path length without pre-planning is 72,306 mm. The pre-planned path is 52.6% shorter, significantly improving inspection efficiency.
(3)
Integration of RRT algorithm with ACO pre-planning
As shown in Figure 12, the path planned by the RRT algorithm contains many invalid paths in various directions due to the randomness of its parameters. This simulation results in a longer total path length of 38,531 mm, which is 4303 mm longer than the A* algorithm with ACO. Additionally, the path smoothness is lower, with higher curvature and torsion.
(4)
Integration of PSO algorithm with ACO pre-planning
As shown in Figure 13, the path planned by the PSO algorithm oscillates near the nodes. The path length is 64,163 mm, nearly double that of the A* algorithm. In this project, the PSO algorithm does not offer significant advantages.

4.3. Path-Planning Result Evaluation

In the internal inspection task of large oil-immersed transformers, the combination of the A* algorithm and ACO provides a relatively optimal overall path. However, since the A* algorithm is fundamentally a grid-based path search method, i.e., path planning on a discrete grid, the paths it generates are typically in the form of right angles or zigzags. This path characteristic can restrict the actual movement of inspection tools. For the inspection micro-robot, which is designed to maneuver flexibly and fluidly in narrow spaces, the right-angle paths generated by A* require the robot to make sharp turns continuously, which not only affects movement efficiency but also increases mechanical wear and tear, energy consumption, and ultimately prolongs the inspection time.
Therefore, further path smoothing is essential. By smoothing the path, it becomes more fluid and natural, reducing the movement resistance of the inspection micro-robot in narrow spaces, allowing it to follow a path that is closer to a continuous curve. This not only improves inspection efficiency and accuracy but also reduces frictional losses during turns, helping to maintain equipment stability and safety during inspections. The necessity of path smoothing lies in providing the most suitable trajectory for the inspection micro-robot, maximizing its advantages in autonomous movement within complex environments.
Curvature is one of the metrics used to measure the degree of curve bending and a higher value indicates more severe bending and more frequent sharp turns. Torsion is a parameter that measures the degree of twisting of a spatial curve and a higher value indicates more pronounced twisting in a three-dimensional space. A smaller curvature and torsion mean that the path is easier to execute, with fewer sharp turns or excessive twists, resulting in higher stability for the inspection micro-robot.
(1)
Curvature
Curvature is a variable that measures the degree of bending of a curve at a given point. The higher the curvature, the more the curve bends, and the more frequent the sharp turns. The formula for curvature is as follows:
κ = r ( t ) × r ( t ) r ( t ) 3
where r ( t ) is the first derivative of the curve (velocity vector) and r ( t ) is the second derivative.
(2)
Torsion
Torsion describes the degree of twisting of a spatial curve. The higher the torsion, the more complex the twisting of the curve in space. The formula for torsion is:
τ = ( r ( t ) × r ( t ) ) r ( t ) r ( t ) × r ( t ) 2
where r ( t ) represents the third derivatives of the curve.
(3)
Curve-Smoothing Method
B-spline curve is formed by piecing together polynomial segments and it is advantageous for smoothing paths because it can create a continuous and smooth curve [36]. By adjusting the control points, the shape of the curve can be modified and it offers local control, meaning that adjusting one control point only affects the corresponding local section of the curve. In this paper, the B-spline method is used to smooth the path optimized by the A* + ACO hybrid algorithm. The simulation results are shown in Figure 14. After B-spline interpolation and smoothing, the total path length is 37,766 mm. The curvature and torsion are shown in Figure 15. The curvature is less than 0.033, indicating that the curve is fairly smooth overall. The torsion falls within the range of −0.034 to 0.026, suggesting that the path does not exhibit excessive twisting in the three-dimensional space, meeting the mechanical requirements for the inspection micro-robot to navigate within the transformer.
(4)
Path-Tracking Stability via Lyapunov Theory
To ensure the smoothed path meets closed-loop control requirements, formal stability guarantees are established through the following analysis:
Defining tracking errors between the inspection robot’s actual pose (x,y,z,θ) and the reference path (xd, yd, zd, θd), the lateral error is exy, height error ez, and the heading error is θe.
e x y = ( x x d ) 2 + ( y y d ) 2
e z = z z d
θ e = θ θ d
For a differential-drive robot, the error dynamics derived from nonholonomic constraints are:
e ˙ x y = v x y sin θ e e ˙ z = v z θ ˙ e = ω v x y κ
where v x y and v z are linear velocity in the horizontal and vertical direction, respectively, ω is the angular velocity, and κ is the path curvature.
Lyapunov function candidate:
V ( e , θ e ) = 1 2 e x y 2 + 1 2 e z 2 + 1 2 θ e 2
The objective is to design control law ω to drive e x y 0 , e z 0 , θ e 0 :
ω = v x y κ k θ e v z = k z e z
where k > 0 and kz > 0 are the feedback gains of horizontal direction and the vertical direction, respectively. Combined with the error dynamics in Equation (25), the time derivative of V is:
V ˙ = e x y e ˙ x y + e z e ˙ z + θ e θ ˙ e = e x y ( v x y sin θ e ) + e z ( v z ) + θ e ( ω v x y κ ) = e x y v x y sin θ e k z e z 2 k θ e 2
For small heading errors (θe ≈ 0), Equation (28) can be simplified as Equation (29) using sin θ e θ e :
V ˙ v x y e x y θ e k z e z 2 k θ e 2
Selecting parameters (k, kz) appropriately ensures and proves the convergence of all tracking errors (exy, ez, θe).
The A* + ACO raw path exhibits significant jaggedness, forcing the robot to perform abrupt turns at inflection points. This places excessive demands on the controller to respond promptly under speed/acceleration constraints, resulting in overshoot and large tracking errors. In contrast, the smoothed path with continuous curvature reduces dynamic stress on the controller, thereby minimizing tracking deviations. By applying the identical Lyapunov controller to both paths and simulating the robot’s motion trajectories with an initial velocity of 0.3 m/s and controller parameters k = kz = 1.0, the simulation results in Table 3 demonstrate that the smoothed path achieves significantly lower tracking errors. This indicates that the actual control system operates closer to the theoretical assumptions (e.g., no actuator saturation, validity of linearization) during path following, thereby validating enhanced stability of the smoothed trajectory.

4.4. Discussion

Based on the analysis and simulation results presented, the proposed path planning method, which integrates the A* algorithm with ACO, has demonstrated superior performance in navigating an inspection micro-robot within large oil-immersed transformers. However, there are still areas where the performance can be further improved: (1) in practical applications, the internal environment of a transformer may undergo dynamic changes, such as fluctuations in oil flow or variations in equipment operating conditions, which can impact the robot’s navigation path. While the current algorithm performs well in pre-planning and path optimization, there is room for improvement in terms of real-time responsiveness to such environmental changes. Future research could focus on incorporating more dynamic path-adjustment mechanisms that allow the robot to quickly replan its path in response to sudden changes, without requiring complete recalculation, thereby enhancing the system’s responsiveness and robustness. (2) The internal environment of a transformer is not only complex and narrow, but also potentially hazardous. In addition to minimizing path length and ensuring smoothness, the robot must also consider path safety. For example, the robot needs to avoid areas with strong electromagnetic fields or high temperatures. Future studies could integrate environmental sensing and multi-modal information fusion technologies, incorporating physical field information (such as temperature and electromagnetic fields) into path planning. This would enhance the safety and stability of the planned paths, ensuring safer navigation for the robot.

5. Conclusions

This paper addresses the critical challenge of path planning for an inspection micro-robot operating within large oil-immersed transformers. An integrated approach that combines the strengths of multiple algorithms to achieve superior performance was constructed and optimized. This paper presents a novel and effective path-planning framework that significantly enhances the inspection efficiency and flexibility of miniature inspection robots.
1.
Constrained TSP formulation and node pre-planning: To tackle the complex three-dimensional environment inside transformers, the problem is formulated as a constrained TSP. The ACO algorithm is employed for pre-planning the optimal visitation sequence of inspection nodes. This approach effectively reduces the overall path complexity and serves as a foundation for subsequent path planning.
2.
Integration of path-planning algorithms: Building upon the pre-planning stage, path-planning algorithms such as A*, RRT, and PSO are utilized to generate detailed paths. The A* algorithm, when integrated with the pre-planned node sequence, demonstrates the best performance in terms of path length, smoothness, and stability. The B-spline smoothing method is further applied to enhance the fluidity and naturalness of the robot’s movement path, addressing the limitations of traditional A* algorithms that tend to produce right-angle paths.
3.
Performance evaluation: The combination of A* and ACO achieves the shortest path length while maintaining excellent smoothness and stability. After B-spline smoothing, the total path length is 37,766 mm, with a curvature less than 0.033 and torsion within the range of −0.034 to 0.026, ensuring that the path is both smooth and free from excessive twisting. This meets the mechanical requirements for the miniature inspection robot to navigate within the transformer efficiently.

Author Contributions

Conceptualization, H.J. and J.F.; methodology, H.J. and J.F.; software, X.L. and J.F.; validation, J.F.; formal analysis, X.L.; investigation, H.J.; resources, H.J. and L.L.; data curation, C.H. and X.L.; writing—original draft preparation, J.F. and X.L.; writing—review and editing, C.H. and L.L.; visualization, X.L.; supervision, J.F.; project administration, H.J.; funding acquisition, H.J. All authors have read and agreed to the published version of the manuscript.

Funding

This research was funded by the State Grid Tianjin Electric Power Technology Project (Electric Power Research and Development 23–40).

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

Dataset available on request from the authors.

Conflicts of Interest

Author Junji Feng was employed by the company State Grid Tianjin Electric Power Research Institute. The remaining authors declare that the research was conducted in the absence of any commercial or financial relationships that could be construed as a potential conflict of interest.

Nomenclature

Symbol/
Acronym
DescriptionUnit/Remark
Symbols
C Full 3D environment space of transformer [ x , y , z ] 3
C o b s Obstacle subspace in transformer [ x , y , z ] 3
C f r e e Free navigable space in transformer C \ C o b s
P s t a r t , P e n d Start and end point coordinates ( x , y , z ) in mm
f ( n ) Total cost function in A* algorithmUnitless grid steps
g ( n ) Actual path cost from start to node in A*Unitless grid steps
h ( n ) Heuristic estimate cost from node to goal in A*Unitless grid steps
d i j Euclidean distance between nodes i and jMm
τ i j Pheromone concentration on path ij in ACOUnitless
η i j Heuristic function in ACOUnitless
α Pheromone influence factor in ACODimensionless
β Distance influence factor in ACODimensionless
ρ Pheromone evaporation rate in ACO
Acronyms
ACOAnt Colony OptimizationUsed for CTSP node sequencing
A*A-Star AlgorithmSearch-based path planning
RRTRapidly-exploring Random TreeSampling-based path planning
PSOParticle Swarm OptimizationSwarm intelligence optimization
CTSPConstrained Traveling Salesman ProblemMulti-node path planning with obstacles
TSPTraveling Salesman ProblemMulti-node path planning
PRMProbabilistic RoadmapSampling-based global planning
SMASlime Mould AlgorithmMetaheuristic optimization
APFArtificial Potential FieldReactive obstacle avoidance
B&BBranch and BoundCombinatorial optimization method
B-splineBasis SplinePath-smoothing technique

References

  1. Qi, B.; Ji, M.; Zheng, Y.P.; Zhu, K.H.; Pan, S.Y.; Zhao, L.J.; Li, C.R. Application status and development prospect of power internet of things technology in condition assessment of power transmission and transformation equipment. High Volt. Eng. 2022, 48, 3012–3031. [Google Scholar]
  2. Nachimuthu, S.; Zuo, M.J.; Seewald, S.; Richard, J.; Thicke, C. Modelling of Inspection Cycles for Power Distribution Transformers. In Proceedings of the 2020 Asia-Pacific International Symposium on Advanced Reliability and Maintenance Modeling (APARM), Vancouver, BC, Canada, 20–23 August 2020; pp. 1–5. [Google Scholar] [CrossRef]
  3. Sun, C.; van der Tol, R.; Melenhorst, R.; Pacheco, L.A.P.; Koerkamp, P.G. Path planning of manure-robot cleaners using grid-based reinforcement learning. Comput. Electron. Agric. 2024, 226, 109456. [Google Scholar] [CrossRef]
  4. Bailey, J.P.; Nash, A.; Tovey, C.A.; Koenig, S. Path-length analysis for grid-based path planning. Artif. Intell. 2021, 301, 103560. [Google Scholar] [CrossRef]
  5. Jiang, X.; Wang, Z.; Dong, C. A Path Planning Algorithm Based on Improved RRT Sampling Region. Comput. Mater. Contin. 2024, 80, 4303–4323. [Google Scholar] [CrossRef]
  6. Liu, C.; Xie, S.; Sui, X.; Huang, Y.; Ma, X.; Guo, N.; Yang, F. PRM-D* Method for Mobile Robot Path Planning. Sensors 2023, 23, 3512. [Google Scholar] [CrossRef] [PubMed]
  7. Ortner, R.; Kurmi, I.; Bimber, O. Acceleration-Aware Path Planning with Waypoints. Drones 2021, 5, 143. [Google Scholar] [CrossRef]
  8. Martins, O.O.; Adekunle, A.A.; Olaniyan, O.M.; Bolaji, B.O. An Improved multi-objective a-star algorithm for path planning in a large workspace: Design, Implementation, and Evaluation. Sci. Afr. 2022, 15, e01068. [Google Scholar] [CrossRef]
  9. Miyombo, M.E.; Liu, Y.K.; Mulenga, C.M.; Siamulonga, A.; Kabanda, M.C.; Shaba, P.; Xi, C.; Ayodeji, A. Optimal path planning in a real-world radioactive environment: A comparative study of A-star and Dijkstra algorithms. Nucl. Eng. Des. 2024, 420, 113039. [Google Scholar] [CrossRef]
  10. Roy, R.; Mahadevappa, M.; Kumar, C.S. Trajectory Path Planning of EEG Controlled Robotic Arm Using GA. Procedia Comput. Sci. 2016, 84, 147–151. [Google Scholar] [CrossRef]
  11. Elloumi, W.; El Abed, H.; Abraham, A.; Alimi, A.M. A comparative study of the improvement of performance using a PSO modified by ACO applied to TSP. Appl. Soft Comput. 2014, 25, 234–241. [Google Scholar] [CrossRef]
  12. 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. [Google Scholar] [CrossRef]
  13. Li, S.; Chen, H.; Wang, M.; Heidari, A.A.; Mirjalili, S. Slime mould algorithm: A new method for stochastic optimization. Future Gener. Comput. Syst. 2020, 111, 300–323. [Google Scholar] [CrossRef]
  14. 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. [Google Scholar] [CrossRef]
  15. Yang, L.; Li, P.; Qian, S.; Quan, H.; Miao, J.; Liu, M.; Hu, Y.; Memetimin, E. Path Planning Technique for Mobile Robots: A Review. Machines 2023, 11, 980. [Google Scholar] [CrossRef]
  16. Sung, I.; Choi, B.; Nielsen, P. On the training of a neural network for online path planning with offline path planning algorithms. Int. J. Inf. Manag. 2021, 57, 102142. [Google Scholar] [CrossRef]
  17. Fang, W.; Liao, Z.; Bai, Y. Improved ACO algorithm fused with improved Q-Learning algorithm for Bessel curve global path planning of search and rescue robots. Robot. Auton. Syst. 2024, 182, 104822. [Google Scholar] [CrossRef]
  18. Fu, B.; Chen, Y.; Quan, Y.; Zhou, X.; Li, C. Bidirectional Artificial Potential Field-based Ant Colony Optimization for Robot Path Planning. Robot. Auton. Syst. 2024, 183, 104834. [Google Scholar] [CrossRef]
  19. Sui, F.; Tang, X.; Dong, Z.; Gan, X.; Luo, P.; Sun, J. ACO+PSO+A*: A bi-layer hybrid algorithm for multi-task path planning of an AUV. Comput. Ind. Eng. 2023, 175, 108905. [Google Scholar] [CrossRef]
  20. Zhang, Z.; Wu, R.; Pan, Y.; Wang, Y.; Wang, Y.; Guan, X.; Hao, J.; Zhang, J.; Li, G. A Robust Reference Path Selection Method for Path Planning Algorithm. IEEE Robot. Autom. Lett. 2022, 7, 4837–4844. [Google Scholar] [CrossRef]
  21. Heng, H.; Ghazali MH, M.; Rahiman, W. Exploring the application of ant colony optimization in path planning for Unmanned Surface Vehicles. Ocean Eng. 2024, 311, 118738. [Google Scholar] [CrossRef]
  22. Huynh, L.Q.; Tran, L.V.; Phan, P.N.K.; Yu, Z.; Dao, S.V.T. Intermediary RRT*-PSO: A Multi-Directional Hybrid Fast Convergence Sampling-Based Path Planning Algorithm. Comput. Mater. Contin. 2023, 76, 2281–2300. [Google Scholar] [CrossRef]
  23. Li, X.; Huang, R.; Zhao, Y.; Zhang, Z.; Guo, T. Mobile Robot SLAM Algorithm for Transformer Internal Detection and Location. In Proceedings of the 2018 International Conference on Electronics Technology, Chengdu, China, 23–27 May 2018; pp. 251–256. [Google Scholar]
  24. Feng, Y.; Kou, Y.; Liu, Y. Visual Localization of an Internal Inspection Robot for the Oil-Immersed Transformer. J. Robot. 2023, 2023, 6699265. [Google Scholar] [CrossRef]
  25. Zhang, Y.; Shen, Y.; Wang, Q.; Song, C.; Dai, N.; He, B. A novel hybrid swarm intelligence algorithm for solving TSP and desired-path-based online obstacle avoidance strategy for AUV. Robot. Auton. Syst. 2024, 177, 104678. [Google Scholar] [CrossRef]
  26. Toaza, B.; Esztergár-Kiss, D. A review of metaheuristic algorithms for solving TSP-based scheduling optimization problems Image 1. Appl. Soft Comput. 2023, 148, 110908. [Google Scholar] [CrossRef]
  27. Zhang, R.; Guo, H.; Andriukaitis, D.; Li, Y.; Królczyk, G.; Li, Z. Intelligent path planning by an improved RRT algorithm with dual grid map. Alex. Eng. J. 2024, 88, 91–104. [Google Scholar] [CrossRef]
  28. Feng, Z.; Zhou, L.; Qi, J.; Hong, S. DBVS-APF-RRT*: A global path planning algorithm with ultra-high speed generation of initial paths and high optimal path quality, Part A. Expert Syst. Appl. 2024, 249, 123571. [Google Scholar] [CrossRef]
  29. Skinderowicz, H.R. Focused ACO with node relocation procedure for solving large TSP instances. Procedia Comput. Sci. 2023, 225, 2992–3000. [Google Scholar] [CrossRef]
  30. Yan, J.; Zlatanova, S.; Lee, J.B.; Liu, Q. Indoor Traveling Salesman Problem (ITSP) Path Planning. ISPRS Int. J. Geo-Inf. 2021, 10, 616. [Google Scholar] [CrossRef]
  31. Janoš, J.; Vonásek, V.; Pěnička, R. Multi-Goal Path Planning Using Multiple Random Trees. IEEE Robot. Autom. Lett. 2021, 6, 4201–4208. [Google Scholar] [CrossRef]
  32. Cai, Z.; Liu, J.; Xu, L.; Wang, J. Cooperative path planning study of distributed multi-mobile robots based on optimised ACO algorithm. Robot. Auton. Syst. 2024, 179, 104748. [Google Scholar] [CrossRef]
  33. Feng, Y.; Liu, Y.; Gao, H.; Ju, Z. Hovering Control of Submersible Transformer Inspection Robot Based on ASMBC Method. IEEE Access 2020, 8, 76287–76302. [Google Scholar] [CrossRef]
  34. Ji, H.; Cui, X.; Ren, W.; Liu, L.; Wang, W. Visual inspection for transformer insulation defects by a patrol robot fish based on deep learning. IET Sci. Meas. Technol. 2021, 15, 606–618. [Google Scholar] [CrossRef]
  35. Zhu, C. Research on the Fault Diagnosis of Transformer based on Generating Adversarial Network Data Enhancement and Vibration Signal. Master’s Thesis, North China Electric Power University, Beijing, China, 2022. [Google Scholar]
  36. Huo, F.; Zhu, S.; Dong, H.; Ren, W. A new approach to smooth path planning of Ackerman mobile robot based on improved ACO algorithm and B-spline curve. Robot. Auton. Syst. 2024, 175, 104655. [Google Scholar] [CrossRef]
Figure 2. A 3D environment model of an oil-immersed transformer.
Figure 2. A 3D environment model of an oil-immersed transformer.
Sensors 25 02666 g002
Figure 3. A* algorithm of the searching process.
Figure 3. A* algorithm of the searching process.
Sensors 25 02666 g003
Figure 4. RRT algorithm of the searching process.
Figure 4. RRT algorithm of the searching process.
Sensors 25 02666 g004
Figure 5. Hybrid algorithm based on the ACO and A* algorithm flowchart.
Figure 5. Hybrid algorithm based on the ACO and A* algorithm flowchart.
Sensors 25 02666 g005
Figure 6. A* algorithm optimized path.
Figure 6. A* algorithm optimized path.
Sensors 25 02666 g006
Figure 7. RRT algorithm optimized path.
Figure 7. RRT algorithm optimized path.
Sensors 25 02666 g007
Figure 8. PSO algorithm optimized path.
Figure 8. PSO algorithm optimized path.
Sensors 25 02666 g008
Figure 9. ACO preliminary planning of the path node order.
Figure 9. ACO preliminary planning of the path node order.
Sensors 25 02666 g009aSensors 25 02666 g009b
Figure 10. A* algorithm with ACO pre-planning.
Figure 10. A* algorithm with ACO pre-planning.
Sensors 25 02666 g010
Figure 11. Comparison of A* algorithm optimized paths with and without pre-planning.
Figure 11. Comparison of A* algorithm optimized paths with and without pre-planning.
Sensors 25 02666 g011
Figure 12. RRT algorithm with ACO pre-planning.
Figure 12. RRT algorithm with ACO pre-planning.
Sensors 25 02666 g012aSensors 25 02666 g012b
Figure 13. PSO algorithm with ACO pre-planning.
Figure 13. PSO algorithm with ACO pre-planning.
Sensors 25 02666 g013
Figure 14. A* algorithm with ACO path smoothed by B-spline.
Figure 14. A* algorithm with ACO path smoothed by B-spline.
Sensors 25 02666 g014
Figure 15. Curvature and torsion of the A* with ACO planned path after B-spline smoothing.
Figure 15. Curvature and torsion of the A* with ACO planned path after B-spline smoothing.
Sensors 25 02666 g015
Table 1. Multi-point inspection locations and coordinates.
Table 1. Multi-point inspection locations and coordinates.
Inspection PointsCoordinates (mm)
High-voltage lead-out detection points(1100, 350,2700)(3000, 350,2700)(4900, 350,2700)
Low-voltage lead-out detection points(1100, 2650, 2700)(3000, 2650, 2700)(4900, 2650, 2700)
Winding bottom and spacer detection point(1100, 2650, 300)(3000, 2650, 300)(4900, 2650, 300)
Inter-winding detection points(2050, 1500,1000)(2050, 1500,2000)(2050, 1500,2700)
(3950, 1500,1000)(3950, 1500,2000)(3950, 1500,2700)
Historical fault points(2200, 1900, 1500)(3300, 700, 2000)(4900, 2700, 1500)
Table 2. Path comparison of different algorithms.
Table 2. Path comparison of different algorithms.
AlgorithmsPath Length (mm)Features
A* with non-optimized waypoints72,306Longer path, good stability
A* + ACO34,228Shorter path, good stability
RRT + ACO38,531~43,979Shorter path, poor stability
PSO + ACO64,163Longer path, poor stability
Table 3. Numerical verification of control stability of A* + ACO hybrid algorithm path.
Table 3. Numerical verification of control stability of A* + ACO hybrid algorithm path.
ParametersA* + ACO PathSmoothed PathImprovement
Maximum curvature0.120.03379%
Max height error (ez, mm)25.65.280%
Max lateral error (exy, mm)12.43.770.2%
Error convergence time8.2s2.1s74.4%
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.

Share and Cite

MDPI and ACS Style

Feng, J.; Liu, X.; Ji, H.; He, C.; Liu, L. Research on 3D Path Optimization for an Inspection Micro-Robot in Oil-Immersed Transformers Based on a Hybrid Algorithm. Sensors 2025, 25, 2666. https://doi.org/10.3390/s25092666

AMA Style

Feng J, Liu X, Ji H, He C, Liu L. Research on 3D Path Optimization for an Inspection Micro-Robot in Oil-Immersed Transformers Based on a Hybrid Algorithm. Sensors. 2025; 25(9):2666. https://doi.org/10.3390/s25092666

Chicago/Turabian Style

Feng, Junji, Xinghua Liu, Hongxin Ji, Chun He, and Liqing Liu. 2025. "Research on 3D Path Optimization for an Inspection Micro-Robot in Oil-Immersed Transformers Based on a Hybrid Algorithm" Sensors 25, no. 9: 2666. https://doi.org/10.3390/s25092666

APA Style

Feng, J., Liu, X., Ji, H., He, C., & Liu, L. (2025). Research on 3D Path Optimization for an Inspection Micro-Robot in Oil-Immersed Transformers Based on a Hybrid Algorithm. Sensors, 25(9), 2666. https://doi.org/10.3390/s25092666

Note that from the first issue of 2016, this journal uses article numbers instead of page numbers. See further details here.

Article Metrics

Back to TopTop