Next Article in Journal
Demagnetization Fault Diagnosis of a PMSM for Electric Drilling Tools Using GAF and CNN
Previous Article in Journal
Novel Hybrid SOR- and AOR-Based Multi-User Detection for Uplink M-MIMO B5G Systems
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Path Planning and Tracking Control of Tracked Agricultural Machinery Based on Improved A* and Fuzzy Control

1
College of Mechanical and Electrical Engineering, Hebei Agricultural University, Baoding 071000, China
2
Hebei Province Smart Agriculture Equipment Technology Innovation Center, Baoding 071001, China
*
Author to whom correspondence should be addressed.
These authors contributed equally to this work.
Electronics 2024, 13(1), 188; https://doi.org/10.3390/electronics13010188
Submission received: 30 November 2023 / Revised: 25 December 2023 / Accepted: 28 December 2023 / Published: 1 January 2024

Abstract

:
In order to improve the efficiency of agricultural machinery operations and reduce production costs, this article proposes a path planning algorithm based on the improved A* algorithm (IA*) and a tracking controller based on fuzzy sliding mode variable structure control (F-SMC) to meet the operation requirements of tracked agricultural machinery. Firstly, we introduce a heuristic function with variable weights, a penalty, and a fifth-order Bezier curve to make the generated path smoother. On this basis, the ant colony algorithm is introduced to further optimize the obtained path. Subsequently, based on fuzzy control theory and sliding mode variable structure control theory, we established a kinematic model for tracked agricultural machinery as the control object, designed a fuzzy sliding mode approaching law, and preprocessed it to reduce the time required for sliding mode control to reach the chosen stage. The simulation experiment of path planning shows that compared with A*, the average reduction rate of the path length for IA* is 5.51%, and the average reduction rate of the number of turning points is 39.01%. The path tracking simulation experiment shows that when the driving speed is set to 0.2 m/s, the adjustment time of the F-SMC controller is reduced by 0.99 s and 1.42 s compared to the FUZZY controller and PID controller, respectively. The variance analysis of the adjustment angle shows that the minimum variance of the F-SMC controller is 0.086, and the error converges to 0, proving that the vehicle trajectory is smoother and ultimately achieves path tracking. The field test results indicate that the path generated by the IA* algorithm can be tracked by the F-SMC controller in the actual environment. Compared to the A* algorithm and FUZZY controller, the path tracking time reduction rate of IA* and F-SMC is 29.34%, and the fuel consumption rate is reduced by 2.75%. This study is aimed at providing a feasible approach for improving the efficiency of tracked agricultural machinery operations, reducing emissions and operating costs.

1. Introduction

In the trend of land transfer, large-scale planting has created conditions for the intelligent development of agricultural machinery [1,2]. The positioning and navigation systems based on the global positioning system, Glonass, Galileo, and Beidou navigation satellite systems are increasingly being applied into precision agriculture [3,4]. The auto drive system is composed of an information perception module, positioning and attitude measurement module, path planning module, and tracking control module. While path planning and tracking control are effective supports for the implementation of autonomous driving in the field of engineering applications [5,6], as a common type of agricultural robot, tracked agricultural machinery can autonomously perceive external environmental information. It can also make decisions and plans for its own posture and path, independently controlling its own behavior during operations [7,8].
In response to the current efficiency requirements and special complex environmental characteristics faced by agricultural machinery operations, path planning technology has developed many methods with a wide range of applications [9]. For static path planning, commonly used path planning algorithms include Rapidly Exploring Random Trees (RRTs) [10], the Probabilistic Roadmap Method (PRM) [11], the Dijkstra algorithm [12], the A* algorithm [13], etc. RRT and PRM belong to the sampling-based methods, which have a stronger search ability when the spatial dimension is high or the size is large. Despite the great computational complexity, there is still significant room for planning efficiency improvements. The Dijkstra algorithm is a typical search planning algorithm, but it has drawbacks such as a large amount of search data, multiple redundant nodes, and inefficient path planning [14].
On the basis of the Dijkstra algorithm, the A* algorithm introduces an evaluation function to determine the search direction, which to some extent improves the efficiency of path planning [15,16]. When global information is known, the A* algorithm can quickly achieve path planning through node state detection and simple estimation. However, this algorithm ignores the motion constraints on the robot, resulting in too many planned path turning points and curvature jumps, which is not in line with kinematic principles [17,18]. In response to the problem of too many turning points in the traditional A* algorithm, Lao et al. [19] optimized the key point selection strategy. Simulation experiments showed that this optimization method is smoother and more efficient compared to the A* algorithm, Dijkstra algorithm, and RRT algorithm. Hu et al. [20] used the fuzzy C-means (FCM) clustering algorithm to cluster obstacles for full coverage tasks containing obstacles. Based on the clustering results, the maximum and minimum values of the horizontal and vertical coordinates of each type of obstacle were calculated; then, the Bresenham algorithm was used to segment regions along the maximum and minimum values of the obstacle boundary; then, the A* algorithm was used to find the optimal path of the subregion; and finally, the reciprocating coverage method was used to achieve subarea coverage operations. Wang et al. [21], based on the A* algorithm, first combined it with the skip search algorithm to reduce computational complexity by replacing nodes in the A* algorithm with skip points. Then, a pruning algorithm was used to prune the obtained path, further removing unnecessary nodes. Finally, they used the quadratic Bezier curve to smooth the path. And the superiority of the improved algorithm was verified through simulation experiments and experiments in actual environments.
However, the above paper only considers path planning in an ideal environment, and the working environment of agricultural machinery is complex. In highly unstructured working environments with variable soil characteristics, agricultural machinery is subject to many uncertain factors. As a result, this poses great difficulties on accurately following the established trajectory for autonomous driving [22,23]. So, it is required that the path tracking controller has certain anti-interference and adaptive capabilities to ensure a high accuracy and stability of agricultural machinery automatic driving [24,25]. At present, scholars have conducted extensive research on control systems for trajectory tracking design of ground robots, including a PID controller [26], fuzzy controller [27], sliding mode controller [28], etc. The PID controller has a simple structure and strong adaptability, so it is often used in agricultural machinery navigation control. But the main problem with the PID controller is parameter tuning for different operating conditions, as well as a difficulty in controlling overshoot and response time. Sliding mode variable structure control is widely used in nonlinear control due to its advantages such as insensitivity to disturbances, fewer adjustment parameters, and a fast response speed. Wu et al. [29] designed a fast terminal sliding mode variable structure control algorithm based on an interference observer for the kinematic model of agricultural machinery, which compensates for the observed interference values to the kinematic model. It has the advantages of fast convergence speed, no overshoot, and high tracking accuracy. However, this study focuses on wheeled agricultural machinery, which exhibits significant differences to tracked agricultural machinery tracking control. To ensure the robustness of the control and improve the path tracking performance of agricultural vehicles, it is necessary to ensure the deflection angle control of the inner and outer tracks based on scientific kinematic models. Jiao et al. [28] proposed an adaptive sliding mode control strategy based on equivalent control and switching control for tracked robots and designed an adaptive integral sliding mode switching function with variable tilt parameters based on the kinematic model of agricultural machinery and motor driving characteristics. This adaptive sliding mode control method has good anti-interference performance, but there may be chattering during the control process. The main drawback of sliding mode control is that the discontinuity of the control can lead to chattering and infinite convergence time.
To sum up, in response to the shortcomings of the traditional A* algorithm, such as multiple turning points and discontinuous sliding mode control, this paper introduces the Bezier curve, variable weight penalty function, and penalty functions into the traditional A* algorithm. Then, a path tracking control law was designed based on sliding mode control theory, and a fuzzy sliding mode variable structure controller was designed using fuzzy mathematics principles to improve the anti-interference ability and path-tracking accuracy of tracked agricultural machinery in complex environments. The content of the remaining chapters of this article is as follows: Section 2 introduces the design concept of the IA*; Section 3 constructs the mathematical model for tracked agricultural machinery; Section 4 designs the F-SMC tracking controller; Section 5 uses simulation experiments to verify the performance of the IA* and F-SMC; Section 6 validates the practicality of the IA* algorithm and F-SMC in real field environments; and Section 7 summarizes the content of this article and introduces our future research directions. Due to the excessive number of terms involved in this article, in order to facilitate browsing, we have added a text box below to introduce their meanings.

2. Design of the IA* Algorithm

2.1. Path Smoothing Method

The A* algorithm is a heuristic search algorithm that is used to find the shortest path in a static environment [30]. The evaluation function of this algorithm is defined as follows:
F ( n ) = G ( n ) + H ( n )
Compared to other path planning methods, the A* algorithm has the advantages of low computational complexity and high accuracy. However, as indicated by Equation (1), the path generated by the A* algorithm is generally a sequence of scattered points, resulting in many turning points and sudden changes in curvature. This path may not necessarily conform to the kinematic principles of the agricultural machinery. Therefore, parametric curves such as Dubins curves [31] and clothoids [32] are used in path planning, as they require less computation. On the other hand, these curves are not practical because they cannot generate closed paths [33]. Moreover, most curve-based path planning techniques rely on the interpolation of reference points, with the resulting curve passing through all reference points. This approach often results in longer paths compared to the Bezier curve, since these curves only pass through the first and last control points [34]. The Bezier curve is used in various fields, such as face recognition [35], medical imaging [36], computer graphics and animation [37], path planning for robots [38,39,40], etc. The fifth-order Bezier curve is formed for the path of the wheeled mobile robot with the constraints of speed, acceleration, and jerk [41]. To address this issue, we use a fifth-order Bezier curve to smooth the path generated by the traditional A* algorithm. The Bezier curve is capable of describing complex polygons [42]. First, we connect the start and end points of the path to form a polygon. Then, we approximate this polygon using the Bezier formula to obtain the parameters of the Bezier curve (as shown in Figure 1). The points that determine the direction of the curve are called control points, and the polygon formed by connecting these points is called the control polygon.
By applying a fifth-order Bezier curve to smooth the path generated by the A* algorithm, the expression of the fifth-order Bezier curve is shown as follows:
P ( u ) = ( 1 u ) 5 P 0 + 5 ( 1 u ) 4 u P 1 + 10 ( 1 u ) 3 u 2 P 2 + 10 ( 1 u ) 3 P 3 + 5 ( 1 u ) 4 P 4 + u 5 P 5
Converting Equation (2) into matrix form, we can determine that
P = u b 5 u b 4 u b 3 u b 2 u b 1 × 1 5 10 5 20 30 10 30 30 10 5 1 20 5 0 10 0 0 10 20 10 5 5 0 1 0 0 0 0 0 0 0 0 0 0 0 × P 0 P 1 P 2 P 3 P 4 P 5
where the constant matrix in the middle represents the coefficient matrix of the Bezier curve.
Based on the properties of the Bezier curve, it can be determined that it has a second-order derivative. Therefore, the curvature k of the Bezier curve at any point can be expressed as follows:
k ( u b ) = P ( u b ) × P ( u b ) P ( u b ) 2
As the path planned by the A* algorithm consists of nodes, we assume that the planned path is
P path = ( P x , P y )
By using Ppath as the control points of the fifth-order Bezier curve and calculating the corresponding Bezier curve, path smoothing can be achieved. Therefore, based on Equation (4), the optimized path curvature C can be calculated as
C ( u b ) = P x ( u b ) P y ( u b ) P y ( u b ) P x ( u b ) P x ( u b ) + P y ( u b ) 3 / 2

2.2. Introduction of Heuristic Functions and Penalty Functions with Variable Weights

In the traditional A* algorithm, the heuristic function H(n) in Equation (1) is calculated using either Euclidean distance (Equation (7)) or Manhattan distance (Equation (8)).
H ( n ) = ( x t x n ) 2 + ( y t y n ) 2
H ( n ) = x t x n + y t y n
From these equations, it can be observed that both Euclidean distance and Manhattan distance cannot quickly respond to deviations in search direction when there are multiple nodes. Based on the idea of Manhattan distance, this paper uses the difference in distance between the current node and the target node. This serves as a guiding indicator to assign different weights for searching the target node quickly and accurately (as shown in Figure 2). The new evaluation cost calculation method is as follows:
H ( n ) = α x t x n + β y t y n α y t y n + β x t x n ,   α > β
where α and β are constant coefficients.
Due to the presence of obstacles in the environment, the A* algorithm may not strictly follow the shortest distance principle when expanding nodes during path planning. When the environment is complex, A* tends to deviate from the theoretically shortest path during the search. To search faster towards the vicinity of the shortest path, we introduce a penalty function q(n) in the evaluation function. The new evaluation function is as follows:
F ( n ) = G ( n ) + H ( n ) + q ( n )
When a node deviates from the theoretically shortest path during the search process, a penalty is imposed on that node. The penalty function is as follows:
a x + b y + c = 0
q ( n ) = γ x n + y n + c a 2 + b 2
Equation (11) represents the straight line between the start node and the target node, and x and y represent the independent and dependent variables of the equation, respectively. Equation (12) represents the distance between the current node and the theoretically shortest path, and x0 and y0 represent the coordinates of the current node.

2.3. Combination with the Ant Colony Algorithm

The ant colony algorithm (ACA) is a biomimetic intelligent algorithm that utilizes its own secreted “pheromones” to transmit information during the foraging process. With the accumulation of search times, the shorter the path, the more ants pass by, and the more pheromones remain on the path [43,44]. The basic principle of the ACA is similar to finding the optimal path for mobile robots. Therefore, it is widely used in path planning. The ACA generally adopts distributed computing, positive feedback parallelism, and heuristic search systems, which have advantages such as strong robustness and easy integration with other algorithms [45,46]. In order to further improve job performance, we use the ant colony algorithm to further optimize the A* algorithm.
Assuming there are ρ points, the agricultural machinery covers them in sequential order X = ( x 1 , x 2 , , x ρ ) , and the distance is denoted as V(X). We transform solving the shortest path problem into the TSP (traveling salesman problem), which is to find a sequence of points X that minimizes the distance function V(X). The mathematical expression is as follows:
min V ( X ) = i = 1 ρ 1 D ( x i , x i + 1 ) + D ( x ρ , x 1 )
D = 0 d 21 d 31 d ρ 1 , 1 d ρ , 1 d 12 0 d 32 d ρ 1 , 2 d ρ , 2 d 13 d 23 0 d ρ 1 , 3 d ρ , 3 d 1 , ρ 1 d 2 , ρ 1 d 3 , ρ 1 0 d ρ , ρ 1 d 1 , ρ d 2 , ρ d 3 , ρ d ρ 1 , ρ 0
Based on the distance matrix D, we use the ACA to find a sequence of points X that minimizes the distance function V(X). Given the number of ants m in the ant colony and the distance matrix D, we use a taboo table tk to record the points that are visited by ant k. After one cycle, the taboo table is cleared, and the ants can make another free choice. Each ant determines its state transition probability during movement based on the distribution of pheromones and heuristic information:
p i j k = τ i j α ( t ) η i j β ( t ) / s a k τ i s α ( t ) η i s β ( t ) , j a k 0 , Others
η i j ( t ) = 1 / d i j
The ants select the next node according to Equations (15) and (16). The length of the movement path is denoted as Lk (k = 1, 2, …, m). The shortest path Lmin and the coverage order are recorded, and then Δ τ i j is reset and the pheromones are updated:
τ i j ( t + 1 ) = ( 1 ρ 1 ) τ i j ( t ) + Δ τ i j ( t )
Δ τ i j ( t ) = k = 1 m Δ τ i j k ( t )
Δ τ i j k ( t ) = Q / L k , The   k th   ant   passes   through   ( i ,   j ) 0 , The   k th   ant   did   not   pass   through   ( i ,   j )
when the maximum number of iterations is reached, the algorithm exits the loop, and the optimal coverage path X at that time is output as the solution.
The IA* pseudo code is as follows (Algorithm 1): generate_control_points and generate_bezier_curves are two specific functions that need to be implemented. The former is responsible for generating control points for the fifth-order Bezier curve based on the current node, while the latter uses these control points to generate Bezier curves and ensures that these curves do not collide with any obstacles.
Algorithm 1 IA*
FUCTION IA*(start, goal, obstacles, m, ρ1, α, β)
openSet = PriorityQueue()
closedSet = Set()
cameFrom = Dictionary()
gScore = Dictionary()
fScore = Dictionary()
pheromone = initialize_pheromone(start, goal)
openSet.add(start)
gScore[start] = 0
fScore[start] = heuristic(start, goal)
while openSet is not empty:
   current = openSet.extract_min()
   if current is goal:
      return reconstruct_path(cameFrom, current)
   openSet.remove(current)
   closedSet.add(current)
   controlPoints = generate_control_points(current)
   neighbors = generate_bezier_curves(controlPoints, obstacles)
for each ant in m:
   current = start
   path = [current]
   while current is not goal:
      neighbors = generate_bezier_curves(current, obstacles)
      nextNode = choose_next_node(current, neighbors, pheromone, α, β)
      path.append(nextNode)
      update_pheromone(pheromone, path, ρ1)
      current = nextNode
   if is_path_better(path):
      openSet.clear()
      closedSet.clear()
      cameFrom.clear()
      gScore.clear()
      fScore.clear()
      openSet.add(start)
      gScore[start] = 0
      fScore[start] = heuristic(start, goal)
      update_pheromone_with_new_path(pheromone, path)
   return reconstruct_path(cameFrom, goal)
function choose_next_node(current, neighbors, pheromone, α, β)
   probabilities = calculate_probabilities(neighbors, pheromone, α, β)
   return select_node_by_roulette_wheel(probabilities)
function update_pheromone(pheromone, path, ρ1)
   for each edge in path
      pheromone[edge] *= (1 − ρ1)
      pheromone[edge] += pheromone_deposit
function is_path_better(path)
   return betterPathFound
This chapter designs the IA* algorithm. Firstly, we introduce a heuristic function with variable weights in the traditional A* algorithm, using the difference in distance between the current node and the target node as the guiding indicator. By assigning different weights, it is guided to quickly and accurately search for the target node. In order to quickly search for nodes around the shortest route, we introduce a penalty function in the evaluation function. We introduce a fifth-order Bezier curve to make the generated path smoother based on the Manhattan distance concept. The purpose is to overcome the shortcomings of the A* algorithm having too many turning points and not complying with the kinematic principles of tracked agricultural machinery. On this basis, the ant colony algorithm is introduced to further optimize the obtained path.

3. Tracked Agricultural Machinery Model

The soil characteristics in the working environment of the agricultural machinery are complex. The design of the tracking controller is based on the geometric relationship between the tracked agricultural machinery body and the desired path. The tracked agricultural machinery generally adopts differential steering, which means that steering is achieved by the speed difference of the tracks, allowing the agricultural machinery to maneuver flexibly. During steering, there is a phenomenon of rotation in the inner track [28]. Based on the above analysis, we have established the kinematic model as shown in Figure 3.
As shown in Figure 3, xOy represents the Cartesian coordinate system. The line on which AB lies (denoted as H) is the desired path; CD represents the inner track, with C being the front point of the inner track. EF represents the outer track. C′D′ and E′F′ represent the tracks before adjustment. M is the centroid of mass of the fuselage; OL and OR are the centers of the inner and outer tracks, respectively. φ represents the angle between the current velocity direction and the desired path, which is the desired value of the heading angle. From the geometric relationship in Figure 3, we have that
α R = β R = arctan L 1 2 R + L 2 α L = β L = arctan L 1 2 R L 2
From Equation (20), we know that the deviation angle of the tracks is determined by R, L1, and L2.
Assuming that the linear velocity of the agricultural machinery is V, we establish the kinematic equation:
x = l 1 sin φ = l 1 sin φ + l 1 cos φ = V sin φ y = l 1 cos φ = l 1 sin φ l 1 cos φ = V cos φ
The real-time pose of the fuselage is represented as follows:
x t = x M + t 0 t x . t d t y t = y M + t 0 t y . t d t φ d = φ 0 + t 0 t φ . d d t
As the inner and outer tracks of the agricultural machinery move in opposite directions during turning, we assume that the deviation angles of C and E are x1 and x2 in radians, respectively. The state equations are as follows:
x 1 = θ r = 2 V sin α L L 2 = 2 V L 1 L 2 4 4 L 2 3 R + ( 4 R 2 + L 1 ) L 2 2 x 2 = θ f = 2 V cos α R L 1 = 2 V L 1 L 2 4 + 4 L 2 3 R + ( 4 R 2 + L 1 ) L 2 2
The linear velocity of the fuselage should be the vector sum of the linear velocities of the inner and outer tracks. According to the physical relationship between linear velocity and angular velocity, we have that
x ˙ 1 = v 1 = θ r Δ t · L 1 2
x ˙ 2 = v 2 = θ f Δ t · L 1 2
V = ( θ r + θ f ) L 1 2 4 Δ t
Based on the second law of Newton, we can derive that
V = d X t 2 + Y t 2 d t = ( x ˙ 1 + x ˙ 2 ) L 1 2
This chapter constructs a kinematic model for tracked agricultural machinery and then designs the expected deflection angle polynomials for the inner and outer tracks, with time as the variable.

4. Design of F-SMC

4.1. Design of Position Control Law

To ensure a safe and stable tracking path of agricultural machinery, a control system is designed with the input of the inner and outer track deviation angles as follows:
x ˙ = f ( x , t ) + B u ( t )
x = ( x 1 , x 2 ) T
From Figure 3, it can be seen that the adjustment angle of the fuselage center of mass is the vector sum of the inner and outer track deviation angles. The control equations for the inner and outer tracks are as follows:
θ R = θ r + t 0 t ε dt θ F = θ f + t 0 t κ dt
The error tracking equation is
x ˙ e = V cos φ x ˙ M y ˙ e = V sin φ y ˙ M
where s1 = xe = xtxM, s2 = ye = ytyM. In this case, we assume that V cos φ = k1u1 and V sin φ = k2u2. From this, we can obtain the desired trajectory as
φ = arctan k 1 u 1 k 2 u 2 = arctan x e x M y e y M
When φ = φ d , the tracking control is completed, and the agricultural machinery reaches the desired position.

4.2. Design of Posture Control Law

After designing the position control law, we further design the attitude control law to achieve tracking of the desired angles. We design the sliding mode function s3 = φ e= φ φ d, from which it can be obtained that
s ˙ 3 = φ ˙ e = ω φ ˙ d
Based on this, the attitude control law is
ω = φ ˙ d k 3 s 3 η 3 · sgn s 3
where k3 > 0, η 3 > 0 (both k3 and η 3 are constant coefficients).
From this, we can obtain that
s ˙ 3 = k 3 s 3 η 3 sgn s 3
Taking the Lyapunov function V = 1 2 s 3 2 , we have that
V ˙ = s 3 · s ˙ 3 = k 3 s 3 2 η 3 s 3 k 3 s 3 2
From this, we can obtain that
V ˙ 2 k 3 V
From this, it can be seen that φ e converges to 0, i.e., φ φ d → 0. Therefore, the deviation linear velocity of the tracks converges, proving that the agricultural machinery can achieve attitude adjustment and path tracking.

4.3. Fuzzy Approximation Sliding Mode Attitude Control

In order to improve the performance of the control system, we design a fuzzy control based on the attitude control law to improve the speed, with the control system converging to the origin. In this paper, parameters ε and κ are designed. We take the derivative of the vector sum of the adjusted angular velocity of the inner and outer tracks, which is the attitude angular velocity of the tracked machinery. The fuzzy exponential approach law of ω is set as follows:
s ˙ ( x ) = φ ˙ d η 1 ε η 2 κ s
where ε and κ are determined by fuzzy mathematical methods; the constant coefficients η 1 and η 2 are selected based on the motion characteristics of the tracked agricultural machinery. The fuzzy approach is used to normalize the switching function s. The input of the fuzzy sliding mode variable structure controller is defined as
s n = λ s
where n is 1, 2, 3; ε and κ are the output of the fuzzy controller. We define the linguistic values of sn, ε , and κ as { A 3 ¨ , A 2 ¨ , A 1 ¨ , A 0 ¨ , A 1 ¨ , A 2 ¨ , A 3 ¨ }, { B 3 ¨ , B 2 ¨ , B 1 ¨ , B 0 ¨ , B 1 ¨ , B 2 ¨ , B 3 ¨ }, and { C 1 ¨ , C 2 ¨ , C 3 ¨ }, respectively. The pseudo code for the fuzzy control rules is as follows (Algorithm 2):
Algorithm 2 Fuzzy control rules
R ε : if sn is B ¨ then ε is
B i ¨ (i = −3, −2, −1, 0, 1, 2, 3)
Input sn is u = ( C B ) 1 ( η 1 ε + η 2 k s + C f ^ ) then
Output ε is C 3 ¨
Rk: if sn is A ¨ −3,−2,−1 then κ is C 3 ¨
if sn is A 0 ¨ then κ is C 2 ¨
if sn is A ¨ 1,2,3 then κ is C 1 ¨
Input sn is A ¨ then
Output κ is C ¨
According to the control rules, the maximum value principle is used to convert the fuzzy controller outputs ε and κ into precise control variables. The calculation method is as follows:
ε = 3 / 4 3 / 4 ε B ( ε ) d ε / 3 / 4 3 / 4 ε B ( ε ) d ε κ = 0 3 / 4 κ C ( κ ) d κ / 0 3 / 4 C ( κ ) d κ
Therefore, substituting ε   a n d   κ into the fuzzy approximation law, we obtain the following:
u = ( C B ) 1 ( η 1 ε + η 2 κ s + C f ^ )
This chapter introduced the design of the F-SMC tracking controller. Based on fuzzy control ideas and sliding mode variable structure control theory, we designed a fuzzy sliding mode variable structure path tracking controller. We established a kinematic model using tracked agricultural machinery as the control object and designed the expected deflection angle polynomial of the inner and outer tracks with time as the variable. We designed a sliding mode function using the expected deflection angle and derived the attitude control law for angular velocity, as well as proved that the sliding mode function converges to 0 through the Lyapunov theorem. Next, we designed a fuzzy sliding mode reaching law and preprocessed it to reduce the time for sliding mode control to reach the next stage.

5. Simulation Test

5.1. Path Planning Simulation Experiment

In order to explore the values of α ,   β , and γ , we first conducted a preliminary experiment. We set α : β = {2:1, 3:1, 4:1, 5:1, 3:2, 4:3, 5:2, 5:3, 5:4}. The results show that the algorithm has the best performance when α : β = 5:4. Next, we set α : β = 5:4, γ = {0.1, 0.2,…, 0.9}. The results show that when γ = 0.3, the algorithm has the best performance. Therefore, our final determined values are α = 1,   β = 0.8, and γ = 0.3.
To verify the performance of the IA* algorithm, we compare the A* algorithm with it. We designed three grid environments (denoted as scenes 1~3). They simulate transported agricultural machinery for small warehouses, large warehouses, and standard orchards, respectively. The configuration environment of the computer is MATLAB R2022a, Intel Core i7-12700H CPU, 2.30 GHz main frequency, 32 GB memory, and Windows 11 operating system. Among them, the black grid represents obstacles (when the obstacle is less than one grid, expand the obstacle to fill the grid), the white grid represents feasible areas, the green grid represents the starting point, and the yellow grid represents the ending point, with a resolution of 1 m × 1 m. The simulation results are shown in Figure 4, Figure 5 and Figure 6.
In order to visually compare the A* algorithm with the IA* algorithm, we recorded their planned path length, runtime, and number of turning points. The results are shown in Table 1.
From Figure 4, Figure 5 and Figure 6 and Table 1, it can be seen that both the A* algorithm and the IA* algorithm can plan a path from the starting point to the ending point, but there are differences in path length, calculation time, and path continuity. In all three scenarios, the path length calculated by the IA* algorithm was smaller than A*, with reduction values of 2.73 m, 5.1 m, and 1.86 m, respectively. The reduction rates were 5.58%, 5.36%, and 5.59%, with an average reduction rate of 5.51%. The IA* algorithm has a computing time that is 0.001 s, 0.003 s, and 0.001 s longer than the A* algorithm, which is far less than the shortest time that human vision can perceive. In terms of turning points, IA* has reduced the number of turning points by five, four, and two, respectively, compared to A*, with a reduction rate of 62.50%, 36.36%, and 18.18% and an average reduction rate of 39.01%. From the figures, it can be seen that the two curves planned by the A* algorithm only have equal coordinate values at their coincident points. It is indicated that the zero-order parameters are continuous. This leads to the need for agricultural machinery to first reduce its speed to 0 and then turn before moving forward when encountering a turning point during the forward-moving process. The path planned by the IA* algorithm not only satisfies the continuity of zero-order parameters at the intersection point of two curves, but also satisfies the continuity of first-order and second-order parameters. Therefore, agricultural machinery can maintain a constant speed or acceleration when turning. Based on the data, it can be seen that the IA* algorithm always outperforms the A* algorithm in path length and smoothness planning, which can reduce the time and energy consumption of agricultural machinery during path tracking.

5.2. Path Tracking Simulation Experiment

In this paper, MATLAB/SIMULINK is used as the simulation platform to verify the performance of the F-SMC controller. The tracking control of the U-turn path for a tracked agricultural machinery is conducted under the condition of no disturbance (the parameters of the control system are shown in Table 2). We compare the fuzzy controller (FUZZY), PID controller, and the proposed F-SMC controller in this paper. Among them, the parameters required by the FUZZY controller are the same as those of the F-SMC. We referred to reference [47] for the parameters for the PID controller. We designed the control system structure diagram of F-SMC (as shown in Figure 7). According to Figure 7, we establish a corresponding controller model in SIMULINK that combines the fuzzy control front-end and sliding mode variable structure control at the back end, as shown in Figure 8. In Figure 8, X12 (the expected deflection angle of the inner and outer tracks) is input to S1 (the input terminal of the F-SMC controller). After being processed by the FUZZY, the output parameters are combined to the S2 (position controller) to calculate the thd (position parameter). The thd is input to the S3 (differential controller) for differential processing and output as dthd. After being processed by the S4 (attitude controller), the ut (preadjusted deflection angle) is output. After comparing with the S5 (kinematic model of the controlled object, a tracked lawn mower), the feedback signal is output to FUZZY. The F-SMC controller integrates the S1 and S5 to output phi (the actual adjustment angle). The F-SMC controller operates continuously during the time period t.
Figure 9 shows the comparison of path tracking. From Figure 9, it can be seen that the tracked agricultural machinery meets greater difficulty in path tracking in the curved section, specifically from coordinates (25, −10) to (32, 0). To further compare the control accuracy of each controller, we sampled the deviation angles of each controller in this section, as shown in Figure 10 and Table 3. To explore the dispersion of each sampling point further, we set φe to 0 and plotted a boxplot, as shown in Figure 11.
From Figure 9 and Figure 10, compared to the FUZZY and PID controllers, it can be observed that the F-SMC controller has the smallest deviation, with the closest tracking path to the desired value. In Figure 10, within the sampling range of [200, 600], the F-SMC controller requires the fewest number of samples to adjust the deviation angle back to 0, with an average of 192 samples. The FUZZY and PID controllers require 291 and 334 samples, respectively. This indicates that during the path tracking process, the F-SMC controller can quickly calculate the deviation between the actual path and the desired path, and it can complete the task using fewer samples, improving the efficiency of path tracking and reducing the response time. From Figure 11, it can be seen that the total adjustment time for turning is 1.92 s, 2.91 s, and 3.34 s for the F-SMC, FUZZY, and PID controllers, respectively. The F-SMC controller has the shortest response time, resulting in efficiency improvements of 34.02% and 42.51% compared to the FUZZY and PID controllers, respectively.
In this chapter, we validated the superiority of IA* and F-SMC compared to other classic methods through simulation experiments on computers.

6. Field Experiment

6.1. Materials and Methods

To further verify the feasibility of IA* and F-SMC in real environments, we selected the G33 lawn mower produced by Wuxi Kalman Navigation Technology Co., Ltd. (Wuxi, China) for path planning and tracking experiments (as shown in Figure 12). The mechanical and structural parameters of G33 are shown in Table 4. The experimental environment is the Shunnong Fruit Modern Agricultural Park in Shunping County, Baoding City, Hebei Province.
Due to the influence of various factors such as equipment performance, orchard road conditions, and signal quality during the experimental process, the actual walking trajectory of the lawn mower deviates greatly from the theoretical calculation. Therefore, the length of the path in this section is not used as an indicator to evaluate the efficiency of the operation. In addition to path length, the total operation time (T) and mowing oil consumption (G) are also intuitive efficiency evaluation indicators. Among them, T is timed by a timer, and G is calculated as follows:
G = H 1 H 2 H 3 × 100 %
In order to observe the chattering suppression effect of F-SMC, we randomly selected 500 sampling points during the experiment. The vibration frequency of these sampling points was measured using a vibration sensor.

6.2. Result and Analysis

We conducted a field experiment on 2 August 2023, with the results shown in Figure 13 and Figure 14. We used the radar carried by the lawn mower to create a map of the environment, and the mapping process was completed using the rviz platform in the ubunto system. In order to make the comparison effect obvious, we used the FUZZY controller to track the path generated by A* (blue line in Figure 13) and used the F-SMC controller to track the path generated by IA* (yellow line in Figure 13). Figure 14 shows the vibration suppression effect of FUZZY and F-SMC. In order to compare the vibration suppression effects of the two controllers more intuitively, we have drawn a comparison chart of vibration suppression errors (as shown in Figure 15). The experimental results are shown in Table 5.
From Figure 13 and Table 5, it can be seen that the IA* algorithm is practical with F-SMC, and the paths generated by IA* can normally be tracked by F-SMC. Compared to A* and FUZZY, IA* and F-SMC has a path tracking time reduction rate of 29.34% and a fuel consumption reduction rate of 2.75%. From Figure 14 and Figure 15, it can be seen that compared with the FUZZY controller, ε and κ can improve the accuracy of the θ R and θ F , reduce the computational workload of the controller’s back end, shorten the adjustment time of F-SMC, and accelerate the tracking of the desired path of tracked agricultural machinery. When using the FUZZY controller to track the path, the average vibration frequency of the tracked agricultural machine is 16.93 Hz. When using the F-SMC controller to track the path, the average vibration frequency of the tracked agricultural machine is 36.76 Hz. F-SMC has a better vibration suppression effect.
In this chapter, we transplanted IA* and F-SMC to the control system of the G33 lawn mower, verifying their practicality in real-world environments.

7. Conclusions

In order to improve the efficiency of agricultural operations to reduce the cost of agricultural products, this paper proposes an IA* path planning algorithm. Meanwhile, it recommends an F-SMC path tracking controller that is characterized by tracked agricultural machinery operations.
  • We introduce a heuristic function with variable weights in the traditional A* algorithm, taking the difference in distance between the current node and the target node as the guiding indicator. By assigning different weights, we guide it to quickly and accurately search for the target node. In order to quickly search for nodes that are near the shortest route, we introduce a penalty function in the evaluation function. In order to overcome the shortcomings of the A* algorithm, which has too many turning points that do not comply with the kinematic principles of tracked agricultural machinery, and based on the Manhattan distance concept, we introduced a fifth-order Bezier to make the generated path smoother. On this basis, the ACA is introduced to further optimize the obtained path.
  • Based on fuzzy control theory and sliding mode variable structure control theory, we have designed an F-SMC controller. We established a kinematic model using tracked agricultural machinery as the control object and designed the expected deflection angle polynomial of the inner and outer tracks with time as the variable. The sliding mode function is designed using the expected deflection angle, and the attitude control law for angular velocity is derived. The convergence of the sliding mode function to 0 is proved through the Lyapunov theorem. Next, we designed a fuzzy sliding mode reaching law and preprocessed it to reduce the time required for the sliding mode control to reach the chosen stage.
  • We conducted simulation experiments and field experiments. The simulation test results show that compared with A*, the average reduction rate of the path length for IA* is 5.51%, and the average reduction rate of the number of turning points is 39.01%. Compared with the FUZZY controller and PID controller, the adjustment time of F-SMC is reduced by 0.99 s and 1.42 s, respectively. The field test results show that compared to the A* algorithm and FUZZY controller, the path tracking time reduction rate of IA* and F-SMC is 29.34%, and the fuel consumption rate is reduced by 2.75%.
The IA* and F-SMC proposed in this article belong to path planning and path tracking technology, but the functions of the algorithm are limited. The application scenarios of agricultural machinery are complex. Highly intelligent agricultural machinery should have real-time modeling technology to cope with different scenarios. Therefore, we will carry out environmental modeling work in the future.

Author Contributions

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

Funding

This research was funded by the earmarked fund for CARS (CARS-27) and supported by the Earmarked Fund for Hebei Apple Innovation Team of Modern Agro-industry Technology Research System (HBCT2023120202).

Data Availability Statement

Data is contained within the article.

Conflicts of Interest

The authors declare no conflicts of interest.

Nomenclature

nThe current node of the agricultural machinery
F(n)The cost function of the current node n
G(n)The actual cost from the initial node to node n
H(n)The estimated cost from the current node n to the target point
Pi (i = 1, 2,...,5)The six control points of the fifth-order Bezier curve
ubThe parameter of the Bezier curve, ub ∈ [0, 1]
(Px, Py)The coordinates of the path node
P x and P y The first-order partial derivatives of the fifth-order Bezier curve at the control node P with respect to ub
P x and P y The second-order partial derivatives of the fifth-order Bezier curve at the control node P with respect to ub
(xn, yn)The coordinates of the current node
(xt, yt)The coordinates of the target node
q(n)Penalty function
γA constant coefficient
ρnNumber of nodes
DThe distance matrix between points, satisfying D = DT
dijThe feasible path distance from point i to j, which is equal to dij = dji, i, j ∈ [1, ρ]
D ( x i , x j ) The distance d x i x j with the number xi as the starting point and xj as the ending point
mThe number of ants
tkTaboo table
p i j k The state transition probability
iThe current node of an ant
jThe next node of an ant
τ i j ( t ) The amount of pheromones on the link between i and j at time t
η i j ( t ) The heuristic function
akThe set of feasible nodes that have not been added to the taboo list
αThe coefficient for the relative importance of pheromones
βThe coefficient for the relative importance of visibility
Δ τ i j The change in pheromone level at node (i, j) per unit time
Δ τ i j k ( t ) The increment of pheromone for the kth ant
ρ1The pheromone evaporation coefficient
LkThe distance traveled by the kth ant
QThe pheromone reinforcement coefficient
αL (βL)The deviation angles of the front (rear) ends of the inner track
αR (βR)The deviation angles of the front (rear) ends of the outer track
L1The length of the track
L2The distance between the front (rear) points of the inner and outer tracks
RThe turning radius of the agricultural machinery.
θrThe steering angles of the inner track
θfThe steering angles of the outer track
x ˙ The first derivatives of the lateral deviation of the fuselage centroid
y ˙ The first derivatives of the longitudinal deviation of the fuselage centroid
l1The distance between M and B
xtThe lateral displacement of the track at time t
ytThe longitudinal displacement of the track at time t
(xM,yM)The coordinate of the fuselage centroid
φ0The angle between the velocity direction at time t0 and the desired path
φdThe desired value of the heading angle at time t0
x 1 ˙ and x 2 ˙ The first-order derivatives of x1 and x2
θ r ˙ and θ f ˙ The first-order derivatives of θr and θf
v1 and v2The linear velocities of the inner and outer tracks
ΔtThe sampling time
xThe state vector
uThe control variable
θR and θFThe desired deviation angles for the inner and outer tracks
ε and κ The control coefficients for the inner and outer track deviation angles
k1 and k2Constant coefficients
η 1 and η 2 Constant coefficients
sSwitching function
λPositive number
H1The height of the fuel tank of the lawn mower before the test
H2The oil level height of the mower fuel tank after the test
H3The height of the fuel tank when the lawn mower is filled with oil, measured as 0.32 m

References

  1. Qian, L.; Lu, H.; Gao, Q.; Lu, H. Household-owned farm machinery vs. outsourced machinery services: The impact of agricultural mechanization on the land leasing behavior of relatively large-scale farmers in China. Land Use Policy 2022, 115, 106008. [Google Scholar] [CrossRef]
  2. Chakraborty, S.; Elangovan, D.; Govindarajan, P.L.; ELnaggar, M.F.; Alrashed, M.M.; Kamel, S. A comprehensive review of path planning for agricultural ground robots. Sustainability 2022, 14, 9156. [Google Scholar] [CrossRef]
  3. Sharma, V.; Tripathi, A.K.; Mittal, H. Technological revolutions in smart farming: Current trends, challenges & future directions. Comput. Electron. Agric. 2022, 201, 107217. [Google Scholar]
  4. Albiero, D.; Garcia, A.P.; Umezu, C.K.; Paulo, R.L. Swarm robots in mechanized agricultural operations: A review about challenges for research. Comput. Electron. Agric. 2022, 193, 106608. [Google Scholar] [CrossRef]
  5. Zhang, M.; Ji, H.Y.; Li, S.C.; Cao, R.Y.; Xu, H.Z.; Zhang, Z.Q. Research Progress of Agricultural Machinery Navigation Technology. Trans. Chin. Soc. Agric. Mach. 2020, 51, 1–18. [Google Scholar]
  6. Zheng, L. Optimization of agricultural machinery task scheduling algorithm based on multiobjective optimization. J. Sens. 2022, 2022, 5800332. [Google Scholar] [CrossRef]
  7. Zhou, J.H.; Zhou, J.Q.; Zheng, Y.S.; Kong, B. Research on path planning algorithm of intelligent mowing robot used in large airport lawn. In Proceedings of the 2016 International Conference on Information System and Artificial Intelligence (ISAI), Hong Kong, China, 24–26 June 2016; pp. 375–379. [Google Scholar]
  8. Tian, Z.; Shi, W. Edge Coverage Path Planning for Robot Mowing. arXiv 2022, arXiv:2209.05405. [Google Scholar]
  9. Sandamurthy, K.; Ramanujam, K. A hybrid weed optimized coverage path planning technique for autonomous harvesting in cashew orchards. Inf. Process. Agric. 2020, 7, 152–164. [Google Scholar] [CrossRef]
  10. Abdallaoui, S.; Aglzim, E.H.; Chaibet, A.; Kribèche, A. Thorough review analysis of safe control of autonomous vehicles: Path planning and navigation techniques. Energies 2022, 15, 1358. [Google Scholar] [CrossRef]
  11. Chen, G.; Luo, N.; Liu, D.; Zhao, Z.; Liang, C. Path planning for manipulators based on an improved probabilistic roadmap method. Robot. Comput.-Integr. Manuf. 2021, 72, 102196. [Google Scholar] [CrossRef]
  12. Dijkstra, E.W. A note on two problems in connexion with graphs. Numer. Math. 1959, 1, 269–271. [Google Scholar] [CrossRef]
  13. Wang, Y.F.; Cao, X.H.; Guo, X. Warehouse AGV path planning method based on improved A* algorithm and system short-term state prediction. Comput. Integr. Manuf. Syst. 2023, 29, 3897–3908. [Google Scholar]
  14. Choubey, N.; Gupta, M. Analysis of working of Dijkstra and A* to obtain optimal path. Int. Comput. Sci. Manag. Res. 2013, 2, 1898–1904. [Google Scholar]
  15. Ammar, A.; Bennaceur, H.; Châari, I.; Koubâa, A.; Alajlan, M. Relaxed Dijkstra and A* with linear complexity for robot path planning problems in large-scale grid environments. Methodol. Appl. 2016, 20, 4149–4171. [Google Scholar] [CrossRef]
  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. [Google Scholar] [CrossRef]
  17. Xu, H.; Yu, G.; Wang, Y.; Zhao, X.; Chen, Y.; Liu, J. Path Planning of Mecanum Wheel Chassis Based on Improved A* Algorithm. Electronics 2023, 12, 1754. [Google Scholar] [CrossRef]
  18. You, Z.; Shen, K.; Huang, T.; Liu, Y.; Zhang, X. Application of A* Algorithm Based on Extended Neighborhood Priority Search in Multi-Scenario Maps. Electronics 2023, 12, 1004. [Google Scholar] [CrossRef]
  19. Lao, C.; Li, P.; Feng, Y. Path Planning of Greenhouse Robot Based on Fusion of.Improved A* Algorithm and Dynamic Window Approach. Trans. Chin. Soc. Agric. Mach. 2021, 52, 14–22. [Google Scholar]
  20. Hu, X.; Yang, S.; Zhu, L.; Song, Y. Coverage Path Planning Method Based on Grid Region Decomposition. Mach. Electron. 2022, 40, 13–16. [Google Scholar]
  21. Wang, X.; Liu, Z.; Liu, J. Mobile robot path planning based on an improved A* algorithm. In Proceedings of the International Conference on Computer Graphics, Artificial Intelligence, and Data Processing (ICCAID 2022), Guangzhou, China, 23–25 December 2022; Volume 12604, pp. 1093–1098. [Google Scholar]
  22. Li, Y.; Wu, T.; Xiao, Y.; Gong, L.; Liu, C. Path planning in continuous adjacent farmlands and robust path-tracking control of a rice-seeding robot in paddy field. Comput. Electron. Agric. 2023, 210, 107900. [Google Scholar] [CrossRef]
  23. Yang, Q.; Du, X.; Wang, Z.; Meng, Z.; Ma, Z.; Zhang, Q. A review of core agricultural robot technologies for crop productions. Comput. Electron. Agric. 2023, 206, 107701. [Google Scholar] [CrossRef]
  24. Bai, Y.; Zhang, B.; Xu, N.; Zhou, J.; Shi, J.; Diao, Z. Vision-based navigation and guidance for agricultural autonomous vehicles and robots: A review. Comput. Electron. Agric. 2023, 205, 107584. [Google Scholar] [CrossRef]
  25. Ge, Z.; Man, Z.; Wang, Z.; Bai, X.; Wang, X.; Xiong, F.; Li, D. Robust adaptive sliding mode control for path tracking of unmanned agricultural vehicles. Comput. Electr. Eng. 2023, 108, 108693. [Google Scholar] [CrossRef]
  26. Dong, F.; Heinemann, W.; Kasper, R. Development of a row guidance system for an autonomous robot for white asparagus harvesting. Comput. Electron. Agric. 2011, 79, 216–225. [Google Scholar] [CrossRef]
  27. Zhang, Y.; Li, Y.; Liu, X.; Tao, J.; Liu, C.; Li, R. Fuzzy Adaptive Control Method for Autonomous Rice Seeder. Trans. Chin. Soc. Agric. Mach. 2018, 49, 30–37. [Google Scholar]
  28. Jiao, J.; Chen, J.; Qiao, Y.; Wang, W.; Wang, M.; Gu, L.; Li, Z. Adaptive sliding mode control of trajectory tracking based on DC motor drive for agricultural tracked robot. Trans. Chin. Soc. Agric. Eng. 2018, 34, 64–70. [Google Scholar]
  29. Wu, T.; Li, Y.; Lin, H.; Gong, L.; Liu, C. Fast Terminal Sliding Mode Control for Autonomous Rice Seeding Machine Based on Disturbance Observer. Trans. Chin. Soc. Agric. Mach. 2021, 52, 24–31. [Google Scholar]
  30. Wang, X.; Zhang, H.; Liu, S.; Wang, J.; Wang, Y.; Shangguan, D. Path planning of scenic spots based on improved A* algorithm. Sci. Rep. 2022, 12, 1320. [Google Scholar] [CrossRef]
  31. Mittal, K.; Song, J.; Gupta, S.; Wettergren, T.A. Rapid path planning for Dubins vehicles under environmental currents. Robot. Auton. Syst. 2020, 134, 103646. [Google Scholar] [CrossRef]
  32. Lambert, E.D.; Romano, R.; Watling, D. Optimal smooth paths based on clothoids for car-like vehicles in the presence of obstacles. Int. J. Control Autom. Syst. 2021, 19, 2163–2182. [Google Scholar] [CrossRef]
  33. Liao, B.; Hua, Y.; Wan, F.; Zhu, S.; Zong, Y.; Qing, X. Stack-RRT*: A Random Tree Expansion Algorithm for Smooth Path Planning. Int. J. Control Autom. Syst. 2023, 21, 993–1004. [Google Scholar] [CrossRef]
  34. Bulut, V. Path planning of mobile robots in dynamic environment based on analytic geometry and cubic Bézier curve with three shape parameters. Expert Syst. Appl. 2023, 233, 120942. [Google Scholar] [CrossRef]
  35. Alsmadi, M. Facial recognition under expression variations. Int. Arab J. Inf. Technol. 2016, 13, 133–141. [Google Scholar]
  36. Abdel-Aziz, H.S.; Zanaty, E.A.; Ali, H.A.; Saad, M.K. Generating Bézier curves for medical image reconstruction. Results Phys. 2021, 23, 103996. [Google Scholar] [CrossRef]
  37. Masters, D.A.; Taylor, N.J.; Rendall, T.C.S.; Allen, C.B.; Poole, D.J. Geometric comparison of aerofoil shape parameterization methods. AIAA J. 2017, 55, 1575–1589. [Google Scholar] [CrossRef]
  38. Klančar, G.; Seder, M. Coordinated Multi-Robotic Vehicles Navigation and Control in Shop Floor Automation. Sensors 2022, 22, 1455. [Google Scholar] [CrossRef]
  39. Sanchez-Ibanez, J.R.; Perez-del-Pulgar, C.J.; García-Cerezo, A. Path planning for autonomous mobile robots: A review. Sensors 2021, 21, 7898. [Google Scholar] [CrossRef]
  40. Xu, L.; Cao, M.; Song, B. A new approach to smooth path planning of mobile robot based on quartic Bezier transition curve and improved PSO algorithm. Neurocomputing. 2022, 473, 98–106. [Google Scholar] [CrossRef]
  41. Benko Loknar, M.; Klančar, G.; Blažič, S. Minimum-Time Trajectory Generation for Wheeled Mobile Systems Using Bézier Curves with Constraints on Velocity. Acceleration and Jerk. Sensors 2023, 23, 1982. [Google Scholar] [CrossRef]
  42. Huang, H.; Liu, Y.; Liu, J.; Yang, Q.; Wang, J.; Abbink, D.; Zgonnikov, A. General Optimal Trajectory Planning: Enabling Autonomous Vehicles with the Principle of Least Action. Engineering 2023. [Google Scholar] [CrossRef]
  43. Dorigo, M.; Gambardella, L.M. Ant colonies for the travelling salesman problem. Bio Syst. 1997, 43, 73–81. [Google Scholar] [CrossRef] [PubMed]
  44. Dai, X.; Long, S.; Zhang, Z.; Gong, D. Mobile robot path planning based on ant colony algorithm with A* heuristic method. Front. Neurorobot. 2019, 13, 15. [Google Scholar] [CrossRef] [PubMed]
  45. Chu, K.; Chang, T.; Wang, Q.; Yan, X. Path Planning Method of Ant Colony Algorithm Based on Effective Turning Point and Shortest-minimum Path. Trans. Chin. Soc. Agric. Mach. 2021, 52, 400–407. [Google Scholar]
  46. 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. [Google Scholar] [CrossRef]
  47. Sun, Z.; Xia, C.; Jiang, Y.; Guo, Y.; Wang, R. Research on Omnidirectional Leveling Control of Crawler-type Work Machine Based on QBP-PID. Trans. Chin. Soc. Agric. Mach. 2023, 1–13. Available online: https://link.cnki.net/urlid/11.1964.S.20230920.1956.016 (accessed on 27 December 2023).
Figure 1. Control polygon controlled by the Bezier curve.
Figure 1. Control polygon controlled by the Bezier curve.
Electronics 13 00188 g001
Figure 2. Schematic diagram of the variable weight heuristic function. (a) x t x n > y t y n , deviation in the X; (b) x t x n < y t y n , deviation in the Y.
Figure 2. Schematic diagram of the variable weight heuristic function. (a) x t x n > y t y n , deviation in the X; (b) x t x n < y t y n , deviation in the Y.
Electronics 13 00188 g002
Figure 3. Kinematics model of a tracked agricultural machinery.
Figure 3. Kinematics model of a tracked agricultural machinery.
Electronics 13 00188 g003
Figure 4. Simulation results of scene 1. (a) A* algorithm; (b) IA* algorithm.
Figure 4. Simulation results of scene 1. (a) A* algorithm; (b) IA* algorithm.
Electronics 13 00188 g004
Figure 5. Simulation results of scene 2. (a) A* algorithm; (b) IA* algorithm.
Figure 5. Simulation results of scene 2. (a) A* algorithm; (b) IA* algorithm.
Electronics 13 00188 g005
Figure 6. Simulation results of scene 3. (a) A* algorithm; (b) IA* algorithm.
Figure 6. Simulation results of scene 3. (a) A* algorithm; (b) IA* algorithm.
Electronics 13 00188 g006
Figure 7. Block diagram of the control system structure.
Figure 7. Block diagram of the control system structure.
Electronics 13 00188 g007
Figure 8. F-SMC controller model.
Figure 8. F-SMC controller model.
Electronics 13 00188 g008
Figure 9. Path tracing comparison chart.
Figure 9. Path tracing comparison chart.
Electronics 13 00188 g009
Figure 10. Off-angle sampling comparison chart.
Figure 10. Off-angle sampling comparison chart.
Electronics 13 00188 g010
Figure 11. Trajectory tracking error analysis comparison chart.
Figure 11. Trajectory tracking error analysis comparison chart.
Electronics 13 00188 g011
Figure 12. Tracked mower: (a) In a real environment; (b) Kinematics model; (c) Side view; (d) Front view.
Figure 12. Tracked mower: (a) In a real environment; (b) Kinematics model; (c) Side view; (d) Front view.
Electronics 13 00188 g012
Figure 13. Path tracking test results.
Figure 13. Path tracking test results.
Electronics 13 00188 g013
Figure 14. Vibration suppression effect diagram.
Figure 14. Vibration suppression effect diagram.
Electronics 13 00188 g014
Figure 15. Comparison chart of vibration suppression error.
Figure 15. Comparison chart of vibration suppression error.
Electronics 13 00188 g015
Table 1. Comparison of path planning simulation test data.
Table 1. Comparison of path planning simulation test data.
SceneAlgorithmLength [m]Reduction Rate [%]Runtime [s]Number of Turning Points [pc]Reduction Rate [%]
1A*48.965.581.647862.50
IA*46.231.6483
2A*95.105.362.1731136.36
IA*90.002.1767
3A*33.285.591.6601118.18
IA*31.421.6619
Table 2. F-SMC control system parameters.
Table 2. F-SMC control system parameters.
ParameterV [m/s]L1 [m]L2 [m] θ r [°] θ f [°]StartEndk1k2 ε κ
Data0.501.040.6800(1, −10)(1, 10)1111
Table 3. Deviation angle sampling error comparison table.
Table 3. Deviation angle sampling error comparison table.
ControllerSample Point [pc]Total Error [°]Average [°]Variance [°]
F-SMC700−41.313−0.0590.086
Fuzzy700−60.201−0.0860.094
PID700−194.60−0.2780.276
Table 4. Field test results.
Table 4. Field test results.
ParameterSize [m]L1 [m]L2 [m]R [m]V1 [m/s]V2 [m/s] ω [rad/s]
Data1.07 × 0.98 × 0.440.600.7521.51.50.2
Table 5. Field test results.
Table 5. Field test results.
MethodT [s]Reduction Rate [%]G [%]Number of Sampling Points [pc]Mean Vibration Frequency [Hz]
A* and FUZZY89329.346.3050036.76
IA* and F-SMC6313.5550016.93
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

Liu, L.; Wang, X.; Wang, X.; Xie, J.; Liu, H.; Li, J.; Wang, P.; Yang, X. Path Planning and Tracking Control of Tracked Agricultural Machinery Based on Improved A* and Fuzzy Control. Electronics 2024, 13, 188. https://doi.org/10.3390/electronics13010188

AMA Style

Liu L, Wang X, Wang X, Xie J, Liu H, Li J, Wang P, Yang X. Path Planning and Tracking Control of Tracked Agricultural Machinery Based on Improved A* and Fuzzy Control. Electronics. 2024; 13(1):188. https://doi.org/10.3390/electronics13010188

Chicago/Turabian Style

Liu, Lixing, Xu Wang, Xiaosa Wang, Jinyan Xie, Hongjie Liu, Jianping Li, Pengfei Wang, and Xin Yang. 2024. "Path Planning and Tracking Control of Tracked Agricultural Machinery Based on Improved A* and Fuzzy Control" Electronics 13, no. 1: 188. https://doi.org/10.3390/electronics13010188

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