Articles | Volume 13, issue 1
https://doi.org/10.5194/ms-13-41-2022
https://doi.org/10.5194/ms-13-41-2022
Research article
 | 
08 Feb 2022
Research article |  | 08 Feb 2022

Evolutionary multi-objective trajectory optimization for a redundant robot in Cartesian space considering obstacle avoidance

Yong Liu, Xiang Li, Peiyang Jiang, Zhe Du, Zhe Wu, Boxi Sun, and Xinyan Huang
Abstract

A method of end-effector trajectory planning in Cartesian space based on multi-objective optimization is proposed in this paper to solve the collision problem during the motion of the redundant manipulator. First, a cosine polynomial function is used to interpolate the trajectory of the end effector, enabling it to reach the desired pose at a specific time. Then, the joint trajectory of the manipulator is solved by inverse kinematics, and the null space term is introduced as the joint limit constraint in the inverse kinematics equation. During the operation of the manipulator, the collision detection algorithm is employed to calculate the distance between the obstacle and each arm in real time. Finally, a multi-objective, multi-optimization model of trajectory that considers the obstacle avoidance, joint velocity, joint jerk and energy consumption is established and optimized with a multi-objective particle swarm optimization algorithm. The simulation results demonstrate that the proposed method can effectively accomplish the trajectory planning task and avoid obstacles; the joint trajectories obtained are smooth and meet the limit constraints; the joint jerk and energy consumption are well suppressed.

Dates
1 Introduction

In many of today's vastly complex and difficult manufacturing applications, manipulators may have more degrees of freedom (DOFs) than essential due to the need of executing intended complicated jobs like human arms. Specifically, the end effector of redundant manipulator should satisfy a desired trajectory while its body avoids colliding with obstacles in the environment, contributing to finishing the job. The extremely crucial obstacle avoidance problem is that robotic manipulators are required to move from an initial pose to a specified final objective without colliding with any obstacles in the workspace.

To solve the trajectory planning problem considering obstacle avoidance, many researchers have focused on different methods. For example, Ma and Liang (2020) proposed an obstacle avoidance algorithm for a 6-DOF manipulator based on a sixth-degree polynomial, with limitations to the redundant manipulator. For the obstacle-avoiding motion of the end effector of the redundant robot, Shen et al. (2014) presented an obstacle avoidance algorithm based on the transition between the primary and the secondary tasks to acquire a smooth and continuous trajectory. Dalla and Pathak (2017) put forward a methodology that a limited number of joints are actuated and a curve-constrained link trajectory tracking is developed to control hyper-redundant space robots. However, these are only for planar robots. Shi et al. (2019) constructed a visual servoing system, which obtained the image errors by the ORB feature points and constructed a virtual repulsion torque to avoid obstacles.

In addition to the above methods, more researchers handle the obstacle avoidance problem by introducing the concept of potential field to construct the artificial potential field. Safeea et al. (2020) redefined the obstacle avoidance problem as a second-order optimization problem and constructed the potential function that is minimized by Newton's method to realize real-time trajectory calculation in joint space. It lacks the intuitiveness and efficiency compared with Cartesian space trajectory planning. Wang et al. (2018) realized trajectory planning and obstacle avoidance through the improved artificial potential field method with the consideration of both position and posture of manipulator end effectors. Park et al. (2020) employed a Jacobian matrix-based numerical method and an improved potential field method to achieve path planning and obstacle avoidance, both in redundant and non-redundant conditions.

The above-mentioned trajectory planning methods focus more on obstacle avoidance than kinematics or dynamics optimization. Nowadays, an optimized path should be found for robot motion regarding minimum time (Bourbonnais et al., 2015), minimum distance (Salaris et al., 2010), and minimum energy (Arakelian et al., 2011) given the robot optimization problem in obstacle avoidance planning. This suggests that multiple objective functions should be simultaneously optimized to obtain a suitable trajectory. Based on the above articles, some criteria for evaluating manipulator trajectory can be obtained:

  1. Trajectories need to be predictable, accurate, and effective to both compute and execute.

  2. Trajectories need to ensure that the joints of the robotic arm do not appear singular.

  3. Trajectories should be found for a manipulator with respect to minimum time, minimum distance, and minimum energy.

Many researchers used an evolutionary algorithm to address multi-objective planning problems considering obstacle avoidance. For example, Saravanan et al. (2008) optimized two evolutionary algorithms of an elite non-dominant sorting genetic algorithm (NSGA-II) and differential evolution (DE) to handle the multi-objective problem and achieved the predetermined goal in the PUMA560 robot. Han et al. (2013) realized the obstacle avoidance path planning optimization of the robot arm in the environment with single or multiple obstacles based on genetic algorithms with execution time, space distance, and trajectory length as the optimization parameters. However, most of the above researchers have weighted each constraint as an objective function, making the result very dependent on the setting of the weight factor. Some researchers transform multi-objective problems into quadratic programming (QP) problems. Chen and Zhang (2017) proposed a hybrid multi-objective scheme including the specified primary task for the end effector, obstacle avoidance, joint-physical limits avoidance, and repetitive motion of redundant robot manipulators and transformed it into a dynamic quadratic program (DQP) problem. Zhang et al. (2020) studied two schemes of hybrid end-effector pose-maintaining and obstacle-limits avoidance (PM-OLA) for redundant robot motion planning based on QP framework to solve the end-effector drift problem in the planar task. Other researchers obtained the Pareto front in multi-objective problems, as well as the non-dominant solution. Guigue et al. (2010) employed the discrete dynamic programming (DDP) approximation method to obtain an approximate solution of the Pareto optimal set to handle multi-objective robotic trajectory planning problems. Marcos et al. (2012) combined a closed-loop pseudo-inverse method with a multi-objective genetic algorithm to control the joint position and choose a solution from the Pareto solution set. Although these researchers solved the multi-objective problem, they did not add energy consumption constraint to the multi-objective problem for obtaining a superior solution with more energy-saving or less joint jerk.

Besides, many researchers have improved the particle swarm optimization (PSO) algorithm to acquire the optimized trajectory of the robotic arm. Cao et al. (2016) adopted a hybrid algorithm combing crossover and mutation particle swarm optimization (CMPSO) with the interior point method (IPM) to determine the minimum-length motion path of robot end effector and the best movement posture of the robot arm. Lin (2014) proposed a k-means clustering method based on PSO to address the near-optimal solution of the minimum-jerk joint trajectory, making it easy to obtain the optimized trajectory control law. Kucuk (2017) developed an optimal trajectory generation algorithm (OTGA) for generating smooth motion trajectories with minimum time with the PSO algorithm. Under the diversification of robot optimization goals, some researchers used a multi-objective particle swarm optimization (MOPSO) algorithm (Coello Coello and Lechuga, 2002) to solve multi-objective optimization problems. For instance, Yan et al. (2020) presented multi-objective configuration optimization for the maximum maneuverability and minimum base disturbance in the pre-contact stage of dual-arm space robot by MOPSO. Liu and Zhang (2021) proposed an improved external archives self-searching multi-objective particle swarm optimization (EASS-MOPSO) algorithm to handle the multi-objective trajectory optimization problem.

In this paper, regarding obstacle avoidance, the change rate of joint torque, joint angular velocity, and energy consumption are minimized using the path planning method based on a multi-objective optimization algorithm. The main contributions of this paper are highlighted as follows.

  1. A cosine polynomial function is used to interpolate the trajectory of the end effector, enabling it to reach the desired pose at a specific time, and the null space term is introduced as the joint limit constraint in the inverse kinematics equation.

  2. During the operation of the manipulator, a collision detection algorithm is employed to calculate the distance between the obstacle and each arm in real time.

  3. The trajectory optimization model of redundant manipulator was established to consider obstacle avoidance, joint velocity, joint jerk and energy consumption, and the optimized trajectories were obtained by a multi-objective particle swarm optimization algorithm.

The remaining paper is organized as follows. In Sect. 2, the end trajectory of the robotic arm is interpolated using the cosine fifth-degree polynomial, allowing the end to reach the specified pose at the specified time. Then, the joint trajectory of the robotic arm is reversed through inverse kinematics. Section 3 presents the collision detection algorithm used in this paper. Afterward, the multi-objective optimization problem equations are described in Sect. 4. The obstacle avoidance trajectory planning based on multi-objective optimization is introduced in Sect. 5. Simulation results are analyzed in Sect. 6. Finally, conclusions are drawn in Sect. 7.

2 Trajectory planning of redundant manipulator

2.1 Trajectory parameterization of end effector in Cartesian space

A five-order cosine polynomial is adopted to describe the trajectory to ensure the position, orientation, velocity, and acceleration of the end effector change smoothly and continuously. With this method, the motion of the end effector follows a helical curve in Cartesian space (Zghal et al., 1990). The pose of the end effector is taken to compose a six-dimensional generalized coordinate vector Xe=X1(t),,X6(t)T as the status variable of the system. The trajectory is parameterized as

(1) X j ( t ) = λ j 5 t 5 + λ j 4 t 4 + λ j 3 t 3 + λ j 2 t 2 + λ j 1 t + λ j 0 cos 2 π t T j + φ j + X j 0 ,

where Xj0 denotes the initial pose of end effector, and λ, T and φ are trajectory parameters, j=1,,6.

By taking the differential of the equation above, the generalized velocity and acceleration of the end effector can be expressed as

(2) X ˙ j t = K j 1 t cos 2 π t T j + φ j - 2 π T j K j 2 t sin 2 π t T j + φ j X ¨ j t = K j 3 t cos 2 π t T j + φ j - 4 π T j K j 1 t sin 2 π t T j + φ j - 4 π 2 T j 2 K j 2 t cos 2 π t T j + φ j ,

where Kj(t) can be described as follows:

(3) K j 1 t = 5 λ j 5 t 4 + 4 λ j 4 t 3 + 3 λ j 3 t 2 + 2 λ j 2 t + λ j 1 K j 2 t = λ j 5 t 5 + λ j 4 t 4 + λ j 3 t 3 + λ j 2 t 2 + λ j 1 t + λ j 0 K j 3 t = 20 λ j 5 t 3 + 12 λ j 4 t 2 + 6 λ j 3 t + 2 λ j 2 .

The boundary conditions of the trajectory planning problem are

(4) X j t 0 = X j 0 , X ˙ j t 0 = X ¨ j t 0 = 0 X j t f = X j f , X ˙ j t f = 0 , X ¨ j t f = 0 ,

where t0 and tf represent the initial and final time, respectively; Xjf refers to the desired pose of end effector.

By substituting Eq. (4) into Eqs. (1) and (2), the following relationship can be obtained:

(5) λ j 0 = λ j 1 = λ j 2 = 0 λ j 3 = 2 ( 2 π 2 D j t f 2 sin 2 ( ψ ) + π 2 D j t f 2 cos 2 ( ψ ) - 4 π D j T j t f sin ( ψ ) cos ( ψ ) + 5 D j T j 2 cos 2 ( ψ ) ) T j 2 t f 3 cos 3 ( ψ ) λ j 4 = - [ D j ( 8 π 2 t f 2 sin 2 ( ψ ) + 4 π 2 t f 2 cos 2 ( ψ ) - 14 π T j t f sin ( ψ ) cos ( ψ ) + 15 T j 2 cos 2 ( ψ ) ) ] T j 2 t f 4 cos 3 ( ψ ) λ j 5 = 2 D j ( 2 π 2 t f 2 sin 2 ( ψ ) + π 2 t f 2 cos 2 ( ψ ) - 3 π T j t f sin ( ψ ) cos ( ψ ) + 3 T j 2 cos 2 ( ψ ) ) T j 2 t f 5 cos 3 ( ψ ) ,

where ψ and Dj can be described as

(6) ψ = 2 π t f T j + φ j D j = X j f - X j 0 .

According to Eq. (5), polynomial coefficients can be determined with parameters Tj and φj.

Then trajectories of end effector that satisfy the constraints can be obtained with the following parameters vector:

(7) ξ = T 1 , φ 1 , T 2 , φ 2 , , T 6 , φ 6 T .

2.2 Joint motion planning for redundant manipulator

The subject of this paper is a n-DOF redundant manipulator. Assuming the dimension of task space is m(m≤6), a redundant manipulator satisfies n>m. The joint velocity vector of redundant manipulator is

(8) q ˙ = J + x ˙ e + I - J + J Φ ˙ ,

where xe∈ℝm indicates the pose of end effector in Cartesian space; q∈ℝn denotes joint angle vector; JRn×m represents the Jacobian matrix of manipulator; IRn×n refer to unit matrix; Φ˙Rn stands for an arbitrary n-dimensional vector; (I-J+J)Rn×n designates the null space projection matrix; J+Rn×m means the generalized inverse of the Jacobian matrix, which is defined by

(9) J + = J T JJ T - 1 .

For redundant manipulators, a specific trajectory of end effector can be obtained by multiple joint trajectories. Hence, the joint trajectory should be selected to ensure that the motion of the manipulator follows specific constraints. Null space (Zghal et al., 1990) term is introduced in this paper to enable the joint motion to satisfy joint limit constraints. The joint limit constraint function is established as

(10) H q = i = 1 n q i max - q i min q i max - q i q i - q i min ,

where qi donates the angle of joint i; qimax and qimin represent upper and lower limits of joint i, respectively.

According to the gradient projection method, the joint angle limit constraints are resolved by substituting kH(q) for Φ˙ in Eq. (8) as

(11) q ˙ = J + x ˙ e + k ( I - J + J ) H ( q ) ,

where the gradient vector H(q) is given by

(12) H ( q ) = H ( q ) q 1 , H ( q ) q 2 , , H ( q ) q n .

H(q) reaches minimum value when qi=(qimin+qimax)/2; H(q) approaches to infinity when qi=qimin or qi=qimax.

3 Collision detection algorithm

A collision detection algorithm should be established to achieve obstacle avoidance. A redundant manipulator is explored in this paper. Most of the links are like cuboids or cylinders. Moreover, obstacles are irregular geometric objects. The collision detection between the manipulator and obstacles is extremely complicated. Thus, sphere and cylindrical envelopes are applied in this paper to describe the manipulator links, joints, and obstacles.

3.1 The description of space geometry relation

Considering that obstacles in three-dimensional space generally have irregular geometric shapes and various kinds, it is difficult to extract their boundary contours. Thus, regular body envelopment is adopted in this paper to simplify the obstacle model, so as to simplify the complexity of obstacle modeling. For example, the cylindrical envelopment model and sphere envelopment model are employed for slender rod and rounded objects, respectively. This modeling method expands the range of obstacles while guaranteeing the reliability of the collision detection algorithm.

The obstacle uses a sphere envelope, as illustrated in Fig. 1. The radius of the sphere is rS. The cylindrical envelope is used for the links of the manipulator while the sphere envelope and cylindrical envelope are adopted to describe the joint. In this paper, a 7-DOF redundant manipulator (Fig. 5) is studied. As exhibited in Fig. 2. The two typical cases are described as follows.

  1. For case I, when axes of adjacent links are vertical, straight connecting links (link i−1 and link i) are enveloped by cylinders whose axes are coplanar. The intersection points Pi of cylindrical axes are centers of joint envelope spheres. The radius of the cylinder for the link i is ri; the radius of the sphere for the joint i is rijri2+ri-12. Hence, the distance between links and obstacles can be substituted as the distance from a line segment to a point in 3-dimensional space.

  2. For case II, when axes of adjacent links are parallel, joint i and link i−1 are enveloped in the same way as case I considering the joint with offset. Hence, rijrjoint2+ri-12, where rjoint indicates the radius of envelope cylinder for joint i. Two cylinders whose axes are coplanar and a sphere whose center is located in the intersection point (Pi) of the axes are applied to envelop it.

https://ms.copernicus.org/articles/13/41/2022/ms-13-41-2022-f01

Figure 1The obstacle uses sphere envelope.

Download

https://ms.copernicus.org/articles/13/41/2022/ms-13-41-2022-f02

Figure 2Links of the manipulator use cylindrical envelope and sphere envelope. (a) Case I. (b) Case II.

Download

https://ms.copernicus.org/articles/13/41/2022/ms-13-41-2022-f03

Figure 3The space geometry relations between manipulator's links and obstacle. (a) Class I. (b) Class II. (c) Class III.

Download

3.2 Collision detection algorithm

The space geometry (Guan et al., 2015) relations between manipulator's links and obstacle are divided into three classes, as exhibited in Fig. 3. Whether the links and obstacle collide depends on di, it denotes the minimum distance between the obstacle and manipulator's link/joint. If di>0, the obstacle is avoided; otherwise, it collides with the manipulator. Therefore, the collision detection problem between cylinder and sphere can be reduced to the calculation of the shortest distance between a point and line segment in 3D space.

Assume the length of link i is Li. Centers of the bottom are Pi and Pi+1. A vertical line of segment PiPi+1 is drawn through P0, and Pvi indicates the point of intersection to the cylindrical axis.

Based on the space geometry relation, the collision detection algorithm (Cheng et al., 1993) to achieve obstacle avoidance path planning for redundant manipulators is summarized as follows.

Step 1. Based on forwarding kinematics, the coordinates Pi of all nodes and joints are calculated with the current configuration and geometrical sizes of the manipulator.

The relative translation and rotation between link i coordinate and link i−1 coordinate can be described with a homogeneous transformation matrix Ti-1i. The kinematics equation of n degree of freedom manipulators can be expressed as

(13) T i 0 = j = 1 i T j j - 1 .

Step 2. PiPvi is defined as the projection vector of PiP0 on PiPi+1, and the scale factor λ is calculated:

(14) λ = P i P v i P i P i + 1 = P i P 0 P i P i + 1 P i P i + 1 P i P i + 1 .

The three-dimensional coordinates of the perpendicular foot Pvi can be obtained with Pvi=Pi+λ(Pi+1-Pi).

Step 3. The minimal distance from the links/joints to the obstacles is calculated. There are three possible positions of perpendicular foot Pvi related to PiPi+1:

  • For class I, Pvi is on PiPi+1 when λ1.

  • For class II, Pvi is on the reverse extension of PiPi+1 when λ<0.

  • For class III, Pvi is on the extension of PiPi+1 when λ>1.

Therefore, the minimum distance between P0 and PiPi+1 is

(15) d i = P 0 P v i - r i - r S , λ < 0 min { P 0 P i + 1 - r i j - r S , P 0 P v i - r i - r S } , 0 λ 1 P 0 P i + 1 - r i j - r S , λ > 1 .

Step 4. If min{d1,d2,,dn}<0, a collision occurs. Then, the collision information is outputted. According to the collision condition, obstacles can be avoided if min{d1,d2,,dn}>0.

https://ms.copernicus.org/articles/13/41/2022/ms-13-41-2022-f04

Figure 4The maintenance process of external repository.

Download

4 Description of multi-objective trajectory planning problem

In this study, minimization of total energy, joint jerks, and avoidance of obstacles are considered together to build a multi-criterion cost function. Singularity involved in null space and joint limits is considered a constraint.

4.1 Establishment of objective functions

  1. For a given trajectory of the end effector, the smaller the joint velocity is, the less likely the joint angle mutation occurs. Therefore, the optimization of joint angular velocity has the effect of avoiding singularity. Meanwhile, the null space term is used to constrain the joint limit when solving inverse kinematics. Since the collision detection algorithm is also the kinematic solution of the manipulator in essence, the obstacle avoidance term is taken as a penalty function in this paper to fuse with the joint angular velocity optimization objective. The specific expression is

    (16) obt = λ 1 max - d 1 , - d 2 , , - d n , min { d 1 , d 2 , , d n } > 0 λ 2 , min { d 1 , d 2 , , d n } < 0 ,

    where obt denotes obstacle avoidance term; λ1 and λ2 are scale factors.

    Combining with Eq. (11), the kinematic optimization term can be expressed as

    (17) f 1 = min i = 1 n ( q ˙ i ) + obt .

    Due to the scale factors, joint angular velocity is the major term when obstacles are avoided. Besides, the objective function is larger when the links failed to avoid the obstacle. This is convenient for choosing feasible solutions in the process of trajectory optimization.

  2. For redundant manipulators, the frequent changes in the joint jerk would cause a great impact. Reducing the joint jerk can indirectly limit the change rate of joint torque and thus make the movement of the manipulator more stable. This effectively reduces the execution error of the manipulator and resonance caused by the movement and wear on the joint mechanism. The jerk is the third derivative of the joint angle regarding time, and its optimization objective function is

    (18) f 2 = min i = 1 n q ′′′ i .
  3. Total energy consumption may significantly increase when the manipulator is trying to find an obstacle avoidance trajectory with a small joint jerk. This may result in frequent acceleration and deceleration, which should also be avoided in the manipulator's motion. The optimization objective function is

    (19) f 3 = i = 1 n t 0 t f [ q ˙ i ( t ) τ i ( t ) ] 2 d t ,

    where τi denotes the torque of joint i. Joint torque is calculated by the following dynamics equations (Saramago and Junior, 2000).

    (20) τ i = j = 1 n D i j ( q ) q ¨ j + j = 1 n k = 1 n C i j k ( q ) q ˙ j q ˙ k + g i q , i = 1 , , n ,

    where Cijk=Dijqk-Djk2qi; j=1nDij(q)q¨j indicates the acceleration term; Dij represents inertial system matrix. j=1nk=1nCijk(q)q˙jq˙k stands for quadratic velocity term; Cijk refers to Coriolis and centripetal forces matrix; gi(q) designates a configuration-dependent term that depends on the gravity.

https://ms.copernicus.org/articles/13/41/2022/ms-13-41-2022-f05

Figure 57-DOF redundant manipulator.

Download

Table 1Mass parameters a 7-DOF redundant manipulator.

Download Print Version | Download XLSX

4.2 Description of multi-objective trajectory planning problem

The trajectory of the manipulator's end effector is only decided by (Tjφj) according to Eqs. (3) and (5). Different trajectories can be obtained by changing the values of (Tjφj) in the cosine polynomial when initial conditions are given. Hence, Tj and φj are selected as the decision variables in the following optimization. The range of them is defined as the feasible region:

(21) ξ Ω : T min T j T max φ min φ j φ max , j = 1 , 2 , , 6 .

For redundant manipulators, the core of the multi-objective trajectory planning problem is to determine the decision vector ξ that will optimize the following objective vector:

(22) F ( ξ ) = f 1 ( ξ ) , f 2 ( ξ ) , f 3 ( ξ ) T .

ξ is defined in Eq. (7), which generates the trajectory of the end effector in Cartesian space. The objective vector F=[f1,f2,f3]T is composed of the objective functions' values.

The constraints in the optimization problem include the initial and final.

During the trajectory planning process, the joint limit constraints are

(23) q i min q i t q i max .

qi(t) is angle of joint i at time t.

https://ms.copernicus.org/articles/13/41/2022/ms-13-41-2022-f06

Figure 6Minimum value of objective functions during iteration. (a) Angular velocity. (b) Joint jerk. (c) Energy.

Download

https://ms.copernicus.org/articles/13/41/2022/ms-13-41-2022-f07

Figure 7Pareto front.

Download

5 Trajectory planning based on multi-objective optimization

It is difficult to find a global minimum solution for multi-objective optimization problems (MOPs). In MOP (Liu et al., 2015), a vector ξ dominates ξ(ξξ) when the following Pareto dominance principle is satisfied.

(24) f i ξ f i ξ , i = 1 , 2 , 3 , , N f i ξ < f i ξ , i { 1 , 2 , 3 , , N } .

The solution satisfying Eq. (24) is defined as a non-dominated solution of Eq. (22).

Respecting the given multi-objective trajectory optimization problem, the Pareto optimal solution set S is defined as

(25) S = ξ Ω ¬ ξ Ω , ξ ξ .

The mapping of S is a three-dimensional surface called Pareto front. Therefore, discovering as many non-dominated solutions as possible to cover all features of MOP is the key to solving the proposed trajectory planning problem.

MOPSO algorithm is adopted to solve the multi-objective trajectory optimization problem. This algorithm employs an external repository of particles as guidance to guide the evolution of the whole population toward the Pareto front. Only non-dominated solutions can be stored in the repository according to the following process.

https://ms.copernicus.org/articles/13/41/2022/ms-13-41-2022-f08

Figure 8The minimum distances between center of obstacle and manipulator's links.

Download

https://ms.copernicus.org/articles/13/41/2022/ms-13-41-2022-f09

Figure 9The configuration change of the manipulator and its geometric relationship with the obstacle. (a) Solution 2. (b) Solution 3.

Download

The velocity formula of particle's flight consists of not only the position and velocity of the current particle (P[k], V[k]) but also the best position that all the particles ever had in the repository (R[h]):

(26) V [ k ] = χ [ V [ k ] + C 1 R 1 ( P best [ k ] - P [ k ] ) + C 2 R 2 ( R [ h ] - P [ k ] ) ] .

χ=2/(|2-ϕ-ϕ(ϕ-4)|) represents the constriction factor; ϕ=C1+C2, where C1 and C2 refer to the learning factors regulating the step size of the particles flying to Pbest (the best position a particle has ever explored) and the best position that all the particles ever had, respectively; R1 and R2 indicate independent random numbers in the range [0,1].

Combining with the trajectory planning algorithm and MOPSO mentioned above, the obstacle avoidance trajectory optimization can be concluded as follows.

  1. The population containing nP particles is initialized, and the range of decision variables is defined as [Tmin,Tmax] and [φmin,φmax]. Decision variables ξ are randomly generated, and the trajectory of the end effector is calculated by Eq. (1).

  2. The joint trajectories are solved according to inverse kinematics, and then the values of three objective functions are obtained following kinematics and dynamics calculation results.

  3. The repository is initialized, and its maximum allowable number is restricted to nR. Next, the positions of particles that represent non-dominated decision vectors in the initial population are stored. Then, the best positions that the particles have had are initialized.

  4. While the maximum number of Imax has not been reached, evolutionary computations are performed to update and maintain the repository. The velocities of particles are calculated using Eq. (26), and the position of each particle is updated. Besides, particles that failed to avoid the obstacle are eliminated. The reserved solutions are added into the repository according to the process as shown in Fig. 4. The loop counter is incremented until the maximum number is reached.

  5. The non-dominated solutions are obtained from the repository. The particles constitute the set of non-dominant solution S in this paper.

Table 2Decision vectors and objective vectors of S2 and S3.

Download Print Version | Download XLSX

6 Simulation results and analysis

In this paper, a 7-DOF redundant manipulator is adopted to simulate the approached algorithm. The parameters are exhibited in Fig. 5. Mass parameters are provided in Table 1.

The initial configuration of the manipulator is qini=[0,0,0,0,0,0,0]. The corresponding pose of the end effector is Xini=[-0.5,-0.2,4.6m,0,0,0]. The desired pose of the end effector is Xdes=[-1.50,1.20,3.60m,78,-73,-90]. The total time of motion is tf=40 s. The upper and lower limits of joint i(i=1,2,,7) are qimin=-100 and qimax=100, respectively. The radius of link i is ri=0.1 m. The radius of joint envelope sphere is rij=0.1 m. The obstacle is a sphere whose radius is rS=0.2 m. The center of the obstacle is located in Z0=[-0.5,0.3,1.25m]. Scale factors in Eq. (16) are λ1=0.01 and λ2=10. The parameters of MOPSO are set as [λmin1,λmax1]=[+10×102,+10×103], [λmin2,λmax2]=[-π,+π], nP=1000; nR=1500; C1=C2=2.05.

https://ms.copernicus.org/articles/13/41/2022/ms-13-41-2022-f10

Figure 10The position and orientation change of end effector. (a) The position changes of end effector in solution 2. (b) The orientation changes of end effector in solution 2. (c) The position changes of end effector in solution 3. (d) The orientation changes of end effector in solution 3.

Download

https://ms.copernicus.org/articles/13/41/2022/ms-13-41-2022-f11

Figure 11The change of joint angular. (a) Solution 2. (b) Solution 3.

Download

https://ms.copernicus.org/articles/13/41/2022/ms-13-41-2022-f12

Figure 12The change of joint angular velocities. (a) Solution 2. (b) Solution 3.

Download

Figure 6 illustrates the minimum value of three objective functions during the iteration, which demonstrates the excellent astringency and stability of the proposed algorithm. The Pareto front is exhibited in Fig. 7. The particles are divided into two categories owing to the penalty function. Red particles satisfy the obstacle avoidance constraint while blue ones do not. Although the screening process can be executed to remove all blue solutions in each iteration, they are reserved to demonstrate the effectiveness of trajectory optimization for obstacle avoidance in this paper. According to the obstacle avoidance constraint, all the remaining non-dominant solutions successfully avoid the obstacle after the particles that fail to avoid the obstacle are removed. This reflects that the proposed algorithm has a good performance in obstacle avoidance.

The first objective function is merely adopted to avoid singularity and obstacles. It will not affect the other physical performance of the redundant manipulator. Therefore, only f2 and f3 are considered in the solution selection. The extreme values of cost functions are f2min=0.06%f2max and f3min=13.41%f3max, the specific values are f2min=0.05, f2max=76.22, f3min=2.79×104 and f3max=2.08×105. The jerks and energy costs corresponding to different end trajectories significantly vary, verifying the necessity of trajectory optimization.

Given no optimal solution to the multi-objective optimization problem, all the solutions are non-dominant. In this paper, the non-dominant solutions corresponding to the minimum values of f2 and f3 are selected for comparative analysis. It is assumed that the non-dominant solutions are S2 and S3. The decision vectors and objective vectors of S2 and S3 are presented in Table 2.

The minimum distances di between the center of obstacles and the manipulator's links are illustrated in Fig. 8. The minimum distances for S2 and S3 are 0.0597 and 0.0014 m, respectively. The trajectory obtained in S2 and S3 successfully avoided the obstacle. The configuration change of the manipulator and its geometric relationship with the obstacle are displayed in Fig. 9. The position and orientation change in the end effector are shown in Fig. 10. The manipulator reached the desired pose with different changing processes.

The change in joint angular over time is exhibited in Fig. 11. Since the joint angular velocity is one of the optimization objectives, no mutation of joint angle occurs. The change in joint angle is smooth. Moreover, the variation range of joint angle is also inhibited with the suppression of joint angular velocity. For solution S3, the joint angle of link i is still suppressed due to the null-space term, though it approaches the limitation at 24 s. Figure 12 provides the change in joint angular velocities. For S3, the joint angular velocity changes abruptly when the joint angle approaches the joint limit, forcing the joint angle of the manipulator to return to the range of the joint limit. This also validates the effectiveness of the null-space term as the joint angle constraint in this paper. The shaking process endured for 2 s and finally stabilized. Besides, lower energy cost always demands higher joint jerk, according to Fig. 7. It takes more energy to achieve a smooth angular velocity change, which reduces the impact on the joint mechanisms for redundant manipulators.

7 Conclusions

In this paper, a method of obstacle avoidance trajectory planning based on a multi-objective optimization algorithm in Cartesian space is proposed to avoid obstacles during the redundant manipulator's motion. On the premise that the end effector reaches the desired position and orientation at a specific time, obstacle avoidance can be achieved successfully, and joint jerk and energy consumption can also be inhibited. The results are described as follows.

  1. The cosine polynomial function was employed to realize the task requirements of the end effector reaching the desired pose at a specific time. Then, the inverse kinematics and null space inverse solution were introduced to meet the joint angle limit constraint.

  2. The multinomial weighted objective function is established in a combination of joint velocity and obstacle avoidance function. By optimizing the proposed function, the manipulator avoids not only the obstacle, but also the joint singularity.

  3. Multi-objective particle swarm optimization was performed to optimize joint jerk and energy consumption simultaneously. The clear physical meaning of the objective functions is beneficial for the selection of non-dominant solutions.

The trajectory optimization method proposed in this paper possesses the strong flexibility and diversity. Obstacle avoidance trajectories can be obtained by inputting the initial and expected pose of the end effector. Several non-dominant solutions can be provided for selection. Therefore, this method has an acceptable prospect in engineering applications. However, the collision detection in this paper was implemented based on static obstacles, with all known environment variables. Thus, how to realize dynamic obstacle avoidance in an unknown environment needs to be investigated in the future.

Data availability

The data are available upon request from the corresponding author.

Author contributions

YL, XL, PJ, and ZD planned the campaign; PJ, ZD, BS, and ZW wrote code and performed the simulations; XL, XH, YL, and ZW analyzed the data; XL, BS, XH, and PJ wrote the manuscript draft; YL, XL, ZW, and ZD reviewed and edited the manuscript.

Competing interests

The contact author has declared that neither they nor their co-authors have any competing interests.

Disclaimer

Publisher's note: Copernicus Publications remains neutral with regard to jurisdictional claims in published maps and institutional affiliations.

Financial support

This research has been supported by the National Natural Science Foundation of China (grant no. 52175013) and the Fundamental Research Funds for the Central Universities (grant no. JZ2020HGTB0034).

Review statement

This paper was edited by Zi Bin and reviewed by three anonymous referees.

References

Arakelian, V., Baron, J.-P. L., and Mottu, P.: Torque minimisation of the 2-DOF serial manipulators based on minimum energy consideration and optimum mass redistribution, Mechatronics, 21, 310–314, https://doi.org/10.1016/j.mechatronics.2010.11.009, 2011. 

Bourbonnais, F., Bigras, P., and Bonev, I. A.: Minimum-Time Trajectory Planning and Control of a Pick-and-Place Five-Bar Parallel Robot, IEEE/ASME T. Mech., 20, 740–749, https://doi.org/10.1109/TMECH.2014.2318999, 2015. 

Cao, H., Sun, S., Zhang, K., and Tang, Z.: Visualized trajectory planning of flexible redundant robotic arm using a novel hybrid algorithm, Optik, 127, 9974–9983, https://doi.org/10.1016/j.ijleo.2016.07.078, 2016. 

Chen, D. and Zhang, Y.: A Hybrid Multi-Objective Scheme Applied to Redundant Robot Manipulators, IEEE T. Autom. Sci. Eng., 14, 1337–1350, https://doi.org/10.1109/TASE.2015.2474157, 2017. 

Cheng, F. T., Chen, T. H., Wang, Y. S., and Sun, Y. Y.: Obstacle avoidance for redundant manipulators using the compact QP method, Proceedings IEEE International Conference on Robotics and Automation (Cat. No. 93CH3247-4), Atlanta, GA, USA, 2–6 May 1993, 263, 262–269, https://doi.org/10.1109/ROBOT.1993.292186, 1993. 

Coello Coello, C. A. and Lechuga, M. S.: MOPSO: a proposal for multiple objective particle swarm optimization, Proceedings of the 2002 Congress on Evolutionary Computation, CEC'02 (Cat. No. 02TH8600), Honolulu, HI, USA, 12–17 May 2002, 1052, 1051–1056, https://doi.org/10.1109/CEC.2002.1004388, 2002. 

Dalla, V. K. and Pathak, P. M.: Curve-constrained collision-free trajectory control of hyper-redundant planar space robot, P. I. Mech. Eng. I-J. Sys., 231, 282–298, https://doi.org/10.1177/0959651817698350, 2017. 

Guan, W., Weng, Z. X., and Zhang, J.: Obstacle avoidance path planning for manipulator based on variable-step artificial potential method, 27th Chinese Control and Decision Conference (CCDC), Qingdao, China, 23–25 May 2015, 4325–4329, https://doi.org/10.1109/CCDC.2015.7162690, 2015. 

Guigue, A., Ahmadi, M., Langlois, R., and Hayes, M. J. D.: Pareto Optimality and Multiobjective Trajectory Planning for a 7-DOF Redundant Manipulator, IEEE T. Robot., 26, 1094–1099, https://doi.org/10.1109/TRO.2010.2068650, 2010. 

Han, T., Wu, H.-Y., Du, Z.-J., and Zheng, X.-J.: Research on path planning for manipulator to avoid real-time obstacle based on genetic algorithms, Appl. Res. Comput., 30, 1373–1376, https://doi.org/10.3969/j.issn.1001-3695.2013.05.023, 2013. 

Kucuk, S.: Optimal trajectory generation algorithm for serial and parallel manipulators, Robot. Cim.-Int. Manuf., 48, 219–232, https://doi.org/10.1016/j.rcim.2017.04.006, 2017. 

Lin, H.-I.: A Fast and Unified Method to Find a Minimum-Jerk Robot Joint Trajectory Using Particle Swarm Optimization, J. Intell. Robot. Syst., 75, 379–392, https://doi.org/10.1007/s10846-013-9982-8, 2014. 

Liu, Y. and Zhang, X.: Trajectory optimization for manipulators based on external archives self-searching multi-objective particle swarm optimization, P. I. Mech. Eng. C-J. Mec., 0954406221997486, https://doi.org/10.1177/0954406221997486, 2021. 

Liu, Y., Jia, Q., Chen, G., Sun, H., and Peng, J.: Multi-Objective Trajectory Planning of FFSM Carrying a Heavy Payload, Int. J. Adv. Robot. Syst., 12, 118 pp., https://doi.org/10.5772/61235, 2015. 

Ma, Y. and Liang, Y.: An Obstacle Avoidance Algorithm for Manipulators Based on Six-Order Polynomial Trajectory Planning, Journal of Northwestern Polytechnical University, 38, 392–400, https://doi.org/10.3969/j.issn.1000-2758.2020.02.021, 2020. 

Marcos, M. D. G., Tenreiro Machado, J. A., and Azevedo-Perdicoúlis, T. P.: A multi-objective approach for the motion planning of redundant manipulators, Appl. Soft. Comput., 12, 589–599, https://doi.org/10.1016/j.asoc.2011.11.006, 2012. 

Park, S.-O., Lee, M. C., and Kim, J.: Trajectory Planning with Collision Avoidance for Redundant Robots Using Jacobian and Artificial Potential Field-based Real-time Inverse Kinematics, Int. J. Control Autom., 18, 2095–2107, https://doi.org/10.1007/s12555-019-0076-7, 2020. 

Safeea, M., Bearee, R., and Neto, P.: Collision Avoidance of Redundant Robotic Manipulators Using Newton's Method, J. Intell. Robot. Syst., 99, 673–681, https://doi.org/10.1007/s10846-020-01159-3, 2020. 

Salaris, P., Fontanelli, D., Pallottino, L., and Bicchi, A.: Shortest Paths for a Robot With Nonholonomic and Field-of-View Constraints, IEEE T. Robot., 26, 269–281, https://doi.org/10.1109/TRO.2009.2039379, 2010.  

Saramago, S. F. P. and Junior, V. S.: Optimal trajectory planning of robot manipulators in the presence of moving obstacles, Mech. Mach. Theory, 35, 1079–1094, https://doi.org/10.1016/S0094-114X(99)00062-2, 2000. 

Saravanan, R., Ramabalan, S., and Balamurugan, C.: Evolutionary collision-free optimal trajectory planning for intelligent robots, Int. J. Adv. Manuf. Tech., 36, 1234–1251, https://doi.org/10.1007/s00170-007-0935-x, 2008. 

Shen, H., Wu, H., Chen, B., Ding, L., and Yang, X.: Obstacle Avoidance Algorithm for Redundant Robots Based on Transition between the Primary and Secondary Tasks, Robot, 36, 425–429, https://doi.org/10.13973/j.cnki.robot.2014.0425, 2014. 

Shi, H., Chen, J., Pan, W., Hwang, K., and Cho, Y.: Collision Avoidance for Redundant Robots in Position-Based Visual Servoing, IEEE Syst. J., 13, 3479–3489, https://doi.org/10.1109/JSYST.2018.2865503, 2019. 

Wang, W. R., Zhu, M. C., Wang, X. M., He, S., He, J. P., and Xu, Z. B.: An improved artificial potential field method of trajectory planning and obstacle avoidance for redundant manipulators, Int. J. Adv. Robot. Syst., 15, 1729881418799562, https://doi.org/10.1177/1729881418799562, 2018. 

Yan, L., Xu, W., Hu, Z., and Liang, B.: Multi-objective configuration optimization for coordinated capture of dual-arm space robot, Acta Astronaut., 167, 189–200, https://doi.org/10.1016/j.actaastro.2019.11.002, 2020. 

Zghal, H., Dubey, R. V., and Euler, J. A.: Efficient gradient projection optimization for manipulators with multiple degrees of redundancy, P. IEEE Int. C. Robot. Auto., Cincinnati, OH, USA, 13–18 May 1990, 1002, 1006–1011, https://doi.org/10.1109/ROBOT.1990.126123, 1990. 

Zhang, Z., Chen, S., Zhu, X., and Yan, Z.: Two Hybrid End-Effector Posture-Maintaining and Obstacle-Limits Avoidance Schemes for Redundant Robot Manipulators, IEEE T. Ind. Inform., 16, 754–763, https://doi.org/10.1109/TII.2019.2922694, 2020. 

Download
Short summary
First, we calculated the trajectory of the end effector of manipulator. This trajectory enables the end effector to reach the desired pose. At the same time, collision detection algorithm was employed to calculate the distance between each link of the manipulator and obstacle. We utilized the multi-objective particle swarm optimization algorithm to optimize the trajectory to minimize joint motor energy consumption and reduce joint velocity and joint impact during the movement of the manipulator.