0% found this document useful (0 votes)
13 views13 pages

Application of A Merit Function Based Interior Point Method To Linear Model Predictive Control

This paper introduces a robust linear model predictive control (MPC) technique that utilizes a merit function based on a path following strategy to solve the quadratic programming (QP) problems arising in MPC. The proposed primal dual interior point method ensures global convergence to the optimal solution while adhering to inequality constraints, and it is implemented on a linear MPC problem of an undamped oscillator. Results demonstrate that the method effectively manages external disturbances and noise, showcasing its robustness in practical applications.

Uploaded by

ijitmcjournal12
Copyright
© © All Rights Reserved
We take content rights seriously. If you suspect this is your content, claim it here.
Available Formats
Download as PDF, TXT or read online on Scribd
0% found this document useful (0 votes)
13 views13 pages

Application of A Merit Function Based Interior Point Method To Linear Model Predictive Control

This paper introduces a robust linear model predictive control (MPC) technique that utilizes a merit function based on a path following strategy to solve the quadratic programming (QP) problems arising in MPC. The proposed primal dual interior point method ensures global convergence to the optimal solution while adhering to inequality constraints, and it is implemented on a linear MPC problem of an undamped oscillator. Results demonstrate that the method effectively manages external disturbances and noise, showcasing its robustness in practical applications.

Uploaded by

ijitmcjournal12
Copyright
© © All Rights Reserved
We take content rights seriously. If you suspect this is your content, claim it here.
Available Formats
Download as PDF, TXT or read online on Scribd
You are on page 1/ 13

International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.

2, May 2014

APPLICATION OF A MERIT FUNCTION BASED INTERIOR


POINT METHOD TO LINEAR MODEL PREDICTIVE
CONTROL

Prashant Bansode1, D. N. Sonawane2 and Prashant Basargi3


1,2,3
Department of Instrumentation and Control Engineering, College of Engineering,
Pune, Maharashtra

ABSTRACT
This paper presents robust linear model predictive control (MPC) technique for small scale linear MPC
problems. The quadratic programming (QP) problem arising in linear MPC is solved using primal dual
interior point method. We present a merit function based on a path following strategy to calculate the step
length α, which forces the convergence of feasible iterates. The algorithm globally converges to the optimal
solution of the QP problem while strictly following the inequality constraints. The linear system in the QP
problem is solved using LDLT factorization based linear solver which reduces the computational cost of
linear system to a certain extent. We implement this method for a linear MPC problem of undamped
oscillator. With the help of a Kalman filter observer, we show that the MPC design is robust to the external
disturbances and integrated white noise.

KEYWORDS
Model Predictive Control, Quadratic Programming, Primal Dual Interior Point Methods, Merit Function

1. INTRODUCTION

MPC is an advanced control strategy. It predicts the effect of the input control signal on internal
states and the output of the plant. At each sampling interval of this strategy, the plant output is
measured, the current state of the plant is estimated and based on these calculations a new control
signal is delivered to the plant. The purpose of the new control input is to ensure that the output
signal tracks the reference signal while satisfying the objective function of the MPC problem
without violating the given constraints, see [1]-[3]. The objective function is defined in such a
way that the output signal tracks the reference signal while it eliminates the effect of known
disturbances and noise signals to achieve closed loop control of the plant. The constraints can be
given in terms of bounds on input and output signals. In reality, these constraints can be the
physical limitations on actuator movements, often called as hard constraints. MPC strategy
handles physical constraints effectively which makes it suitable for industrial applications.

MPC problem can be formulated as a quadratic programming (QP) optimal control problem, see
[2]-[4]. This QP problem is solved at a specific sampling interval to compute a sequence of
current and future optimal control inputs from the predictions made on the current state and the
plant output over a finite horizon known as prediction horizon; see [4]. Only the current optimal
input is implemented as the plant input and the plant is updated for internal states and the plant
output. Again, at next sampling interval the updated plant information is used to formulate a new
DOI : 10.5121/ijitmc.2014.2205 37
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014

optimal control problem and the process is repeated. MPC problem may require a long
sampling time depending upon computational complexities associated with the QP problem
solving algorithm. Therefore, the application of MPC is restricted to systems with slow dynamic
performance; such applications are found in chemical industries. Interior point methods are
widely accepted as the QP problem solving techniques in MPC applications. In last two decades,
many research literatures have discussed the application of interior point methods to MPC
problems with relatively faster dynamics by exploiting the structure of QP problems arising in
MPC, see [1], [5], [6], [11]. The general discussion on interior point methods is seen in [1], [5],
[6], [7], [8], [9], [10], [11]. For discussion on MPC as an optimal control strategy, see [2], [3], [4],
[12], [13]. For small scale MPC problems (with state dimension not more than five) we need not
exploit the structure of the problem, rather the effort should be in the direction to render faster
execution of QP solving techniques by introducing new step length strategies and improving
linear solvers while retaining the stability of the system, see [10], [11].

If we consider the barrier method (earlier form of interior point method) for MPC problems, it has
computational complexities associated with calculating the inverse of the Hessian matrix [9]. The
computational cost of inverting the Hessian is O(n3), Secondly, the barrier method requires two
distinct iterations to update primal and dual variables, see [9]. Moreover, this method works only
for strictly feasible problems. If barrier methods are considered for MPC problems, the above
issues will dramatically affect the computational time of a numerical QP algorithm, as a result,
also the sampling time of the MPC. The primal dual interior point method has several advantages
over barrier methods such as updates of primal and dual variables are computed in a single
iteration, efficiency in terms of accuracy and ability to work even when problem is not strictly
feasible, and inverting the Hessian matrix is not required. Hence, it is more cost effective to select
the primal dual interior point methods for QP problems than selecting the barrier methods.
Further, faster convergence of iterates can be achieved by considering new step length strategies
in the primal dual algorithm. One of such strategies is to measure progress to the solution by
monitoring a merit function. We can measure progress to the solution between two successive
iterates using a proper merit function, see [15]-[17]. We consider a logarithmic merit function that
contains all the possible information required to minimize a convex quadratic objective function.

This paper discusses the primal dual interior point method to solve linear model predictive control
problems with convex quadratic objective function and linear inequality constraints on the control
input. The proposed method utilizes a log barrier penalty function as a merit function which
estimates the progress to the solution and forces convergence of the primal dual feasible iterates,
hence making the algorithm to execute faster while strictly maintaining the feasibility. To solve a
linear system for computation of Newton steps, we use LDLT factorization linear solver which
reduces the computational cost of the linear solver from O(n3) to its O((1/3)n3), see [9]. The step
length selection is based on the mathematical condition derived using the merit function, and only
that step length value is selected for which a sufficient decrease in the derived condition is
observed. Finally, we implement this algorithm to a problem of undamped oscillator described in
[3] using MATLAB platform. In results, we show that the proposed method solves a MPC
problem within the specified sampling interval. Secondly, using Kalman filter observer we also
prove that our MPC design is robust in terms of disturbance and noise rejection.

We organize the paper as follows: Section 2 describes linear MPC plant model and its QP
formulation. In section 3, we discuss the proposed QP solving algorithm; section 4 includes MPC
implementation on the undamped oscillator problem with simulation results. Section 5 concludes
our paper.

38
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014

2. MPC PROBLEM FORMULATION

The linear MPC comprises a linear plant model, convex quadratic objective function and linear
inequality constraints. The plant model is described in the section below.

2.1. Plant Model

We assume a state space model of the plant as given below:

xt +1 = Axt + Bu t + Gwt ,
(1)
yt = Cxt + Du t + vt .

Where x t ∈ R n x , u t ∈ R nu , y t ∈ R y .
n

Further, we assume that the plant is subjected to white noise disturbances i.e. unbiased process
noise wt and measurement noise vt which are Gaussian distributed with zero mean. We design a
Kalman filter observer to calculate the estimates of the current state and the plant output. If Np is
a prediction horizon, MPC computes these estimates over the entire prediction horizon from time
t+1 until time t+Np based on the information about previous plant measurements available from t-
1 up to current time t. Let us represent the optimal estimates of the state space equations as given
below:

xt +i +1 = Axt +i + Bu t +i + Gwt +i ,
(2)
y t +i = Cxt +i + Du t +i + vt +i .

Where, i =1,…, Np.

2.2. Control Objective

The main objective of MPC is to force yt to track the reference signal, denoted by rt while
rejecting the disturbance signal, denoted by dt. A control objective can be represented
mathematically using an objective function which obeys certain inequality constraints. By
including a penalty term such as ||yt-rt|| in the objective function, we penalize deviations of the
output from the reference. Secondly by adding a term like ||ut-ut-1|| to the objective functions we
penalize the control signal ut not to exceed a given limit, say lb ≤ ut ≤ ub, where lb and ub are
lower and upper bounds on the input respectively. The objective function for the MPC problem is
defined below as:

1 P
J= ∑ ||yt + k − rt + k ||Q2 + || ut + k − ut + k −1 ||2S .
2 k =1
(3)

In the above, matrices Q and S act as weight factors on yt and ut respectively, and they are
assumed to be symmetric and positive definite. Further, we can illustrate that:

|| y t + k − rt + k ||Q2 = ( y t + k − rt + k ) T Q ( y t + k − rt + k ). (4)

39
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014

And
|| ut +k − ut +k −1 ||2S = (ut +k − ut +k −1 )T S (ut +k − ut +k −1 ). (5)

We derive the objective function in a compact form as given below:

1
J = U tT HU t + h T U t . (6)
2

Where Ut is the optimal control input as a solution to the above QP problem. The state space
matrices and weighting factors do not change unless modified by the user. Hence, the matrix H
can be computed prior to the plant simulation i.e. it is computed offline. The basic formulation of
a MPC problem as a QP optimal control problem is cited in [2]-[4].

2.3. Inequality Constraints

Inequality constraints on the control input signal prevent it from exceeding a specific limit. We
describe the inequality constraints on the control input as given below:

U min < U < U max or

− I  − U min 
 I  U =  max  . (7)
  U 

With the control objective and the inequality constraints formulated as shown in (6) and (7)
respectively, we compute the optimal control input Ut* as a solution to QP optimal control
problem shown below:

U t* = min J
(8)
s.t PinU t ≤ qin .

3. QP SOLVER

In this section, we discuss the algorithm for primal dual interior point method. At first, we define
Lagrangian function and derive its K-K-T optimality conditions. In later part, we discuss the
merit function and finally the algorithm.

Consider an inequality constrained QP problem in general form as given below:

1
min J = u T Hu + h T u ,
2 (9)
subject to Pu ≤ q.

For the sake of simplicity of the algorithm, we use notations u, P and q for Ut, Pin and qin
respectively.

40
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014

3.1. K-K-T Optimality Conditions

The Lagrangian of the above QP problem is given below:

L(u ,  ) = u T Hu + h T u + T ( Pu − q ). (10)

Where, λ is the Lagrange multiplier for the inequality constraints and s is the slack variable
associated with it. The optimality conditions for the general QP in (9) with u as a primal variable
and λ as a dual variable are given below:

Hu + P T  = − h,
Pu + s = q,
(11)
T s = 0,
 , s > 0.

Since we consider MPC-QP problems, they are assumed to be convex in nature and H is assumed
to be positive symmetric semidefinite matrix. Hence, the Optimality conditions derived above are
both necessary and sufficient.

The augmented linear system for above optimality conditions is given by:

H − P   ∆u   rd 
 PT −1    = −  .
  s  ∆  rp  (12)

Where rd and r p are the residues as given below:

rd = Hu + P T  + h and rp = Pu + s − q. (13)

3.2. Merit Function

We consider a force field interpretation theory [3] for selection of a proper merit function. We
consider force field acting on a particle in a feasible region as given below:

∇f i (u )
Fi (u ) = −∇(− log(− f i (u ))) = . (14)
f i (u )

The force Fi (u ) is associated with each constraint acting on a particle when it is at position u.
The potential associated with the total force field generated by constraints is summation of all
such force fields which is given as the logarithmic barrier function  . As the particle moves
toward the boundary of a feasible set, the bound on the particle grows strong repelling it away
from the boundary.

41
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014

The merit function we considered depends essentially upon a log barrier function given by:

m
f =  ∑ log(T ( piT u − qi )), with dom  = {u ∈ R m | f i (u ) < 0, i = 1,..., m}.
i =1

Where m=number of inequality constraints.

Now, if we penalise the Lagrangian L with the log barrier function f, we get:

m
  ( w) = L(u,  ) −  ∑ log(T ( piT u − qi )). (15)
i =1

Substituting for L(u,  ) in (15), we get:

m
  ( w) = J + T ( Pu − q) −  ∑ log(T ( piT u − qi )). (16)
i =1

Where, w = (u ,  ) which satisfies (u ,  ) > 0.

The merit function   (w) can be thought of as another QP minimization problem because f is
convex and strictly satisfy the constraints, it is given below as:

min   ( w),
(17)
Pu ≤ q.

The problem in (17) decreases along the direction ∆w forcing the convergence of w towards the
solution of (12) which is unique, say w*. We can say that:

 (wi +1 ) ≤  (wi ) . (18)

We derive the conditions for a stationary point w* by computing ∇  ( w) = 0 using its directional
gradient ∇  (w) as given below:

∇  ( w) = ∇ u   ( w) + ∇    ( w) , (19)

m pi
∇ u   ( w) = ∇ u J + P  −  ∑ , (20)
i =1 ( p T
i u − qi )
m
1
∇    ( w) = Pu − q −  ∑ . (21)
i =1 

42
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014

Further, we can modify (20) and (21) as:

m
∇ u   ( w) = ∇ u J + ∇ u ( Pu − q) −  ∑ ∇( Pi u − qi )( piT u − qi ) −1 . (22)
i =1
m
∇    ( w) = Pu − q −  ∑ Λ−1e . (23)
i =1

In equations (22) and (23), ∇ u   (w) and ∇  (w) act as force fields on particles at position u
and λ respectively, forcing them away from the boundaries of the convex region to follow the
central path defined by the set of points (u*, λ*), for u>0 and λ>0.

Where Λ = Diagonal ( i ,...,  m ) and e is the unit vector associated with Λ.

The directional gradient ∇  (w) at point w is nonpositive, to assure that   (w) is only
decreasing as w moves along the central path toward the optimal solution w * . Now, the
progress to the QP solution can be monitored using the Newton step ∆w , associated step length
 and a point w = w +  ∆ w. The choice of sufficient decrease condition is in spirits with the
sufficient decrease condition mentioned in [9], [12]. We consider the Taylor’s series expansion of
  ( w + ∆w) at a point w which is given as:

 ( w + ∆w) ≤  ( w) + ∇ ( w)T ∆w. (24)

The above expansion term satisfies the condition given in (18); it also shows that   (w) reduces
as w moves towards its optimal solution. The backtracking search algorithm is used to compute
 such that w +  ∆w ≥ 0 . We stop the search algorithm if sufficient decrease in the condition
given in (24) is satisfied, if sufficient decrease in (24) is not observed then the value of  is
decreased and set to a value using  =  *  where  ∈ (0,1) and the process is repeated until the
sufficient decrease condition is satisfied. Hence, only those values of  are chosen for which
algorithm generates feasible iterates and values of  for which algorithm deviates from the
central path are rejected.

3.2. Algorithm

Let w0 = (u 0 , 0 ) be an initial point satisfying (u 0 , 0 ) > 0 and assume that H 0 is available for k=0,
1 , . . . ,  > 1,  feas > 0,  > 0.

Do

1. Choose  k ∈ (0,1) and set  k =  k * duality gap.


Where duality gap = k T s k / m and m = number of inequality constraints.

2. Compute Newton steps ∆u k & ∆ k by solving following augmented linear system. As


proposed, we solve the linear system using LDL T factorization method.
 H k − Pk  ∆uk  rd k 
 PT −1s  ∆  = − r ,
 k k k  k  p k 

43
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014

and ∇s k = −1 ( rs − S∆ ).


Where rd = Hu + P T  + h , rp = Pu + s − q − Se and rs = SΛe
And S = Diagonal ( s i ,..., s m ) .

3. Compute a step size  by using a backtracking line search.


Set  =  max = 1,
and test the sufficient decrease condition:   ( w + ∆w) ≤   ( w) + ∇  ( w) T ∆w,
Where  ∈ (0,1).
If the test function is not decreased sufficiently, decrease and compute  as given below:
  
 =  max min1,  min − ∆ < 0 ,
 ∆ 
Where  ∈ (0,1).

4. Update wk +1 = wk +  k ∆wk .
Until || rpri || 2 ≤  feas , || rdual || 2 ≤  feas , where  feas = tolerance level .

3.3. LDLT Factorization

The linear system given in (12) is of the form AX=B, where A is a Hermitian positive definite
matrix, the algorithm uniquely factors A as:

A = LDLT (Cost O((1/3)n3))

L is a lower triangular square matrix with unity elements at diagonal positions, D is the diagonal
matrix, and LT is the Hermitian transpose of L.

The equation LDLT X = B is solved for X by the following steps.

1. Substitute
Y = DLT X
2. Substitute
Z = LT X
3. Solve
LY = B , using forward substitution (Cost O(n2))
DZ = Y , solving diagonally (Cost O(n))
LT X = Z , using backward substitution (Cost O(n2))

The overall cost of the above linear solver is dominated by cost of A = LDLT which is O((1/3)n3).

44
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014

4. MPC IMPLEMENTATION

4.1. Plant Model

We consider a following problem of undamped oscillator for implementing linear MPC strategy;
this problem is cited from [3]. Its state space representation is given below:

 x1 (t )   0 1  x1 (t )  1
 x (t ) = − 4 0  x (t ) + 0u (t ),
 2    2   
(25)
 x (t ) 
y (t ) = [0 1] 1 .
 x2 (t )

The state space model given in (25) is both controllable and observable. The discrete time state
space representation of the system in (25) with sampling time of 0.1 seconds is given below

 x1 ( k + 1)   0.9801 0.0993  x1 ( k )   0.0993 


 x ( k + 1)  =  − 0.3973 0.9801  x ( k )  +  − 0.0199  u ( k ),
 2    2   
(26)
 x ( k ) 
y ( k ) = [0 1] 1 .
 2 
x ( k )

The control signal u(k) has inequality constraints given as -25 ≤ u(k) ≤ 25. We set the prediction
horizon to Np=10 and the control horizon to Nc=5 with the MPC sampling interval of Ts=1unit.

In our case, we introduce an integrated white noise signal in the plant which is assumed to be
Gaussian distributed with zero mean and covariance matrices Qo and Ro respectively.

The new plant model is given as:

 x(k + 1)   A 0  x(k )   B 
d (k + 1) =  0 I  d (k ) +  0 u (k ),
      
(27)
 x(k ) 
y (k ) = [C I ] .
d (k )

4.2. Observer Design

The observer equations for the state space representation in (27) are given as:

 x ( k + 1)    A 0  L x    x ( k + 1)   B  L 
 d ( k + 1)  =   0 I  −  L [C I ]   +  u (k ) +  x  y (k ) . (28)
     d   d ( k + 1)   0  L d 

For the plant subjected to white noise disturbances, we design Kalman filter observer with the
gain matrix L such that mean value of the sum of estimation errors is minimum. We obtain L
recursively using MATLAB command dlqe, see [3], [4] which is given as:

L = dlqe ( Ao , G o , C o , Qo , Ro ) . (29)

45
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014

 − 0.43
With Ao = A , G o = [I ]2 x 2 , C o = [1 1] , Q o = [I ]2 x 2 and Ro = 1 , we obtain L =  .
 0.52 

For the state space representation in (26), we obtain matrices Q, R, H and h as given below:

0.2022 0.1785 0.1498 0.1180 0.0860   0.8461


0.1785 0.1629 0.1391 0.1117 0.0828  0.7845
 0 .2    
Q = [ I ] 2 x 2 , R =   , H = 0.1498 0.1391 0.1233 0.1008 0.0763 and h = 0.6922 .
 0.1    
0.1180 0.1117 0.1008 0.0763 0.0666  0.5758
0.0563 0.0551 0.0557 0.0462 0.0387  0.4450

5. SIMULATION RESULTS

For the problem mentioned in (26), the simulations are run for 150 sampling intervals with Ts=1,
output disturbance is introduced for samples with t>50. The results shown in figure 1 are the
plant states x1 and x2 and their state estimations. Figure 2 shows the output response yt to the plant
in the presence of white noise and the output disturbances. In figure 3, we show the plant output
response yt without the presence of the white noise and output disturbances. We testify the
proposed method by comparing it with Matlab’s standard QP solver ‘Quadprog’ for the accuracy
of computed values of ut. In figure 4, we plot the graph for computational accuracy as well as
time comparison between the proposed method and Quadprog tool. In the graphs below, we use
PD-IP as a legend for proposed interior point method.

Figure 1. Plant states and their estimation using Kalman filter

46
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014

Figure 2. Plant output with disturbances and integrated white noise

Figure 3. Plant output without disturbances and integrated white noise

47
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014

Figure 4. Plot of computational time comparison for u(t)

6. CONCLUSION
In this paper, we presented a linear model predictive control of an undamped oscillator. The
primal dual interior point method has been used to solve the QP optimal control problem arising
in MPC. The logarithmic barrier merit function is used in such a way that it enables faster
convergence of iterates while they remain strictly feasible. From the simulations; it is found that
the proposed method is robust in the sense that it considerably rejects the output disturbances. For
a given example, the proposed method was able to compute the optimal solution of the MPC
problem approximately 3 times faster than that of using Quadprog without affecting the accuracy
of ut computations.

ACKNOWLEDGEMENTS

We would like to thank our senior colleagues Vihang Naik and Deepak Ingole for their helpful
technical discussions with us on the concept of MPC problem formulation.

REFERENCES

[1] C. Rao, S. J. Wright, and J. B. Rawlings, “Application of interior point methods to model predictive
control”, Journal of Optimization Theory and Applications, pp. 723-757, 1998.
[2] Carlos E. Garcia, D. M. Prett, and M. Morari, Model Predictive Control: theory and practice – a
survey. Automatica, 25-335-348,1989.
[3] Liuping Wang, Model Predictive Control Design and Implementation Using MATLAB. Springer-
Verlag London Limited, 2009.
[4] J. M. Maciejowski, Predictive control with constraints. Eaglewood Cliffs, NJ: Prentice Hall, 2002.
48
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014

[5] Yang Wang and Stephen Boyd, “Fast Model Predictive Control Using Online Optimization”, IEEE
Transactions on Control Systems Technology, Vol. 18, No. 2, March, 2010.
[6] A. G. Wills, W. P. Heath, “Interior-Point methods For Linear Model Predictive Control”, In: Control,
UK, 2004.
[7] Don Hush, Patrick Kelly, Clint Scovel, Ingo Steinwart, “QP Algorithms with Guarantied Accuracy
and Run Time for Support Vector Machines”, Journal of Machine Learning Research 7, pp. 733-769,
2006.
[8] S. Mehrtotra, “On implementation of a primal-dual interior-point method”, SIAM Journal on
Optimization, 2(4), 575-601, (1992).
[9] Stephen Boyd and Lieven Vandenberghe, Convex Optimization, Cambridge University Press, 2009.
[10] Vihangkumar Naik, D. N. Sonwane, Deepak Ingole, Divyesh Ginoya and Neha Girme, “Design and
Implementation of Interior-Point method Based Linear Model Predictive Controller”, AIM/CCPE
2012, CCIS 296, Springer Berlin Heidelberg, pp. 255-261, 2013.
[11] Vihangkumar Naik, D. N. Sonawane, Deepak Ingole, L. Ginoya and Vedika Patki, “Design and
Implementation of Proportional Integral Observer based Linear Model Predictive Controller”,
ACEEE Int. J. On Control System and Instrumentation, pp. 23-30, Vol. 4, No. 1, 2013.
[12] A. Bemporard, M. Morari, V. Dua, and E. N. Pistikopoulos, “The explicit linear quadratic regulator
for constrained systems”, Automatica, vol.38, no.1, pp. 3-20, Jan., 2002.
[13] J. B. Rawlings: Tutorial overview of model predictive control technology, IEEE Control Systems
Magazine, 20:38-52, 2000.
[14] Y. Nesterov and A. Nemirovski, “Interior-Point polynomial methods in convex programming”,
Warrandale, PA: SIAM, 1994.
[15] K. M. Anstreicher and J. P. Vial, “On the convergence of an infeasible primal-dual interior-point
method for convex programming”, Optim. Methods Softw., 3, pp. 273-283, 1994.
[16] A. G. Wills and W. P. Heath, “Barrier Function Based Model Predictive Control”, Automatica, Vol.
40, No. 8, pp. 1415-1422, August, 2004.
[17] P. Armand, J. Gilbert, and S. Jan-Jegou, “A Feasible BFGS Interior Point Algorithm for Solving
Convex Minimization Problems”, SIAM J. OPTIM, Vol. 11, No. 1, pp. 199-222, 2000.

Authors

Prashant Bansode received the B.E degree in Instrumentation Engineering from The University of
Mumbai, in 2010 and the M.Tech degree in Instrumentation and Control Engineering from College of
Engineering Pune, in 2013. His current research interests include convex optimization with applications to
control, embedded system design, and implementation of numerical optimization algorithms using FPGA
platforms.

Dr. D. N. Sonawane received the B.E degree in Instrumentation and Control Engineering from S.G.G.S
College of Engineering, Nanded, in 1997. He received the M.E in Electronics and Telecommunication
Engineering and the Ph.D degree in Engineering from College of Engineering Pune, in 2000 and 2012
respectively. He joined College of Engineering Pune as a lecturer in 1998, currently he is an Associate
Professor with the Instrumentation and Control Department, College of Engineering Pune. He is the author
of the book Introduction to Embedded System Design (ISTE WPLP, May, 2010). His research interests
include Model Predictive Control, Quadratic Programming solver and their hardware implementation and
acceleration using FPGA platforms. He is also involved in various research projects funded by different
agencies of Govt. of India. He is a recipient of Uniken Innovation Award for the project “Sub Cutaneous
Vein Detection System for Drug Delivery Assistance: an Embedded Open Source Approach”, August,
2012, Followed by numerous National level awards. His paper titled “Design and Implementation of
Interior-point Method based Linear Model Predictive Control” received best paper award at International
Conference on Control, Communication and Power engineering, Bangalore, India, 2012.

Prashant Basargi received the B.E degree in Instrumentation Engineering from Shivaji University, in 2011
and the M.Tech degree in Instrumentation and Control Engineering from College of Engineering Pune, in
2013. His current research interests include Model Predictive Control, implementation of numerical
optimization algorithms and Quadratic programming solvers using FPGA platforms.

49

You might also like