SlideShare une entreprise Scribd logo
1  sur  8
Télécharger pour lire hors ligne
Full Paper
                                                   ACEEE Int. J. on Control System and Instrumentation, Vol. 4, No. 1, Feb 2013



   Design and Implementation of Proportional Integral
   Observer based Linear Model Predictive Controller
       Vihangkumar V. Naik, D. N. Sonawane, Deepak D. Ingole, Divyesh L. Ginoya and Vedika V. Patki
                                 Department of Instrumentation & Control Engineering,
                                          College of Engineering, Pune- 411 005
                                                    Maharashtra, India
             Email: naikvihang@gmail.com, dns.instru@coep.ac.in, dingole21@yahoo.in, dlginoya007@gmail.com,
                                                 patki.vedika@gmail.com


Abstract—This paper presents an interior-point method (IPM)              fast response time and/or embedded applications where
based quadratic programming (QP) solver for the solution of              computational resource may be limited [4].
optimal control problem in linear model predictive control                    Recently, many reports in the literature address applying
(MPC). LU factorization is used to solve the system of linear            MPC to control applications with short sampling intervals,
equations efficiently at each iteration of IPM, which renders
                                                                         by adapting fast optimization algorithms. These algorithms
faster execution of QP solver. The controller requires internal
states of the system. To address this issue, a Proportional
                                                                         solve the resulting QP by exploiting the special structure of
Integral Observer (PIO) is designed, which estimates the state           the control problem the MPC sub problem. IPM approaches
vector, as well as the uncertainties in an integrated manner.            the solution of Karush-Kuhn-Tucker (KKT) equations by
MPC uses the states estimated by PIO, and the effect of                  successive decent steps. Each decent step is Newton’s like
uncertainty is compensated by augmenting MPC with PIO-                   step and the solution is obtained by solving system of linear
estimated uncertainties and external disturbances. The                   equations using appropriate numerical methods in order to
approach is demonstrated practically by applying MPC to QET              determine search direction. Matrix factorization approach
DC servomotor for position control application. The proposed             provides a means to simplify the computation involved in
method is compared with classical control strategy-PID
                                                                         linear solver. Different matrix factorization methods are used
control.
                                                                         such as Gauss elimination, QR, LU, and Cholesky [3], [5], [6].
Index Terms—Model Predictive Control, Interior-Point                          Model predictive control has received considerable
Method, LU factorization, DC Servomotor, Proportional                    attention driven largely by its ability to handle hard
Integral Observer.                                                       constraints. An inherent problem is that model predictive
                                                                         control normally requires full knowledge of the internal states.
                         I. INTRODUCTION                                 In the physical implementation of control strategy based on
                                                                         the system states, if the states are not available for
    This paper considers Interior-point algorithm used on-
                                                                         measurement then state feedback will not be the
line with Linear Model Predictive Control (MPC). Linear MPC
                                                                         implementable.
assumes a linear system model, linear inequality constraints
                                                                              The problem of robust control system design with an
and a convex quadratic cost function [1]. MPC can be
                                                                         observer based on the knowledge of input and output of the
formulated as a quadratic programming (QP) problem and
                                                                         plant has attracted many researchers now-a-days [7], [8], [9],
solved at each sampling interval. It thus has the natural ability
                                                                         [10], [11], [12], [20]. The observer proves to be useful in not
to handle physical constraints arising in industrial
                                                                         only system estimation and regulation but also identifying
applications [2].
                                                                         failures in dynamic systems. This requirement of obtaining
    At each sampling instance MPC solves an online QP
                                                                         the estimates of uncertainty, as well as state vector in an
optimization problem, computes the sequence of optimal
                                                                         integrated manner is fulfilled by PIO. PIO approach basically
current and future control inputs by minimizing the difference
                                                                         works when the system uncertainty varies slowly with respect
between set-points and future outputs predicted from a given
                                                                         to time. It is an observer in which an additional term, which is
plant model over a finite horizon in forward time. Then, only
                                                                         proportional to the integral of the output estimation error, is
the current optimal input is applied to the plant. The updated
                                                                         added in order to estimate the uncertainties and improve the
plant information is used to formulate and solve a new optimal
                                                                         system performance [7], [8], [9].
control problem at the next sampling instance. This procedure
                                                                              In this paper, we present an interior-point algorithm to
is repeated at the each sampling instance and the concept is
                                                                         solve MPC problem, which utilizes Mehrotra’s predictor-
called as receding horizon control MPC strategy. Since this
                                                                         corrector algorithm [13], and the linear system at each IPM
quadratic program can be large depending upon control
                                                                         iteration is solved by LU factorization based Linear Solver.
problem, MPC requires long computation times at each
                                                                         PIO is designed for state and uncertainties estimation. The
sampling instants, therefore it is usually restricted to systems
                                                                         remainder of the paper is organized as follows: section II
with slow dynamics and large sampling intervals, such as
                                                                         describes MPC problem formulation. Section III presents the
chemical processes [3]. The ability to solve the QP problem
                                                                         interior-point method. In section IV, the PIO theory is briefly
online become critical when applying MPC to systems with
© 2013 ACEEE                                                        23
DOI: 01.IJCSI.4.1.1064
Full Paper
                                                        ACEEE Int. J. on Control System and Instrumentation, Vol. 4, No. 1, Feb 2013


reviewed and applied for state and uncertainty estimation.                    where, N u is control horizon. The goal of the controller is to
Mathematical modeling of DC servomotor is derived in
Section V. IPM QP solver results, the effectiveness of observer                                                       ˆ
                                                                              make the difference between the output, y (t  N P ) and the
based MPC scheme with simulation results is presented in                      reference, yref (t  N P ) as small as possible. This can be
section VI. MPC implementation on Quanser QET DC
servomotor is presented in section VII.                                       defined by using a standard least squares problem.
                                                                              The objective function is defined as,
                  II. MPC PROBLEM FORMULATION                                        1 NP                         2 1 Nu 1      2
    A discrete time linear time-invariant model of a system in
                                                                              J       
                                                                                     2 i1
                                                                                           y(t  i)  yref (t  i)   u(t  i) R .
                                                                                           ˆ
                                                                                                                  Q 2 i1
                                                                                                                                             (7)
a state space form is given as,
                                                                              where, u (t  i )  u (t  i )  u (t  i  1)
           x(t  1)  Ax(t )  Bu(t )
                                     .                                       subjected to linear inequality constraints on system inputs,
                                                                  (1)
                  y (t )  Cx(t )    
                                                                                                   umin  u (t )  umax
   where, y (t )             are output vector, u (t ) 
                                               ,
                                                                              where, yref is the set-point and while Q and R are the
are input vector and x (t )               are internal states vector.
                                                                     .        positive definite weight matrices [14]. To get optimal solution,
 A and B are system parameter matrices. Given a predicted                     the MPC problem can be formulated as a standard quadratic
input sequence, the corresponding sequence of state                           programming (QP) problem as,
predictions is generated by simulating the model forward                               1               
                                                                              J (U )   U T HU  f T U  subjected to AU  b  0. (8)
over the prediction horizon ( N P ) intervals.                                         2               
    x(t  2)  Ax(t  1)  Bu (t  1)                                        where, H is (lN u  lN u ) Hessian matrix, f is
             2                           .                       (2)
x(t  2)  A x(t )  ABu(t )  Bu (t  1)                                    (lN u 1) column vector [14], [16].
                                  N P 1
x(t  N P )  A N P x(t )   j 0 ( A N P 1 j B )u ( j ).      (3)
                                                                                                 III. INTERIOR-POINT METHOD
The prediction model is given by,
                                                                                    Consider the following standard QP problem,
              ˆ
              y (t  N P )  Cx (t  N P ).                       (4)
                                                                              min     1 xT Qx CT x subjected
                                                                                      2
                                                                                                                to Ax  b  0, Lx  k  0 .
                                                                                x
Putting the value of x (t  N P ) in (4), we get,
                                                                                                                                   (9)
                                       N 1
y(t  N P )  C[ A N P x(0)   j P0 ( A N P 1 j B)u ( j )].
ˆ                                                                             Except equality constraints, (9) resembles (8). The KKT
                                                                              Conditions for optimality are given by,
                                                                  (5)
In matrix form (5) is written as,
                                                                                         Qx  AT y  LT z  C 
          Y  x(0)  U .                                        (6)                                          
with,
                                                                                              Ax  b  0       
                                                                                                               
                                                                                            Lx  s  k  0     .
Y   y (t  1)    y(t  2)  y (t  N P ) ,
                                           T
      ˆ            ˆ          ˆ                                                                  T                                         (10)
                                                                                               z s0
                                                                                                               
U  u (t ) u (t  1)  y (t  N u  1)  ,
                                                   T
                        ˆ                                                                      z, s  0        
                                                                                                               
                CA                                                          where, y and z represents the Lagrange multipliers for
                CA 2                                                        equality and inequality constraints respectively. The slack
                   ,                                                      variable s is introduced for converting inequality into
                 
                NP                                                          equality. By applying Newton’s method, search direction
               CA                                                           ( x,y ,z , s ) is obtained as shown in (11), where
                                                                              J ( x , y , z , s ) denotes Jacobian of f ( x, y, z , s ) ,
   CB      0                                     0
   CAB    CB                                     0
                                                                                                              x    r1 
                                                 
                                                                                                              y    
                                               0
   N p 1 N p 2                           N p Nu                                       J ( x, y, z , s )      r2 .
  CA B CA        B                     CA        B                                                         z    r3                  (11)
                                                                                                                    
                                                                         24                                   s    r4 
© 2013 ACEEE
DOI: 01.IJCSI.4.1.1064
Full Paper
                                                        ACEEE Int. J. on Control System and Instrumentation, Vol. 4, No. 1, Feb 2013


Considering only inequality constraints, augmented form of                  A  LU ;
original system is given as,
                                                                            Solve LY  B; //forward substitution
            Q    LT  x        r1    
                  1            1 
                                           .                    (12)        UX  Y ; //backward substitution
             L  Z S   z  r3  Z r4 
                                                                            X   X 1; X 2 ;
            s  Z 1 (r4  Sz).                        (13)
                                                                                          Interior-point method(IPM) algorithm
We use Mehrotra’s Predictor-corrector algorithm [13] to solve
                                                                            Initialization and input
(12) and (13) for ( x ,  z ,  s ). Predictor or affine and
                                                                            X 0  0 0  0 ;
                                                                                                               T

corrector-centering steps uses ( r1 , r3 , r4 ) values from (14)
                                                                            Z0  1 1  1 ; S0  1 1  1 ; Z0 , S0  0;
                                                                                                           T                    T
and (15) respectively to form the right-hand side of (12) and
(13) which in turn finds ( x aff ,  z aff , s aff ) and
                                                                            e  1 1  1 ;  0.25
                                                                                                       T


(x cc , z cc , s cc ) [1], [15], [17], [18], [19].                       Input Q, C , L, k matrices from given QP problem
                                      T
             r1     Qx  C  L         z                                          T
                                                                                  Z 0 S0
             r     Lx  s  k                                                    ; m- no. of constraints
             3                          .                   (14)                 m
            r4 
                        ZSe                                             Start the loop and terminate if stopping criterion are satisfied
                                          
                                                                            Predictor or affine step
                                                                            S  diag ( S 0 ); Z  diag ( Z 0 );
     r1                    0                                            r1aff  QX 0  C  LT Z 0 ; r3aff  LX 0  S0  k ;
    r                                                     (15)
                             0                 .
      3

    r4 
          diag (z aff )diag (s aff )e  e                            r4 aff  ZSe;
                                                                          Solve (13), (12) by linear solver and compute
where,  is centering parameter and  is complementarity
measure or duality gap. Thus, solution of linear system in                  x aff , z aff , s aff
(13) is to be calculated twice at each iteration of IPM, which
puts major computational load on overall performance of IPM,                Compute centring parameter             
and eventually on MPC. Linear system in (13) uses two
different right-hand side components but the same coefficient                         ( Z 0  z aff )T ( S 0  saff )
matrix, so just one factorization of this matrix is required per             aff                                          ;
iteration. Such system can be solved using Gauss elimination,                                                  m
QR, LU, Cholesky factorization methods.                                                     3
    The coefficient matrix in a linear system (13) involved in                           
                                                                               aff
                                                                                         ;
                                                                                           
IPM is symmetric and indefinite so conventional and more
                                                                                          
numerically stable Cholesky factorization cannot be used to
solve the linear system. Compared to computational cost of                  Corrector and centring step to obtain search direction
QR decomposition (2/3n3) and the problem of associated                      Z aff  diag ( z aff ); S aff  diag ( saff );
pivoting with ill condition of Gauss elimination, LU
factorization proves to be more effective and accurate to solve             r1cc  0; r3cc  0; r4 aff  Z aff S aff e   e;
system of linear equations [5], [6]. We propose LU
factorization based Linear Solver for the same. The pseudo
                                                                            Solve (13), (12) by linear solver and compute
code of LU factorization Linear Solver for (13) is given as
follows:                                                                    x cc , z cc , s cc
Pseudo Code-LU factorization
A   A11     A12 ;   A21    A22 ;                                         Update ( x ,  z ,  s ) as

where, A11  Q; A12  LT ; A22  L; A22   Z 1S                           (x, z, s)  ( x aff , z aff , s aff )  (x cc , z cc , s cc )
B  B11; B22 ;                                                            Update X 0 , Z 0 , S 0 as

where, B11  r1 , B22  ( r3  Z 1r4 );                                    X 0  X 0   x ; Z 0  Z 0   z ; S 0  S 0   s ;
                                                                            End of loop
© 2013 ACEEE                                                           25
DOI: 01.IJCSI.4.1.1064
Full Paper
                                                               ACEEE Int. J. on Control System and Instrumentation, Vol. 4, No. 1, Feb 2013


                       IV. OBSERVER DESIGN                                                Simplifying (13)
    The implementation of MPC requires the measurements                                    ~(t  1)   A B  L 
                                                                                            x                             ~ (t )
                                                                                                                            x
of all the states. As only an encoder is used for measurement                                                C 0  ~ .
                                                                                           ~ (t  1)  0 0  M         e (t )                       
of the motor shaft position in practice. PIO is designed in this                          e                              
section for present application.
    Consider a linear time-invariant system                                               It follows that x(t ) is an estimate of x(t ) if and only if,
                                                                                                          ˆ
                                                                                             q R   0 for q  1, , ( n  p ) . The generalized block
~ (t  1)  A~ (t )  Bu (t )  L( y (t )  y (t ))  Be(t ) 
x              x                             ˆ         ˆ                                  diagram of the observer based MPC system is shown in
                      ˆ         ˆ
                      y (t )  Cx(t )                        
                                                             .                       Fig. 1.
           ˆ          ˆ                    ˆ
           e(t  1)  e(t )  M ( y(t )  y (t ))            
                                                             
                                                                                                V. MATHEMATICAL MODELLING OF DC SERVOMOTOR
                                                                                              For mathematical model derivation of DC servomotor, the
where ~ (t ) is the estimated state vector and e (t ) is the
       x                                           ~
                                                                                          electrical & torque characteristic equations are formulated.
estimation of uncertainties of p-dimensional vector. L
proportional and M integral observer gain matrices of
appropriate dimension.
    The system described by Eq. (16) is said to be a full-order
PI observer for system (1) if and only if

              lim ~ (t )  0
                   x          
              t 
              lim e~ (t )  0 . 
              t             
                              
where, ~(t )  x(t )  x(t ) represents the observer’s state
       x               ˆ
                     ~                ˆ
estimation error and e (t )  e(t )  e(t ) represents the error
in uncertainty estimation.
    We are assuming the following for derivation.                                                   Figure 2. Schematic diagram of DC Servomotor

1. Matrices A, B, C are known. All uncertainties associated                                 Fig. 2, shows the schematic diagram of armature controlled
                                                                                          DC servomotor. Using Kirchhoff’s voltage law (KVL),
with the matrices A and B are lumped into e(t ) .
                                                                                                                      
2. The pair ( A, B) is controllable.                                                                Vm  R m I m  Lm   I m  k m  m . .            
                                                                                                                       t 
3. The pair ( A, C ) is observable.
                                                                                          where, k m is the back-emf constant, R m is the motor winding

                                                                                          resistance and L m is the motor winding inductance, I m is
                                                                                          the current through the motor winding.
                                                                                                    TABLE I. NOMINAL DC SERVOMOTOR PARAMETERS [21]
                                                                                                   Description             Symbol     Value          Unit
                                                                                            Motor electric time constant    e      7.74 * 10-5        s

                                                                                                 Moment of inertia          J eq     2.21*10-5       Kg.m2

                                                                                             Motor maximum velocity        umax        298.8         rad/s

                                                                                             Motor maximum current          I max      1.42           A


Figure 1. Generalized block diagram of observer based MPC system
                                                                                              Motor maximum torque         Tmax        0.068         N.m

From (1) and (16), the dynamic of the observer error becomes                                   Motor torque constant        km        0.0502         N.m/A
          ~ (t  1)  ( A  LC ) ~ (t )  B~ (t ).
          x                      x         e                                           Motor armature resistance      Rm         10.6          Ohm
which together with (16) results in;                                                        Motor armature inductance       Lm         0.82           mH

      ~(t  1)  A  LC
       x                                 B   ~(t )
                                               x                                             Open loop time constant        T         0.0929           s
      ~(t  1)    MC                    ~ (t ).               Open loop steady state gain     K          19.9       rad/(V.s)
     e                                0  e 
© 2013 ACEEE                                                                         26
DOI: 01.IJCSI.4.1.1064
Full Paper
                                                                               ACEEE Int. J. on Control System and Instrumentation, Vol. 4, No. 1, Feb 2013


Representing (21) in Laplace domain as follows:
                R m I m  Lm I m s  Vm  k m  m . 
The armature electrical time constant of system is represented
as,
                                     Lm
                         e            .
                                     R m 
Expressing the torque equation into the Laplace domain,
                J eq  m s  k m I m  Td .                  
Combining (21) and (23),                                                                                     Figure 3. Per iteration computation time comparison of QP solving
                                2                       2                                                                                 methods
                          k m  m ( s ) k m Vm (s )                                                          servomotor.
 J eq  m ( s )s                                   Td ( s ).                            
                              Rm            Rm                                                                   Substituting the parameter values from Table I in (29), the
                                                                                                             state space representation of DC servomotor model can be
Transfer function from motor shaft position to the motor input
                                                                                                             obtained as,
voltage can be given as,
                                     ( s)                                                                     0 1          0 
               Gm ( s )                     .               
                                                                                                             A      , B   210 , C  1 0, D  0.                (30)
                                    Vm ( s )                                                                   0  1           
The plant system parameters can be expressed as,                                                                 QET DC servomotor model as given in (30) was considered
                                                                                                             for the MATLAB simulation of MPC. The simulation results
                                              km                                                             of the proposed Observer based MPC and high pass filter
               Gm ( s )                            2
                                                                 .                                           (HPF) based MPC are shown in Fig. 4, Fig. 5, and Fig. 6.
                                                k 
                                    Rm  J eq s  m 
                                       
                                                                           
                                                 Rm 
Simplifying the above equation further,
                                         b          K
               G m ( s)                                  . 
                                    s ( s  a) s ( s   )

                                                              km
where,                      2          and       b
                      km                                    J eq Rm
             a
                     J eq Rm
km is the steady state gain and  is the time constant of the
                                                                                                                      Figure 4. Comparative plot of position response
system.
Converting the transfer function into the state space form,                                                      From the results it is observed that observer does better
                                                                                                             state estimation compared to HPF in transient time. Due to
       0  1         0                                                                                    better state estimation of actual states, control input is
     A   1  , B   K  , C  1 0, D  0.                                                             conservative and states have less oscillation in the transient
       0   
                    
                                                                                                           response.


                                VI. MATLAB SIMULATION
A. QP Solver
   The proposed algorithm is coded in MATLAB. Fig. 3,
shows per iteration computation time comparison of proposed
method with QR factorization and MATLAB’s QP solver
quadprog.
B. MPC Implimentation
   The designed MPC with PIO is tested through
experimentation for position control application of a DC                                                                Figure 5. Comparative plot of second state
© 2013 ACEEE                                                                                            27
DOI: 01.IJCSI.4.1.1064
Full Paper
                                                     ACEEE Int. J. on Control System and Instrumentation, Vol. 4, No. 1, Feb 2013




             Figure 6. Comparative plot of control input

                 VII. HARDWARE IMPLEMENTATION
   Efficacy of the proposed approach is demonstrated
practically on Quanser QET DC servomotor plant with 0.01s
sample time.                                                                      Figure 8. Quanser QET DC servomotor setup




                                                                           Figure 9. Comparative plot of position response using PID
                                                                                             controller and MPC

  Figure 7. Real-time MPC Implementation strategy for position
                 control of QET DC servomotor
    The experimental setup has DC servomotor with Q2 USB
based data acquisition card and a PC equipped with
proprietary QuaRc 2.1 software. QuaRc provides hardware-
in-loop simulation environment [21]. Motor shaft position
θ(t) is measured by an encoder. To provide state estimation
of plant, PIO is developed. The proposed real-time MPC
implementation strategy and the experimental setup are shown
in Fig. 7 and Fig. 8 respectively.
    The performance of designed observer based MPC
scheme is compared with classical controller i.e. PID
controller. Experimentation has been carried out with constant
load to DC servomotor as an external disturbance. Fig. 9,
shows the plot of position response using PID controller               Figure 10. Comparative plot of control input of PID controller and
                                                                                                     MPC
and MPC. It shows that proposed MPC scheme has better
transient response compare to classical controller.                       Fig. 11, shows the position responses of the plant using
    Plot of control input of MPC and PID controller is shown           two different prediction horizon with the control horizon kept
in Fig.10. Control input of MPC is conservative as compare             constant at N u  3 . From Fig. 12, it is observed that
to PID, which can be clearly observed from the plot.
© 2013 ACEEE                                                      28
DOI: 01.IJCSI.4.1.1064
Full Paper
                                                     ACEEE Int. J. on Control System and Instrumentation, Vol. 4, No. 1, Feb 2013


                                                                                               ACKNOWLEDGMENT
                                                                           The authors would like to thank Rashmi More from De-
                                                                        partment of Mathematics, College of Engineering, Pune, for
                                                                        her sustained contribution towards this work.

                                                                                                   REFERENCES
                                                                        [1] A. G. Wills, W. P. Heath, “Interior-Point Methods for Linear
                                                                             Model Predictive Control,” Control 2004, University of Bath,
                                                                             UK, 2004.
                                                                        [2] A. G. Wills, A. Mills, B. Ninness, “FPGA Implementation of
                                                                             an Interior-Point Solution for Linear Model Predictive Control,”
                                                                             Preprints of the 18 th IFAC World Congress Milano (Italy),
                                                                             pp. 14527-14532, 2011.
   Figure 11. Plant response to reference position for different        [3] C. V. Rao, S. J. Wright, J. B. Rawlings, “Application of interior
                       prediction horizon                                    point methods to model predictive control,” Journal of
                                                                             Optimization Theory and Applications, pp.723-757, 1998.
                                                                        [4] K. V. Ling, S. P. Yue, and J. M. Maciejowski, “A FPGA
                                                                             Implementation of Model Predictive Control,” Proceedings
                                                                             of the 2006 American Control Conference, pp. 1930-1935.
                                                                             Minneapolis, Minnesota, USA, 2011.
                                                                        [5] A. Sudarsanam, T. Hauser, A. Dasu, S. Young, “A Power
                                                                             Efficient Linear Equation Solver on a Multi-FPGA
                                                                             Accelerator,” International Journal of Computers and
                                                                             Applications, Vol. 32(1), pp. 1-19, 2010.
                                                                        [6] W. Chai, D. Jiao, “An LU Decomposition Based Direct Integral
                                                                             Equation Solver of Linear Complexity and Higher-Order
                                                                             Accuracy for Large-Scale Interconnect Extraction,” IEEE
                                                                             Transactions on Advanced Packaging, Vol. 33(4), pp. 794-
                                                                             803, 2010.
                                                                        [7] S. Belale, B. Shafai, “Robust Control System Design with a
     Figure 12. Control input for different prediction horizon               Proportional Integral Observer,” International Journal of
                                                                             Control, Vol. 50(1), pp. 97-111, 1989.
N p  10 results in a shorter rise time and a shorter settling          [8] S. Belale, B. Shafai, H. H. Niemann, J. L. Stoustrup, “LTR
                                                                             Design of Discrete-Time Proportional-Integral Observers,”
time in the position response then N p  40 . Thus the                       IEEE Transactions on Automatic Control, Vol. 41(7), pp. 1056-
                                                                             1062, 1996.
responses are faster while decreasing the Prediction                    [9] B. Shafai, H. M. Oloomi, “Output Derivative Estimation and
                                                                             Disturbance Attenuation using PI Observer with Application
Horizon N p . Fig. 12, shows that this improvement is achieved
                                                                             to a Class of Nonlinear Systems,” IEEE Conference
at the cost of larger control signal.                                        proceedings, pp. 1056-1062, 2003.
                                                                        [10] S. Belale, B. Shafai, H. H. Niemann, J. L. Stoustrup, “LTR
                          CONCLUSIONS                                        Design of Discrete-Time Proportional-Integral Observers,”
                                                                             IEEE Transactions on Power Electronics, Vol. 15(6), pp. 1056-
    In this paper, LU factorization based linear solver for                  1028, 2000.
solution of IPM is presented, which is used for real-time               [11] W. H. Chen, D. Ballance, P. Gawthrop, & J. O’Reilly, “A
implementation of constrained linear model predictive                        nonlinear disturbance observer for robotic manipulators,” IEEE
controller for position control of DC servomotor. The issue                  Transactions on Industrial Electronics, 47(4), 932–938, 2000.
of unavailability of internal state vector for implementation           [12] K. S. Low, and H. Zhuang, “Roboust Model Predictive Control
of MPC is addressed by designing a PIO. Simulation results                   and Observer for Direct Drive Applications,” IEEE
                                                                             Transactions on Power Electronics, Vol. 15, NO. 6, November
are presented to demonstrate the effectiveness of PIO.
                                                                             2000.
Simulation result shows the superior performance of observer            [13] S. Mehrotra, “On Implementation of a primal-dual interior-
to estimate the state vector as well uncertainty compared to                 point method,” SIAM Journal on Optimization, Vol. 2(4),
HPF. From experimentation results it is observed that, the                   pp.575-601, 1992.
proposed scheme solves QP problem efficiently within the                [14] J. M. Maciejowski, “Predictive Control with Constraints,”
specified sample period and performs well for tracking a                     Pearson Education Limited, 2002.
reference position of DC servomotor which is relatively a               [15] S. J. Wright, “Applying new optimization algorithms to model
fast dynamic system. Performance of the designed MPC has                     predictive control,” Chemical Process Control-V, CACHE,
been compared with PID control via experimental results. It is               AIChE Symposium Series, Vol. 93(316), pp-147-155, 1997.
                                                                        [16] A. G. Wills, “Technical Report EE04025 - Notes on Linear
also observed that, the controller is robust to handle parameter
                                                                             Model Predictive Control”, 2004.
uncertainties and load disturbances.
© 2013 ACEEE                                                       29
DOI: 01.IJCSI.4.1.1064
Full Paper
                                                 ACEEE Int. J. on Control System and Instrumentation, Vol. 4, No. 1, Feb 2013

[17] T. R. Kruth, “Interior-Point Algorithms for Quadratic             [19] A. G. Wills, W. P. Heath, “Interior-Point Methods for Linear
     Programming,” IMM-M.Sc-2008-19, Technical University of                Model Predictive Control,” Technical Report, University of
     Denmark, 2008.                                                         Newcastle, Australia, 2003.
[18] I. M. Nejdawi, “An Efficient interior Point Method for            [20] F. Stinga, M. Roman, A. Soimu, E. Bobasu, “Optimal and
     Sequential Quadratic Programming Based Optimal Power                   MPC Control of the Quanser Flexible Link Experiment,”4th
     Flow,” IEEE Transactions on Power Systems, Vol. 15(4), pp.             WSEAS/IASME International Conference on Dynamical
     1179—1183, 2000.                                                       Systems and Control (Control’08), pp. 175—180, 2008.
                                                                       [21] “QET QuaRc Integration-instructor manual”, Quanser Inc.,
                                                                            Markham, ON, Canada, 2010.




© 2013 ACEEE                                                      30
DOI: 01.IJCSI.4.1.1064

Contenu connexe

Tendances

An Application of Genetic Programming for Power System Planning and Operation
An Application of Genetic Programming for Power System Planning and OperationAn Application of Genetic Programming for Power System Planning and Operation
An Application of Genetic Programming for Power System Planning and OperationIDES Editor
 
IRJET- Jeevn-Net: Brain Tumor Segmentation using Cascaded U-Net & Overall...
IRJET-  	  Jeevn-Net: Brain Tumor Segmentation using Cascaded U-Net & Overall...IRJET-  	  Jeevn-Net: Brain Tumor Segmentation using Cascaded U-Net & Overall...
IRJET- Jeevn-Net: Brain Tumor Segmentation using Cascaded U-Net & Overall...IRJET Journal
 
IRJET - A Review on Replay Spoof Detection in Automatic Speaker Verificat...
IRJET -  	  A Review on Replay Spoof Detection in Automatic Speaker Verificat...IRJET -  	  A Review on Replay Spoof Detection in Automatic Speaker Verificat...
IRJET - A Review on Replay Spoof Detection in Automatic Speaker Verificat...IRJET Journal
 
A NOVEL EVALUATION APPROACH TO FINDING LIGHTWEIGHT MACHINE LEARNING ALGORITHM...
A NOVEL EVALUATION APPROACH TO FINDING LIGHTWEIGHT MACHINE LEARNING ALGORITHM...A NOVEL EVALUATION APPROACH TO FINDING LIGHTWEIGHT MACHINE LEARNING ALGORITHM...
A NOVEL EVALUATION APPROACH TO FINDING LIGHTWEIGHT MACHINE LEARNING ALGORITHM...IJNSA Journal
 
Model based test case prioritization using neural network classification
Model based test case prioritization using neural network classificationModel based test case prioritization using neural network classification
Model based test case prioritization using neural network classificationcseij
 
Event triggered control design of linear networked systems with quantizations
Event triggered control design of linear networked systems with quantizationsEvent triggered control design of linear networked systems with quantizations
Event triggered control design of linear networked systems with quantizationsISA Interchange
 
Kinetics reaction scheme_v1 3
Kinetics reaction scheme_v1 3Kinetics reaction scheme_v1 3
Kinetics reaction scheme_v1 3RobBerger
 
A NEW TOOL FOR LARGE SCALE POWER SYSTEM TRANSIENT SECURITY ASSESSMENT
A NEW TOOL FOR LARGE SCALE POWER SYSTEM TRANSIENT SECURITY ASSESSMENTA NEW TOOL FOR LARGE SCALE POWER SYSTEM TRANSIENT SECURITY ASSESSMENT
A NEW TOOL FOR LARGE SCALE POWER SYSTEM TRANSIENT SECURITY ASSESSMENTPower System Operation
 
Integrating fault tolerant scheme with feedback control scheduling algorithm ...
Integrating fault tolerant scheme with feedback control scheduling algorithm ...Integrating fault tolerant scheme with feedback control scheduling algorithm ...
Integrating fault tolerant scheme with feedback control scheduling algorithm ...ijics
 
FPGA Optimized Fuzzy Controller Design for Magnetic Ball Levitation using Gen...
FPGA Optimized Fuzzy Controller Design for Magnetic Ball Levitation using Gen...FPGA Optimized Fuzzy Controller Design for Magnetic Ball Levitation using Gen...
FPGA Optimized Fuzzy Controller Design for Magnetic Ball Levitation using Gen...IDES Editor
 
Robust Fault-Tolerant Training Strategy Using Neural Network to Perform Funct...
Robust Fault-Tolerant Training Strategy Using Neural Network to Perform Funct...Robust Fault-Tolerant Training Strategy Using Neural Network to Perform Funct...
Robust Fault-Tolerant Training Strategy Using Neural Network to Perform Funct...Eswar Publications
 
IRJET- Prediction of Crime Rate Analysis using Supervised Classification Mach...
IRJET- Prediction of Crime Rate Analysis using Supervised Classification Mach...IRJET- Prediction of Crime Rate Analysis using Supervised Classification Mach...
IRJET- Prediction of Crime Rate Analysis using Supervised Classification Mach...IRJET Journal
 
SOHOMA19 Conference slides
SOHOMA19 Conference slidesSOHOMA19 Conference slides
SOHOMA19 Conference slidesBang Xiang Yong
 
PERFORMANCE COMPARISON OF TWO CONTROLLERS ON A NONLINEAR SYSTEM
PERFORMANCE COMPARISON OF TWO CONTROLLERS ON A NONLINEAR SYSTEMPERFORMANCE COMPARISON OF TWO CONTROLLERS ON A NONLINEAR SYSTEM
PERFORMANCE COMPARISON OF TWO CONTROLLERS ON A NONLINEAR SYSTEMijccmsjournal
 
A FUZZY MATHEMATICAL MODEL FOR PEFORMANCE TESTING IN CLOUD COMPUTING USING US...
A FUZZY MATHEMATICAL MODEL FOR PEFORMANCE TESTING IN CLOUD COMPUTING USING US...A FUZZY MATHEMATICAL MODEL FOR PEFORMANCE TESTING IN CLOUD COMPUTING USING US...
A FUZZY MATHEMATICAL MODEL FOR PEFORMANCE TESTING IN CLOUD COMPUTING USING US...ijseajournal
 
Comparison Analysis of Model Predictive Controller with Classical PID Control...
Comparison Analysis of Model Predictive Controller with Classical PID Control...Comparison Analysis of Model Predictive Controller with Classical PID Control...
Comparison Analysis of Model Predictive Controller with Classical PID Control...ijeei-iaes
 
Improving face recognition by artificial neural network using principal compo...
Improving face recognition by artificial neural network using principal compo...Improving face recognition by artificial neural network using principal compo...
Improving face recognition by artificial neural network using principal compo...TELKOMNIKA JOURNAL
 
Image-Based Multi-Sensor Data Representation and Fusion Via 2D Non-Linear Con...
Image-Based Multi-Sensor Data Representation and Fusion Via 2D Non-Linear Con...Image-Based Multi-Sensor Data Representation and Fusion Via 2D Non-Linear Con...
Image-Based Multi-Sensor Data Representation and Fusion Via 2D Non-Linear Con...CSCJournals
 

Tendances (19)

An Application of Genetic Programming for Power System Planning and Operation
An Application of Genetic Programming for Power System Planning and OperationAn Application of Genetic Programming for Power System Planning and Operation
An Application of Genetic Programming for Power System Planning and Operation
 
IRJET- Jeevn-Net: Brain Tumor Segmentation using Cascaded U-Net & Overall...
IRJET-  	  Jeevn-Net: Brain Tumor Segmentation using Cascaded U-Net & Overall...IRJET-  	  Jeevn-Net: Brain Tumor Segmentation using Cascaded U-Net & Overall...
IRJET- Jeevn-Net: Brain Tumor Segmentation using Cascaded U-Net & Overall...
 
IRJET - A Review on Replay Spoof Detection in Automatic Speaker Verificat...
IRJET -  	  A Review on Replay Spoof Detection in Automatic Speaker Verificat...IRJET -  	  A Review on Replay Spoof Detection in Automatic Speaker Verificat...
IRJET - A Review on Replay Spoof Detection in Automatic Speaker Verificat...
 
A NOVEL EVALUATION APPROACH TO FINDING LIGHTWEIGHT MACHINE LEARNING ALGORITHM...
A NOVEL EVALUATION APPROACH TO FINDING LIGHTWEIGHT MACHINE LEARNING ALGORITHM...A NOVEL EVALUATION APPROACH TO FINDING LIGHTWEIGHT MACHINE LEARNING ALGORITHM...
A NOVEL EVALUATION APPROACH TO FINDING LIGHTWEIGHT MACHINE LEARNING ALGORITHM...
 
Model based test case prioritization using neural network classification
Model based test case prioritization using neural network classificationModel based test case prioritization using neural network classification
Model based test case prioritization using neural network classification
 
Event triggered control design of linear networked systems with quantizations
Event triggered control design of linear networked systems with quantizationsEvent triggered control design of linear networked systems with quantizations
Event triggered control design of linear networked systems with quantizations
 
Kinetics reaction scheme_v1 3
Kinetics reaction scheme_v1 3Kinetics reaction scheme_v1 3
Kinetics reaction scheme_v1 3
 
A NEW TOOL FOR LARGE SCALE POWER SYSTEM TRANSIENT SECURITY ASSESSMENT
A NEW TOOL FOR LARGE SCALE POWER SYSTEM TRANSIENT SECURITY ASSESSMENTA NEW TOOL FOR LARGE SCALE POWER SYSTEM TRANSIENT SECURITY ASSESSMENT
A NEW TOOL FOR LARGE SCALE POWER SYSTEM TRANSIENT SECURITY ASSESSMENT
 
Integrating fault tolerant scheme with feedback control scheduling algorithm ...
Integrating fault tolerant scheme with feedback control scheduling algorithm ...Integrating fault tolerant scheme with feedback control scheduling algorithm ...
Integrating fault tolerant scheme with feedback control scheduling algorithm ...
 
FPGA Optimized Fuzzy Controller Design for Magnetic Ball Levitation using Gen...
FPGA Optimized Fuzzy Controller Design for Magnetic Ball Levitation using Gen...FPGA Optimized Fuzzy Controller Design for Magnetic Ball Levitation using Gen...
FPGA Optimized Fuzzy Controller Design for Magnetic Ball Levitation using Gen...
 
Robust Fault-Tolerant Training Strategy Using Neural Network to Perform Funct...
Robust Fault-Tolerant Training Strategy Using Neural Network to Perform Funct...Robust Fault-Tolerant Training Strategy Using Neural Network to Perform Funct...
Robust Fault-Tolerant Training Strategy Using Neural Network to Perform Funct...
 
IRJET- Prediction of Crime Rate Analysis using Supervised Classification Mach...
IRJET- Prediction of Crime Rate Analysis using Supervised Classification Mach...IRJET- Prediction of Crime Rate Analysis using Supervised Classification Mach...
IRJET- Prediction of Crime Rate Analysis using Supervised Classification Mach...
 
SOHOMA19 Conference slides
SOHOMA19 Conference slidesSOHOMA19 Conference slides
SOHOMA19 Conference slides
 
PERFORMANCE COMPARISON OF TWO CONTROLLERS ON A NONLINEAR SYSTEM
PERFORMANCE COMPARISON OF TWO CONTROLLERS ON A NONLINEAR SYSTEMPERFORMANCE COMPARISON OF TWO CONTROLLERS ON A NONLINEAR SYSTEM
PERFORMANCE COMPARISON OF TWO CONTROLLERS ON A NONLINEAR SYSTEM
 
A FUZZY MATHEMATICAL MODEL FOR PEFORMANCE TESTING IN CLOUD COMPUTING USING US...
A FUZZY MATHEMATICAL MODEL FOR PEFORMANCE TESTING IN CLOUD COMPUTING USING US...A FUZZY MATHEMATICAL MODEL FOR PEFORMANCE TESTING IN CLOUD COMPUTING USING US...
A FUZZY MATHEMATICAL MODEL FOR PEFORMANCE TESTING IN CLOUD COMPUTING USING US...
 
Comparison Analysis of Model Predictive Controller with Classical PID Control...
Comparison Analysis of Model Predictive Controller with Classical PID Control...Comparison Analysis of Model Predictive Controller with Classical PID Control...
Comparison Analysis of Model Predictive Controller with Classical PID Control...
 
Improving face recognition by artificial neural network using principal compo...
Improving face recognition by artificial neural network using principal compo...Improving face recognition by artificial neural network using principal compo...
Improving face recognition by artificial neural network using principal compo...
 
Ay33292297
Ay33292297Ay33292297
Ay33292297
 
Image-Based Multi-Sensor Data Representation and Fusion Via 2D Non-Linear Con...
Image-Based Multi-Sensor Data Representation and Fusion Via 2D Non-Linear Con...Image-Based Multi-Sensor Data Representation and Fusion Via 2D Non-Linear Con...
Image-Based Multi-Sensor Data Representation and Fusion Via 2D Non-Linear Con...
 

Similaire à Design and Implementation of Proportional Integral Observer based Linear Model Predictive Controller

Trajectory Control With MPC For A Robot Manipülatör Using ANN Model
Trajectory Control With MPC For A Robot Manipülatör Using  ANN ModelTrajectory Control With MPC For A Robot Manipülatör Using  ANN Model
Trajectory Control With MPC For A Robot Manipülatör Using ANN ModelIJMER
 
Application of a merit function based interior point method to linear model p...
Application of a merit function based interior point method to linear model p...Application of a merit function based interior point method to linear model p...
Application of a merit function based interior point method to linear model p...Zac Darcy
 
Magnetic levitation system
Magnetic levitation systemMagnetic levitation system
Magnetic levitation systemrahul bhambri
 
An efficient application of particle swarm optimization in model predictive ...
An efficient application of particle swarm optimization in model  predictive ...An efficient application of particle swarm optimization in model  predictive ...
An efficient application of particle swarm optimization in model predictive ...IJECEIAES
 
Performance analysis of a liquid column in a chemical plant by using mpc
Performance analysis of a liquid column in a chemical plant by using mpcPerformance analysis of a liquid column in a chemical plant by using mpc
Performance analysis of a liquid column in a chemical plant by using mpceSAT Publishing House
 
Performance analysis of a liquid column in a chemical plant by using mpc
Performance analysis of a liquid column in a chemical plant by using mpcPerformance analysis of a liquid column in a chemical plant by using mpc
Performance analysis of a liquid column in a chemical plant by using mpceSAT Publishing House
 
Control Strategies for Autonomous quadrotors.pptx
Control Strategies for Autonomous quadrotors.pptxControl Strategies for Autonomous quadrotors.pptx
Control Strategies for Autonomous quadrotors.pptxMahiRanka2
 
An adaptive PID like controller using mix locally recurrent neural network fo...
An adaptive PID like controller using mix locally recurrent neural network fo...An adaptive PID like controller using mix locally recurrent neural network fo...
An adaptive PID like controller using mix locally recurrent neural network fo...ISA Interchange
 
Experimental evaluation of control performance of MPC as a regulatory controller
Experimental evaluation of control performance of MPC as a regulatory controllerExperimental evaluation of control performance of MPC as a regulatory controller
Experimental evaluation of control performance of MPC as a regulatory controllerISA Interchange
 
Discrete event systems comprise of discrete state spaces and event
Discrete event systems comprise of discrete state spaces and eventDiscrete event systems comprise of discrete state spaces and event
Discrete event systems comprise of discrete state spaces and eventNitish Nagar
 
Neural Network-Based Actuator Fault Diagnosis for a Non-Linear Multi-Tank System
Neural Network-Based Actuator Fault Diagnosis for a Non-Linear Multi-Tank SystemNeural Network-Based Actuator Fault Diagnosis for a Non-Linear Multi-Tank System
Neural Network-Based Actuator Fault Diagnosis for a Non-Linear Multi-Tank SystemISA Interchange
 
MRAC BASED DC SERVO MOTOR MOTION CONTROL
MRAC BASED DC SERVO MOTOR MOTION CONTROLMRAC BASED DC SERVO MOTOR MOTION CONTROL
MRAC BASED DC SERVO MOTOR MOTION CONTROLIAEME Publication
 
MPC Bilinear com restrições - MCA 2008
MPC Bilinear com restrições - MCA 2008MPC Bilinear com restrições - MCA 2008
MPC Bilinear com restrições - MCA 2008Márcio Garcia
 
Dynamic Matrix Control (DMC) on jacket tank heater - Rishikesh Bagwe
Dynamic Matrix Control (DMC) on jacket tank heater - Rishikesh BagweDynamic Matrix Control (DMC) on jacket tank heater - Rishikesh Bagwe
Dynamic Matrix Control (DMC) on jacket tank heater - Rishikesh BagweRishikesh Bagwe
 
Integrating Fault Tolerant Scheme With Feedback Control Scheduling Algorithm ...
Integrating Fault Tolerant Scheme With Feedback Control Scheduling Algorithm ...Integrating Fault Tolerant Scheme With Feedback Control Scheduling Algorithm ...
Integrating Fault Tolerant Scheme With Feedback Control Scheduling Algorithm ...ijics
 
Moving Horizon Model Based Control in the Presence of Feedback Noise
Moving Horizon Model Based Control in the Presence of Feedback NoiseMoving Horizon Model Based Control in the Presence of Feedback Noise
Moving Horizon Model Based Control in the Presence of Feedback NoiseEditor IJCATR
 
Concepts of predictive control
Concepts of predictive controlConcepts of predictive control
Concepts of predictive controlJARossiter
 
PERFORMANCE COMPARISON OF TWO CONTROLLERS ON A NONLINEAR SYSTEM
PERFORMANCE COMPARISON OF TWO CONTROLLERS ON A NONLINEAR SYSTEMPERFORMANCE COMPARISON OF TWO CONTROLLERS ON A NONLINEAR SYSTEM
PERFORMANCE COMPARISON OF TWO CONTROLLERS ON A NONLINEAR SYSTEMijccmsjournal
 

Similaire à Design and Implementation of Proportional Integral Observer based Linear Model Predictive Controller (20)

Trajectory Control With MPC For A Robot Manipülatör Using ANN Model
Trajectory Control With MPC For A Robot Manipülatör Using  ANN ModelTrajectory Control With MPC For A Robot Manipülatör Using  ANN Model
Trajectory Control With MPC For A Robot Manipülatör Using ANN Model
 
Application of a merit function based interior point method to linear model p...
Application of a merit function based interior point method to linear model p...Application of a merit function based interior point method to linear model p...
Application of a merit function based interior point method to linear model p...
 
Magnetic levitation system
Magnetic levitation systemMagnetic levitation system
Magnetic levitation system
 
An efficient application of particle swarm optimization in model predictive ...
An efficient application of particle swarm optimization in model  predictive ...An efficient application of particle swarm optimization in model  predictive ...
An efficient application of particle swarm optimization in model predictive ...
 
Performance analysis of a liquid column in a chemical plant by using mpc
Performance analysis of a liquid column in a chemical plant by using mpcPerformance analysis of a liquid column in a chemical plant by using mpc
Performance analysis of a liquid column in a chemical plant by using mpc
 
Performance analysis of a liquid column in a chemical plant by using mpc
Performance analysis of a liquid column in a chemical plant by using mpcPerformance analysis of a liquid column in a chemical plant by using mpc
Performance analysis of a liquid column in a chemical plant by using mpc
 
Control Strategies for Autonomous quadrotors.pptx
Control Strategies for Autonomous quadrotors.pptxControl Strategies for Autonomous quadrotors.pptx
Control Strategies for Autonomous quadrotors.pptx
 
Bj4301341344
Bj4301341344Bj4301341344
Bj4301341344
 
An adaptive PID like controller using mix locally recurrent neural network fo...
An adaptive PID like controller using mix locally recurrent neural network fo...An adaptive PID like controller using mix locally recurrent neural network fo...
An adaptive PID like controller using mix locally recurrent neural network fo...
 
Aa04405152157
Aa04405152157Aa04405152157
Aa04405152157
 
Experimental evaluation of control performance of MPC as a regulatory controller
Experimental evaluation of control performance of MPC as a regulatory controllerExperimental evaluation of control performance of MPC as a regulatory controller
Experimental evaluation of control performance of MPC as a regulatory controller
 
Discrete event systems comprise of discrete state spaces and event
Discrete event systems comprise of discrete state spaces and eventDiscrete event systems comprise of discrete state spaces and event
Discrete event systems comprise of discrete state spaces and event
 
Neural Network-Based Actuator Fault Diagnosis for a Non-Linear Multi-Tank System
Neural Network-Based Actuator Fault Diagnosis for a Non-Linear Multi-Tank SystemNeural Network-Based Actuator Fault Diagnosis for a Non-Linear Multi-Tank System
Neural Network-Based Actuator Fault Diagnosis for a Non-Linear Multi-Tank System
 
MRAC BASED DC SERVO MOTOR MOTION CONTROL
MRAC BASED DC SERVO MOTOR MOTION CONTROLMRAC BASED DC SERVO MOTOR MOTION CONTROL
MRAC BASED DC SERVO MOTOR MOTION CONTROL
 
MPC Bilinear com restrições - MCA 2008
MPC Bilinear com restrições - MCA 2008MPC Bilinear com restrições - MCA 2008
MPC Bilinear com restrições - MCA 2008
 
Dynamic Matrix Control (DMC) on jacket tank heater - Rishikesh Bagwe
Dynamic Matrix Control (DMC) on jacket tank heater - Rishikesh BagweDynamic Matrix Control (DMC) on jacket tank heater - Rishikesh Bagwe
Dynamic Matrix Control (DMC) on jacket tank heater - Rishikesh Bagwe
 
Integrating Fault Tolerant Scheme With Feedback Control Scheduling Algorithm ...
Integrating Fault Tolerant Scheme With Feedback Control Scheduling Algorithm ...Integrating Fault Tolerant Scheme With Feedback Control Scheduling Algorithm ...
Integrating Fault Tolerant Scheme With Feedback Control Scheduling Algorithm ...
 
Moving Horizon Model Based Control in the Presence of Feedback Noise
Moving Horizon Model Based Control in the Presence of Feedback NoiseMoving Horizon Model Based Control in the Presence of Feedback Noise
Moving Horizon Model Based Control in the Presence of Feedback Noise
 
Concepts of predictive control
Concepts of predictive controlConcepts of predictive control
Concepts of predictive control
 
PERFORMANCE COMPARISON OF TWO CONTROLLERS ON A NONLINEAR SYSTEM
PERFORMANCE COMPARISON OF TWO CONTROLLERS ON A NONLINEAR SYSTEMPERFORMANCE COMPARISON OF TWO CONTROLLERS ON A NONLINEAR SYSTEM
PERFORMANCE COMPARISON OF TWO CONTROLLERS ON A NONLINEAR SYSTEM
 

Plus de IDES Editor

Power System State Estimation - A Review
Power System State Estimation - A ReviewPower System State Estimation - A Review
Power System State Estimation - A ReviewIDES Editor
 
Artificial Intelligence Technique based Reactive Power Planning Incorporating...
Artificial Intelligence Technique based Reactive Power Planning Incorporating...Artificial Intelligence Technique based Reactive Power Planning Incorporating...
Artificial Intelligence Technique based Reactive Power Planning Incorporating...IDES Editor
 
Design and Performance Analysis of Genetic based PID-PSS with SVC in a Multi-...
Design and Performance Analysis of Genetic based PID-PSS with SVC in a Multi-...Design and Performance Analysis of Genetic based PID-PSS with SVC in a Multi-...
Design and Performance Analysis of Genetic based PID-PSS with SVC in a Multi-...IDES Editor
 
Optimal Placement of DG for Loss Reduction and Voltage Sag Mitigation in Radi...
Optimal Placement of DG for Loss Reduction and Voltage Sag Mitigation in Radi...Optimal Placement of DG for Loss Reduction and Voltage Sag Mitigation in Radi...
Optimal Placement of DG for Loss Reduction and Voltage Sag Mitigation in Radi...IDES Editor
 
Line Losses in the 14-Bus Power System Network using UPFC
Line Losses in the 14-Bus Power System Network using UPFCLine Losses in the 14-Bus Power System Network using UPFC
Line Losses in the 14-Bus Power System Network using UPFCIDES Editor
 
Study of Structural Behaviour of Gravity Dam with Various Features of Gallery...
Study of Structural Behaviour of Gravity Dam with Various Features of Gallery...Study of Structural Behaviour of Gravity Dam with Various Features of Gallery...
Study of Structural Behaviour of Gravity Dam with Various Features of Gallery...IDES Editor
 
Assessing Uncertainty of Pushover Analysis to Geometric Modeling
Assessing Uncertainty of Pushover Analysis to Geometric ModelingAssessing Uncertainty of Pushover Analysis to Geometric Modeling
Assessing Uncertainty of Pushover Analysis to Geometric ModelingIDES Editor
 
Secure Multi-Party Negotiation: An Analysis for Electronic Payments in Mobile...
Secure Multi-Party Negotiation: An Analysis for Electronic Payments in Mobile...Secure Multi-Party Negotiation: An Analysis for Electronic Payments in Mobile...
Secure Multi-Party Negotiation: An Analysis for Electronic Payments in Mobile...IDES Editor
 
Selfish Node Isolation & Incentivation using Progressive Thresholds
Selfish Node Isolation & Incentivation using Progressive ThresholdsSelfish Node Isolation & Incentivation using Progressive Thresholds
Selfish Node Isolation & Incentivation using Progressive ThresholdsIDES Editor
 
Various OSI Layer Attacks and Countermeasure to Enhance the Performance of WS...
Various OSI Layer Attacks and Countermeasure to Enhance the Performance of WS...Various OSI Layer Attacks and Countermeasure to Enhance the Performance of WS...
Various OSI Layer Attacks and Countermeasure to Enhance the Performance of WS...IDES Editor
 
Responsive Parameter based an AntiWorm Approach to Prevent Wormhole Attack in...
Responsive Parameter based an AntiWorm Approach to Prevent Wormhole Attack in...Responsive Parameter based an AntiWorm Approach to Prevent Wormhole Attack in...
Responsive Parameter based an AntiWorm Approach to Prevent Wormhole Attack in...IDES Editor
 
Cloud Security and Data Integrity with Client Accountability Framework
Cloud Security and Data Integrity with Client Accountability FrameworkCloud Security and Data Integrity with Client Accountability Framework
Cloud Security and Data Integrity with Client Accountability FrameworkIDES Editor
 
Genetic Algorithm based Layered Detection and Defense of HTTP Botnet
Genetic Algorithm based Layered Detection and Defense of HTTP BotnetGenetic Algorithm based Layered Detection and Defense of HTTP Botnet
Genetic Algorithm based Layered Detection and Defense of HTTP BotnetIDES Editor
 
Enhancing Data Storage Security in Cloud Computing Through Steganography
Enhancing Data Storage Security in Cloud Computing Through SteganographyEnhancing Data Storage Security in Cloud Computing Through Steganography
Enhancing Data Storage Security in Cloud Computing Through SteganographyIDES Editor
 
Low Energy Routing for WSN’s
Low Energy Routing for WSN’sLow Energy Routing for WSN’s
Low Energy Routing for WSN’sIDES Editor
 
Permutation of Pixels within the Shares of Visual Cryptography using KBRP for...
Permutation of Pixels within the Shares of Visual Cryptography using KBRP for...Permutation of Pixels within the Shares of Visual Cryptography using KBRP for...
Permutation of Pixels within the Shares of Visual Cryptography using KBRP for...IDES Editor
 
Rotman Lens Performance Analysis
Rotman Lens Performance AnalysisRotman Lens Performance Analysis
Rotman Lens Performance AnalysisIDES Editor
 
Band Clustering for the Lossless Compression of AVIRIS Hyperspectral Images
Band Clustering for the Lossless Compression of AVIRIS Hyperspectral ImagesBand Clustering for the Lossless Compression of AVIRIS Hyperspectral Images
Band Clustering for the Lossless Compression of AVIRIS Hyperspectral ImagesIDES Editor
 
Microelectronic Circuit Analogous to Hydrogen Bonding Network in Active Site ...
Microelectronic Circuit Analogous to Hydrogen Bonding Network in Active Site ...Microelectronic Circuit Analogous to Hydrogen Bonding Network in Active Site ...
Microelectronic Circuit Analogous to Hydrogen Bonding Network in Active Site ...IDES Editor
 
Texture Unit based Monocular Real-world Scene Classification using SOM and KN...
Texture Unit based Monocular Real-world Scene Classification using SOM and KN...Texture Unit based Monocular Real-world Scene Classification using SOM and KN...
Texture Unit based Monocular Real-world Scene Classification using SOM and KN...IDES Editor
 

Plus de IDES Editor (20)

Power System State Estimation - A Review
Power System State Estimation - A ReviewPower System State Estimation - A Review
Power System State Estimation - A Review
 
Artificial Intelligence Technique based Reactive Power Planning Incorporating...
Artificial Intelligence Technique based Reactive Power Planning Incorporating...Artificial Intelligence Technique based Reactive Power Planning Incorporating...
Artificial Intelligence Technique based Reactive Power Planning Incorporating...
 
Design and Performance Analysis of Genetic based PID-PSS with SVC in a Multi-...
Design and Performance Analysis of Genetic based PID-PSS with SVC in a Multi-...Design and Performance Analysis of Genetic based PID-PSS with SVC in a Multi-...
Design and Performance Analysis of Genetic based PID-PSS with SVC in a Multi-...
 
Optimal Placement of DG for Loss Reduction and Voltage Sag Mitigation in Radi...
Optimal Placement of DG for Loss Reduction and Voltage Sag Mitigation in Radi...Optimal Placement of DG for Loss Reduction and Voltage Sag Mitigation in Radi...
Optimal Placement of DG for Loss Reduction and Voltage Sag Mitigation in Radi...
 
Line Losses in the 14-Bus Power System Network using UPFC
Line Losses in the 14-Bus Power System Network using UPFCLine Losses in the 14-Bus Power System Network using UPFC
Line Losses in the 14-Bus Power System Network using UPFC
 
Study of Structural Behaviour of Gravity Dam with Various Features of Gallery...
Study of Structural Behaviour of Gravity Dam with Various Features of Gallery...Study of Structural Behaviour of Gravity Dam with Various Features of Gallery...
Study of Structural Behaviour of Gravity Dam with Various Features of Gallery...
 
Assessing Uncertainty of Pushover Analysis to Geometric Modeling
Assessing Uncertainty of Pushover Analysis to Geometric ModelingAssessing Uncertainty of Pushover Analysis to Geometric Modeling
Assessing Uncertainty of Pushover Analysis to Geometric Modeling
 
Secure Multi-Party Negotiation: An Analysis for Electronic Payments in Mobile...
Secure Multi-Party Negotiation: An Analysis for Electronic Payments in Mobile...Secure Multi-Party Negotiation: An Analysis for Electronic Payments in Mobile...
Secure Multi-Party Negotiation: An Analysis for Electronic Payments in Mobile...
 
Selfish Node Isolation & Incentivation using Progressive Thresholds
Selfish Node Isolation & Incentivation using Progressive ThresholdsSelfish Node Isolation & Incentivation using Progressive Thresholds
Selfish Node Isolation & Incentivation using Progressive Thresholds
 
Various OSI Layer Attacks and Countermeasure to Enhance the Performance of WS...
Various OSI Layer Attacks and Countermeasure to Enhance the Performance of WS...Various OSI Layer Attacks and Countermeasure to Enhance the Performance of WS...
Various OSI Layer Attacks and Countermeasure to Enhance the Performance of WS...
 
Responsive Parameter based an AntiWorm Approach to Prevent Wormhole Attack in...
Responsive Parameter based an AntiWorm Approach to Prevent Wormhole Attack in...Responsive Parameter based an AntiWorm Approach to Prevent Wormhole Attack in...
Responsive Parameter based an AntiWorm Approach to Prevent Wormhole Attack in...
 
Cloud Security and Data Integrity with Client Accountability Framework
Cloud Security and Data Integrity with Client Accountability FrameworkCloud Security and Data Integrity with Client Accountability Framework
Cloud Security and Data Integrity with Client Accountability Framework
 
Genetic Algorithm based Layered Detection and Defense of HTTP Botnet
Genetic Algorithm based Layered Detection and Defense of HTTP BotnetGenetic Algorithm based Layered Detection and Defense of HTTP Botnet
Genetic Algorithm based Layered Detection and Defense of HTTP Botnet
 
Enhancing Data Storage Security in Cloud Computing Through Steganography
Enhancing Data Storage Security in Cloud Computing Through SteganographyEnhancing Data Storage Security in Cloud Computing Through Steganography
Enhancing Data Storage Security in Cloud Computing Through Steganography
 
Low Energy Routing for WSN’s
Low Energy Routing for WSN’sLow Energy Routing for WSN’s
Low Energy Routing for WSN’s
 
Permutation of Pixels within the Shares of Visual Cryptography using KBRP for...
Permutation of Pixels within the Shares of Visual Cryptography using KBRP for...Permutation of Pixels within the Shares of Visual Cryptography using KBRP for...
Permutation of Pixels within the Shares of Visual Cryptography using KBRP for...
 
Rotman Lens Performance Analysis
Rotman Lens Performance AnalysisRotman Lens Performance Analysis
Rotman Lens Performance Analysis
 
Band Clustering for the Lossless Compression of AVIRIS Hyperspectral Images
Band Clustering for the Lossless Compression of AVIRIS Hyperspectral ImagesBand Clustering for the Lossless Compression of AVIRIS Hyperspectral Images
Band Clustering for the Lossless Compression of AVIRIS Hyperspectral Images
 
Microelectronic Circuit Analogous to Hydrogen Bonding Network in Active Site ...
Microelectronic Circuit Analogous to Hydrogen Bonding Network in Active Site ...Microelectronic Circuit Analogous to Hydrogen Bonding Network in Active Site ...
Microelectronic Circuit Analogous to Hydrogen Bonding Network in Active Site ...
 
Texture Unit based Monocular Real-world Scene Classification using SOM and KN...
Texture Unit based Monocular Real-world Scene Classification using SOM and KN...Texture Unit based Monocular Real-world Scene Classification using SOM and KN...
Texture Unit based Monocular Real-world Scene Classification using SOM and KN...
 

Dernier

Powerpoint exploring the locations used in television show Time Clash
Powerpoint exploring the locations used in television show Time ClashPowerpoint exploring the locations used in television show Time Clash
Powerpoint exploring the locations used in television show Time Clashcharlottematthew16
 
"LLMs for Python Engineers: Advanced Data Analysis and Semantic Kernel",Oleks...
"LLMs for Python Engineers: Advanced Data Analysis and Semantic Kernel",Oleks..."LLMs for Python Engineers: Advanced Data Analysis and Semantic Kernel",Oleks...
"LLMs for Python Engineers: Advanced Data Analysis and Semantic Kernel",Oleks...Fwdays
 
DevoxxFR 2024 Reproducible Builds with Apache Maven
DevoxxFR 2024 Reproducible Builds with Apache MavenDevoxxFR 2024 Reproducible Builds with Apache Maven
DevoxxFR 2024 Reproducible Builds with Apache MavenHervé Boutemy
 
Scanning the Internet for External Cloud Exposures via SSL Certs
Scanning the Internet for External Cloud Exposures via SSL CertsScanning the Internet for External Cloud Exposures via SSL Certs
Scanning the Internet for External Cloud Exposures via SSL CertsRizwan Syed
 
Nell’iperspazio con Rocket: il Framework Web di Rust!
Nell’iperspazio con Rocket: il Framework Web di Rust!Nell’iperspazio con Rocket: il Framework Web di Rust!
Nell’iperspazio con Rocket: il Framework Web di Rust!Commit University
 
SAP Build Work Zone - Overview L2-L3.pptx
SAP Build Work Zone - Overview L2-L3.pptxSAP Build Work Zone - Overview L2-L3.pptx
SAP Build Work Zone - Overview L2-L3.pptxNavinnSomaal
 
How AI, OpenAI, and ChatGPT impact business and software.
How AI, OpenAI, and ChatGPT impact business and software.How AI, OpenAI, and ChatGPT impact business and software.
How AI, OpenAI, and ChatGPT impact business and software.Curtis Poe
 
Anypoint Exchange: It’s Not Just a Repo!
Anypoint Exchange: It’s Not Just a Repo!Anypoint Exchange: It’s Not Just a Repo!
Anypoint Exchange: It’s Not Just a Repo!Manik S Magar
 
"ML in Production",Oleksandr Bagan
"ML in Production",Oleksandr Bagan"ML in Production",Oleksandr Bagan
"ML in Production",Oleksandr BaganFwdays
 
TeamStation AI System Report LATAM IT Salaries 2024
TeamStation AI System Report LATAM IT Salaries 2024TeamStation AI System Report LATAM IT Salaries 2024
TeamStation AI System Report LATAM IT Salaries 2024Lonnie McRorey
 
TrustArc Webinar - How to Build Consumer Trust Through Data Privacy
TrustArc Webinar - How to Build Consumer Trust Through Data PrivacyTrustArc Webinar - How to Build Consumer Trust Through Data Privacy
TrustArc Webinar - How to Build Consumer Trust Through Data PrivacyTrustArc
 
Developer Data Modeling Mistakes: From Postgres to NoSQL
Developer Data Modeling Mistakes: From Postgres to NoSQLDeveloper Data Modeling Mistakes: From Postgres to NoSQL
Developer Data Modeling Mistakes: From Postgres to NoSQLScyllaDB
 
Human Factors of XR: Using Human Factors to Design XR Systems
Human Factors of XR: Using Human Factors to Design XR SystemsHuman Factors of XR: Using Human Factors to Design XR Systems
Human Factors of XR: Using Human Factors to Design XR SystemsMark Billinghurst
 
Search Engine Optimization SEO PDF for 2024.pdf
Search Engine Optimization SEO PDF for 2024.pdfSearch Engine Optimization SEO PDF for 2024.pdf
Search Engine Optimization SEO PDF for 2024.pdfRankYa
 
Story boards and shot lists for my a level piece
Story boards and shot lists for my a level pieceStory boards and shot lists for my a level piece
Story boards and shot lists for my a level piececharlottematthew16
 
Ensuring Technical Readiness For Copilot in Microsoft 365
Ensuring Technical Readiness For Copilot in Microsoft 365Ensuring Technical Readiness For Copilot in Microsoft 365
Ensuring Technical Readiness For Copilot in Microsoft 3652toLead Limited
 
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage Cost
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage CostLeverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage Cost
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage CostZilliz
 
Take control of your SAP testing with UiPath Test Suite
Take control of your SAP testing with UiPath Test SuiteTake control of your SAP testing with UiPath Test Suite
Take control of your SAP testing with UiPath Test SuiteDianaGray10
 
"Debugging python applications inside k8s environment", Andrii Soldatenko
"Debugging python applications inside k8s environment", Andrii Soldatenko"Debugging python applications inside k8s environment", Andrii Soldatenko
"Debugging python applications inside k8s environment", Andrii SoldatenkoFwdays
 
"Subclassing and Composition – A Pythonic Tour of Trade-Offs", Hynek Schlawack
"Subclassing and Composition – A Pythonic Tour of Trade-Offs", Hynek Schlawack"Subclassing and Composition – A Pythonic Tour of Trade-Offs", Hynek Schlawack
"Subclassing and Composition – A Pythonic Tour of Trade-Offs", Hynek SchlawackFwdays
 

Dernier (20)

Powerpoint exploring the locations used in television show Time Clash
Powerpoint exploring the locations used in television show Time ClashPowerpoint exploring the locations used in television show Time Clash
Powerpoint exploring the locations used in television show Time Clash
 
"LLMs for Python Engineers: Advanced Data Analysis and Semantic Kernel",Oleks...
"LLMs for Python Engineers: Advanced Data Analysis and Semantic Kernel",Oleks..."LLMs for Python Engineers: Advanced Data Analysis and Semantic Kernel",Oleks...
"LLMs for Python Engineers: Advanced Data Analysis and Semantic Kernel",Oleks...
 
DevoxxFR 2024 Reproducible Builds with Apache Maven
DevoxxFR 2024 Reproducible Builds with Apache MavenDevoxxFR 2024 Reproducible Builds with Apache Maven
DevoxxFR 2024 Reproducible Builds with Apache Maven
 
Scanning the Internet for External Cloud Exposures via SSL Certs
Scanning the Internet for External Cloud Exposures via SSL CertsScanning the Internet for External Cloud Exposures via SSL Certs
Scanning the Internet for External Cloud Exposures via SSL Certs
 
Nell’iperspazio con Rocket: il Framework Web di Rust!
Nell’iperspazio con Rocket: il Framework Web di Rust!Nell’iperspazio con Rocket: il Framework Web di Rust!
Nell’iperspazio con Rocket: il Framework Web di Rust!
 
SAP Build Work Zone - Overview L2-L3.pptx
SAP Build Work Zone - Overview L2-L3.pptxSAP Build Work Zone - Overview L2-L3.pptx
SAP Build Work Zone - Overview L2-L3.pptx
 
How AI, OpenAI, and ChatGPT impact business and software.
How AI, OpenAI, and ChatGPT impact business and software.How AI, OpenAI, and ChatGPT impact business and software.
How AI, OpenAI, and ChatGPT impact business and software.
 
Anypoint Exchange: It’s Not Just a Repo!
Anypoint Exchange: It’s Not Just a Repo!Anypoint Exchange: It’s Not Just a Repo!
Anypoint Exchange: It’s Not Just a Repo!
 
"ML in Production",Oleksandr Bagan
"ML in Production",Oleksandr Bagan"ML in Production",Oleksandr Bagan
"ML in Production",Oleksandr Bagan
 
TeamStation AI System Report LATAM IT Salaries 2024
TeamStation AI System Report LATAM IT Salaries 2024TeamStation AI System Report LATAM IT Salaries 2024
TeamStation AI System Report LATAM IT Salaries 2024
 
TrustArc Webinar - How to Build Consumer Trust Through Data Privacy
TrustArc Webinar - How to Build Consumer Trust Through Data PrivacyTrustArc Webinar - How to Build Consumer Trust Through Data Privacy
TrustArc Webinar - How to Build Consumer Trust Through Data Privacy
 
Developer Data Modeling Mistakes: From Postgres to NoSQL
Developer Data Modeling Mistakes: From Postgres to NoSQLDeveloper Data Modeling Mistakes: From Postgres to NoSQL
Developer Data Modeling Mistakes: From Postgres to NoSQL
 
Human Factors of XR: Using Human Factors to Design XR Systems
Human Factors of XR: Using Human Factors to Design XR SystemsHuman Factors of XR: Using Human Factors to Design XR Systems
Human Factors of XR: Using Human Factors to Design XR Systems
 
Search Engine Optimization SEO PDF for 2024.pdf
Search Engine Optimization SEO PDF for 2024.pdfSearch Engine Optimization SEO PDF for 2024.pdf
Search Engine Optimization SEO PDF for 2024.pdf
 
Story boards and shot lists for my a level piece
Story boards and shot lists for my a level pieceStory boards and shot lists for my a level piece
Story boards and shot lists for my a level piece
 
Ensuring Technical Readiness For Copilot in Microsoft 365
Ensuring Technical Readiness For Copilot in Microsoft 365Ensuring Technical Readiness For Copilot in Microsoft 365
Ensuring Technical Readiness For Copilot in Microsoft 365
 
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage Cost
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage CostLeverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage Cost
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage Cost
 
Take control of your SAP testing with UiPath Test Suite
Take control of your SAP testing with UiPath Test SuiteTake control of your SAP testing with UiPath Test Suite
Take control of your SAP testing with UiPath Test Suite
 
"Debugging python applications inside k8s environment", Andrii Soldatenko
"Debugging python applications inside k8s environment", Andrii Soldatenko"Debugging python applications inside k8s environment", Andrii Soldatenko
"Debugging python applications inside k8s environment", Andrii Soldatenko
 
"Subclassing and Composition – A Pythonic Tour of Trade-Offs", Hynek Schlawack
"Subclassing and Composition – A Pythonic Tour of Trade-Offs", Hynek Schlawack"Subclassing and Composition – A Pythonic Tour of Trade-Offs", Hynek Schlawack
"Subclassing and Composition – A Pythonic Tour of Trade-Offs", Hynek Schlawack
 

Design and Implementation of Proportional Integral Observer based Linear Model Predictive Controller

  • 1. Full Paper ACEEE Int. J. on Control System and Instrumentation, Vol. 4, No. 1, Feb 2013 Design and Implementation of Proportional Integral Observer based Linear Model Predictive Controller Vihangkumar V. Naik, D. N. Sonawane, Deepak D. Ingole, Divyesh L. Ginoya and Vedika V. Patki Department of Instrumentation & Control Engineering, College of Engineering, Pune- 411 005 Maharashtra, India Email: naikvihang@gmail.com, dns.instru@coep.ac.in, dingole21@yahoo.in, dlginoya007@gmail.com, patki.vedika@gmail.com Abstract—This paper presents an interior-point method (IPM) fast response time and/or embedded applications where based quadratic programming (QP) solver for the solution of computational resource may be limited [4]. optimal control problem in linear model predictive control Recently, many reports in the literature address applying (MPC). LU factorization is used to solve the system of linear MPC to control applications with short sampling intervals, equations efficiently at each iteration of IPM, which renders by adapting fast optimization algorithms. These algorithms faster execution of QP solver. The controller requires internal states of the system. To address this issue, a Proportional solve the resulting QP by exploiting the special structure of Integral Observer (PIO) is designed, which estimates the state the control problem the MPC sub problem. IPM approaches vector, as well as the uncertainties in an integrated manner. the solution of Karush-Kuhn-Tucker (KKT) equations by MPC uses the states estimated by PIO, and the effect of successive decent steps. Each decent step is Newton’s like uncertainty is compensated by augmenting MPC with PIO- step and the solution is obtained by solving system of linear estimated uncertainties and external disturbances. The equations using appropriate numerical methods in order to approach is demonstrated practically by applying MPC to QET determine search direction. Matrix factorization approach DC servomotor for position control application. The proposed provides a means to simplify the computation involved in method is compared with classical control strategy-PID linear solver. Different matrix factorization methods are used control. such as Gauss elimination, QR, LU, and Cholesky [3], [5], [6]. Index Terms—Model Predictive Control, Interior-Point Model predictive control has received considerable Method, LU factorization, DC Servomotor, Proportional attention driven largely by its ability to handle hard Integral Observer. constraints. An inherent problem is that model predictive control normally requires full knowledge of the internal states. I. INTRODUCTION In the physical implementation of control strategy based on the system states, if the states are not available for This paper considers Interior-point algorithm used on- measurement then state feedback will not be the line with Linear Model Predictive Control (MPC). Linear MPC implementable. assumes a linear system model, linear inequality constraints The problem of robust control system design with an and a convex quadratic cost function [1]. MPC can be observer based on the knowledge of input and output of the formulated as a quadratic programming (QP) problem and plant has attracted many researchers now-a-days [7], [8], [9], solved at each sampling interval. It thus has the natural ability [10], [11], [12], [20]. The observer proves to be useful in not to handle physical constraints arising in industrial only system estimation and regulation but also identifying applications [2]. failures in dynamic systems. This requirement of obtaining At each sampling instance MPC solves an online QP the estimates of uncertainty, as well as state vector in an optimization problem, computes the sequence of optimal integrated manner is fulfilled by PIO. PIO approach basically current and future control inputs by minimizing the difference works when the system uncertainty varies slowly with respect between set-points and future outputs predicted from a given to time. It is an observer in which an additional term, which is plant model over a finite horizon in forward time. Then, only proportional to the integral of the output estimation error, is the current optimal input is applied to the plant. The updated added in order to estimate the uncertainties and improve the plant information is used to formulate and solve a new optimal system performance [7], [8], [9]. control problem at the next sampling instance. This procedure In this paper, we present an interior-point algorithm to is repeated at the each sampling instance and the concept is solve MPC problem, which utilizes Mehrotra’s predictor- called as receding horizon control MPC strategy. Since this corrector algorithm [13], and the linear system at each IPM quadratic program can be large depending upon control iteration is solved by LU factorization based Linear Solver. problem, MPC requires long computation times at each PIO is designed for state and uncertainties estimation. The sampling instants, therefore it is usually restricted to systems remainder of the paper is organized as follows: section II with slow dynamics and large sampling intervals, such as describes MPC problem formulation. Section III presents the chemical processes [3]. The ability to solve the QP problem interior-point method. In section IV, the PIO theory is briefly online become critical when applying MPC to systems with © 2013 ACEEE 23 DOI: 01.IJCSI.4.1.1064
  • 2. Full Paper ACEEE Int. J. on Control System and Instrumentation, Vol. 4, No. 1, Feb 2013 reviewed and applied for state and uncertainty estimation. where, N u is control horizon. The goal of the controller is to Mathematical modeling of DC servomotor is derived in Section V. IPM QP solver results, the effectiveness of observer ˆ make the difference between the output, y (t  N P ) and the based MPC scheme with simulation results is presented in reference, yref (t  N P ) as small as possible. This can be section VI. MPC implementation on Quanser QET DC servomotor is presented in section VII. defined by using a standard least squares problem. The objective function is defined as, II. MPC PROBLEM FORMULATION 1 NP 2 1 Nu 1 2 A discrete time linear time-invariant model of a system in J  2 i1 y(t  i)  yref (t  i)   u(t  i) R . ˆ Q 2 i1 (7) a state space form is given as, where, u (t  i )  u (t  i )  u (t  i  1) x(t  1)  Ax(t )  Bu(t ) . subjected to linear inequality constraints on system inputs, (1) y (t )  Cx(t )  umin  u (t )  umax where, y (t )  are output vector, u (t )  , where, yref is the set-point and while Q and R are the are input vector and x (t )  are internal states vector. . positive definite weight matrices [14]. To get optimal solution, A and B are system parameter matrices. Given a predicted the MPC problem can be formulated as a standard quadratic input sequence, the corresponding sequence of state programming (QP) problem as, predictions is generated by simulating the model forward 1  J (U )   U T HU  f T U  subjected to AU  b  0. (8) over the prediction horizon ( N P ) intervals. 2  x(t  2)  Ax(t  1)  Bu (t  1)  where, H is (lN u  lN u ) Hessian matrix, f is 2 . (2) x(t  2)  A x(t )  ABu(t )  Bu (t  1) (lN u 1) column vector [14], [16]. N P 1 x(t  N P )  A N P x(t )   j 0 ( A N P 1 j B )u ( j ). (3) III. INTERIOR-POINT METHOD The prediction model is given by, Consider the following standard QP problem, ˆ y (t  N P )  Cx (t  N P ). (4) min 1 xT Qx CT x subjected 2 to Ax  b  0, Lx  k  0 . x Putting the value of x (t  N P ) in (4), we get, (9) N 1 y(t  N P )  C[ A N P x(0)   j P0 ( A N P 1 j B)u ( j )]. ˆ Except equality constraints, (9) resembles (8). The KKT Conditions for optimality are given by, (5) In matrix form (5) is written as, Qx  AT y  LT z  C  Y  x(0)  U . (6)  with, Ax  b  0   Lx  s  k  0 . Y   y (t  1) y(t  2)  y (t  N P ) , T ˆ ˆ ˆ T  (10) z s0  U  u (t ) u (t  1)  y (t  N u  1)  , T ˆ z, s  0    CA  where, y and z represents the Lagrange multipliers for  CA 2  equality and inequality constraints respectively. The slack  , variable s is introduced for converting inequality into     NP  equality. By applying Newton’s method, search direction CA  ( x,y ,z , s ) is obtained as shown in (11), where J ( x , y , z , s ) denotes Jacobian of f ( x, y, z , s ) ,  CB 0  0  CAB CB  0  x   r1     y        0  N p 1 N p 2 N p Nu  J ( x, y, z , s )      r2 . CA B CA B  CA B  z   r3  (11)     24  s   r4  © 2013 ACEEE DOI: 01.IJCSI.4.1.1064
  • 3. Full Paper ACEEE Int. J. on Control System and Instrumentation, Vol. 4, No. 1, Feb 2013 Considering only inequality constraints, augmented form of A  LU ; original system is given as, Solve LY  B; //forward substitution Q LT  x  r1   1      1  . (12) UX  Y ; //backward substitution  L  Z S   z  r3  Z r4  X   X 1; X 2 ; s  Z 1 (r4  Sz). (13) Interior-point method(IPM) algorithm We use Mehrotra’s Predictor-corrector algorithm [13] to solve Initialization and input (12) and (13) for ( x ,  z ,  s ). Predictor or affine and X 0  0 0  0 ; T corrector-centering steps uses ( r1 , r3 , r4 ) values from (14) Z0  1 1  1 ; S0  1 1  1 ; Z0 , S0  0; T T and (15) respectively to form the right-hand side of (12) and (13) which in turn finds ( x aff ,  z aff , s aff ) and e  1 1  1 ;  0.25 T (x cc , z cc , s cc ) [1], [15], [17], [18], [19]. Input Q, C , L, k matrices from given QP problem T  r1  Qx  C  L z T Z 0 S0  r     Lx  s  k   ; m- no. of constraints  3  . (14) m r4     ZSe  Start the loop and terminate if stopping criterion are satisfied   Predictor or affine step S  diag ( S 0 ); Z  diag ( Z 0 );  r1   0  r1aff  QX 0  C  LT Z 0 ; r3aff  LX 0  S0  k ; r     (15)  0 .  3 r4    diag (z aff )diag (s aff )e  e r4 aff  ZSe;   Solve (13), (12) by linear solver and compute where,  is centering parameter and  is complementarity measure or duality gap. Thus, solution of linear system in x aff , z aff , s aff (13) is to be calculated twice at each iteration of IPM, which puts major computational load on overall performance of IPM, Compute centring parameter  and eventually on MPC. Linear system in (13) uses two different right-hand side components but the same coefficient ( Z 0  z aff )T ( S 0  saff ) matrix, so just one factorization of this matrix is required per  aff  ; iteration. Such system can be solved using Gauss elimination, m QR, LU, Cholesky factorization methods. 3 The coefficient matrix in a linear system (13) involved in      aff   ;  IPM is symmetric and indefinite so conventional and more   numerically stable Cholesky factorization cannot be used to solve the linear system. Compared to computational cost of Corrector and centring step to obtain search direction QR decomposition (2/3n3) and the problem of associated Z aff  diag ( z aff ); S aff  diag ( saff ); pivoting with ill condition of Gauss elimination, LU factorization proves to be more effective and accurate to solve r1cc  0; r3cc  0; r4 aff  Z aff S aff e   e; system of linear equations [5], [6]. We propose LU factorization based Linear Solver for the same. The pseudo Solve (13), (12) by linear solver and compute code of LU factorization Linear Solver for (13) is given as follows: x cc , z cc , s cc Pseudo Code-LU factorization A   A11 A12 ; A21 A22 ; Update ( x ,  z ,  s ) as where, A11  Q; A12  LT ; A22  L; A22   Z 1S (x, z, s)  ( x aff , z aff , s aff )  (x cc , z cc , s cc ) B  B11; B22 ; Update X 0 , Z 0 , S 0 as where, B11  r1 , B22  ( r3  Z 1r4 ); X 0  X 0   x ; Z 0  Z 0   z ; S 0  S 0   s ; End of loop © 2013 ACEEE 25 DOI: 01.IJCSI.4.1.1064
  • 4. Full Paper ACEEE Int. J. on Control System and Instrumentation, Vol. 4, No. 1, Feb 2013 IV. OBSERVER DESIGN Simplifying (13) The implementation of MPC requires the measurements  ~(t  1)   A B  L  x   ~ (t ) x of all the states. As only an encoder is used for measurement     C 0  ~ .  ~ (t  1)  0 0  M  e (t )  of the motor shaft position in practice. PIO is designed in this e        section for present application. Consider a linear time-invariant system It follows that x(t ) is an estimate of x(t ) if and only if, ˆ q R   0 for q  1, , ( n  p ) . The generalized block ~ (t  1)  A~ (t )  Bu (t )  L( y (t )  y (t ))  Be(t )  x x ˆ ˆ diagram of the observer based MPC system is shown in ˆ ˆ y (t )  Cx(t )  .  Fig. 1. ˆ ˆ ˆ e(t  1)  e(t )  M ( y(t )  y (t ))   V. MATHEMATICAL MODELLING OF DC SERVOMOTOR For mathematical model derivation of DC servomotor, the where ~ (t ) is the estimated state vector and e (t ) is the x ~ electrical & torque characteristic equations are formulated. estimation of uncertainties of p-dimensional vector. L proportional and M integral observer gain matrices of appropriate dimension. The system described by Eq. (16) is said to be a full-order PI observer for system (1) if and only if lim ~ (t )  0 x  t  lim e~ (t )  0 .  t    where, ~(t )  x(t )  x(t ) represents the observer’s state x ˆ ~ ˆ estimation error and e (t )  e(t )  e(t ) represents the error in uncertainty estimation. We are assuming the following for derivation. Figure 2. Schematic diagram of DC Servomotor 1. Matrices A, B, C are known. All uncertainties associated Fig. 2, shows the schematic diagram of armature controlled DC servomotor. Using Kirchhoff’s voltage law (KVL), with the matrices A and B are lumped into e(t ) .  2. The pair ( A, B) is controllable. Vm  R m I m  Lm   I m  k m  m . .   t  3. The pair ( A, C ) is observable. where, k m is the back-emf constant, R m is the motor winding resistance and L m is the motor winding inductance, I m is the current through the motor winding. TABLE I. NOMINAL DC SERVOMOTOR PARAMETERS [21] Description Symbol Value Unit Motor electric time constant e 7.74 * 10-5 s Moment of inertia J eq 2.21*10-5 Kg.m2 Motor maximum velocity umax 298.8 rad/s Motor maximum current I max 1.42 A Figure 1. Generalized block diagram of observer based MPC system Motor maximum torque Tmax 0.068 N.m From (1) and (16), the dynamic of the observer error becomes Motor torque constant km 0.0502 N.m/A ~ (t  1)  ( A  LC ) ~ (t )  B~ (t ). x x e  Motor armature resistance Rm 10.6 Ohm which together with (16) results in; Motor armature inductance Lm 0.82 mH  ~(t  1)  A  LC x B   ~(t ) x Open loop time constant T 0.0929 s  ~(t  1)    MC   ~ (t ).  Open loop steady state gain K 19.9 rad/(V.s) e   0  e  © 2013 ACEEE 26 DOI: 01.IJCSI.4.1.1064
  • 5. Full Paper ACEEE Int. J. on Control System and Instrumentation, Vol. 4, No. 1, Feb 2013 Representing (21) in Laplace domain as follows: R m I m  Lm I m s  Vm  k m  m .  The armature electrical time constant of system is represented as, Lm e  . R m  Expressing the torque equation into the Laplace domain, J eq  m s  k m I m  Td .  Combining (21) and (23), Figure 3. Per iteration computation time comparison of QP solving 2 2 methods k m  m ( s ) k m Vm (s ) servomotor. J eq  m ( s )s    Td ( s ).  Rm Rm Substituting the parameter values from Table I in (29), the state space representation of DC servomotor model can be Transfer function from motor shaft position to the motor input obtained as, voltage can be given as,  ( s) 0 1   0  Gm ( s )  .  A  , B   210 , C  1 0, D  0. (30) Vm ( s ) 0  1   The plant system parameters can be expressed as, QET DC servomotor model as given in (30) was considered for the MATLAB simulation of MPC. The simulation results km of the proposed Observer based MPC and high pass filter Gm ( s )  2 . (HPF) based MPC are shown in Fig. 4, Fig. 5, and Fig. 6.  k  Rm  J eq s  m     Rm  Simplifying the above equation further, b K G m ( s)   .  s ( s  a) s ( s   ) km where, 2 and b km J eq Rm a J eq Rm km is the steady state gain and  is the time constant of the Figure 4. Comparative plot of position response system. Converting the transfer function into the state space form, From the results it is observed that observer does better state estimation compared to HPF in transient time. Due to 0 1   0  better state estimation of actual states, control input is A 1  , B   K  , C  1 0, D  0. conservative and states have less oscillation in the transient 0          response.  VI. MATLAB SIMULATION A. QP Solver The proposed algorithm is coded in MATLAB. Fig. 3, shows per iteration computation time comparison of proposed method with QR factorization and MATLAB’s QP solver quadprog. B. MPC Implimentation The designed MPC with PIO is tested through experimentation for position control application of a DC Figure 5. Comparative plot of second state © 2013 ACEEE 27 DOI: 01.IJCSI.4.1.1064
  • 6. Full Paper ACEEE Int. J. on Control System and Instrumentation, Vol. 4, No. 1, Feb 2013 Figure 6. Comparative plot of control input VII. HARDWARE IMPLEMENTATION Efficacy of the proposed approach is demonstrated practically on Quanser QET DC servomotor plant with 0.01s sample time. Figure 8. Quanser QET DC servomotor setup Figure 9. Comparative plot of position response using PID controller and MPC Figure 7. Real-time MPC Implementation strategy for position control of QET DC servomotor The experimental setup has DC servomotor with Q2 USB based data acquisition card and a PC equipped with proprietary QuaRc 2.1 software. QuaRc provides hardware- in-loop simulation environment [21]. Motor shaft position θ(t) is measured by an encoder. To provide state estimation of plant, PIO is developed. The proposed real-time MPC implementation strategy and the experimental setup are shown in Fig. 7 and Fig. 8 respectively. The performance of designed observer based MPC scheme is compared with classical controller i.e. PID controller. Experimentation has been carried out with constant load to DC servomotor as an external disturbance. Fig. 9, shows the plot of position response using PID controller Figure 10. Comparative plot of control input of PID controller and MPC and MPC. It shows that proposed MPC scheme has better transient response compare to classical controller. Fig. 11, shows the position responses of the plant using Plot of control input of MPC and PID controller is shown two different prediction horizon with the control horizon kept in Fig.10. Control input of MPC is conservative as compare constant at N u  3 . From Fig. 12, it is observed that to PID, which can be clearly observed from the plot. © 2013 ACEEE 28 DOI: 01.IJCSI.4.1.1064
  • 7. Full Paper ACEEE Int. J. on Control System and Instrumentation, Vol. 4, No. 1, Feb 2013 ACKNOWLEDGMENT The authors would like to thank Rashmi More from De- partment of Mathematics, College of Engineering, Pune, for her sustained contribution towards this work. REFERENCES [1] A. G. Wills, W. P. Heath, “Interior-Point Methods for Linear Model Predictive Control,” Control 2004, University of Bath, UK, 2004. [2] A. G. Wills, A. Mills, B. Ninness, “FPGA Implementation of an Interior-Point Solution for Linear Model Predictive Control,” Preprints of the 18 th IFAC World Congress Milano (Italy), pp. 14527-14532, 2011. Figure 11. Plant response to reference position for different [3] C. V. Rao, S. J. Wright, J. B. Rawlings, “Application of interior prediction horizon point methods to model predictive control,” Journal of Optimization Theory and Applications, pp.723-757, 1998. [4] K. V. Ling, S. P. Yue, and J. M. Maciejowski, “A FPGA Implementation of Model Predictive Control,” Proceedings of the 2006 American Control Conference, pp. 1930-1935. Minneapolis, Minnesota, USA, 2011. [5] A. Sudarsanam, T. Hauser, A. Dasu, S. Young, “A Power Efficient Linear Equation Solver on a Multi-FPGA Accelerator,” International Journal of Computers and Applications, Vol. 32(1), pp. 1-19, 2010. [6] W. Chai, D. Jiao, “An LU Decomposition Based Direct Integral Equation Solver of Linear Complexity and Higher-Order Accuracy for Large-Scale Interconnect Extraction,” IEEE Transactions on Advanced Packaging, Vol. 33(4), pp. 794- 803, 2010. [7] S. Belale, B. Shafai, “Robust Control System Design with a Figure 12. Control input for different prediction horizon Proportional Integral Observer,” International Journal of Control, Vol. 50(1), pp. 97-111, 1989. N p  10 results in a shorter rise time and a shorter settling [8] S. Belale, B. Shafai, H. H. Niemann, J. L. Stoustrup, “LTR Design of Discrete-Time Proportional-Integral Observers,” time in the position response then N p  40 . Thus the IEEE Transactions on Automatic Control, Vol. 41(7), pp. 1056- 1062, 1996. responses are faster while decreasing the Prediction [9] B. Shafai, H. M. Oloomi, “Output Derivative Estimation and Disturbance Attenuation using PI Observer with Application Horizon N p . Fig. 12, shows that this improvement is achieved to a Class of Nonlinear Systems,” IEEE Conference at the cost of larger control signal. proceedings, pp. 1056-1062, 2003. [10] S. Belale, B. Shafai, H. H. Niemann, J. L. Stoustrup, “LTR CONCLUSIONS Design of Discrete-Time Proportional-Integral Observers,” IEEE Transactions on Power Electronics, Vol. 15(6), pp. 1056- In this paper, LU factorization based linear solver for 1028, 2000. solution of IPM is presented, which is used for real-time [11] W. H. Chen, D. Ballance, P. Gawthrop, & J. O’Reilly, “A implementation of constrained linear model predictive nonlinear disturbance observer for robotic manipulators,” IEEE controller for position control of DC servomotor. The issue Transactions on Industrial Electronics, 47(4), 932–938, 2000. of unavailability of internal state vector for implementation [12] K. S. Low, and H. Zhuang, “Roboust Model Predictive Control of MPC is addressed by designing a PIO. Simulation results and Observer for Direct Drive Applications,” IEEE Transactions on Power Electronics, Vol. 15, NO. 6, November are presented to demonstrate the effectiveness of PIO. 2000. Simulation result shows the superior performance of observer [13] S. Mehrotra, “On Implementation of a primal-dual interior- to estimate the state vector as well uncertainty compared to point method,” SIAM Journal on Optimization, Vol. 2(4), HPF. From experimentation results it is observed that, the pp.575-601, 1992. proposed scheme solves QP problem efficiently within the [14] J. M. Maciejowski, “Predictive Control with Constraints,” specified sample period and performs well for tracking a Pearson Education Limited, 2002. reference position of DC servomotor which is relatively a [15] S. J. Wright, “Applying new optimization algorithms to model fast dynamic system. Performance of the designed MPC has predictive control,” Chemical Process Control-V, CACHE, been compared with PID control via experimental results. It is AIChE Symposium Series, Vol. 93(316), pp-147-155, 1997. [16] A. G. Wills, “Technical Report EE04025 - Notes on Linear also observed that, the controller is robust to handle parameter Model Predictive Control”, 2004. uncertainties and load disturbances. © 2013 ACEEE 29 DOI: 01.IJCSI.4.1.1064
  • 8. Full Paper ACEEE Int. J. on Control System and Instrumentation, Vol. 4, No. 1, Feb 2013 [17] T. R. Kruth, “Interior-Point Algorithms for Quadratic [19] A. G. Wills, W. P. Heath, “Interior-Point Methods for Linear Programming,” IMM-M.Sc-2008-19, Technical University of Model Predictive Control,” Technical Report, University of Denmark, 2008. Newcastle, Australia, 2003. [18] I. M. Nejdawi, “An Efficient interior Point Method for [20] F. Stinga, M. Roman, A. Soimu, E. Bobasu, “Optimal and Sequential Quadratic Programming Based Optimal Power MPC Control of the Quanser Flexible Link Experiment,”4th Flow,” IEEE Transactions on Power Systems, Vol. 15(4), pp. WSEAS/IASME International Conference on Dynamical 1179—1183, 2000. Systems and Control (Control’08), pp. 175—180, 2008. [21] “QET QuaRc Integration-instructor manual”, Quanser Inc., Markham, ON, Canada, 2010. © 2013 ACEEE 30 DOI: 01.IJCSI.4.1.1064