Motion Control Pick N Place Manipulator
Motion Control Pick N Place Manipulator
Motion Control Pick N Place Manipulator
Abstract— The purpose is to control a mobile robot manip- high cost to know the regressive matrix of the robot dynamic
ulator to execute the pick-and-place operation by efficiently model. A way to overcome this cost is through applying
reaching the desired target location. A 6-DOF mobile robot neural networks. Single layer neural networks replace the re-
manipulator with omnidirectional mobile base is chosen for
the study. The mobile robot is entitled to reach the target gressive matrix with a vector containing activation functions
position when unanticipated forces act on the end effector, that are not limited to single robot configuration [2]. Hence
which requires control of the manipulator as well as the from the above set of controllers we propose to choose PD
mobile base. The control strategies utilized will be Proportional- with gravity compensation and Classic Adaptive controller to
Derivative control with gravity compensation, and Classical evaluate the performance of a 6DOF mobile manipulator in
Adaptive Controller for the combined control of the mobile
robot manipulator to reach the target position. In order to handling unexpected end effector forces using metrics such
assess the controllers, the performance of the PD controller as tracking error, convergence rate, and robustness.
and Classical Adaptive controller will be compared using the
performance metrics such as tracking error, rate of error
II. M ATERIALS AND M ETHODS
convergence and robustness to uncertain external forces.
The mobile robot manipulator system considered for the
study is shown in the Fig. 1.
I. I NTRODUCTION
The field of robotics has been through numerous advance-
ments ever since GM motors introduced “UNIMATE”, the
first industrial robotic arm in the 1950s. Today, they are an
integral part of many industries to perform various tasks such
as welding, pick and place, painting etc. Robotic manipula-
tors are widely adopted in industries to increase productivity
and precision, while minimizing human error. One of the
main advantages of having a manipulator is its ability to work
in critical conditions where it is risky or fatiguing for humans
while having the advantage to easily reprogram and modify
for new operations. These advanced robotic manipulators
mounted on a mobile platform can be termed as mobile
robot manipulators, combine the advantages of mobile plat-
forms and robotic arms and reduce their drawbacks. The
mobile platform extends the workspace of the arm and wide
opens a whole new range of applications such as mining,
construction, home assistants, space exploration, search and
rescue, and military [1]. In order for these manipulators to
be versatile and useful, it needs the ability to handle various
Fig. 1. 6 DOF Mobile Manipulator System
objects and unanticipated forces while interacting with the
world.
Numerous control algorithms have been developed for
controlling these manipulators such as PD, PD with gravity A. Software and Hardware
compensation, PID, adaptive, fuzzy, and neural network In this project, the steps starting from dynamic modelling
controllers. PD and PID controllers are still widely used to controller implementation is programmed and simulated
in industries primarily due to their simplicity and relatively in MATLAB R2018 a. The 6-DOF kinematic chain of the
satisfactory performances. For horizontal planar robots PD mobile manipulator is extracted (explained in detail in II-
controllers have asymptotic stabilization, but for robots with B.) and modelled as one dimensional link chain to alleviate
rotational DOF tend to have permanent tracking error. Even computation complexity.
though it is simpler to implement, analyzing its stability
can be complex. Fuzzy PID controller can improve the
performance of a linear PID controller, but is more complex B. Kinematic-chain diagram
to implement and analyze its stability. Classical adaptive con- The kinematic chain of the mobile manipulator is devel-
troller enables asymptotic tracking error but has an associated oped according to the Denavit-Hartenberg(DH) procedure.
ECE 780, Robot Dynamics and Control, University of Waterloo, Spring 2022 2
Following conditions are to be satisfied, for employing the • The Y -axis shall be oriented according to the right hand
DH method for kinematic and dynamic modeling: rule
• The robot has to be considered as a manipulator with The DH parameters for the modified kinematic chain
chain of ‘n’ links of the mobile robot manipulator was used to compute the
• The ‘n’ link robot shall have ‘n − 1’ joints with each Manipulator Jacobian J. The DH parameter is tabulated in
of the joints having one DOF. the table shown below.
• Every joint DOF shall be either prismatic or revo-
TABLE I
lute.Thus the joint variable, qi shall either be angle of
DH PARAMETERS
rotation θi , in case of a revolute joint and displacement
of the joint, and di , if the joint is revolute. Joint αi θi ai di
( π
θi if joint i is revolute 1 2
0 0 d1
qi = (1)
di if joint i is prismatic 2 π π
0 d2
2 2
(
0 if joint i is prismatic
Jω i = h i (5)
Ri0 −1 · 0 0 1 T
if joint i is revolute
D. Dynamic modelling And,in this study, the regressor matrix Y is computed using
The dynamic model for any ‘n’ link serial manipulator is the pseudo-inverse of vector θ, as Y = τ · θ† instead of
of the form [5]: using equation(11), to increase the speed of computation.
Note:The parameters of the first two virtual links are not
M(q)q̈ + C(q, q̇)q̇ + g(q) = τ (7) considered as they are assumed to have zero mass.
where,
When external force is acting on the mobile manipulator
τ ∈ Rn is the control torque and forces vector
system, the dynamics have to be modified as:
q ∈ Rn is the vector of joint translations and rotation angles
q̇ ∈ Rn is the joint velocity vector
q̈ ∈ Rn is the vector of joint acceleration M(q)q̈ + C(q, q̇)q̇ + g(q) − J T F = τ (12)
M (q) ∈ Rnxn is the inertial matrix
where F ∈ R3x1 is a vector of force acting on the end
C(q, q̇)∈Rnxn is the matrix of Coriolis and Centrifugal force
effector.
components
g(q) is the vector representing the gravitational forces
In this study, following assumptions and considerations E. PD controller with Gravity Compensation Design
are made, while computing the dynamic model in order to The control law of the PD controller for controlling the
reduce the computational complexity. dynamic model is given as [6] [5] :
• The effect of viscous friction in the dynamics is negli-
gible τ = Kp · q̃ + Kd · q̃˙ (13)
1
• The inertia values, Ii are one dimensional,i.e Ii ∈ R
• Motor mass is neglected and only masses of the links
Where
are considered Center of mass of all the links Li are τ is the torque as a control input
considered to be at the midpoint of the link, Kp ∈ Rn×n is the positive definite matrix for proportional
i.e Lci = Li /2, with the exception of COM of link 3 gain for ’n’ DOFs
considered at the joint 3, as the joint 3 is at the COM Kp ∈ Rn×n is the positive definite matrix for derivative
of the mobile base. gain for ’n’ DOFs
The dynamic model equation (7) is used in this study
As the mobile manipulator is vertically erect, the gravita-
to control the joint space of the robot. The end effector
tional forces might add to the tracking error.Thus the effect of
position is ultimately controlled by converting task space
gravitational forces is compensated by the modified control
configuration i.e the end effector positions to joint space
law of the PD controller as shown in eqn (14).
using inverse kinematics as shown below:
qk = qk−1 + αk J −1 (qk−1 ) (xd − f (qk−1 )) , k = 1, 2, . . . τ = Kp · q̃ + Kd · q̃˙ + g(q) (14)
(8)
where αk > 0 is the step size for the iterations of the where g(q) ∈ Rn is the vector of gravitational forces
equation (12) , till the desired error between the xd and In this project, the Kp and Kd matrices are assumed to
x = f (qk−1 ) is achieved. be a positive diagonal matrix multiplied by a scalar term as
Though the dynamic model explained above in the equa- shown below:
tion (7) can be used for PD joint controllers, the classic Kp = k · I n×n (15)
adaptive controllers need the vector of uncertain parameters
θ ∈ Rm , which have every components as a function of
uncertain link mass, length and inertia. Kd = p · I n×n (16)
For any q,q̇ ∈ Rm , θ ∈ Rm is related with the control force
Where, k ∈ R and p ∈ R
vector τ ,as shown below:
The control schematics of the PD controller with gravity
τ =Yθ (9)
compensation is shown in Fig.3 below.
where, Y ∈ Rnxm is the regressor matrix,whose matrix
elements are given by:
∂τi
Yij = (10)
∂θj
I is the row number of the matrix Y and vector τ , J is the
row number of the vector θj
In this study, 8 uncertain parameters are considered in the
τ vector,given as shown below, as utilized in [1]
Fig. 3. Control scheme of PD + G controller [6]
T
θ = m1 m2 m3 m4 I1 I2 I3 I4 (11)
ECE 780, Robot Dynamics and Control, University of Waterloo, Spring 2022 4
Fig. 5. Joint torque plots for (a) Kp = 6, PD +G controller (b) Kp = 30, PD +G controller (c) Kp = 6,Classic Adaptive controller (d) Kp = 30,Classic
Adaptive controller.
undershoots were observed in the amplitude of the joint is better in noise reduction compared to that of a P D
torques and joint forces in this case. controller with gravity compensation.
When the proportional gain is increased to Kp = 30
For the same P D controller, when the proportional gain for the classic adaptive controller, undershoots with large
is increased to Kp = 30, with the same derivative gain oscillations were observed for joint1 force. Joint2 also had
Kd = 8, undershoot of the torque amplitudes occurred for undershoots, but without oscillation of the torque amplitude
joints1 and joint2 and overshoots of different degrees with respect to time. No other joints had overshoots and
were observed for the other four joints. These undershoots undershoots.
and overshoots are due to insufficient derivative gain for Based on the above discussion, it is inferred that choosing
the proportional gain selected. In other words, the damping relevant and optimal Kd for Kp is needed to avoid overshoots
ratio would have to be increased or decreased to avoid the and over damping. However, selecting different Kp and Kd
overshoots and undershoots respectively. However,by doing values for different joints is needed to solve the overshoots
so, the overshoots and undershoots for all the joint torques and undershoots all at once, which demands automated PD
could not be avoided, as the Kp and Kd for all the joints tuning. The prevention of these overshoots and undershoots
are the same, according to equation 15 , 16. This shows of the joint torque as a control input is crucial, as the same
that each of the joints should have different proportional would lead to oscillation of the control response.
and derivative gains to prevent overshoot and undershoots Other than the above observations and inference, increase
of the in Kp is found to improve the error convergence rate. This
could be observed when comparing Fig. 5(a) and Fig.5 (b),
where the torque magnitude of most of the joints reach zero
joint torques for all the joints. In the case of classic adaptive faster for Kp = 30, when compared to Kp =6.
controllers, proportional gain Kp = 6 and derivative gain
Kd = 8 lead to smooth curves of torque with respect to time
steps and no noises were observed for this case. A very B. Joint Configuration Error Plots
mild undershoot of the joint 1 torque amplitude was noted. In this subsection, the effect of Kp and Kd on the joint
When comparing the torque plot results of classic adaptive angle error for the P D(gravity compensated) and classic
controller with PD controller Kp = 30, it is observed that adaptive controllers are investigated.The comparison of the
the initial torque input noises of joint1, joint5 and joint6 joint configuration errors for the scenarios as listed below
are eliminated. This infers that the classic adaptive control are shown in the Fig. 6:
ECE 780, Robot Dynamics and Control, University of Waterloo, Spring 2022 6
Fig. 6. Joint configuration error plots for (a) Kp = 6, PD +G controller (b) Kp = 30, PD +G controller (c) Kp = 6, Classic Adaptive controller (d) Kp
= 30,Classic Adaptive controller.
were smooth without much of the noises. However mild • uncertain external forces to assess the performance of
noises were observed for the joints5 and joint6 , for the the chosen controllers in terms of tracking error
time steps from 0 to 10.This plot is shown in Fig. 6 (a). • error convergence rate of controllers
The noise in the torque of these joints (as discussed in the • robustness to uncertain external forces
subsection III-A) could be the reason for these mild noises. The plot has log||xd − x|| as Y -axis ,which varies in
Increase in proportional gain to Kp = 30 for the same P D accordance with the time steps in the X -axis.
controller results in joint configuration error oscillations as The end effector position error plots were compared be-
shown in 6 (b). This is attributed by the increase in Kp with tween the PD controller and classical adaptive controller for
insufficient Kd . However, the convergence rate was observed four scenarios as mentioned below:
T
to be quicker than the PD controller with Kp = 6.This is
• Kp = 30, F = 0 0 0
based on the observation that the joint configuration error
• Kp = 30, F = 0 0 −4.95 N
T
reaches closer to zero in the 150th time step for Kp = 30 T
• Kp = 30, F = 0 0 0
as shown in Fig. 6 (b), whereas the error was not converged T
at the same time step for PD controller with Kp = 06 ,as • Kp = 60, F = 0 0 −4.95 N
depicted in Fig. 6 (a) . For all the four plots shown in 7, the tracking error of
ECE 780, Robot Dynamics and Control, University of Waterloo, Spring 2022 7
Fig. 7. End effector error plot for (a) Kp = 30, uncertain mass =0 kg (b) Kp = 60, uncertain mass =0 kg (c) Kp = 30, uncertain mass =0.5 kg (d) Kp
= 60, uncertain mass =0.5 kg
the PD controller (gravity compensated) is observed to be of the robustness of the controller considered is shown in
lower than the classical adaptive controller. Whereas, the equation (25).
convergence rate of the classic adaptive controller in all the
four cases is higher than that of the P D controller with (xc − xuc )
R= (25)
gravity compensation. Moreover, the P D controller is found xc
to have greater oscillations of the tracking error,whereas the
where,
classic adaptive controller has fewer oscillations and curves
R is the robustness measure
flatten sooner.
xc is the L2 norm error in certain conditions (when the
It is also observed that for an increase in external uncertain uncertain force F = [0 0 0]T )
force from 0 to 4.95 N in −Z direction, there is an increase xuc is the L2 norm error in uncertain conditions(when the
in permanent tracking error irrespective of the controller uncertain force acting is not a zero vector)
type.Similar observation was found in one of the reference
papers[2], where the controllers had a permanent tracking Based on the above equation robustness for the classical
error due to effect of gravitational force. Thus, this result adaptive and P D controllers for different proportional gains
once again acknowledges that the external forces contribute are computed and plotted in the Fig. 8 shown below.The
to permanent tracking error of the PD and classic adaptive figure has two plots and each of the plots are the robustness
controllers. for uncertain external force magnitudes of 2.45 N and 4.9
Moreover, the increase in proportional gain Kp is found N respectively. For the cases with no uncertain forces or
to reduce the tracking error. The same is observed while disturbances, the robustness of the controllers are considered
comparing the Fig. 7 (c) with Fig. 7 (d) , wherein the tracking to be 100%.
error for adaptive controllers was found to be approximately From the plots for robustness of the controllers as shown
-2.5 for Kp = 30 and -3 for Kp = 60. in Fig. 8 (a) and Fig. 8(b), the robustness is found to increase
The robustness of the P D with gravity compensation linearly with increase in the proportional gain. Moreover, the
and classical adaptive controllers are compared using the robustness decreases with increase in the external uncertain
robustness plots in the Fig. 8 as shown below. input or disturbances, which is the unknown object mass in
For this study, robustness is considered as a quantitative the end effector.
measure, which is defined as a ratio of change in tracking Based on the above plots, the robustness of the P D
error to the tracking error without uncertainty. The equation controller with gravity compensation is higher than that of
ECE 780, Robot Dynamics and Control, University of Waterloo, Spring 2022 8
Fig. 8. Robustness plot between PD+G and adaptive for (a) Uncertain Mass = 0.25 kg, (b) Uncertain Mass = 0.5 kg
the classical adaptive controller.Though, the classic adaptive controller for the 6-DOF mobile manipulator chosen in this
controller was expected to perform better than the P D study.
controller, the result obtained is counter-intuitive . In order to
TABLE II
investigate this , one extra simulation test was run changing
S UMMARY OF CONTROLLER PERFORMANCES
the value of the regressor matrix Y and applying the same
in the classic adaptive controller. For the chosen uncertain
Controller Tracking Error Robustness
parameters, the regressor matrix Y was computed as shown error Conver-
in equation(10), and compared with computation using the gence
pseudo-inverse of the vector θ . The tracking error obtained is PD+G controller Low Low High
found to vary drastically, according to the change in the mag- Classical Adaptive Controller High High Low
nitude of the components in the regressor matrix. Moreover,
it was computationally complex to find the regressor matrix
Y for the chosen theta parameters, for this 6-DOF robot. IV. C ONCLUSION
Thus, in this study, the inaccuracy of the regressor matrix
In this study, the performance of the Proportional Deriva-
parameters is found to contribute to the classic adaptive
tive controller with gravity compensation is compared with
controller being less robust than the PD controller (gravity
the performance of the classic adaptive controller for a pick-
compensated).
The Fig. 9 below shows the trajectory followed by the end and-place 6-DOF mobile manipulator, to study the effect of
effector to reach the desired end effector position. Though the uncertain mass of the object picked on the controller
the tracking error and convergence rate of the classic adaptive performances.
controller and the P D controllers vary between each other, Both the PD + G controller and classic adaptive controllers
a similar trajectory was followed by both of the controllers. were found to have a constant tracking error, which is due
to the uncertain mass acting as a weight on the end effector
in −Z direction. PD + G controller was simpler and faster
to implement than the classic adaptive controller. This is
attributed to the computation time of the regressor matrix
Y for a 6-DOF mobile manipulator. Though the rate of error
convergence was faster for the classic adaptive controller, the
PD + G controller has smaller tracking error when compared
to the classic adaptive controller, which was quite a counter-
intuitive result. However, the high sensitivity of the tracking
error for smaller inaccuracies in the Y regressor matrix is
the reason for a higher tracking error in the classic adaptive
controller.
Since robustness is considered as the relative measure of
error in uncertain conditions with respect to the error in
Fig. 9. Trajectory Followed by the End Effector and the Mobile Base to
reach the desired End Effector Position. certain conditions, PD + G controller found to be more
robust than the classic adaptive controller , in this study.
The table shown below summarizes the performance com- Apart from the above conclusions,increasing the proportional
parison of the adaptive and P D controller (gravity compen- gain reduced the tracking error, and increased the error
sated) relative to each other.Based on the following summary, convergence rate and robustness of the MRM irrespective
the P D controller performs better than the classical adaptive of the controllers chosen. However, a wise choice of the
ECE 780, Robot Dynamics and Control, University of Waterloo, Spring 2022 9
R EFERENCES
[1] M. Boukattaya, T. Damak, M. Jallouli, Robust adaptive control for
mobile manipulators, International Journal of Automation and Com-
puting 8 (1) (2011) 8–13. doi:10.1007/s11633-010-0548-y.
URL http://link.springer.com/10.1007/
s11633-010-0548-y
[2] T. Žilić, J. Kasać, M. Essert, B. Novaković, Ž. Šitum, Performance
comparison of different control algorithms for robot manipulators,
Strojarstvo: časopis za teoriju i praksu u strojarstvu 54 (5) (2012) 399–
407.
[3] C. López-Franco, J. Hernández-Barragán, A. Y. Alanis, N. Arana-
Daniel, M. López-Franco, Inverse kinematics of mobile manipulators
based on differential evolution, International Journal of Advanced
Robotic Systems 15 (1) (2018) 1729881417752738.
[4] B. Siciliano, L. Sciavicco, L. Villani, G. Oriolo, Differential kinematics
and statics, Robotics: Modelling, Planning and Control (2009) 105–160.
[5] M. W. Spong, S. Hutchinson, M. Vidyasagar, Robot modeling and
control, John Wiley & Sons, 2020.
[6] B. Siciliano, L. Sciavicco, L. Villani, G. Oriolo, Motion control,
Robotics: Modelling, Planning and Control (2009) 303–361.