1. Introduction
Unmanned underwater vehicles (UUVs), including autonomous underwater vehicles (AUVs) and remotely operated vehicles (ROVs), have played a significant role in exploring the deep sea. However, human interest in underwater research is not only limited to observation but also requires a certain degree of intervention [
1], a capability that classical UUVs lack. Therefore, UUVs equipped with underwater manipulators, named underwater vehicle-manipulator systems (UVMSs), are widely used in marine energy and architecture industries [
2,
3]. To achieve a larger work range and certain cooperation abilities, UVMSs often assemble two manipulators for specific tasks. This type of UVMS is called underwater vehicle-dual-manipulator systems (UVDMSs), which have the intuitive advantage of dealing with precise tasks since they are expected to be substitutes for human bodies underwater.
Research related to dual arms has always been a hot topic in the field of robotics, including but not limited to space robotics [
4], medical robotics [
5], drones [
6], wheeled robotics [
7], and humanoid robotics [
8]. An obvious advantage of dual-arm robots is their ability to capture and transport target objects. An adaptive hybrid control scheme is designed to capture unknown objects by dual arms cooperatively in [
9]. Refs. [
10,
11] propose an integrated multi-agent global planning and central strategy for reactive dual arm manipulation while modeling the dual arm cooperative control by dual qualifications, which performs perfectly in transporting objects. Compared to single-arm robots, the problem of mutual collisions between the two arms is a significant constraint for motion planning of dual-arm robots. Therefore, collision avoidance is essential for the cooperative control of dual manipulators. Ref. [
12] describes a control scheme to avoid conflicts between dual manipulators with high accuracy in tracking the desired path while regarding distances of obstacles as constraints in the optimization model. The obstacle avoidance strategy in [
11], using the artificial potential field method, can avoid obstacles in the transporting task effectively. In terms of UVDMSs, cooperative control, and obstacle avoidance are more complicated due to the complex dynamics, limited workspace, and lack of obstacle information. In [
13], a multiple impedance dual-arm control for the task of object manipulation is proposed with reliable performance when contacting the environment. Ref. [
14] introduces the coordination control problems of UVMSs and discusses the application of the proposed framework to transportation problems of UVDMSs at the end. Their later research [
15] improves the previous framework to adapt to more scenarios.
UVDMSs are composed of multiple rigid bodies, which result in complicated modeling with couplings and uncertainties, so the motion planning and control of UVDMSs are challenging. The motion redundancy caused by multiple degrees of freedom makes it difficult to obtain an inversion solution from Cartesian space. The most common method to solve the redundancy problem is the task priority strategy [
15], which decomposes tasks into several sub-tasks in forms of target velocities and executes them in order. The sub-tasks are projected into the zero space of the main task, which will not be affected. Although this method fully utilizes the freedoms of UVDMS, selecting a proper task priority is not so easy, in that inappropriate configurations may lead to task failures. Optimization methods that regard the kinematic control as an optimization problem perform effectively in the motion planning of UVDMSs by limiting the solution to a small range through appropriate constraints. Extensive research on dual-arm robotics uses the quadratic programming scheme to deal with redundancy control [
16,
17,
18]. On this basis, the model predictive control (MPC), which has better dynamic performance, is suitable for the control of systems with high degrees of freedom. Static obstacles involved in a constrained workspace for multiple UVMSs’ cooperative transportation control are studied by [
19], which considers the kinematic singularities, obstacles, joint limits, and input saturation. The effectiveness of their results has been proved in both simulations and real experiments. Ref. [
20] developed a model predictive kinematic visual servoing control strategy by decoupling the control of the UVMS to separated vehicle and manipulator controls. For trajectory tracking of UVMSs, ref. [
21] proposes a fast MPC method with the extended Kalman filter (EKF) to compensate for model uncertainties and disturbances. A fast tube MPC scheme for moving target tracking of UVMSs is proposed in [
22], with an EKF to overcome the sensor noise. Similarly, to deal with noises, disturbances, and model uncertainties, ref. [
23] presents a sliding mode MPC strategy for coordinated control of the UVMS. Model uncertainties are also studied by other researchers, with robust and adaptive controls. In [
24], a robust controller, which performs well in trajectory tracking in the presence of system uncertainties and disturbances, is introduced. The adaptive control scheme and observer-based method for uncertainties of the UVMS are studied in [
25], utilizing the neural network (NN) to approximate the unknown dynamics. An NN is also used in [
26] as both a disturbance observer and state predictor. By this operation, a composite control scheme consisting of an NN and MPC is established to generate optimal control actions in the presence of uncertainties and input saturation.
Based on the previous research, this work focuses on the collision avoidance and trajectory tracking of UVDMS. Both mutual collision and frame collision are considered by defining constraints of the minimum distance velocities of all manipulator links. A model predictive kinematic control scheme is proposed to track the reference trajectory of the grasped object. Then, a neural network-based dynamic inversion control framework is used to track the command velocity generated by the kinematic controller. At last, a 3D UVDMS platform is established to test the performances of the proposed control strategy.
This work is organized as follows.
Section 2 provides a brief mathematical model of the UVDMS and formulates the collision avoidance constraints, as well as the object transport model. In
Section 3, the kinematic MPC tracking scheme and neural network-based dynamic inversion controller with stability analysis are established. Finally, simulation experiments are tested on the platform based on Creo 10.0.1.0, Unity 2022.3.15f1c1, and Matlab R2023b in
Section 4.
2. Problem Formulation
In this section, the kinematic and dynamic models of UVDMS are described briefly. Initially, the kinematic model is given by defining relevant coordinates and variables. Then, the collision avoidance method is established as constraints in the control system. Moreover, the object transport model is established.
2.1. UVDMS Model
Figure 1 shows the necessary coordinates and variables that describe the motions of UVDMSs. The vehicle moves in the inertial frame
, which is always fixed on the ground with the
z-axis downward. In
, positions of the vehicle and end effectors are defined as
(including the global position
and Euler angles
) and
with
for the left end effector and
for the right one. The vehicle velocity, in frame
fixed with the vehicle body, is
, which contains the linear velocity
and the angular velocity
. The joint angles of both underwater manipulators are
where
is the angle vector of the left manipulator and
for the right one. And the joint velocities
have the same forms. In addition,
and
, in
Figure 1, represent the right manipulator base frame and the right end-effector frame, respectively.
By defining the system velocity as
, the rotation matrix
from
to
, and the Jacobian matrix
of the vehicle angular velocity we obtain the system velocity in the frame
, as follows.
Then, the relationship between the system velocity and the end effector velocity can be formulated as
where the Jacobian matrix
transfors the system velocity to the end effector velocity, contains the linear velocity transfomation
, and the angular velocity transformation
.
According to [
27,
28], the dynamic model of UVDMS is expressed as follows.
where
is the inertial matrix in which the diagonal elements include the inertial of both the vehicle and the manipulators while other elements represent the couplings.
is the added Coriolis and centripetal matrix while
is the damping and hydrodynamic lift matrix. It should be noted that the current velocity is ignored in this model because UVDMS usually works in stable environments. The system input (torques of the vehicle and joints) and gravity are denoted by the vectors
and
. Thus, the UVDMS model can be represented by
where the dynamic model is written in a general function form as
to simplify the control formulation.
2.2. Collision Avoidance
The collision avoidance study of UVDMSs differs significantly from the manipulators on land. Firstly, UVDMSs are always designed in the form of ROVs with outer frames which limit the workspace severely. Secondly, the limited space may result in a close distance between two manipulators so that the probability of interference increases. Moreover, the thick watertight joint shells further reduce the available workspace. At last, collision monitoring using global information (i.e., the visual system) is difficult underwater. In this section, a collision avoidance strategy considering the UVDMS configurations is established.
In this study, the manipulators’ mutual collisions and the outer frame collisions are discussed. Both of them are handled by calculating their minimum distances to develop velocity constraints. It is reasonable that when one manipulator (i.e., the right one without loss of generality) is working, another one is regarded as an obstacle. The purpose of collision prevention is to ensure that the minimum distance between the manipulators does not exceed the limit. The minimum distance is defined in
Figure 2 where the i-th link of the right manipulator is represented by the line segment AB with A and B being the endpoints of the link. The distance between AB and the left manipulator is defined by the minimal one among the distances between AB and all the links of the left manipulator. In this way, the line segment PE in
Figure 2 is computed as the distance between AB and the left manipulator. After calculating all 6 right links, one obtains the distances from them to the left manipulator as d(1)~d(6).
Algorithm 1 provides a numerical method to obtain the approximate value which is higher than the actuate value.
Algorithm 1 Manipulators Distances Calculation Algorithm |
Manipulators Minimum Distances Calculation Algorithm |
1. | Load DH_l(q), DH_r(q), A(0), C(0); |
2. | Calculate transforms T_l(1~7) and T_r(1~7) using DH(q); |
3. | A(1)←T_r(1)(A(0)), C(1)←T_l(1)(C(0)); |
4. | for k = 1 : 6 |
5. | A(k+1)←T_r(k + 1)(A(0)) |
6. | AB(k)←vector(A(k), A(k + 1)) |
7. | Initialize D’(0) |
8. | for i = 1 : n |
9. | Initialize D(i, 0) |
10. | P’(i)←A(k) + i/n*AB(k) |
11. | for m = 1 : 6 |
12. | C(m+1)←T_l(m + 1)(C(0)) |
13. | CD(m)←line segment(C(m), C(m + 1)) |
14. | D(i,m)←distance(P’(i), CD(m)) |
15. | if Di(i,m) < D(i, m − 1) |
16. | D’(i)←D(i, m) |
17. | Generate E’(i) |
18. | end if |
19. | end for |
20. | if D’(i) < D’(i − 1) |
21. | d(k)←D’(i), P(k)←P’(i), E(k)←E’(i) |
22. | end if |
23. | end for |
24. | end for |
25. | Output d(1)~d(6), P(1)~P(6), E(1)~E(6) |
Theorem 1. With d’(k) = d(k) − r as the modified distance, where r is the maximum interval when sampling P(i) and d(k) is the approximate distance calculated by Algorithm 1, the inequality d’(k) < d*(k) holds.
Proof. Obviously, the above inequality holds once the two links are coplanar. The non-coplanar case is shown in
Figure 3 where it is assumed that P(i)E is the computed distance between link AB(k) and link CD(m). The actual closest point is marked as P* between P(i) and P(i + 1) without loss of generality (P* cannot be out of the adjacent intervals of P(i) otherwise the algorithm would output another P(i′) and d(k′)). Thus, we have r + d*(k) = r + P*E* > P(i)P* + P*E* > P(i)E* > P(i)E = d(k), that is d’(k) = d(k) − r < d*(k). □
On the other hand, the outer frames are considered as several planar obstacles. In this case, these planes are the front frame, the left frame, the right frame, and the bottom frame, while other frames cannot be reached by the manipulators (or be reached after the former planes). The right-hand links are taken as an example in
Figure 2 to define the link-plane distances. As before, the i-th link AB has the nearest distance, represented by the line segment MN, to plane F. After calculating the other 5 link-plane distances, as well as the left-hand distances, one obtains the distances from both manipulators’ links to the nearest plane as dr(1)~dr(6) and dl(1)~dl(6). The link-plane distances can also be calculated using Algorithm 1 by replacing the point-line-segment distance with the point-plane distance. Similarly, the modified dr^ = dr − r and dl^ = dl − r are defined and the inequality similar to Theorem 1 still holds. In addition, it should be noted that the accuracy of the algorithm depends on r. In this case, considering the length of all links, the error is within 1cm while more than n = 20 critical points are sampled for each link.
Summarizing the results above, we obtain
where,
is the i-th link-manipulator distance vector (PE(i)) of the right manipulator,
is the i-th link-plane distance vector (MNr(i)) of the right manipulator, and
is the i-th link-plane distance vector (MNl(i)) of the left manipulator.
and
are the Jacobian matrices for the velocities of points P(i), Mr(i), and Ml(i).
and
indicate the velocities of the critical points toward the obstacles. The distance velocities can be written in a compact form as
and
The objective of collision avoidance is to limit
so that the corresponding minimum distances will not decrease. However, direct collision avoidance will have a negative effect once the obstacles are far away or where the UVDMS’ motion is not encumbered. Therefore, the collision detection area, shown in
Figure 2, is divided into three zones by the threshold d1 and d2. When the obstacle reaches the red zone (the distance lower than d1), there is a high probability of collision, so the controller must stop the motion or generate a large escape velocity. When the obstacle (as the orange obstacle shown in
Figure 2) is in the anti-collision zone (the distance between d1 and d2), the normal avoidance velocity is generated to drive the manipulators away. While obstacles are in the safe area (distance higher than d2) no special movement needs to be implemented. According to [
29], a gradually changing operation is defined as
It should be noted that the operation above is not a strict form of a vector function and the scalar variable
represents each component of the distance vectors
and
to simplify the formulation. Thus, the constraints for collision avoidance are given as follows.
2.3. Object Transport Model
Before modeling the object, it is assumed that the object has already been captured by the end effectors with rigid body connections. As shown in
Figure 4, the cylinder object is gripped by two clamps fixed with the end effectors. The object’s kinematic is provided as
where
is the Jacobian matrix from the right end effector velocity to the object velocity in the inertial frame.
and
are the homogeneous transformations that can be obtained by the DH parameters.
Similar to the vehicle model, the underwater object dynamic is described as
where
is the inertial matrix,
is the added Coriolis and centripetal matrix,
is the damping and hydrodynamic lift matrix, and
is the gravity vector. The force
(force and torque) comes from the end effectors as
where
is the force Jacobian matrix from frame
and
to frame
(the object coordinate frame) and
and
are the forces affected by the two end effectors. By adding the reaction force from the end effectors to the UVDMS dynamic model, we obtain
where
are the force Jacobian matrices from the end effectors frame to the vehicle body frame. By substituting Equations (11) and (12), and
into Equation (13), we obtain the dynamic of the whole transport system as
where
Thus, the whole UVDMS-object system model is converted to a compact Lagrange model. The objective is to design a controller to track the reference trajectory of the object.
3. Object Tracking Control
In this section, the control strategy, shown in
Figure 5, is studied to track the desired trajectory of the object, while considering the collision avoidance problem and the dynamic uncertainties. The control scheme in
Figure 5 includes two parts: kinematic and dynamic controls. In the kinematic control, the command velocity is produced by the model predictive controller with certain constraints, including the obstacle velocities limit. Then, the radial basis function (RBF) neural network-based dynamic inversion control framework for the transport task is developed to track the command velocity and compensate for the model uncertainties. At last, the stability of the dynamic control is analyzed briefly.
3.1. Model Predictive Kinematic Tracking Control
The desired objective tracking problem can be solved by an MPC approach once the object kinematic is converted to the discrete-time model as
where
and
represent the object pose, system velocity, vehicle pose, and joint angles at time step
, respectively. The sampling period is
. To establish the MPC optimization model, necessary constraints should be satisfied.
Joint angles and velocities of the underwater manipulators are strictly limited as
where
and
are the minimum and maximum angle values of the i-th joint of the left manipulator while the right one has the same definitions. Similarly,
and
are the joints velocities with their limits represented by the current joint angles, where
is a positive scale parameter and
is the physical velocity limit. These conditions can be noted as
Velocities of the vehicle are also bounded as
due to the thruster limits and the water resistance. Combining them with the joint velocity limits, we obtain
The obstacle approaching velocity is provided in
Section 2.2 and the collision avoidance constraints can be written as
Then, the model predictive object tracking kinematic control is formulated as: Given the UVDMS object transport model in Equation (14), find the optimized kinematic inputs by solving the optimization problem
with
subject to
where
is the cost function of the object tracking error and candidate velocity inputs
.
and
are the predicted the pose of the object, pose of the vehicle, and joint angles.
is the predicted value of the obstacle distance velocity. The prediction and control horizons are
and
with
. The positive defined
and
are weighting matrices.
Once the optimization problem of Equation (21) is solved with the input sequence at time , the first element will be applied to the tracking control as the command velocity .
3.2. Dynamic Inversion and Neural Network-Based Control
The control law of the dynamic system in (14) is designed as
with the virtual control
as the expected acceleration of the system.
and
are the estimates of
and
. The control equation can be written as
Similarly, the origin dynamic system can be denoted as
with
as the modeling error. Then, we obtain
A one-order inertial system
(
is a positive diagonal matrix) is designed as the reference model (having the initial conditions as the origin system) to track the command velocity. Then, the tracking error of the reference velocity
is defined as follows.
By defining the virtual control as
the error system is formulated as
where
is a PI controller with
and
as the control parameters and
is output of the neural network to be designed later.
The RBF neural network
is used to compensate the model uncertainties for its arbitrary approximation ability with
.
and
are the estimated weighting matrix and Gauss function with the adaptive law as
3.3. Stability Analysis
It is assumed that an ideal weighting matrix
exists so that the system uncertainties can be approximated as
where
is the approximation error. The ideal network can be represented by
and
as
Substituting (31) into (28), we obtain
A Lyapunov candidate can be defined as
where
is the solution of
.
can be derived as
It can be seen that when , , where , and are the maximum and minimum eigenvalues of and . if and only if , so when , the convergence rate depends on . is bounded since is bounded; however, its convergence cannot be guaranteed due to the adaptive mechanism.
5. Conclusions
A model predictive control for collision avoidance and grasped object transport of UVDMSs is developed in this paper. Collisions caused by the outer frames and the dual manipulators are considered distance velocity constraints, where a minimum link distances algorithm is proposed to calculate the distance to the obstacle of each link. The kinematic tracking based on MPC generates command velocity for the dynamic control, which is built using the model reference dynamic inversion structure. Uncertainties of the UVDMS-object model are compensated by the neural network for better performance. The stability of the velocity tracking control is analyzed by the Lyapunov theory and the error is ultimately bounded. In addition, simulations of an 18-dof UVDMS in different scenes show good performance of the control strategy for avoiding collisions and object transport.
The obstacles considered in this work are vehicle frames and mutual manipulator links with few perceptions of the environment. Outer obstacles, especially the non-static ones, are another challenge for UVDMSs. In addition, the proposed control scheme deals with objects that are fixed with the end effectors which reduces the degrees of freedom and ability of collaboration. Therefore, outer obstacle avoidance and cooperative control will be the focus of our future work.