Download as pdf or txt
Download as pdf or txt
You are on page 1of 10

See discussions, stats, and author profiles for this publication at: https://www.researchgate.

net/publication/303011456

Going beyond rigid manipulators – A review of control of flexible robotic arms

Conference Paper · April 2016

CITATIONS READS

3 1,316

5 authors, including:

Hafiz Muhammad Wahaj Aziz Jamshed Iqbal


Technische Universität München University of Hull
3 PUBLICATIONS   7 CITATIONS    131 PUBLICATIONS   2,217 CITATIONS   

SEE PROFILE SEE PROFILE

Some of the authors of this publication are also working on these related projects:

Human robot collaboration in cyber physical production systems View project

Educational Robotic Platforms View project

All content following this page was uploaded by Jamshed Iqbal on 13 May 2016.

The user has requested enhancement of the downloaded file.


Going Beyond Rigid Manipulators – A Review of
Control of Flexible Robotic Arms

Hafiz Muhammad Wahaj Aziz, Ifrah Maqsood, Malik Wajahat, Aamir Arslan Afzal, Jamshed Iqbal
Department of Electrical Engineering,
FAST National University of Computer and Emerging Sciences (FAST-NU), Islamabad. Pakistan
Corresponding author: jamshed.iqbal@nu.edu.pk

Abstract— Robots are now an integral part of automation the robotic arm such as increased settling time, especially at
sector, thus indicating the importance of the associated control the end point. The control algorithms of rigid manipulators
strategies. In contrast with conventional rigid manipulators, are insufficient when it comes to flexible manipulators. Thus
flexible arms offer several benefits in terms of light weight and special algorithms must be developed to cater for flexibility
power efficient structure, safe operation due to reduced inertia, in the robotic arms, and these algorithms can be complex,
low manufacturing cost and faster movements. The present considering that the system is non-linear.
paper systematically reviews the key linear as well as non-
linear techniques to control flexible manipulators. Flexibility in
link as well as in joint is discussed highlighting the control
challenges. It is anticipated that this in-depth study will be
potentially beneficial for researchers, control engineers and
industrial interns.

Keywords—Robotics; Flexible Robotic Arm; Control


Techniques.

I. INTRODUCTION
A robot is defined as an electro-mechanical system,
designed to perform specific tasks, with speed, accuracy and Fig.1: A manipulator performing spot welding task [51]
precision [1]. They come in various shapes and sizes, and for The remainder of the paper discusses the various
various tasks and functions. Application areas of robots possibilities when it comes to control of flexible robotic
include but not limited to; medical [2-6], space [7-9], manipulators. Section II explains the details and
industry [10-12], nuclear power plants [13], underwater [14, categorization of flexible robotic arm, while Section III
15] and for target tracking [16, 17]. In medical, they find presents the various control techniques for flexible robotic
potential for rehabilitation [18-20], motion assistance [21- arms available. Section IV and V explain the Linear and
25], cognition [26, 27] etc. The locomotion system of robots Non-Linear control techniques respectively. Finally Section
is usually based on links [28], legs [29] and wheels [30-35]. VI presents some comments and conclusions.
Tremendous research is being carried out in relevant
domains including robot modelling [36-39] and control [40] II. FLEXIBLE ROBOTIC ARMS
[41-48]. One very common function performed by modern An arm consists of two parts. There are joints which
robots, is manipulation of objects in their surroundings [1]. act as pivots of rotation, connected together with links [36].
In general, these manipulators resemble human arms and A single robotic arm may have multiple joints and links.
have multiple Degree of freedom (DOF) [49]. Figure 1 Flexibility in robotic arms can be simulated in two ways:
shows a 6 DOF manipulator performing a spot welding task
on an automobile body in an automotive robotized site [50]. A. Flexible Link
Robotic manipulators can be further categorized as A flexible link is the produced when the armature of
rigid or flexible. Most robotic manipulators are designed the robotic arm is able to bend with force. This can be
with steel or aluminum frames for increased tensile strength. brought about the material used for the armature’s
The result are rigid robotic arms, which are heavy and construction, such as plastic or carbon-fiber or it can be
immobile. With advances in material technology, robotics, produced unintentionally by lengthening a rigid armature,
and the increasing demand of lightweight and portable which, when long enough, starts to exhibit properties of a
robotic arms, have been the catalyst for research in the flexible arm [52]. Figure 2 illustrates a simulation benchmark
design and control of flexible robotic manipulators. with a flexible link module, developed by Quanser.
Flexibility comes from the use of plastic or carbon-fiber
frames, which significantly reduces the cost of
manufacturing and the power consumption of the system.
But with flexibility come a varying degree of inaccuracies in
The PID controller consists of a form of phase
lead-lag compensator having one pole at origin and one pole
at the infinity. A PID controller can also be split into two
parts, namely the PI and PD controllers, where the PI
controller is a form of phase-lag compensator and the PD
controller is a form of phase-lead compensator. A standard
PID controller is also known as a “three-term” controller,
whose transfer function is given by (1):
Fig. 2: Flexible Link by Quanser [53] (1)
G(s)= + +
B. Flexible Joint
A flexible joint is produced when the robotic arm Tuning a PID controller appears to be conceptually
allows it’s armature to bend at the pivot. This action can be intuitive, yet can be tough in practice if multiple objectives
produced by cushioning the armature with springs attached such as short transient and substantial stability are to be
to the base of the arm [54]. Figure 3 shows a similar achieved [56]. Initially the properties of PID frequency are
simulation benchmark to that shown in Figure 2, with a analyzed. Then according to the results, a PID controller is
flexible joint module, also developed by Quanser. designed that bridges the relation among the proportional
gain (Kp), the integral gain (Ki), and the derivative gain
(Kd),with the characteristics of closed loop feedback. This
relationship is helpful in adjusting the values of PID
parameters according to the response of closed system [57].
Table 1 illustrates the PID controller parameters and their
effect on system.

Table 1: Control parameters for PID


Over Settling Steady state
Rise Time
shoot time error
Small
Fig. 3: Flexible Joint by Quanser [55] KP Reduce Increase Reduce
change
III. CONTROL TECHNIQUES Small Small
KI Reduce Reduce
change change
There are numerous control techniques used to
KD Reduce Increase Increase Eliminate
control robotic arm systems. These systems are first
modeled and then control techniques are applied on these
PID control technique can also be used with other
designed models. There are two types of control techniques:
control techniques, such as the Fuzzy Logic Control. These
Linear and Non-Linear.
two control techniques can be used in a combination to get a
A. Linear Control more reliable and stable system, as well as to improve the
The most commonly used linear control techniques overall efficiency and system performance [58].
are Proportional Integral Derivative (PID) and Linear Another important and very common technique
Quadratic Regulator (LQR). PID is the technique most used for linear control of robotic arm systems is the LQR.
commonly used in industry nowadays, because of simplicity The reason for the popularity of LQR is that in many
and its stability. Figure 4 represents the PID control scheme designs the quadratic cost must be minimized. However
being applied on robot. minimizing cost is not the only objective. There are many
other design goals, and the problem is that by decreasing
cost without considering other specifications would not
necessarily result in a suitable controller. To have a
satisfactory controller each performance specification
should be given equal and explicit consideration. LQR
provides a way to express many objectives as integral
quadratic cost thus gives multiple objectives the required
consideration need [59]. Since LQR deals with cost
reduction, the designers can decide which factors are more
important in a control scheme, to get a proper transient or
steady-state response. Another advantage of the LQR
controller is that it has a property of phase margin, which is
greater than 60 and an infinite gain margin. These properties
Fig. 4: Control scheme of PID [54] are useful in many applications of power electronics.
However it cannot deal with systematic uncertainties like µ- Sliding mode control [65] is another method that
synthesis and H∞ [60]. This technique is used for forces the system trajectories to constrain to the sliding
suppressing the vibrations as well as for reference tracking. surface, which is in fact the normal behavior of the system.
When comparing a control scheme based on LQR and The system invariance properties would be observed during
another based on LQR with PID, a significant amount of the sliding phase known as chattering. It can excite
vibrations were reduced when PID was used along with undesirable high frequency dynamics. The chattering can be
LQR. However in case of tracking the response both LQR reduced by combining it with the fuzzy logic controller.
and LQR with PID showed similar results [61]. At times For a system consisting of cascaded subsystems,
the back stepping control technique [66] is used. As an
LQR can also be used with a robust compensator to design a
example, the spacecraft kinematics and dynamics form a
LQR Robust Controller for the plant. Such a model would
cascaded system as shown in Figure 6. The vector ‘ω’ is a
have contain a nominal feed forward controller, an LQR pseudo input vector, whereas the input ‘u’ is the real control
controller and a robust compensator. Such techniques are input. The back stepping approach determines how to
helpful in controlling a plant that have both linear and stabilize q using ω and then, how ‘u’ should derive ‘ω’ in
nonlinear disturbances. The linear disturbances would be order to stabilize ‘q’.
removed using LQR and nonlinear disturbances would be
deal with robust controller [62].

B. Nonlinear Control
A lot of research has recently been done, to control
the nonlinearity of the systems, especially in the field of
robotics [63]. Some of the methods of nonlinear control are
described here.
Fuzzy logic control (FLC) system design [64]
consists of pre and post processing of control inputs and
outputs respectively. FLC consists of four components Fig. 6: Spacecraft system and back stepping controller [66]
shown in Figure 5; a Fuzzification interface which converts
the inputs to the information, which can be used by the
interface mechanism to apply rules, a De-Fuzzification IV. CONTROL OF FELXIBLE ARM BASED ON LINEAR
interface that converts the results of the interface mechanism The linear techniques are the easiest as compared to
to the actual inputs for the process, and the Rules-Base that the non-linear techniques but linear techniques are not as
contains the set of ‘if-then’ rules to achieve good control. accurate as non-linear.
The main focus of this paper was on the rule base of the
A. Proportional Derivative Controller
controller. The rules are set based on the experience of the
human expert. The performance of the controller is directly This controller is used to control the position and
related to the quality and detail of the loaded rules, as vibrations of the flexible arm. This PD Controller was used
decisions are based on the given rules. The feedback along with an algorithm known as Simple Genetic
( ) is used to for the decision making process and Algorithm (SGA). The results show that it gives high
the ( ) is calculated using (2). accuracy along with faster convergence [67]. Figure 7
shows the improved GA control scheme.
( )= _ ( ) – ( ) (2)

Fig. 7: The feedback control scheme based on improved GA


[67]

B. Adaptive Control
Adaptive Control is the combination of control
Fig. 5: Fuzzy logic controller architecture [64] theory and system identification theory. Control theory
helps in attaining the required response of a system, while joint manipulator as shown in Figure 9. Two state variables
system identification theory helps in finding out the are utilized, one at each side of the manipulator. In this
unknown parameters of the system [68]. approach first the equations of motion are written then the
state variables are calculated, then the equations are
C. End Point Control
linearized. The Uncertainty and Disturbance Estimator
Park and Asada worked on how to minimize the technique [75] is used to estimate the disturbances and make
sensor/actuator distance in order to have a minimum phase the feedback linearization based controller strong.
end point control. It was previously found that in many
robotic applications, due to flexibility the sensors are not
collocated with the actuators which results in the non-
minimum phase system. To change the location of torque
application point, a transmission mechanism was attached
along the arm [69].

D. Joint Control
To control the tip position of a flexible arm,
Goldenberg had made a feed-forward controller along with
feedback PD controller. The feed-forward method cancels
the pole-zero of the dominant closed loop poles of the
system and the feedback minimizes any error in the joint
variable [70]. Another controller is used which focuses on Fig. 9: Single link robot manipulator with flexible joint [74]
end point control of single flexible link. The model was
derived using the Lagrange method, which was based of In another research, the sliding mode controller is
Euler-Bernoulli Theory. Voltage being the input is added to designed for flexible joints based on Genetic Algorithm
the controller and the position and the trajectory is (GA) [76] and Input Estimation approach (IE) [77]. The IE
controlled using PID controller [71]. approach measures the disturbance in the torque without
A controller known as Generalized Proportional using the torque sensor based on Kalman Filter (KF) and
output feedback controller was used to control the behavior Recursive Least Square Estimator (RLSE) method. Tuan et
of an uncertain flexible robotic arm. This controller had a al. [78] proposed IE approach in 1996 and it has
fast on-line closed loop identification method [72]. Another successfully solved the induction heat [79, 80] and many
approach for controller known as trajectory tracking other problems. The GA is used to search the optimal
approach is used for end point trajectory control of flexible controller design parameters for SMC.
manipulator, which was based of model predictive control. Another approach which is presented which is the
This approach was actually used to minimize the measured fuzzy PID controller [81]. Fuzzy logic controller is used
lag inflexible manipulators. The manipulator’s dynamics with PID to change the gains of the controller based on the
were used to derive the model and a special prediction inputs. So the PD + I gains are the nonlinear functions of the
strategy was adopted in order to predict the robot’s future input signals and have self-tuned capability performance
behavior with a delayed feedback [73]. Figure 8 illustrates [82, 83]. In this approach only four If-Then rules are used
how the controller works along with the predictive model. for each PD and I. These rules are generic and
mathematically rigorous and can be used for other systems.
The conventional PI controllers are less efficient than SMC
[84] as, PI is a linear technique and does not guarantee the
convergence of error to zero.
Some other techniques have also been deployed to
minimize the effect of flexible joint in the real world
applications. For example, the back stepping approach [85]
in which the actuator dynamics (brushed DC motor) are also
taken into account. This control law is to cope with the
Fig. 8: General Model Predictive Control Scheme [73] difficulties introduced by cascade structure and to achieve
the stability. In other researches [86, 87], dynamic model of
V. CONTROL OF FELXIBLE ARM BASED ON NON-LINEAR the flexible joint robot is derived using Lagrange method.
The nonlinear techniques for both flexible link and The vibration properties of the robot were studied using
flexible joint applications are described in this section. numerical simulations, and it was concluded that the
dynamic model can represent the joint flexibility and
A. Flexible joint robotic arm control vibrations at the end-effector caused by the flexible joints.
The feedback linearization based controller
presented in [74] is used to control the single link flexible
B. Flexible link robotic arm control efficient towards uncertainties and random errors. So the
Dynamic models [88, 89] of flexible link robotic systems would be more reliable, precise, accurate and robust
arm have been derived using different approaches. The in terms of uncertainties and change in plant parameters.
dynamic models of single link flexible arm [88] as shown in
REFERENCES
Figure 10 are derived using the assumption that the link
weight is concentrated at the tip. These models are useful in
the analysis and design of closed loop control system for tip [1] S. A. Ajwad and J. Iqbal, "Emerging trends in
positioning. robotics – A review from applications perspective,"
in International Conference on Engineering and
Emerging Technologies (ICEET), 2015.
[2] A. A. Khan, R. U. Nabi, and J. Iqbal, "Surface
estimation of a pedestrian walk for outdoor use of
power wheelchair based robot," Life Science
Journal, vol. 10, pp. 1697-1704, 2013.
[3] I. Muhammad, K. Ali, J. Iqbal, and A. R. Raja,
"Regulation of hypnosis in Propofol anesthesia
administration based on non-linear control
strategy," Brazilian Journal of Anesthesiology (In
Press), 2016.
[4] J. Iqbal, Hand exoskeleton robotic systems: Role
Fig. 10: Single link robot manipulator with flexible link [88] and deriving the design requirements: LAP
LAMBERT Academic Publishing, 2012.
Many control algorithms have been proposed to [5] J. Iqbal and K. Baizid, "Stroke rehabilitation using
deal with the flexible link robotics arm. A Nonsingular exoskeleton-based robotic exercisers: Mini
Terminal Sliding Mode (NTSM) controller [90] for a two review," Biomedical Research, vol. 26, pp. 197-
link flexible manipulator, based on GA and FLC is 201, 2015.
proposed. In this approach, the whole system is divided into [6] J. Iqbal, N. Tsagarakis, A. E. Fiorilla, and D.
input-output subsystem and a zero dynamic subsystem. Caldwell, "Design requirements of a hand
NTSM is used to ensure that the system converges to its exoskeleton robotic device," in 14th IASTED
equilibrium and the FLC is used to minimize the chattering International Conference on Robotics and
effect of NTSM. The zero dynamics are stabilized using Applications, 2009, pp. 44-51.
GA. [7] J. Iqbal, S. Heikkilä, and A. Halme, "Tether
In another research [91], an adaptive fuzzy tracking and control of ROSA robotic rover," in
controller is used to overcome the defects of the 10th IEEE International Conference on Control,
conventional control methods. It utilizes the neighborhood Automation, Robotics and Vision, 2008, pp. 689-
clustering algorithm, the inverse system theory and the 693.
variable regressive algorithm. This system is useful for [8] J. Iqbal, M. Rehman-Saad, A. Malik, and A.
nonlinear control of a multilink flexible robotic arm, and can Mahmood-Tahir, "State estimation technique for a
suppress the overshoot, undershoot and vibrations of the planetary robotic rover," Revista Facultad de
arm during motion. Ingeniería Universidad de Antioquia, pp. 58-68,
In most of the models that have been developed 2014.
and described in this paper, the full effects of dynamic [9] J. Iqbal, R. U. Nabi, A. A. Khan, and H. Khan, "A
structural flexibility are neglected which results in error novel track-drive mobile robotic framework for
while tracking accuracy in transient and steady state. So the conducting projects on robotics and control
2nd order sliding model [92] is presented using the structural systems," Life Science Journal, vol. 10, pp. 130-
flexibilities effects for the set point and trajectory control of 137, 2013.
the system. This resulted in the improved performance and [10] K. Baizid, A. Meddahi, A. Yousnadj, R. Chellali,
precision. H. Khan, and J. Iqbal, "Robotized task time
scheduling and optimization based on Genetic
VI. CONCLUSIONS Algorithms for non redundant industrial
manipulators," in IEEE International Symposium
A review of major control techniques is presented for on Robotic and Sensors Environments, 2014, pp.
the control of both flexible joint and link robotic 112-117.
manipulators. It is identified that the combination of linear [11] J. Iqbal, S. A. Ajwad, Z. A. Syed, A. K. Abdul, and
and nonlinear control techniques produces accurate control R. U. Islam, "Automating industrial tasks through
results, For example, the parameters of PID controller can be mechatronic systems – A review of robotics in
assigned by the fuzzy controller to make it more robust. In
future, the control of robotic manipulators would be more
industrial perspective," Tehnički vjesnik - Technical of potential applications from medicine to
Gazette (In Press), 2016. entertainmen," Electronics Letters, vol. 51, p. 880,
[12] R. U. Islam, J. Iqbal, S. Manzoor, A. Khalid, and S. 2015.
Khan, "An autonomous image-guided robotic [25] J. Iqbal, N. Tsagarakis, and D. Caldwell, "Four-
system simulating industrial applications," in 7th fingered lightweight exoskeleton robotic device
IEEE International Conference on System of accommodating different hand sizes," Electronics
Systems Engineering, 2012, pp. 344-349. Letters, vol. 51, pp. 888-890, 2015.
[13] J. Iqbal and A. M. Tahir, "Robotics for nuclear [26] K. Naveed and J. Iqbal, "Brain controlled human
power plants — Challenges and future robot interface," in IEEE International Conference
perspectives," in 2nd IEEE International on Robotics and Artificial Intelligence, 2012, pp.
Conference on Applied Robotics for the Power 55-60.
Industry, 2012, pp. 151-156. [27] M. M. Azeem, J. Iqbal, P. Toivanen, and A.
[14] A. M. Tahir and J. Iqbal, "Underwarter robotic Samad, "Emotions in robots," in Emerging Trends
vehicles: Latest development trends and potential and Applications in Information Communication
challenges," Science International, vol. 26, 2014. Technologies, Communications in Computer and
[15] S. A. Ajwad and J. Iqbal, "Recent advances and Information Science, Springer-Verlag Berlin
applications of tethered robotic systems," Science Heidelberg ed, 2012, pp. 144-153.
International, vol. 26, pp. 2045-2051, 2014. [28] S. Manzoor, R. U. Islam, A. Khalid, A. Samad, and
[16] J. Iqbal, M. Pasha, Riaz-un-Nabi, H. Khan, and J. J. Iqbal, "An open-source multi-DOF articulated
Iqbal, "Real-time target detection and tracking: A robotic educational platform for autonomous object
comparative in-depth review of strategies," Life manipulation," Robotics and Computer-Integrated
Science Journal, vol. 10, pp. 804-813, 2013. Manufacturing, vol. 30, pp. 351-362, 2014.
[17] J. Iqbal, S. M. Pasha, K. Baizid, A. A. Khan, and J. [29] A. H. Arif, M. Waqas, U. ur Rahman, S. Anwar, A.
Iqbal, "Computer vision inspired real-time Malik, and J. Iqbal, "A hybrid humanoid-wheeled
autonomous moving target detection, tracking and mobile robotic educational platform – Design and
locking," Life Science Journal, vol. 10, pp. 3338- prototyping," Indian Journal of Science and
3345, 2013. Technology, vol. 7, pp. 2140-2148, 2015.
[18] J. Iqbal, N. Tsagarakis, and D. Caldwell, "Design [30] O. Ahmad, I. Ullah, and J. Iqbal, "A multi-robot
optimization of a hand exoskeleton rehabilitation educational and research framework," International
device," in Proceedings of RSS workshop on Journal of Academic Research, vol. 6, pp. 217-222,
understanding the human hand for advancing 2014.
robotic manipulation, 2009, pp. 44-45. [31] H. Khan, J. Iqbal, K. Baizid, and T. Zielinska,
[19] J. Iqbal, N. G. Tsagarakis, A. E. Fiorilla, and D. G. "Longitudinal and lateral slip control of
Caldwell, "A portable rehabilitation device for the autonomous wheeled mobile robot for trajectory
hand," in IEEE Annual International Conferenceof tracking," Frontiers of Information Technology and
Engineering in Medicine and Biology Society, Electronic Engineering, vol. 16, pp. 166-172, 2015.
2010, pp. 3694-3697. [32] R. U. Nabi, J. Iqbal, H. Khan, and R. Chellali, "A
[20] J. Iqbal, N. Tsagarakis, and D. Caldwell, "Human unified SLAM solution using partial 3D structure,"
hand compatible underactuated exoskeleton robotic Elektronika ir Elektrotechnika, vol. 20, pp. 3-8,
system," Electronics Letters, vol. 50, pp. 494-496, 2014.
2014. [33] M. Zohaib, S. M. Pasha, H. Bushra, K. Hassan, and
[21] J. Iqbal, N. Tsagarakis, and D. Caldwell, "Design J. Iqbal, "Addressing collision avoidance and
of a wearable direct-driven optimized hand nonholonomic constraints of a wheeled robot:
exoskeleton device," in 4th International Modeling and simulation," in International
Conference on Advances in Computer-Human Conference on Robotics and Emerging Allied
Interactions, 2011, pp. 23-28. Technologies in Engineering, 2014, pp. 306-311.
[22] J. Iqbal, O. Ahmad, and A. Malik, "HEXOSYS II - [34] M. Zohaib, S. M. Pasha, N. Javaid, and J. Iqbal,
Towards realization of light mass robotics for the "IBA: Intelligent Bug Algorithm – A novel strategy
hand," in 14th IEEE International Multitopic to navigate mobile robots autonomously," in
Conference, 2011, pp. 115-119. Emerging Trends and Applications in Information
[23] J. Iqbal, N. G. Tsagarakis, and D. G. Caldwell, "A Communication Technologies, Communications in
multi-DOF robotic exoskeleton interface for hand Computer and Information Science, Springer-
motion assistance," in IEEE Annual International Verlag Berlin Heidelberg ed, 2013, pp. 291-299.
Conferenceof Engineering in Medicine and [35] M. Zohaib, S. M. Pasha, N. Javaid, A. Salaam, and
Biology Society, 2011, pp. 1575-1578. J. Iqbal, "An improved algorithm for collision
[24] J. Iqbal, "A helping hand: A lightweight, flexible, avoidance in environments having U and H shaped
under-actuated exoskeleton hand with a wide range
obstacles," Studies in Informatics and Control, vol. [47] M. I. Ullah, S. A. Ajwad, M. Irfan, and J. Iqbal,
23, pp. 97-106, 2014. "Non-linear control law for articulated serial
[36] S. A. Ajwad, M. I. Ullah, R. U. Islam, and J. Iqbal, manipulators: Simulation augmented with
"Modeling robotic arms–A review and derivation hardware implementation," Elektronika ir
of screw theory based kinematics," in International Elektrotechnika, vol. 22, pp. 3-7, 2016.
Conference on Engineering & Emerging [48] J. Iqbal, M. I. Ullah, A. A. Khan, and M. Irfan,
Technologies 2014, pp. 66-69. "Towards sophisticated control of robotic
[37] M. I. Ullah, S. A. Ajwad, R. U. Islam, U. Iqbal, and manipulators: An experimental study on a pseudo-
J. Iqbal, "Modeling and computed torque control of industrial arm," Strojniški vestnik-Journal of
a 6 degree of freedom robotic arm," in IEEE Mechanical Engineering, vol. 61, pp. 465-470,
International Conference on Robotics and 2015.
Emerging Allied Technologies in Engineering, [49] S. Ajwad, M. Ullah, B. Khelifa, and J. Iqbal, "A
2014, pp. 133-138. comprehensive state-of-the-art on control of
[38] K. Baizid, R. Chellali, R. Yousnadj, A. Meddahi, J. industrial articulated robots," Journal of Balkan
Iqbal, and T. Bentaleb, "Modelling of robotized Tribological Association, vol. 20, pp. 499-521,
site and simulation of robots optimum placement 2014.
and orientation zone," in 21st IASTED [50] K. Baizid, A. Yousnadj, A. Meddahi, R. Chellali,
International Conference on Modelling and and J. Iqbal, "Time scheduling and optimization of
Simulation, 2010, pp. 9-16. industrial robotized tasks based on genetic
[39] J. Iqbal, R. U. Islam, and H. Khan, "Modeling and algorithms," Robotics and Computer-Integrated
analysis of a 6 DOF robotic arm manipulator," Manufacturing, vol. 34, pp. 140-150, 2015.
Canadian Journal on Electrical and Electronics [51] A. Meddahi, K. Baizid, A. Yousnadj, and J. Iqbal,
Engineering, vol. 3, pp. 300-306, 2012. "API based graphical simulation of robotized
[40] M. F. Khan, R. U. Islam, and J. Iqbal, "Control sites," in 14th IASTED International Conference on
strategies for robotic manipulators," in IEEE Robotics and Applications, 2009, pp. 485-492.
International Conference on Robotics and [52] R. L. Wells, J. K. Schueller, and J. Tlusty,
Artificial Intelligence (ICRAI), 2012, pp. 26-33. "Feedforward and feedback control of a flexible
[41] S. A. Ajwad, J. Iqbal, M. I. Ullah, and A. robotic arm," Control Systems Magazine, IEEE,
Mehmood, "A systematic review of current and vol. 10, pp. 9-15, 1990.
emergent manipulator control approaches," [53] Quanser. (10-3-2016). Quanser rotary Flexible
Frontiers of Mechanical Engineering, vol. 10, pp. link. Available:
198-210, 2015. http://www.quanser.com/products/rotary_flexible_l
[42] S. A. Ajwad, U. Iqbal, and J. Iqbal, "Hardware ink
realization and PID control of multi-degree of [54] İ. H. Akyuz, E. Yolacan, H. M. Ertunc, and Z.
freedom articulated robotic arm," Mehran Bingul, "PID and state feedback control of a single-
University Research Journal of Engineering and link flexible joint robot manipulator," in IEEE
Technology, vol. 34, pp. 1-12, 2015. International Conference on Mechatronics (ICM),
[43] U. Iqbal, A. Samad, Z. Nissa, and J. Iqbal, 2011, pp. 409-414.
"Embedded control system for AUTAREP - A [55] Quanser. (10-3-2016). Quanser rotary Flexible
novel AUTonomous Articulated Robotic joint. Available:
Educational Platform," Tehnički vjesnik - Technical http://www.quanser.com/products/rotary_flexible_j
Gazette, vol. 21, pp. 1255-1261, 2014. oint
[44] R. U. Islam, J. Iqbal, and Q. Khan, "Design and [56] A. Kiam Heong, G. Chong, and L. Yun, "PID
comparison of two control strategies for multi-DOF control system analysis, design, and technology,"
articulated robotic arm manipulator," Journal of IEEE Transactions on Control Systems
Control Engineering and Applied Informatics, vol. Technology, vol. 13, pp. 559-576, 2005.
16, pp. 28-39, 2014. [57] Z. Zhu, Y. He, J. Qi, J. Han, and T. Wang, "The
[45] S. A. Ajwad, M. Adeel, I. U. Muhammad, and J. analysis and synthesis of PID controller based on
Iqbal, "Optimal v/s Robust control: A study and closed loop response characteristics," in IEEE
comparison for articulated manipulator," Journal of International Conference on Robotics and
the Balkan Tribological Association (In Press), Biomimetics (ROBIO), 2012, pp. 1930-1936.
2016. [58] M. A. Ahmad, M. H. Suid, M. S. Ramli, M. A.
[46] S. A. Ajwad, J. Iqbal, A. A. Khan, and A. Zawawi, and R. M. T. R. Ismail, "PD Fuzzy Logic
Mehmood, "Disturbance-observer-based robust with non-collocated PID approach for vibration
control of a serial-link robotic manipulator using control of flexible joint manipulator," in 6th
SMC and PBC techniques," Studies in Informatics International Colloquium on Signal Processing
and Control vol. 24, pp. 401-408, 2015. and Its Applications (CSPA), 2010, pp. 1-5.
[59] A. E. B. Lim and Z. Xun Yu, "Stochastic optimal a flexible manipulator with parameter
LQR control with integral quadratic constraints and uncertainties," in IEEE International Conference
indefinite control weights," IEEE Transactions on on Robotics and Automation, 2007, pp. 3445-3450.
Automatic Control, vol. 44, pp. 1359-1369, 1999. [73] X. Wei and S. Liu, "Computational effective
[60] C. Olalla, R. Leyva, A. E. Aroudi, and I. Queinnec, predictive end-point trajectory control of flexible
"Robust LQR control for PWM converters: An manipulators with measurable feedback lag,"
LMI approach," IEEE Transactions on Industrial Research Journal of Applied Sciences. Eng.
Electronics, vol. 56, pp. 2548-2558, 2009. Technol, vol. 4, pp. 3875-3884, 2012.
[61] M. A. Ahmad, "Vibration and input tracking [74] A. Patel, R. Neelgund, A. Wathore, J. P. Kolhe, M.
control of flexible manipulator using LQR with M. Kuber, and S. E. Talole, "Robust control of
non-Collocated PID controller," in Second UKSIM flexible joint robot manipulator," in IEEE
European Symposium on Computer Modeling and International Conference on Industrial Technology
Simulation., 2008, pp. 40-45. (ICIT), 2006, pp. 649-653.
[62] H. Liu, G. Lu, and Y. Zhong, "Theory and [75] Q.-C. Zhong and D. Rees, "Control of uncertain
experiments on robust LQR attitude control of a 3- LTI systems based on an uncertainty and
DOF lab helicopter," in 30th Chinese Control disturbance estimator," Journal of Dynamic
Conference (CCC), 2011, pp. 2335-2340. Systems, Measurement, and Control, vol. 126, pp.
[63] C. C. Gava, R. F. Vassallo, F. Roberti, R. Carelli, 905-910, 2004.
and T. F. Bastos-Filho, "Nonlinear control [76] K. A. De Jong, "On Using Genetic Algorithms to
techniques and omnidirectional vision for team Search Program Spaces," in Proceedings of 2nd
formation on cooperative robotics," in IEEE International Conference on Genetic Algorithm
International Conference on Robotics and (ICGA), 1987, pp. 210-216.
Automation, 2007, pp. 2409-2414. [77] C.-Y. Ji, Y.-L. Lee, and T.-C. Chen, "Based on
[64] Y. Khemissi and A. Abdulwahab, "Control the genetic algorithm and input estimation approach to
robot movement by fuzzy logic controller," in design a sliding mode controller for flexible-joint
Second IEEE International Conference on robot control system," in IEEE 22nd International
Computer Engineering and Applications (ICCEA), Symposium on Intelligent Control (ISIC), 2007, pp.
2010, pp. 37-41. 481-486.
[65] W. A. Deabes and F. Areed, "Fuzzy sliding motion [78] P.-C. Tuan, C.-C. Ji, L.-W. Fong, and W.-T.
controller for six-degree-of-freedom robotic Huang, "An input estimation approach to on-line
manipulator," in 41st IEEE Southeastern two-dimensional inverse heat conduction
Symposium on System Theory, 2009, pp. 148-152. problems," Numerical Heat Transfer, vol. 29, pp.
[66] K.-S. Kim and Y. Kim, "Robust backstepping 345-363, 1996.
control for slew maneuver using nonlinear tracking [79] P.-C. Tuan and W.-T. Hou, "Adaptive robust
function," IEEE Transactions on Control Systems weighting input estimation method for the 1-D
Technology, vol. 11, pp. 822-829, 2003. inverse heat conduction problem," Numerical Heat
[67] S. Deif, M. Tawfik, and H. A. Kamal, "Vibration Transfer, Part B, vol. 34, pp. 439-456, 1998.
and position control of a flexible manipulator using [80] C. K. Ma, J. M. Chang, and D. C. Lin, "Input
a PD-tuned controller with Modified Genetic forces estimation of beam structures by an inverse
Algorithm," ed: ICCTA, 2011. method," Journal of Sound and Vibration, vol. 259,
[68] D. P. Magee and W. J. Book, "Control and control pp. 387-407, 2003.
theory for flexible robots:Active Control-Leading [81] H. A. Malki, D. Misir, D. Feigenspan, and G.
application of control theory. ," 計測と制御, vol. Chen, "Fuzzy PID control of a flexible-joint robot
32, pp. 309-317, 1993. arm with uncertainties from time-varying loads,"
[69] J.-H. Park and H. Asada, "Design and analysis of IEEE Transactions on Control Systems
flexible arms for minimum-phase endpoint Technology, vol. 5, pp. 371-378, 1997.
control," in American Control Conference, 1990, [82] H. A. Malki, H. Li, and G. Chen, "New design and
pp. 1220-1225. stability analysis of fuzzy proportional-derivative
[70] A. Goldenberg and F. Rakhsha, "Feedforward control systems," IEEE Transactions on Fuzzy
control of a single-link flexible robot," Mechanism Systems, vol. 2, pp. 245-254, 1994.
and Machine Theory, vol. 21, pp. 325-335, 1986. [83] H. Ying, W. Siler, and J. J. Buckley, "Fuzzy
[71] S. Mallikarjunaiah and S. N. Reddy, "Design of control theory: A nonlinear case," Automatica, vol.
PID controller for flexible link manipulator," 26, pp. 513-520, 1990.
International Journal of Engineering Research and [84] L. Zouari, H. Abid, and M. Abid, "Comparative
Applications, vol. 3, pp. 1207-1212, 2013. study between PI and sliding mode controllers for
[72] J. Becedas, J. R. Trapero, H. Sira-Ramírez, and V. flexible joint manipulator driving by brushless DC
Feliu-Battle, "Fast identification method to control motor," in 14th IEEE International Conference on
Sciences and Techniques of Automatic Control and
Computer Engineering (STA), 2013, pp. 294-299.
[85] N. Nasiri, H. Sadjadian, and A. M. Shahri,
"Voltage-based control of a flexible-joint
electrically driven robot using backstepping
approach," in 4th IEEE Power Electronics, Drive
Systems and Technologies Conference (PEDSTC),
2013, pp. 541-546.
[86] Y. Qiang, F. Jing, J. Zeng, and Z. Hou, "Dynamic
modeling and vibration mode analysis for an
industrial robot with rigid links and flexible joints,"
in 24th IEEE Chinese Control and Decision
Conference (CCDC), 2012, pp. 3317-3321.
[87] Y. Xu, Y.-h. Zhang, W.-h. Liu, X.-g. Duan, and L.
Gao, "Dynamics modeling and smooth control of
flexible robot joint," in IEEE International
Conference on Mechatronics and Automation
(ICMA), 2015, pp. 631-636.
[88] I. Payo, F. Ramos, O. D. Cortázar, and V. Feliu,
"Experimental validation of nonlinear dynamic
models for single-link very flexible arms," in 44th
IEEE Conference on Decision and Control,
European Control Conference (CDC-ECC), 2005,
pp. 5304-5309.
[89] D. L. Wang, Y. F. Lu, Y. Liu, and X. G. Li,
"Dynamic model and tip trajectory tracking control
for a two-link flexible robotic manipulator," in
Proceedings of the IEEE Conference on System,
Man and Cybernetics, 1996, pp. 1020-1024.
[90] X. Zheng, J. Platts, and Y. Feng, "Based on
Parameter Optimization and FLC Nonsingular
Terminal Sliding Mode Controller of a Two-Link
Flexible Manipulator," in IEEE International Fuzzy
Systems Conference, 2007, pp. 1-6.
[91] H. Liu, Y. Huang, W. Shi, and H. Xu, "Design of
adaptive fuzzy controller for flexible link
manipulator," in IEEE International Conference on
Industrial Technology (ICIT), 2008, pp. 1-4.
[92] A. Arisoy, M. K. Bayrakceken, S. Basturk, M.
Gokasan, and O. S. Bogosyan, "High order sliding
mode control of a space robot manipulator," in 5th
International Conference on Recent Advances in
Space Technologies (RAST), 2011, pp. 833-838.

View publication stats

You might also like