SlideShare a Scribd company logo
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014
DOI : 10.5121/ijitmc.2014.2205 37
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
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014
38
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.
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014
39
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:
.
,1
tttt
tttt
vDuCxy
GwBuAxx
++=
++=+
(1)
Where .,, yux
n
t
n
t
n
t RyRuRx ∈∈∈
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:
.
,1
itititit
itititit
vDuxCy
GwBuxAx
++++
+++++
++=
++=
(2)
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:
.||||||||
2
1 2
1
2
1
SktktQktkt
P
k
uuryJ −++++
=
−+−= ∑ (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:
).()(|||| 2
ktkt
T
ktktQktkt ryQryry ++++++ −−=− (4)
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014
40
And
).()(|||| 11
2
1 −++−++−++ −−=− ktkt
T
ktktSktkt uuSuuuu (5)
We derive the objective function in a compact form as given below:
.
2
1
t
T
t
T
t UhHUUJ += (6)
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:
maxmin
UUU << or





−
=




−
max
min
U
U
U
I
I
. (7)
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:
.s.t
min*
intin
t
qUP
JU
≤
=
(8)
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:
.subject to
,
2
1
min
qPu
uhHuuJ TT
≤
+=
(9)
For the sake of simplicity of the algorithm, we use notations u, P and q for Ut, Pin and qin
respectively.
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014
41
3.1. K-K-T Optimality Conditions
The Lagrangian of the above QP problem is given below:
).(),( qPuuhHuuuL TTT
−++=  (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:
.0,
,0
,
,
>
=
=+
−=+
s
s
qsPu
hPHu
T
T



(11)
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:
.1 





−=





∆
∆





 −
−
p
d
T
r
ru
sP
PH

(12)
Where dr and pr are the residues as given below:
hPHur T
d ++=  and .qsPurp −+= (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:
.
)(
)(
)))(log(()(
uf
uf
ufuF
i
i
ii
∇
=−−−∇= (14)
The force )(uFi 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.
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014
42
The merit function we considered depends essentially upon a log barrier function given by:
)),(log(
1
∑
=
−=
m
i
i
T
i
T
qupf  with }.,...,1,0)(|{dom miufRu i
m
=<∈=
Where m=number of inequality constraints.
Now, if we penalise the Lagrangian L with the log barrier function f, we get:
)).(log(),()(
1
∑
=
−−=
m
i
i
T
i
T
qupuLw  (15)
Substituting for ),( uL in (15), we get:
)).(log()()(
1
∑
=
−−−+=
m
i
i
T
i
TT
qupqPuJw  (16)
Where, ),( uw = which satisfies .0),( >u
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
qPu
w
≤

(17)
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:
)()( 1 ii
ww   ≤+
. (18)
We derive the conditions for a stationary point w* by computing 0)( =∇ w using its directional
gradient )(w∇ as given below:
)()()( www u   ∇+∇=∇ , (19)
∑
= −
−+∇=∇
m
i i
T
i
i
uu
qup
p
PJw
1 )(
)(  , (20)
∑
=
−−=∇
m
i
qPuw
1
1
)(

 . (21)
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014
43
Further, we can modify (20) and (21) as:
1
1
)()()()( −
=
−−∇−−∇+∇=∇ ∑ i
T
i
m
i
iiuuu qupquPqPuJw  . (22)
∑
=
−
Λ−−=∇
m
i
eqPuw
1
1
)(  . (23)
In equations (22) and (23), )(wu ∇ 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 mi =Λ 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 .www ∆+=  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
)( ww ∆+ at a point w which is given as:
.)()()( wwwww T
∆∇+≤∆+   (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 0≥∆+ ww  . 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 )1,0(∈ 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 ),( 000 uw = be an initial point satisfying 0),( 00 >u and assume that 0H is available for k=0,
1 , . . . , .0,0,1 >>>  feas
Do
1. Choose )1,0(∈k and set gap.duality*kk  =
Where duality gap = msk
T
k / and m = number of inequality constraints.
2. Compute Newton steps kku ∆∆ & by solving following augmented linear system. As
proposed, we solve the linear system using T
LDL factorization method.
,1








−=





∆
∆





 −
−
kp
kd
k
k
kk
T
k
kk
r
ru
sP
PH

International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014
44
and ).(1
 ∆−=∇ −
Srs sk
Where hPHur T
d ++=  , SeqsPurp −−+= and eSrs Λ=
And ),...,(Diagonal mi ssS = .
3. Compute a step size  by using a backtracking line search.
Set ,1max == 
and test the sufficient decrease condition: ,)()()( wwwww T
∆∇+≤∆+  
Where ).1,0(∈
If the test function is not decreased sufficiently, decrease and compute  as given below:
,0min,1minmax






<∆
∆
−= 



Where ).1,0(∈
4. Update kkkk www ∆+=+ 1 .
Until feasdualfeaspri rr  ≤≤ 22 ||||,|||| , where leveltolerance=feas .
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:
T
LDLA = (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 BXLDLT
= is solved for X by the following steps.
1. Substitute
XDLY T
=
2. Substitute
XLZ T
=
3. Solve
BLY = , using forward substitution (Cost O(n2
))
YDZ = , solving diagonally (Cost O(n))
ZXLT
= , using backward substitution (Cost O(n2
))
The overall cost of the above linear solver is dominated by cost of T
LDLA = which is O((1/3)n3
).
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014
45
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:
[ ] .
)(
)(
10)(
),(
0
1
)(
)(
04
10
)(
)(
2
1
2
1
2
1






=






+











−
=





tx
tx
ty
tu
tx
tx
tx
tx


(25)
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
[ ] .
)(
)(
10)(
),(
0199.0
0993.0
)(
)(
9801.03973.0
0993.09801.0
)1(
)1(
2
1
2
1
2
1






=






−
+











−
=





+
+
kx
kx
ky
ku
kx
kx
kx
kx
(26)
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:
[ ] .
)(
)(
)(
),(
0)(
)(
0
0
)1(
)1(






=






+











=





+
+
kd
kx
ICky
ku
B
kd
kx
I
A
kd
kx
(27)
4.2. Observer Design
The observer equations for the state space representation in (27) are given as:
[ ] )()(
0)1(
)1(
0
0
)1(
)1(
ky
L
L
ku
B
kd
kx
IC
L
L
I
A
kd
kx
d
x
d
x






+





+





+
+














−





=





+
+
. (28)
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:
),,,,(dlqe ooooo RQCGAL = . (29)
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014
46
With AAo = , [ ] 22xo IG = , [ ]11=oC , [ ] 22xo IQ = and 1=oR , we obtain 




−
=
52.0
43.0
L .
For the state space representation in (26), we obtain matrices Q, R, H and h as given below:






==
1.0
2.0
,][ 22 RIQ x ,
















=
0387.00462.00557.00551.00563.0
0666.00763.01008.01117.01180.0
0763.01008.01233.01391.01498.0
0828.01117.01391.01629.01785.0
0860.01180.01498.01785.02022.0
H and
















=
4450.0
5758.0
6922.0
7845.0
8461.0
h .
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
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014
47
Figure 2. Plant output with disturbances and integrated white noise
Figure 3. Plant output without disturbances and integrated white noise
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014
48
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.
International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014
49
[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.

More Related Content

What's hot (18)

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
IJMER
 
Robust design of a 2 dof gmv controller a direct self-tuning and fuzzy schedu...
Robust design of a 2 dof gmv controller a direct self-tuning and fuzzy schedu...Robust design of a 2 dof gmv controller a direct self-tuning and fuzzy schedu...
Robust design of a 2 dof gmv controller a direct self-tuning and fuzzy schedu...
ISA Interchange
 
On the Performance of the Pareto Set Pursuing (PSP) Method for Mixed-Variable...
On the Performance of the Pareto Set Pursuing (PSP) Method for Mixed-Variable...On the Performance of the Pareto Set Pursuing (PSP) Method for Mixed-Variable...
On the Performance of the Pareto Set Pursuing (PSP) Method for Mixed-Variable...
Amir Ziai
 
Adaptive dynamic programing based optimal control for a robot manipulator
Adaptive dynamic programing based optimal control for a robot manipulatorAdaptive dynamic programing based optimal control for a robot manipulator
Adaptive dynamic programing based optimal control for a robot manipulator
International Journal of Power Electronics and Drive Systems
 
On the-joint-optimization-of-performance-and-power-consumption-in-data-centers
On the-joint-optimization-of-performance-and-power-consumption-in-data-centersOn the-joint-optimization-of-performance-and-power-consumption-in-data-centers
On the-joint-optimization-of-performance-and-power-consumption-in-data-centers
Cemal Ardil
 
A weighted-sum-technique-for-the-joint-optimization-of-performance-and-power-...
A weighted-sum-technique-for-the-joint-optimization-of-performance-and-power-...A weighted-sum-technique-for-the-joint-optimization-of-performance-and-power-...
A weighted-sum-technique-for-the-joint-optimization-of-performance-and-power-...
Cemal Ardil
 
Using the black-box approach with machine learning methods in ...
Using the black-box approach with machine learning methods in ...Using the black-box approach with machine learning methods in ...
Using the black-box approach with machine learning methods in ...
butest
 
Exploiting 2-Dimensional Source Correlation in Channel Decoding with Paramete...
Exploiting 2-Dimensional Source Correlation in Channel Decoding with Paramete...Exploiting 2-Dimensional Source Correlation in Channel Decoding with Paramete...
Exploiting 2-Dimensional Source Correlation in Channel Decoding with Paramete...
IJECEIAES
 
An optimal general type-2 fuzzy controller for Urban Traffic Network
An optimal general type-2 fuzzy controller for Urban Traffic NetworkAn optimal general type-2 fuzzy controller for Urban Traffic Network
An optimal general type-2 fuzzy controller for Urban Traffic Network
ISA Interchange
 
A METHODOLOGY FOR IMPROVEMENT OF ROBA MULTIPLIER FOR ELECTRONIC APPLICATIONS
A METHODOLOGY FOR IMPROVEMENT OF ROBA MULTIPLIER FOR ELECTRONIC APPLICATIONSA METHODOLOGY FOR IMPROVEMENT OF ROBA MULTIPLIER FOR ELECTRONIC APPLICATIONS
A METHODOLOGY FOR IMPROVEMENT OF ROBA MULTIPLIER FOR ELECTRONIC APPLICATIONS
VLSICS Design
 
Traffic light control in non stationary environments based on multi
Traffic light control in non stationary environments based on multiTraffic light control in non stationary environments based on multi
Traffic light control in non stationary environments based on multi
Mohamed Omari
 
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
 
IRJET - Design of a Low Power Serial- Parallel Multiplier with Low Transition...
IRJET - Design of a Low Power Serial- Parallel Multiplier with Low Transition...IRJET - Design of a Low Power Serial- Parallel Multiplier with Low Transition...
IRJET - Design of a Low Power Serial- Parallel Multiplier with Low Transition...
IRJET Journal
 
Fpga based efficient multiplier for image processing applications using recur...
Fpga based efficient multiplier for image processing applications using recur...Fpga based efficient multiplier for image processing applications using recur...
Fpga based efficient multiplier for image processing applications using recur...
VLSICS Design
 
ENHANCING COMPUTATIONAL EFFORTS WITH CONSIDERATION OF PROBABILISTIC AVAILABL...
ENHANCING COMPUTATIONAL EFFORTS WITH CONSIDERATION OF  PROBABILISTIC AVAILABL...ENHANCING COMPUTATIONAL EFFORTS WITH CONSIDERATION OF  PROBABILISTIC AVAILABL...
ENHANCING COMPUTATIONAL EFFORTS WITH CONSIDERATION OF PROBABILISTIC AVAILABL...
Raja Larik
 
D0212326
D0212326D0212326
D0212326
inventionjournals
 
Presenting an Algorithm for Tasks Scheduling in Grid Environment along with I...
Presenting an Algorithm for Tasks Scheduling in Grid Environment along with I...Presenting an Algorithm for Tasks Scheduling in Grid Environment along with I...
Presenting an Algorithm for Tasks Scheduling in Grid Environment along with I...
Editor IJCATR
 
master-thesis
master-thesismaster-thesis
master-thesis
Jasper Visser
 
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
IJMER
 
Robust design of a 2 dof gmv controller a direct self-tuning and fuzzy schedu...
Robust design of a 2 dof gmv controller a direct self-tuning and fuzzy schedu...Robust design of a 2 dof gmv controller a direct self-tuning and fuzzy schedu...
Robust design of a 2 dof gmv controller a direct self-tuning and fuzzy schedu...
ISA Interchange
 
On the Performance of the Pareto Set Pursuing (PSP) Method for Mixed-Variable...
On the Performance of the Pareto Set Pursuing (PSP) Method for Mixed-Variable...On the Performance of the Pareto Set Pursuing (PSP) Method for Mixed-Variable...
On the Performance of the Pareto Set Pursuing (PSP) Method for Mixed-Variable...
Amir Ziai
 
On the-joint-optimization-of-performance-and-power-consumption-in-data-centers
On the-joint-optimization-of-performance-and-power-consumption-in-data-centersOn the-joint-optimization-of-performance-and-power-consumption-in-data-centers
On the-joint-optimization-of-performance-and-power-consumption-in-data-centers
Cemal Ardil
 
A weighted-sum-technique-for-the-joint-optimization-of-performance-and-power-...
A weighted-sum-technique-for-the-joint-optimization-of-performance-and-power-...A weighted-sum-technique-for-the-joint-optimization-of-performance-and-power-...
A weighted-sum-technique-for-the-joint-optimization-of-performance-and-power-...
Cemal Ardil
 
Using the black-box approach with machine learning methods in ...
Using the black-box approach with machine learning methods in ...Using the black-box approach with machine learning methods in ...
Using the black-box approach with machine learning methods in ...
butest
 
Exploiting 2-Dimensional Source Correlation in Channel Decoding with Paramete...
Exploiting 2-Dimensional Source Correlation in Channel Decoding with Paramete...Exploiting 2-Dimensional Source Correlation in Channel Decoding with Paramete...
Exploiting 2-Dimensional Source Correlation in Channel Decoding with Paramete...
IJECEIAES
 
An optimal general type-2 fuzzy controller for Urban Traffic Network
An optimal general type-2 fuzzy controller for Urban Traffic NetworkAn optimal general type-2 fuzzy controller for Urban Traffic Network
An optimal general type-2 fuzzy controller for Urban Traffic Network
ISA Interchange
 
A METHODOLOGY FOR IMPROVEMENT OF ROBA MULTIPLIER FOR ELECTRONIC APPLICATIONS
A METHODOLOGY FOR IMPROVEMENT OF ROBA MULTIPLIER FOR ELECTRONIC APPLICATIONSA METHODOLOGY FOR IMPROVEMENT OF ROBA MULTIPLIER FOR ELECTRONIC APPLICATIONS
A METHODOLOGY FOR IMPROVEMENT OF ROBA MULTIPLIER FOR ELECTRONIC APPLICATIONS
VLSICS Design
 
Traffic light control in non stationary environments based on multi
Traffic light control in non stationary environments based on multiTraffic light control in non stationary environments based on multi
Traffic light control in non stationary environments based on multi
Mohamed Omari
 
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
 
IRJET - Design of a Low Power Serial- Parallel Multiplier with Low Transition...
IRJET - Design of a Low Power Serial- Parallel Multiplier with Low Transition...IRJET - Design of a Low Power Serial- Parallel Multiplier with Low Transition...
IRJET - Design of a Low Power Serial- Parallel Multiplier with Low Transition...
IRJET Journal
 
Fpga based efficient multiplier for image processing applications using recur...
Fpga based efficient multiplier for image processing applications using recur...Fpga based efficient multiplier for image processing applications using recur...
Fpga based efficient multiplier for image processing applications using recur...
VLSICS Design
 
ENHANCING COMPUTATIONAL EFFORTS WITH CONSIDERATION OF PROBABILISTIC AVAILABL...
ENHANCING COMPUTATIONAL EFFORTS WITH CONSIDERATION OF  PROBABILISTIC AVAILABL...ENHANCING COMPUTATIONAL EFFORTS WITH CONSIDERATION OF  PROBABILISTIC AVAILABL...
ENHANCING COMPUTATIONAL EFFORTS WITH CONSIDERATION OF PROBABILISTIC AVAILABL...
Raja Larik
 
Presenting an Algorithm for Tasks Scheduling in Grid Environment along with I...
Presenting an Algorithm for Tasks Scheduling in Grid Environment along with I...Presenting an Algorithm for Tasks Scheduling in Grid Environment along with I...
Presenting an Algorithm for Tasks Scheduling in Grid Environment along with I...
Editor IJCATR
 

Viewers also liked (20)

Chap05 scr
Chap05 scrChap05 scr
Chap05 scr
Hirwanto Iwan
 
Gesture ppt
Gesture pptGesture ppt
Gesture ppt
riskycahyo
 
Prezentācija par 2015.gada budžetu
Prezentācija par 2015.gada budžetuPrezentācija par 2015.gada budžetu
Prezentācija par 2015.gada budžetu
Finanšu ministrija
 
A bölcs öregkor
A bölcs öregkorA bölcs öregkor
A bölcs öregkor
krizma
 
Par neapgūto ES fondu 2007.-2013. periodā līdzekļu apjomu un priekšlikumu izs...
Par neapgūto ES fondu 2007.-2013. periodā līdzekļu apjomu un priekšlikumu izs...Par neapgūto ES fondu 2007.-2013. periodā līdzekļu apjomu un priekšlikumu izs...
Par neapgūto ES fondu 2007.-2013. periodā līdzekļu apjomu un priekšlikumu izs...
Finanšu ministrija
 
ES fondu 2007.-2013. perioda investīcijas
ES fondu 2007.-2013. perioda investīcijasES fondu 2007.-2013. perioda investīcijas
ES fondu 2007.-2013. perioda investīcijas
Finanšu ministrija
 
Amrita Beamer
Amrita BeamerAmrita Beamer
Amrita Beamer
Hirwanto Iwan
 
перші розділи. герої роману.
перші розділи. герої роману.перші розділи. герої роману.
перші розділи. герої роману.
Андріан Притула
 
001 poesia matemática millôr
001 poesia matemática   millôr001 poesia matemática   millôr
001 poesia matemática millôr
ElizabeteRosa Rosa Santos
 
Tech q
Tech qTech q
Tech q
Jordan Booker
 
OPVMC Sharepoint Site
OPVMC Sharepoint SiteOPVMC Sharepoint Site
OPVMC Sharepoint Site
Dave Warnes
 
ทำความรู้จัก ระบบปฏิบัติการ
ทำความรู้จัก ระบบปฏิบัติการทำความรู้จัก ระบบปฏิบัติการ
ทำความรู้จัก ระบบปฏิบัติการ
30082527
 
Columns in ConTeXt
Columns in  ConTeXt Columns in  ConTeXt
Columns in ConTeXt
Hirwanto Iwan
 
Persamaan lingkaran & garis singgung
Persamaan lingkaran & garis singgungPersamaan lingkaran & garis singgung
Persamaan lingkaran & garis singgung
mumumul
 
Latvijas Universitate Beamer
Latvijas Universitate BeamerLatvijas Universitate Beamer
Latvijas Universitate Beamer
Hirwanto Iwan
 
Optimal content downloading in vehicular network with density measurement
Optimal content downloading in vehicular network with density measurementOptimal content downloading in vehicular network with density measurement
Optimal content downloading in vehicular network with density measurement
Zac Darcy
 
Tom jones
Tom jonesTom jones
Tom jones
amworsley
 
Frederic Chevance
Frederic ChevanceFrederic Chevance
Frederic Chevance
Oscar4B
 
Prezentācija par 2015.gada budžetu
Prezentācija par 2015.gada budžetuPrezentācija par 2015.gada budžetu
Prezentācija par 2015.gada budžetu
Finanšu ministrija
 
A bölcs öregkor
A bölcs öregkorA bölcs öregkor
A bölcs öregkor
krizma
 
Par neapgūto ES fondu 2007.-2013. periodā līdzekļu apjomu un priekšlikumu izs...
Par neapgūto ES fondu 2007.-2013. periodā līdzekļu apjomu un priekšlikumu izs...Par neapgūto ES fondu 2007.-2013. periodā līdzekļu apjomu un priekšlikumu izs...
Par neapgūto ES fondu 2007.-2013. periodā līdzekļu apjomu un priekšlikumu izs...
Finanšu ministrija
 
ES fondu 2007.-2013. perioda investīcijas
ES fondu 2007.-2013. perioda investīcijasES fondu 2007.-2013. perioda investīcijas
ES fondu 2007.-2013. perioda investīcijas
Finanšu ministrija
 
OPVMC Sharepoint Site
OPVMC Sharepoint SiteOPVMC Sharepoint Site
OPVMC Sharepoint Site
Dave Warnes
 
ทำความรู้จัก ระบบปฏิบัติการ
ทำความรู้จัก ระบบปฏิบัติการทำความรู้จัก ระบบปฏิบัติการ
ทำความรู้จัก ระบบปฏิบัติการ
30082527
 
Persamaan lingkaran & garis singgung
Persamaan lingkaran & garis singgungPersamaan lingkaran & garis singgung
Persamaan lingkaran & garis singgung
mumumul
 
Latvijas Universitate Beamer
Latvijas Universitate BeamerLatvijas Universitate Beamer
Latvijas Universitate Beamer
Hirwanto Iwan
 
Optimal content downloading in vehicular network with density measurement
Optimal content downloading in vehicular network with density measurementOptimal content downloading in vehicular network with density measurement
Optimal content downloading in vehicular network with density measurement
Zac Darcy
 
Frederic Chevance
Frederic ChevanceFrederic Chevance
Frederic Chevance
Oscar4B
 

Similar to Application of a merit function based interior point method to linear model predictive control (20)

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
 
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
 
Asymptotic features of Hessian Matrix in Receding Horizon Model Predictive Co...
Asymptotic features of Hessian Matrix in Receding Horizon Model Predictive Co...Asymptotic features of Hessian Matrix in Receding Horizon Model Predictive Co...
Asymptotic features of Hessian Matrix in Receding Horizon Model Predictive Co...
TELKOMNIKA JOURNAL
 
9-12 MPC mode predictive control system.pdf
9-12  MPC mode predictive control system.pdf9-12  MPC mode predictive control system.pdf
9-12 MPC mode predictive control system.pdf
abbas miry
 
Concepts of predictive control
Concepts of predictive controlConcepts of predictive control
Concepts of predictive control
JARossiter
 
Ydstie
YdstieYdstie
Ydstie
quinteroudina
 
Design of predictive controller for smooth set point tracking for fast dynami...
Design of predictive controller for smooth set point tracking for fast dynami...Design of predictive controller for smooth set point tracking for fast dynami...
Design of predictive controller for smooth set point tracking for fast dynami...
eSAT Journals
 
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
eSAT 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 mpc
eSAT Publishing House
 
Tuning the model predictive control of a crude distillation unit
Tuning the model predictive control of a crude distillation unitTuning the model predictive control of a crude distillation unit
Tuning the model predictive control of a crude distillation unit
ISA Interchange
 
A survey of industrial model predictive control technology (2003)
A survey of industrial model predictive control technology (2003)A survey of industrial model predictive control technology (2003)
A survey of industrial model predictive control technology (2003)
Yang Lee
 
Explicit model predictive control of fast dynamic system
Explicit model predictive control of fast dynamic systemExplicit model predictive control of fast dynamic system
Explicit model predictive control of fast dynamic system
eSAT Journals
 
Explicit model predictive control of fast dynamic system
Explicit model predictive control of fast dynamic systemExplicit model predictive control of fast dynamic system
Explicit model predictive control of fast dynamic system
eSAT Publishing House
 
Self tuning, Optimal MPC, DMC.pptx
Self tuning, Optimal MPC, DMC.pptxSelf tuning, Optimal MPC, DMC.pptx
Self tuning, Optimal MPC, DMC.pptx
glan Glandeva
 
Predictive Control for Linear and Hybrid Systems 1st Edition Francesco Borrelli
Predictive Control for Linear and Hybrid Systems 1st Edition Francesco BorrelliPredictive Control for Linear and Hybrid Systems 1st Edition Francesco Borrelli
Predictive Control for Linear and Hybrid Systems 1st Edition Francesco Borrelli
gaddideeja
 
Multi parametric model predictive control based on laguerre model for permane...
Multi parametric model predictive control based on laguerre model for permane...Multi parametric model predictive control based on laguerre model for permane...
Multi parametric model predictive control based on laguerre model for permane...
IJECEIAES
 
Real Time Code Generation for Nonlinear Model Predictive Control
Real Time Code Generation for Nonlinear Model Predictive ControlReal Time Code Generation for Nonlinear Model Predictive Control
Real Time Code Generation for Nonlinear Model Predictive Control
Behzad Samadi
 
Defense_final
Defense_finalDefense_final
Defense_final
Marko Tanaskovic
 
Distributed solution of stochastic optimal control problem on GPUs
Distributed solution of stochastic optimal control problem on GPUsDistributed solution of stochastic optimal control problem on GPUs
Distributed solution of stochastic optimal control problem on GPUs
Pantelis Sopasakis
 
Optimal control problem for processes
Optimal control problem for processesOptimal control problem for processes
Optimal control problem for processes
IJCI JOURNAL
 
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
 
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
 
Asymptotic features of Hessian Matrix in Receding Horizon Model Predictive Co...
Asymptotic features of Hessian Matrix in Receding Horizon Model Predictive Co...Asymptotic features of Hessian Matrix in Receding Horizon Model Predictive Co...
Asymptotic features of Hessian Matrix in Receding Horizon Model Predictive Co...
TELKOMNIKA JOURNAL
 
9-12 MPC mode predictive control system.pdf
9-12  MPC mode predictive control system.pdf9-12  MPC mode predictive control system.pdf
9-12 MPC mode predictive control system.pdf
abbas miry
 
Concepts of predictive control
Concepts of predictive controlConcepts of predictive control
Concepts of predictive control
JARossiter
 
Design of predictive controller for smooth set point tracking for fast dynami...
Design of predictive controller for smooth set point tracking for fast dynami...Design of predictive controller for smooth set point tracking for fast dynami...
Design of predictive controller for smooth set point tracking for fast dynami...
eSAT Journals
 
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
eSAT 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 mpc
eSAT Publishing House
 
Tuning the model predictive control of a crude distillation unit
Tuning the model predictive control of a crude distillation unitTuning the model predictive control of a crude distillation unit
Tuning the model predictive control of a crude distillation unit
ISA Interchange
 
A survey of industrial model predictive control technology (2003)
A survey of industrial model predictive control technology (2003)A survey of industrial model predictive control technology (2003)
A survey of industrial model predictive control technology (2003)
Yang Lee
 
Explicit model predictive control of fast dynamic system
Explicit model predictive control of fast dynamic systemExplicit model predictive control of fast dynamic system
Explicit model predictive control of fast dynamic system
eSAT Journals
 
Explicit model predictive control of fast dynamic system
Explicit model predictive control of fast dynamic systemExplicit model predictive control of fast dynamic system
Explicit model predictive control of fast dynamic system
eSAT Publishing House
 
Self tuning, Optimal MPC, DMC.pptx
Self tuning, Optimal MPC, DMC.pptxSelf tuning, Optimal MPC, DMC.pptx
Self tuning, Optimal MPC, DMC.pptx
glan Glandeva
 
Predictive Control for Linear and Hybrid Systems 1st Edition Francesco Borrelli
Predictive Control for Linear and Hybrid Systems 1st Edition Francesco BorrelliPredictive Control for Linear and Hybrid Systems 1st Edition Francesco Borrelli
Predictive Control for Linear and Hybrid Systems 1st Edition Francesco Borrelli
gaddideeja
 
Multi parametric model predictive control based on laguerre model for permane...
Multi parametric model predictive control based on laguerre model for permane...Multi parametric model predictive control based on laguerre model for permane...
Multi parametric model predictive control based on laguerre model for permane...
IJECEIAES
 
Real Time Code Generation for Nonlinear Model Predictive Control
Real Time Code Generation for Nonlinear Model Predictive ControlReal Time Code Generation for Nonlinear Model Predictive Control
Real Time Code Generation for Nonlinear Model Predictive Control
Behzad Samadi
 
Distributed solution of stochastic optimal control problem on GPUs
Distributed solution of stochastic optimal control problem on GPUsDistributed solution of stochastic optimal control problem on GPUs
Distributed solution of stochastic optimal control problem on GPUs
Pantelis Sopasakis
 
Optimal control problem for processes
Optimal control problem for processesOptimal control problem for processes
Optimal control problem for processes
IJCI JOURNAL
 

Recently uploaded (20)

Talk: On an adventure into the depths of Maven - Kaya Weers
Talk: On an adventure into the depths of Maven - Kaya WeersTalk: On an adventure into the depths of Maven - Kaya Weers
Talk: On an adventure into the depths of Maven - Kaya Weers
Kaya Weers
 
2025-05-22_Automate__Motivate_Spiff_Meets_Marketing_Cloud.pptx
2025-05-22_Automate__Motivate_Spiff_Meets_Marketing_Cloud.pptx2025-05-22_Automate__Motivate_Spiff_Meets_Marketing_Cloud.pptx
2025-05-22_Automate__Motivate_Spiff_Meets_Marketing_Cloud.pptx
katalinjordans2
 
Build your own NES Emulator... with Kotlin
Build your own NES Emulator... with KotlinBuild your own NES Emulator... with Kotlin
Build your own NES Emulator... with Kotlin
Artur Skowroński
 
MCP Dev Summit - Pragmatic Scaling of Enterprise GenAI with MCP
MCP Dev Summit - Pragmatic Scaling of Enterprise GenAI with MCPMCP Dev Summit - Pragmatic Scaling of Enterprise GenAI with MCP
MCP Dev Summit - Pragmatic Scaling of Enterprise GenAI with MCP
Sambhav Kothari
 
GDG Cloud Southlake #43: Tommy Todd: The Quantum Apocalypse: A Looming Threat...
GDG Cloud Southlake #43: Tommy Todd: The Quantum Apocalypse: A Looming Threat...GDG Cloud Southlake #43: Tommy Todd: The Quantum Apocalypse: A Looming Threat...
GDG Cloud Southlake #43: Tommy Todd: The Quantum Apocalypse: A Looming Threat...
James Anderson
 
STKI Israel Market Study 2025 final v1 version
STKI Israel Market Study 2025 final v1 versionSTKI Israel Market Study 2025 final v1 version
STKI Israel Market Study 2025 final v1 version
Dr. Jimmy Schwarzkopf
 
New Ways to Reduce Database Costs with ScyllaDB
New Ways to Reduce Database Costs with ScyllaDBNew Ways to Reduce Database Costs with ScyllaDB
New Ways to Reduce Database Costs with ScyllaDB
ScyllaDB
 
Agentic AI - The New Era of Intelligence
Agentic AI - The New Era of IntelligenceAgentic AI - The New Era of Intelligence
Agentic AI - The New Era of Intelligence
Muzammil Shah
 
Protecting Your Sensitive Data with Microsoft Purview - IRMS 2025
Protecting Your Sensitive Data with Microsoft Purview - IRMS 2025Protecting Your Sensitive Data with Microsoft Purview - IRMS 2025
Protecting Your Sensitive Data with Microsoft Purview - IRMS 2025
Nikki Chapple
 
Security Operations and the Defense Analyst - Splunk Certificate
Security Operations and the Defense Analyst - Splunk CertificateSecurity Operations and the Defense Analyst - Splunk Certificate
Security Operations and the Defense Analyst - Splunk Certificate
VICTOR MAESTRE RAMIREZ
 
Kubernetes Cloud Native Indonesia Meetup - May 2025
Kubernetes Cloud Native Indonesia Meetup - May 2025Kubernetes Cloud Native Indonesia Meetup - May 2025
Kubernetes Cloud Native Indonesia Meetup - May 2025
Prasta Maha
 
Introducing Ensemble Cloudlet vRouter
Introducing Ensemble  Cloudlet vRouterIntroducing Ensemble  Cloudlet vRouter
Introducing Ensemble Cloudlet vRouter
Adtran
 
"AI in the browser: predicting user actions in real time with TensorflowJS", ...
"AI in the browser: predicting user actions in real time with TensorflowJS", ..."AI in the browser: predicting user actions in real time with TensorflowJS", ...
"AI in the browser: predicting user actions in real time with TensorflowJS", ...
Fwdays
 
ECS25 - The adventures of a Microsoft 365 Platform Owner - Website.pptx
ECS25 - The adventures of a Microsoft 365 Platform Owner - Website.pptxECS25 - The adventures of a Microsoft 365 Platform Owner - Website.pptx
ECS25 - The adventures of a Microsoft 365 Platform Owner - Website.pptx
Jasper Oosterveld
 
State-Dependent Conformal Perception Bounds for Neuro-Symbolic Verification o...
State-Dependent Conformal Perception Bounds for Neuro-Symbolic Verification o...State-Dependent Conformal Perception Bounds for Neuro-Symbolic Verification o...
State-Dependent Conformal Perception Bounds for Neuro-Symbolic Verification o...
Ivan Ruchkin
 
Multistream in SIP and NoSIP @ OpenSIPS Summit 2025
Multistream in SIP and NoSIP @ OpenSIPS Summit 2025Multistream in SIP and NoSIP @ OpenSIPS Summit 2025
Multistream in SIP and NoSIP @ OpenSIPS Summit 2025
Lorenzo Miniero
 
UiPath Community Berlin: Studio Tips & Tricks and UiPath Insights
UiPath Community Berlin: Studio Tips & Tricks and UiPath InsightsUiPath Community Berlin: Studio Tips & Tricks and UiPath Insights
UiPath Community Berlin: Studio Tips & Tricks and UiPath Insights
UiPathCommunity
 
AI in Java - MCP in Action, Langchain4J-CDI, SmallRye-LLM, Spring AI
AI in Java - MCP in Action, Langchain4J-CDI, SmallRye-LLM, Spring AIAI in Java - MCP in Action, Langchain4J-CDI, SmallRye-LLM, Spring AI
AI in Java - MCP in Action, Langchain4J-CDI, SmallRye-LLM, Spring AI
Buhake Sindi
 
Introducing the OSA 3200 SP and OSA 3250 ePRC
Introducing the OSA 3200 SP and OSA 3250 ePRCIntroducing the OSA 3200 SP and OSA 3250 ePRC
Introducing the OSA 3200 SP and OSA 3250 ePRC
Adtran
 
cloudgenesis cloud workshop , gdg on campus mita
cloudgenesis cloud workshop , gdg on campus mitacloudgenesis cloud workshop , gdg on campus mita
cloudgenesis cloud workshop , gdg on campus mita
siyaldhande02
 
Talk: On an adventure into the depths of Maven - Kaya Weers
Talk: On an adventure into the depths of Maven - Kaya WeersTalk: On an adventure into the depths of Maven - Kaya Weers
Talk: On an adventure into the depths of Maven - Kaya Weers
Kaya Weers
 
2025-05-22_Automate__Motivate_Spiff_Meets_Marketing_Cloud.pptx
2025-05-22_Automate__Motivate_Spiff_Meets_Marketing_Cloud.pptx2025-05-22_Automate__Motivate_Spiff_Meets_Marketing_Cloud.pptx
2025-05-22_Automate__Motivate_Spiff_Meets_Marketing_Cloud.pptx
katalinjordans2
 
Build your own NES Emulator... with Kotlin
Build your own NES Emulator... with KotlinBuild your own NES Emulator... with Kotlin
Build your own NES Emulator... with Kotlin
Artur Skowroński
 
MCP Dev Summit - Pragmatic Scaling of Enterprise GenAI with MCP
MCP Dev Summit - Pragmatic Scaling of Enterprise GenAI with MCPMCP Dev Summit - Pragmatic Scaling of Enterprise GenAI with MCP
MCP Dev Summit - Pragmatic Scaling of Enterprise GenAI with MCP
Sambhav Kothari
 
GDG Cloud Southlake #43: Tommy Todd: The Quantum Apocalypse: A Looming Threat...
GDG Cloud Southlake #43: Tommy Todd: The Quantum Apocalypse: A Looming Threat...GDG Cloud Southlake #43: Tommy Todd: The Quantum Apocalypse: A Looming Threat...
GDG Cloud Southlake #43: Tommy Todd: The Quantum Apocalypse: A Looming Threat...
James Anderson
 
STKI Israel Market Study 2025 final v1 version
STKI Israel Market Study 2025 final v1 versionSTKI Israel Market Study 2025 final v1 version
STKI Israel Market Study 2025 final v1 version
Dr. Jimmy Schwarzkopf
 
New Ways to Reduce Database Costs with ScyllaDB
New Ways to Reduce Database Costs with ScyllaDBNew Ways to Reduce Database Costs with ScyllaDB
New Ways to Reduce Database Costs with ScyllaDB
ScyllaDB
 
Agentic AI - The New Era of Intelligence
Agentic AI - The New Era of IntelligenceAgentic AI - The New Era of Intelligence
Agentic AI - The New Era of Intelligence
Muzammil Shah
 
Protecting Your Sensitive Data with Microsoft Purview - IRMS 2025
Protecting Your Sensitive Data with Microsoft Purview - IRMS 2025Protecting Your Sensitive Data with Microsoft Purview - IRMS 2025
Protecting Your Sensitive Data with Microsoft Purview - IRMS 2025
Nikki Chapple
 
Security Operations and the Defense Analyst - Splunk Certificate
Security Operations and the Defense Analyst - Splunk CertificateSecurity Operations and the Defense Analyst - Splunk Certificate
Security Operations and the Defense Analyst - Splunk Certificate
VICTOR MAESTRE RAMIREZ
 
Kubernetes Cloud Native Indonesia Meetup - May 2025
Kubernetes Cloud Native Indonesia Meetup - May 2025Kubernetes Cloud Native Indonesia Meetup - May 2025
Kubernetes Cloud Native Indonesia Meetup - May 2025
Prasta Maha
 
Introducing Ensemble Cloudlet vRouter
Introducing Ensemble  Cloudlet vRouterIntroducing Ensemble  Cloudlet vRouter
Introducing Ensemble Cloudlet vRouter
Adtran
 
"AI in the browser: predicting user actions in real time with TensorflowJS", ...
"AI in the browser: predicting user actions in real time with TensorflowJS", ..."AI in the browser: predicting user actions in real time with TensorflowJS", ...
"AI in the browser: predicting user actions in real time with TensorflowJS", ...
Fwdays
 
ECS25 - The adventures of a Microsoft 365 Platform Owner - Website.pptx
ECS25 - The adventures of a Microsoft 365 Platform Owner - Website.pptxECS25 - The adventures of a Microsoft 365 Platform Owner - Website.pptx
ECS25 - The adventures of a Microsoft 365 Platform Owner - Website.pptx
Jasper Oosterveld
 
State-Dependent Conformal Perception Bounds for Neuro-Symbolic Verification o...
State-Dependent Conformal Perception Bounds for Neuro-Symbolic Verification o...State-Dependent Conformal Perception Bounds for Neuro-Symbolic Verification o...
State-Dependent Conformal Perception Bounds for Neuro-Symbolic Verification o...
Ivan Ruchkin
 
Multistream in SIP and NoSIP @ OpenSIPS Summit 2025
Multistream in SIP and NoSIP @ OpenSIPS Summit 2025Multistream in SIP and NoSIP @ OpenSIPS Summit 2025
Multistream in SIP and NoSIP @ OpenSIPS Summit 2025
Lorenzo Miniero
 
UiPath Community Berlin: Studio Tips & Tricks and UiPath Insights
UiPath Community Berlin: Studio Tips & Tricks and UiPath InsightsUiPath Community Berlin: Studio Tips & Tricks and UiPath Insights
UiPath Community Berlin: Studio Tips & Tricks and UiPath Insights
UiPathCommunity
 
AI in Java - MCP in Action, Langchain4J-CDI, SmallRye-LLM, Spring AI
AI in Java - MCP in Action, Langchain4J-CDI, SmallRye-LLM, Spring AIAI in Java - MCP in Action, Langchain4J-CDI, SmallRye-LLM, Spring AI
AI in Java - MCP in Action, Langchain4J-CDI, SmallRye-LLM, Spring AI
Buhake Sindi
 
Introducing the OSA 3200 SP and OSA 3250 ePRC
Introducing the OSA 3200 SP and OSA 3250 ePRCIntroducing the OSA 3200 SP and OSA 3250 ePRC
Introducing the OSA 3200 SP and OSA 3250 ePRC
Adtran
 
cloudgenesis cloud workshop , gdg on campus mita
cloudgenesis cloud workshop , gdg on campus mitacloudgenesis cloud workshop , gdg on campus mita
cloudgenesis cloud workshop , gdg on campus mita
siyaldhande02
 

Application of a merit function based interior point method to linear model predictive control

  • 1. International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014 DOI : 10.5121/ijitmc.2014.2205 37 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
  • 2. International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014 38 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.
  • 3. International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014 39 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: . ,1 tttt tttt vDuCxy GwBuAxx ++= ++=+ (1) Where .,, yux n t n t n t RyRuRx ∈∈∈ 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: . ,1 itititit itititit vDuxCy GwBuxAx ++++ +++++ ++= ++= (2) 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: .|||||||| 2 1 2 1 2 1 SktktQktkt P k uuryJ −++++ = −+−= ∑ (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: ).()(|||| 2 ktkt T ktktQktkt ryQryry ++++++ −−=− (4)
  • 4. International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014 40 And ).()(|||| 11 2 1 −++−++−++ −−=− ktkt T ktktSktkt uuSuuuu (5) We derive the objective function in a compact form as given below: . 2 1 t T t T t UhHUUJ += (6) 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: maxmin UUU << or      − =     − max min U U U I I . (7) 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: .s.t min* intin t qUP JU ≤ = (8) 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: .subject to , 2 1 min qPu uhHuuJ TT ≤ += (9) For the sake of simplicity of the algorithm, we use notations u, P and q for Ut, Pin and qin respectively.
  • 5. International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014 41 3.1. K-K-T Optimality Conditions The Lagrangian of the above QP problem is given below: ).(),( qPuuhHuuuL TTT −++=  (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: .0, ,0 , , > = =+ −=+ s s qsPu hPHu T T    (11) 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: .1       −=      ∆ ∆       − − p d T r ru sP PH  (12) Where dr and pr are the residues as given below: hPHur T d ++=  and .qsPurp −+= (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: . )( )( )))(log(()( uf uf ufuF i i ii ∇ =−−−∇= (14) The force )(uFi 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.
  • 6. International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014 42 The merit function we considered depends essentially upon a log barrier function given by: )),(log( 1 ∑ = −= m i i T i T qupf  with }.,...,1,0)(|{dom miufRu i m =<∈= Where m=number of inequality constraints. Now, if we penalise the Lagrangian L with the log barrier function f, we get: )).(log(),()( 1 ∑ = −−= m i i T i T qupuLw  (15) Substituting for ),( uL in (15), we get: )).(log()()( 1 ∑ = −−−+= m i i T i TT qupqPuJw  (16) Where, ),( uw = which satisfies .0),( >u 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 qPu w ≤  (17) 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: )()( 1 ii ww   ≤+ . (18) We derive the conditions for a stationary point w* by computing 0)( =∇ w using its directional gradient )(w∇ as given below: )()()( www u   ∇+∇=∇ , (19) ∑ = − −+∇=∇ m i i T i i uu qup p PJw 1 )( )(  , (20) ∑ = −−=∇ m i qPuw 1 1 )(   . (21)
  • 7. International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014 43 Further, we can modify (20) and (21) as: 1 1 )()()()( − = −−∇−−∇+∇=∇ ∑ i T i m i iiuuu qupquPqPuJw  . (22) ∑ = − Λ−−=∇ m i eqPuw 1 1 )(  . (23) In equations (22) and (23), )(wu ∇ 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 mi =Λ 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 .www ∆+=  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 )( ww ∆+ at a point w which is given as: .)()()( wwwww T ∆∇+≤∆+   (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 0≥∆+ ww  . 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 )1,0(∈ 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 ),( 000 uw = be an initial point satisfying 0),( 00 >u and assume that 0H is available for k=0, 1 , . . . , .0,0,1 >>>  feas Do 1. Choose )1,0(∈k and set gap.duality*kk  = Where duality gap = msk T k / and m = number of inequality constraints. 2. Compute Newton steps kku ∆∆ & by solving following augmented linear system. As proposed, we solve the linear system using T LDL factorization method. ,1         −=      ∆ ∆       − − kp kd k k kk T k kk r ru sP PH 
  • 8. International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014 44 and ).(1  ∆−=∇ − Srs sk Where hPHur T d ++=  , SeqsPurp −−+= and eSrs Λ= And ),...,(Diagonal mi ssS = . 3. Compute a step size  by using a backtracking line search. Set ,1max ==  and test the sufficient decrease condition: ,)()()( wwwww T ∆∇+≤∆+   Where ).1,0(∈ If the test function is not decreased sufficiently, decrease and compute  as given below: ,0min,1minmax       <∆ ∆ −=     Where ).1,0(∈ 4. Update kkkk www ∆+=+ 1 . Until feasdualfeaspri rr  ≤≤ 22 ||||,|||| , where leveltolerance=feas . 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: T LDLA = (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 BXLDLT = is solved for X by the following steps. 1. Substitute XDLY T = 2. Substitute XLZ T = 3. Solve BLY = , using forward substitution (Cost O(n2 )) YDZ = , solving diagonally (Cost O(n)) ZXLT = , using backward substitution (Cost O(n2 )) The overall cost of the above linear solver is dominated by cost of T LDLA = which is O((1/3)n3 ).
  • 9. International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014 45 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: [ ] . )( )( 10)( ),( 0 1 )( )( 04 10 )( )( 2 1 2 1 2 1       =       +            − =      tx tx ty tu tx tx tx tx   (25) 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 [ ] . )( )( 10)( ),( 0199.0 0993.0 )( )( 9801.03973.0 0993.09801.0 )1( )1( 2 1 2 1 2 1       =       − +            − =      + + kx kx ky ku kx kx kx kx (26) 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: [ ] . )( )( )( ),( 0)( )( 0 0 )1( )1(       =       +            =      + + kd kx ICky ku B kd kx I A kd kx (27) 4.2. Observer Design The observer equations for the state space representation in (27) are given as: [ ] )()( 0)1( )1( 0 0 )1( )1( ky L L ku B kd kx IC L L I A kd kx d x d x       +      +      + +               −      =      + + . (28) 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: ),,,,(dlqe ooooo RQCGAL = . (29)
  • 10. International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014 46 With AAo = , [ ] 22xo IG = , [ ]11=oC , [ ] 22xo IQ = and 1=oR , we obtain      − = 52.0 43.0 L . For the state space representation in (26), we obtain matrices Q, R, H and h as given below:       == 1.0 2.0 ,][ 22 RIQ x ,                 = 0387.00462.00557.00551.00563.0 0666.00763.01008.01117.01180.0 0763.01008.01233.01391.01498.0 0828.01117.01391.01629.01785.0 0860.01180.01498.01785.02022.0 H and                 = 4450.0 5758.0 6922.0 7845.0 8461.0 h . 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
  • 11. International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014 47 Figure 2. Plant output with disturbances and integrated white noise Figure 3. Plant output without disturbances and integrated white noise
  • 12. International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014 48 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.
  • 13. International Journal of Information Technology, Modeling and Computing (IJITMC) Vol. 2, No.2, May 2014 49 [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.