1. Introduction
Ongoing technological advancements have led to a notable shift towards automation within the manufacturing industry [
1]. This transition has seen a growing deployment of Autonomous Mobile Robots (AMRs) in industrial production and warehousing logistics systems [
2]. The significance of path planning for AMRs cannot be understated, as these paths directly influence the efficiency and safety of the robots’ movements. Consequently, a critical challenge arises: devising effective and feasible paths for each AMR operating within a multi-AMR system that comply with their kinematic models while ensuring conflict avoidance throughout the entire path [
3].
In the field of single AMR path planning, researchers have proposed a variety of algorithms, such as the Dijkstra algorithm, Greedy Best-First Search algorithm and A* algorithm, among others [
4,
5,
6,
7,
8,
9]. Multi-AMR systems, which feature several AMRs collaborating within the same scenario, exhibit greater complexity and challenges compared to single AMR systems. Various path planning algorithms have been devised for these systems, encompassing priority-based cooperative algorithms, AI-based algorithms, and conflict-search algorithms. The WHCA* algorithm enhances HCA* by implementing a windowed search strategy, which plans paths near the current place to reduce computational load. It also dynamically adjusts AMRs’ priorities based on window conditions, improving adaptability to environmental changes and interactions among AMRs [
10,
11,
12]. However, these algorithms require maintaining communication among all AMRs for conflict detection. The PBS algorithm stratifies multi-AMR path planning into priority groups, allowing sequential planning where lower-priority AMRs adjust their paths based on those of higher-priority AMRs to prevent collisions [
13]. In the realm of AI-based algorithms, the PRIMAL algorithm employs a distributed architecture that merges deep reinforcement learning with imitation learning for multi-AMR path planning [
14]. Additionally, PRIMAL2 has the lifelong planning capability [
15]. The MADDPG algorithm and the MAPPO algorithm cooperatively trains behaviors of other AMRs in continuous spaces, enabling collaborative decision-making among multi-AMR [
16,
17]. However, these algorithms require substantial amounts of data and computational resources for training and generally have lower interpretability. In conflict-search-based algorithms, the Conflict-Based Search (CBS) algorithm is a multi-layered strategy for multi-AMR path planning where the lower layer independently plans a path for each AMR, and the upper layer assigns spatiotemporal constraints by detecting conflicts among the lower layer’s path [
18,
19,
20].
The AMR path tracking control method based on kinematic models can accurately and effectively design control strategies that meet the motion constraints of AMRs, improving the performance metrics of the system in completing operational tasks. Currently, various algorithms such as Proportional-Integral-Derivative (PID) control, Fuzzy Logic Control (FLC), and Model Predictive Control (MPC) have been developed. PID is a classic control algorithm that achieves precise control of the system by adjusting three parameters: proportional, integral, and derivative, but their performance is limited when dealing with nonlinear systems and multi-constraint problems [
21]. FLC, based on fuzzy set theory, controls the system through fuzzy rules. FLC does not require precise mathematical models, and has good robustness and adaptability, but designing and adjusting fuzzy rules is relatively complex, and achieving precise control can be challenging [
22]. MPC, as an advanced control strategy, has gained widespread attention for its significant advantages in handling multi-constraint optimization problems [
23]. MPC can optimize the current control input by predicting the system’s behavior over a future time horizon in each control cycle, thus achieving precise control of complex systems. It can handle nonlinear systems and effectively cope with uncertainties and disturbances both inside and outside the system. Additionally, MPC excels in considering system dynamics and input–output constraints, ensuring safety and stability while maximizing system performance.
Addressing the path planning issues in multi-AMR systems, we enhance the CBS algorithm by proposing a multi-AMR path planning algorithm based on spatiotemporal conflicts and nonholonomic constraints. The algorithm employs a conflict detection tree integrated with the Separating Axis Theorem for precise collision detection, and efficiently plans feasible paths based on kinematic modeling for AMRs in a continuous space. Furthermore, we achieve precise tracking control of the planned paths based on the kinematic model of AMRs through the model predictive control algorithm. Our main contributions are summarized as follows:
This paper develops a conflict detection tree integrated with the Separating Axis Theorem. It enables precise spatiotemporal conflict detection for each AMR’s path. This reduces the need for replanning and improves the efficiency of the algorithm.
This paper introduces a path planning algorithm that incorporates kinematic models to plan feasible paths for each AMR. In the path planning process, factors required for actual AMR control are considered, addressing the issue of conflicts between AMRs caused by significant discrepancies between planning and control in multi-AMR systems. Moreover, building on this foundation, the algorithm’s heuristic function is weighted to further enhance planning efficiency by biasing the paths towards the goal.
This paper takes the planning results of multi-AMR systems as the desired paths and, through the model predictive control algorithm, considers the specific kinematic models of the AMRs to achieve precise path tracking control.
2. Preliminaries and Problem Setting
In reality, AMRs need to consider their orientation and kinematic models to complete movements. The differences in orientation and kinematic models of AMRs also result in varying amounts of time and space required during path planning and tracking control. For example, Ackermann steering AMRs cannot turn in place and require additional space to turn. Therefore, the problem we need to solve is to achieve path planning and tracking control for multi-AMRs based on kinematic models.
2.1. Kinematic Model
This paper, we consider the orientation and kinematic model of Ackermann steering AMR to plan path. And, we achieve precise path tracking control based on this model.
The kinematic model of the Ackermann steering AMR as shown in
Figure 1. The center of the AMR’s rear axle in the global coordinate system
is
. The yaw angle is
. The AMR’s steering center is
, and the front wheel steering angle is
. The linear velocity
v is controlled by the AMR’s rear wheels. In discrete time, the kinematic model of the Ackermann steering AMR in the global coordinate system is:
where
L is the distance from the AMR’s front axle to its rear axle, and
T is the time step. The coordinates of the AMR’s center position
are:
2.2. Problem Setting
In this paper, we define an enclosed warehouse space C, containing static obstacles O. We consider that there are some AMRs within this enclosed area. For , in the global coordinate system, the center position coordinates are , the yaw angle is , the start coordinate is , the goal coordinate is , and in discrete time, the path is . Let represent the position coordinates and yaw angle of at time t. denotes the space occupied by at that moment. represents the space occupied by static obstacles. As for the Ackermann steering AMR, define the front wheel steering angle as , the linear velocity as , the change in front wheel steering angle as , and the change in linear velocity as .
If a planned path P and a tracking control meet the following conditions, it is considered a feasible path:
The planned path satisfies the nonholonomic constraints of the AMR;
The AMR does not collide with any static obstacles while operating along the planned path, i.e., ;
Any two AMRs operating on their respective planned path will not collide with each other, i.e., .
The control inputs and their rate of change in the path tracking control algorithm meet the constraint conditions.
Considering the reasonableness of the problem, the following assumptions are made:
The start and goal coordinates of different AMRs vary, and neither the start nor the goal positions collide with any static obstacles, i.e., ;
The start and goal positions of any two AMRs do not collide, i.e., ;
The initial position and orientation of the path tracking control algorithm are the same as the desired position and orientation, but the initial speed is zero.
As shown in
Figure 2, we improved the CBS algorithm by considering the kinematic model of AMRs, enabling path planning for a multi-AMR system. Additionally, we designed a model predictive control algorithm based on the kinematic model of AMRs to achieve precise tracking control. The goal is to plan conflict-free, feasible paths for all AMRs by considering their nonholonomic constraints and achieve precise tracking control.
4. Path Tracking Control Algorithm for Multi-AMR Based on Model Predictive Control
In this section, the path planned by the algorithm in the previous section is used as the desired path. By considering the kinematic model of Ackermann steering AMR, the tracking control is implemented based on the MPC algorithm. This ensures that, in a multi-AMR scenario, each AMR can accurately follow the path to complete its task.
For Ackermann steering AMR, for its kinematic models, the nonlinear equation is linearized using a first-order Taylor expansion at point
,
,
,
,
and
. The linearized formula is
After discretization using the forward Euler method, the formula is
At this point, the simplified form of the above formula is
where state vector
, state matrix
, input matrix
, input vector
.
We have simplified the linearized discrete formulas of the Ackermann steering AMR. Then, we will design the predictive formulas.
We define the change in the input vector as
, and combining the state vector and control vector results in
. And, we merge the state matrix and input matrix to construct a new state matrix
and a new input matrix
, where
is the zero matrix,
is the identity matrix,
m is the length of the control vector, and
n is the length of the state vector. Then, we obtain the predictive formula and decompose the state vector and control vector,
where
.
Finally, we construct the cost function and the constraints. For Ackermann steering AMR, the formula is
In the cost function of the algorithm, represents the state error, denotes the change in control input, Q is the weighting matrix for the state error, and R is the weighting matrix for the change in control input. N represents the prediction horizon, and , , , and represent the front wheel steering angle, velocity, front wheel steering angle change, and acceleration, respectively. Each of these variables is subject to upper and lower bound constraints. By minimizing the cost function within the existing constraints and over a finite prediction horizon, a balance between the state error and control input is achieved.
By solving the cost function, the optimized control input is obtained, which then controls the AMR’s movement. This optimization process is repeated based on the latest state, forming a closed-loop control to achieve the desired path tracking.
5. Simulation
In this paper, we use Python for simulation experiments. To verify the effectiveness of the algorithm, we conducts tests in two different scenarios: a without obstacle scenario and a random obstacle scenario, with the number of AMRs in each scenario being 5, 10, and 15, respectively. And the sizes of the scenario maps are 50 × 50, 80 × 80, and 100 × 100 m, respectively. In the random obstacle scenario, the number of obstacles are 10, 20, and 40, respectively.
We use the Priority-Based Search algorithm (PBS), the Spatiotemporal Hybrid A* Conflict-Based Search algorithm (STH-CBS), and the Weighted Spatiotemporal Hybrid A* Conflict-Based Search algorithm (WSTH-CBS) to solve the multi-AMR path planning problem. Further, we define the distance between the start and goal points of each AMR is not less than half of the map’s length. To test the improvement in planning efficiency of the algorithm proposed in this paper compared to the PBS algorithm, we conduct five tests for each type of scenario map. The average of these test results represents the actual performance of the algorithm, as shown in
Table 1.
According to test results, the STH-CBS and WSTH-CBS algorithms, which are improvements based on CBS, have higher planning efficiency than the Priority-Based Search (PBS) algorithm. Additionally, as the number of AMRs planned increases and the scenarios become more complex, the PBS algorithm faces an overload of spatiotemporal constraints for later planned AMRs, leading to fewer feasible paths and thus lower planning efficiency compared to the other two algorithms.
Figure 6 shows the paths of AMRs planned using the WSTH-CBS algorithm in a 100 × 100 random obstacle scenario.
Figure 7 captures the positions at different moments from
Figure 6, where
Figure 7a shows the positions and paths during the AMRs’ operation, and
Figure 7b shows the final positions and motion paths of the AMRs. The black areas represent the static obstacles, and the rectangles represent the Ackermann steering AMRs. Dashed rectangles and squares represent the starting positions of the AMRs, and filled rectangles and squares of the same color represent the current positions of the AMRs. The dashed line between the starting and current positions represent the motion paths of the AMRs.
Based on the paths of all AMRs obtained in
Figure 7b, we perform tracking control using the MPC algorithm. In
Figure 7b, AMR4 and AMR13 are selected as the example.
Figure 8 shows the tracking results achieved through MPC control. Specifically,
Figure 8a presents the tracking result for AMR4, and
Figure 8b presents the result for AMR13. The MPC algorithm parameters are shown in
Table 2. The blue curve represents the desired path obtained from the path planning algorithm, while the red curve represents the actual path achieved through MPC control. It can be observed that the red curve almost completely overlaps with the blue curve, demonstrating the effectiveness of the proposed planning and control algorithms.
To evaluate the performance of the STH-CBS and WSTH-CBS algorithms, further simulation experiments are conducted in the warehouse scenario. The sizes of the warehouse scenario are 50 × 50 and 100 × 100. In this paper, we gradually increase the number of AMRs and compare the performance of the algorithms in terms of planning time and average path length. The planning time is the total time required for all AMRs to find feasible paths, where the less time reflects the higher algorithm efficiency. The average path length is the mean value of the path lengths traveled by each AMR, where a smaller average reflects a better overall planning solution. The comparison results of the algorithms are illustrated in
Figure 9, where the horizontal axis represents the number of AMRs, the left vertical axis represents the planning time of the algorithms, and the right vertical axis represents the average path length planned by the algorithms. The orange and blue lines represent the planning times of the STH-CBS and WSTH-CBS algorithms, respectively. The green and red lines, respectively, represent the average path lengths planned by the STH-CBS and WSTH-CBS algorithms.
In the 50 × 50 warehouse scenario, the number of AMRs starts at two and increases by one each time, until it reaches seven, as shown in
Figure 9a. In six simulation experiments, the average planning time for the STH-CBS algorithm is 32.29 s, and the average path length is 44.67 m; for the WSTH-CBS algorithm, the average planning time is 7.28 s, and the average path length is 47.13 m. Compared to the STH-CBS algorithm, the WSTH-CBS algorithm experiences a 5.51% increase in average path length, but the average planning time decreases by 77.45%.
In the 100 × 100 warehouse scenario, the number of AMRs starts at five and increases by two each time, until it reaches fifteen, as shown in
Figure 9b. In six simulation experiments, the average planning time for the STH-CBS algorithm is 78.34 s, and the average path length is 95.28 m; for the WSTH-CBS algorithm, the average planning time is 22.95 s, and the average path length is 97.73 m. Compared to the STH-CBS algorithm, the WSTH-CBS algorithm experiences a 2.57% increase in average path length, but the average planning time decreases by 70.7%.
Based on the results of simulation experiments conducted on different sizes of warehouse scenario maps, the average path length planned by the WSTH-CBS algorithm is slightly longer than that of the STH-CBS algorithm. However, the WSTH-CBS algorithm shows a significant improvement in path planning efficiency.
To test the performance of the proposed algorithm in a warehouse environment, additional simulations were conducted on a 50 × 50 m scenario map with seven AMRs. An additional path planning algorithm, combining Bezier curves and the CBS algorithm (B-CBS), was introduced as a comparison method. This algorithm first uses the CBS algorithm to plan paths for each AMR on a discrete grid map, then smooths the paths using Bezier curves, and finally controls the AMRs to move simultaneously along the smoothed paths. The path planning success rate of this algorithm was then compared with that of the proposed algorithm. The path planning success rate is defined as the probability that all AMRs successfully avoid each other from the start to the goal. A higher success rate indicates better algorithm performance.
As shown by the data in
Table 3, the B-CBS algorithm requires curve smoothing to meet control requirements, which results in significant deviations between the planned path and the tracking control trajectory, thereby reducing the success rate. In contrast, the proposed algorithm, which is based on the kinematic model of the AMR, enables precise tracking control, achieving a consistent success rate of 100%, thus demonstrating the effectiveness of the proposed algorithm.
Figure 10 shows the paths of AMRs planned using the WSTH-CBS algorithm in a 50 × 50 warehouse scenario.
Figure 11 captures the positions at different moments from
Figure 10, where
Figure 11a shows the positions and paths during the AMRs’ operation, and
Figure 11b shows the final positions and motion paths of the AMRs. The rectangles represent the Ackermann steering AMRs. As shown in
Figure 11a, the blue AMR changes its direction by turning to the left side to avoid a conflict with the orange AMR. At the same times, the orange AMR changes its direction by turning to the right side to avoid a conflict with the blue AMR.
Based on the paths of all AMRs obtained in
Figure 11b, we perform path tracking control using the MPC algorithm. For the Ackermann steering AMRs, we designed an MPC algorithm based on their models to perform path tracking control.
Figure 12 shows the results of the path tracking. The blue curve represents the desired path obtained from the path planning algorithm, while the red curve represents the actual path achieved through the MPC algorithm. The black boxes highlight the paths of some AMRs during turning. By examining the magnified view of these sections, it can be observed that the red curve almost completely overlaps with the blue curve, with only minor control deviations during some turns.
The reason for the control deviations during turning is that, while controlling through the MPC algorithm, we considered the constraints on the upper and lower limits of the front wheel steering angle for the Ackermann steering AMR. Despite these constraints, the deviations between the actual path and the desired path are minimal. This demonstrates the effectiveness of the proposed planning and control algorithms in multi-AMR systems.
6. Conclusions
In this paper, we presented a novel path planning and tracking control algorithm for multi-AMR systems, specifically addressing the complexities introduced by kinematic models among AMRs. Our approach featured a two-layer path planning algorithm. The upper layer effectively identified spatiotemporal conflicts between the planned paths of any two AMRs using a spatiotemporal conflict detection tree combined with the Separating Axis Theorem. The lower layer of the algorithm takes into account the kinematic models of the AMRs, ensuring that the generated paths satisfy the nonholonomic constraints of each robot type. Furthermore, this layer enhanced heuristic evaluations with weighted adjustments, markedly improving planning efficiency. In addition, we developed a tracking control algorithm utilizing MPC. This algorithm precisely managed path tracking by considering the kinematic models and multiple constraints of the AMRs. Simulation results confirmed that our proposed approach successfully generated conflict-free paths while maintaining precise tracking control, fully adhering to the nonholonomic constraints of multi-AMR systems.
Looking ahead, the algorithm proposed in this paper can be further extended to differential drive and omnidirectional AMRs by adjusting the kinematic model. For differential drive AMRs, the primary difference in the kinematic model lies in its use of wheel speed differences to achieve turning. Therefore, the kinematic equations in the current path planning algorithm need to be modified by replacing the front wheel steering angle and linear velocity control of the Ackermann AMR with the speed control of the left and right wheels of the differential drive AMR, to accurately describe the motion characteristics of the differential drive. For omnidirectional AMRs, since they have the ability to move freely in any direction, their kinematic model is relatively simple, and does not require complex steering control. It is even possible to directly control the translational velocities in the x and y axes independently from the angular velocity, further optimizing the efficiency and flexibility of path generation. With these adjustments, the proposed algorithm can adapt to the kinematic models of different types of AMRs, expanding its range of applications and providing efficient path planning and control solutions for multi-robot systems in various real-world scenarios.