User:ShakespeareFan00/Sandbox1

State Feedback edit

  1. H-infinity
  2. H-2
  3. Mixed
  4. Stabilization of Second-Order Systems
  5. LQ Regulation via H2 Control
  6. Controller to achieve the desired Reachable set; Polytopic uncertainty
  7. Controller to achieve the desired Reachable set; Norm bound uncertainty
  8. Controller to achieve the desired Reachable set; Diagonal Norm-bound uncertainty

D-Stability edit

  1. Continuous Time D-Stability Controller

Optimal State Feedback edit

  1. H-infinity
  2. H-2
  3. Mixed

Output Feedback edit

  1. H-infinity
  2. H-2
  3. Mixed

Static Output Feedback edit

  1. H-infinity
  2. H-2
  3. Mixed
  4. Continuous-Time Static Output Feedback Stabilizability

Optimal Output Feedback edit

  1. H-infinity
  2. H-2
  3. Mixed

Stabilizability LMI edit

Stabilizability LMI

A system is stabilizable if all unstable modes of the system are controllable. This implies that if the system is controllable, it will also be stabilizable. Thus, stabilizability is a essentially a weaker version of the controllability condition. The LMI condition for stabilizability of pair is shown below.

The System edit

where , , at any .

The Data edit

The matrices necessary for this LMI are and . There is no restriction on the stability of A.

The LMI: Stabilizability LMI edit

is stabilizable if and only if there exists such that

,

where the stabilizing controller is given by

.

Conclusion: edit

If we are able to find such that the above LMI holds it means the matrix pair is stabilizable. In words, a system pair is stabilizable if for any initial state an appropriate input can be found so that the state asymptotically approaches the origin. Stabilizability is a weaker condition than controllability in that we only need to approach as whereas controllability requires that the state must reach the origin in a finite time.

Implementation edit

This implementation requires Yalmip and Sedumi.

https://github.com/eoskowro/LMI/blob/master/Stabilizability_LMI.m

Related LMIs edit

Hurwitz Stability LMI

Detectability LMI

Controllability Grammian LMI

Observability Grammian LMI

External Links edit

A list of references documenting and validating the LMI.


Return to Main Page: edit

LMI for the Controllability Grammian edit

LMI to Find the Controllability Gramian

Being able to adjust a system in a desired manor using feedback and sensors is a very important part of control engineering. However, not all systems are able to be adjusted. This ability to be adjusted refers to the idea of a "controllable" system and motivates the necessity of determining the "controllability" of the system. Controllability refers to the ability to accurately and precisely manipulate the state of a system using inputs. Essentially if a system is controllable then it implies that there is a control law that will transfer a given initial state and transfer it to a desired final state . There are multiple ways to determine if a system is controllable, one of which is to compute the rank "controllability Gramian". If the Gramian is full rank, the system is controllable and a state transferring control law exists.

The System edit

where , , at any .

The Data edit

The matrices necessary for this LMI are and . must be stable for the problem to be feasible.

The LMI: LMI to Determine the Controllability Gramian edit

is controllable if and only if is the unique solution to

,

where is the Controllability Gramian.

Conclusion: edit

The LMI above finds the controllability Gramian of the system . If the problem is feasible and a unique can be found, then we also will be able to say the system is controllable. The controllability Gramian of the system can also be computed as: , with control law that will transfer the given initial state to a desired final state .

Implementation edit

This implementation requires Yalmip and Sedumi.

https://github.com/eoskowro/LMI/blob/master/Controllability_Gram_LMI.m

Related LMIs edit

Stabilizability LMI

Hurwitz Stability LMI

Detectability LMI

Observability Grammian LMI

External Links edit

A list of references documenting and validating the LMI.


Return to Main Page: edit

LMI for Decentralized Feedback Control edit

LMI for Decentralized Feedback Control

In large-scale systems like a multi-agent robotic system, national economies, or chemical refineries, an actuator should act based on local information, which necessitates a decentralized or distributed control strategy. In a decentralized control framework, the controllers are distributed and each controller has only access to a subset of local measurements. We describe LMI formulations for a general decentralized control framework and then provide an illustrative example of a decentralized control design.

The System edit

In a decentralized controller design, the state feedback controller can be divided into sub-controllers .

The Data edit

A general state space representation of a linear time-invariant system is as follows:

where is a vector of state variables, is the input matrix, is the output matrix, and is called the feedforward matrix. We assume that all the four matrices, , , , and are given.

The Optimization Problem edit

We aim to solve the -optimal full-state feedback control problem using a controller .

In a decentralized fashion, the control input can be divided into sub-controllers and can be written as .

For instance, let and . Thus, there are three control inputs , , and . We also assume that u_{1} only depends on the first and the second states, while and only depend on thrid to sixth states. For this example, the controller gain matrix can be described by:

Thus, the decentralized controller gain consists of sub-matrices of gains.

The LMI: LMI for decentralized feedback controller edit

The mathematical description of the LMI formulation for a decentralised optimal full-state feedback controller can be described by:

where is a positive definite matrix and such that the aforemtntioned constraints in LMIs are satisfied.

Conclusion: edit

The controller gain matrix is defined as:

where can be found after solving the LMIs and obtaining the variables matrices and . Thus,

.

Implementation edit

A link to Matlab codes for this problem in the Github repository:

https://github.com/asalimil/LMI_for_decentralized_feedback_controller/tree/master

Related LMIs edit

External Links edit

A list of references documenting and validating the LMI.

  • [1] - LMI in Control Systems Analysis, Design and Applications

Return to Main Page edit

LMIs in Control/Tools

LMI for Mixed Output Feedback Controller edit

LMI for Mixed Output Feedback Controller

The mixed output feedback control has been known as an example of a multi-objective optimal control problem. In this problem, the control feedback should respond properly to several specifications. In the controller, the channel is used to improve the robustness of the design while the channel guarantees good performance of the system.

The System edit

We consider the following state-space representation for a linear system:

where , , , and are the state matrix, input matrix, output matrix, and feedforward matrix, respectively.

These are the system (plant) matrices that can be shown as .

The Data edit

We assume that all the four matrices of the plant, , are given.

The Optimization Problem edit

In this problem, we use an LMI to formulate and solve the optimal output-feedback problem to minimize both the <> and <> norms. Giving equal weights to each of the norms, we will have the optimization problem in the following form:

The LMI: LMI for mixed / edit

Mathematical description of the LMI formulation for a mixed / optimal output-feedback problem can be written as follows:

where and are defined as the and norm of the system:

Moreover, , , , , , and are variable matrices with appropriate dimensions that are found after solving the LMIs.

Conclusion: edit

The calculated scalars and are the and norms of the system, respectively. Thus, the norm of mixed / is defined as . The results for each individual norm and norms of the system show that a bigger value of norms are found in comparison with the case they are solved separately.

Implementation edit

A link to Matlab codes for this problem in the Github repository:

https://github.com/asalimil/LMI_for_Mixed_H2_Hinf_Output_Feedback_Controller

Related LMIs edit

External Links edit

  • [2] - LMI in Control Systems Analysis, Design and Applications

Return to Main Page edit

LMIs in Control/Tools

Quadratically Stabilizing Controllers with Parametric Norm-Bounded Uncertainty edit

User:ShakespeareFan00/Sandbox1

If the system is quadratically stable, then there exists some and such that the LMI is feasible. The and matrices can also be used to create a quadratically stabilizing controller.

The System edit

The Data edit

The matrices .

The LMI: edit

Conclusion: edit

There exists a controller for the system with where is the quadratically stabilizing controller, if the above LMI is feasible.

Implementation edit

https://github.com/mcavorsi/LMI

Related LMIs edit

H-infinity Optimal Quadratically Stabilizing Controllers with Parametric Norm-Bounded Uncertainty

Stabilizing State-Feedback Controllers with Structured Norm-Bounded Uncertainty

Optimal State-Feedback Controllers with Structured Norm-Bounded Uncertainty

External Links edit

Return to Main Page: edit

H-inf Optimal Quadratically Stabilizing Controllers with Parametric Norm-Bounded Uncertainty edit

User:ShakespeareFan00/Sandbox1

If there exists some , and such that the LMI holds, then the system satisfies There also exists a controller with

The System edit

The Data edit

The matrices .

The Optimization Problem edit

Minimize subject to the LMI constraints below.

The LMI: edit

Conclusion: edit

The controller gains, K, are calculated by .

Implementation edit

https://github.com/mcavorsi/LMI

Related LMIs edit

Quadratically Stabilizing Controllers with Parametric Norm-Bounded Uncertainty

Stabilizing State-Feedback Controllers with Structured Norm-Bounded Uncertainty

Optimal State-Feedback Controllers with Structured Norm-Bounded Uncertainty

External Links edit

Return to Main Page: edit

Stabilizing State-Feedback Controllers with Structured Norm-Bounded Uncertainty edit

User:ShakespeareFan00/Sandbox1

The System edit

The Data edit

The matrices .

The LMI: edit

Conclusion: edit

If the LMI is feasible, the controller, K, is calculated by .

Implementation edit

https://github.com/mcavorsi/LMI

Related LMIs edit

Quadratically Stabilizing Controllers with Parametric Norm-Bounded Uncertainty

H-infinity Optimal Quadratically Stabilizing Controllers with Parametric Norm-Bounded Uncertainty

Optimal State-Feedback Controllers with Structured Norm-Bounded Uncertainty

External Links edit

Return to Main Page: edit

Optimal State-Feedback Controllers with Structured Norm-Bounded Uncertainty edit

User:ShakespeareFan00/Sandbox1

The System edit

The Data edit

The matrices .

The Optimization Problem edit

subject to the LMI constraints.

The LMI: edit

Conclusion: edit

The controller is .

Implementation edit

https://github.com/mcavorsi/LMI

Related LMIs edit

Quadratically Stabilizing Controllers with Parametric Norm-Bounded Uncertainty

H-infinity Optimal Quadratically Stabilizing Controllers with Parametric Norm-Bounded Uncertainty

Stabilizing State-Feedback Controllers with Structured Norm-Bounded Uncertainty

External Links edit

Return to Main Page: edit

Optimal Output Controllability for Systems With Transients edit

Optimal Output Controllability for Systems With Transients


This LMI provides an optimal output controllability problem to check if such controllers for systems with unknown exogenous disturbances and initial conditions can exist or not.


The System edit

where is the state, is the exogenous input, is the control input, is the measured output and is the regulated output.

The Data edit

System matrices need to be known. It is assumed that . are matrices with their columns forming the bais of kernels of and respectively.

The Optimization Problem edit

For a given , the following condition needs to be fulfilled:

The LMI: Output Feedback Controller for Systems With Transients edit

Conclusion: edit

Solution of the above LMI gives a check to see if an optimal output controller for systems with transients can exist or not.

Implementation edit

A link to CodeOcean or other online implementation of the LMI

Related LMIs edit

Links to other closely-related LMIs

External Links edit


Return to Main Page: edit

Quadratic Polytopic Stabilization edit

A Quadratic Polytopic Stabilization Controller Synthesis can be done using this LMI, requiring the information about , , and matrices.

The System edit

where , , at any .
The system consist of uncertainties of the following form

where ,, and

The Data edit

The matrices necessary for this LMI are , , and

The Optimization and LMI:LMI for Controller Synthesis using the theorem of Polytopic Quadratic Stability edit

There exists a K such that

is quadratically stable for if and only if there exists some P>0 and Z such that

Conclusion: edit

The Controller gain matrix is extracted as
Note that here the controller doesn't depend on

  • If you want K to depend on , the problem is harder.
  • But this would require sensing in real-time.


Implementation edit

This implementation requires Yalmip and Sedumi. https://github.com/JalpeshBhadra/LMI/blob/master/quadraticpolytopicstabilization.m

Related LMIs edit

Quadratic Polytopic Controller
Quadratic Polytopic Controller

External Links edit

Quadratic D-Stabilization edit

Continuous-Time D-Stability Controller

This LMI will let you place poles at a specific location based on system performance like rising time, settling time and percent overshoot, while also ensuring the stability of the system.



The System edit

Suppose we were given the continuous-time system

whose stability was not known, and where , , , and for any .

Adding uncertainty to the system


The Data edit

In order to properly define the acceptable region of the poles in the complex plane, we need the following pieces of data:

  • matrices , , ,
  • rise time ()
  • settling time ()
  • percent overshoot ()

Having these pieces of information will now help us in formulating the optimization problem.

The Optimization Problem edit

Using the data given above, we can now define our optimization problem. In order to do that, we have to first define the acceptable region in the complex plane that the poles can lie on using the following inequality constraints:

Rise Time:

Settling Time:

Percent Overshoot:

Assume that is the complex pole location, then:

This then allows us to modify our inequality constraints as:

Rise Time:

Settling Time:

Percent Overshoot:

which not only allows us to map the relationship between complex pole locations and inequality constraints but it also now allows us to easily formulate our LMIs for this problem.

The LMI: An LMI for Quadratic D-Stabilization edit

Suppose there exists and such that


for

Conclusion: edit

Given the resulting controller , we can now determine that the pole locations of satisfies the inequality constraints , and for all

Implementation edit

The implementation of this LMI requires Yalmip and Sedumi https://github.com/JalpeshBhadra/LMI/blob/master/quadraticDstabilization.m

Related LMIs edit

External Links edit

Return to Main Page: edit

Quadratic Polytopic Full State Feedback Optimal Control edit

Quadratic Polytopic Full State Feedback Optimal Control edit

For a system having polytopic uncertainties, Full State Feedback is a control technique that attempts to place the system's closed-loop system poles in specified locations based off of performance specifications given. methods formulate this task as an optimization problem and attempt to minimize the norm of the system.

The System edit

Consider System with following state-space representation.


where , , , , , , , , , , , , , for any .

Add uncertainty to system matrices


New state-space representation


The Optimization Problem: edit

Recall the closed-loop in state feedback is:


This problem can be formulated as optimal state-feedback, where K is a controller gain matrix.

The LMI: edit

An LMI for Quadratic Polytopic Optimal State-Feedback Control


Conclusion: edit

The Optimal State-Feedback Controller is recovered by
Controller will determine the bound on the norm of the system.

Implementation: edit

https://github.com/JalpeshBhadra/LMI/tree/master

Related LMIs edit

Full State Feedback Optimal Controller

External Links edit

Quadratic Polytopic Full State Feedback Optimal Control edit

User:ShakespeareFan00/Sandbox1

Quadratic Polytopic Full State Feedback Optimal Control edit

For a system having polytopic uncertainties, Full State Feedback is a control technique that attempts to place the system's closed-loop system poles in specified locations based on performance specifications given, such as requiring stability or bounding the overshoot of the output. By minimizing the norm of this system we are minimizing the effect noise has on the system as part of the performance specifications.

The System edit

Consider System with following state-space representation.


where , , , , , , , , , , , , , for any .


Add uncertainty to system matrices


New state-space representation


The Data edit

The matrices necessary for this LMI are

The Optimization Problem: edit

Recall the closed-loop in state feedback is:


This problem can be formulated as optimal state-feedback, where K is a controller gain matrix.


The LMI: An LMI for Quadratic Polytopic Optimal edit

State-Feedback Control



Conclusion: edit

The Optimal State-Feedback Controller is recovered by


Implementation: edit

https://github.com/JalpeshBhadra/LMI/blob/master/H2_optimal_statefeedback_controller.m

Related LMIs edit

Optimal State-Feedback Controller

External Links edit

Continuous-Time Static Output Feedback Stabilizability edit

User:ShakespeareFan00/Sandbox1

In view of applications, static feedback of the full state is not feasible in general: only a few of the state variables (or a linear combination of them, , called the output) can be actually measured and re-injected into the system.
So, we are led to the notion of static output feedback

The System edit

Consider the continuous-time LTI system, with generalized state-space realization

The Data edit

The Optimization Problem edit

This system is static output feedback stabilizable (SOFS) if there exists a matrix F such that the closed-loop system

(obtained by replacing which means applying static output feedback)
is asymptotically stable at the origin

The LMI: LMI for Continuous Time - Static Output Feedback Stabilizability edit

The system is static output feedback stabilizable if and only if it satisfies any of the following conditions:

  • There exists a and , where , such that



  • There exists a and , where , such that



  • There exists a and , where , such that



  • There exists a and , where , such that



Conclusion edit

On implementation and optimization of the above LMI using YALMIP and MOSEK (or) SeDuMi we get 2 output matrices one of which is the Symmeteric matrix (or ) and

Implementation edit

A link to the Matlab code for a simple implementation of this problem in the Github repository:

https://github.com/yashgvd/LMI_wikibooks

Related LMIs edit

Discrete time Static Output Feedback Stabilizability
Static Feedback Stabilizability

External Links edit

Return to Main Page: edit

Multi-Criterion LQG edit

User:ShakespeareFan00/Sandbox1

The Multi-Criterion Linear Quadratic Gaussian (LQG) linear matrix inequality will allow one to form an optimized controller, similar to that in an LQR framework, for a state space system with gaussian noise based on several different criterions defined in the Q and R matrices, that are optimized as a part of the arbitrary cost function. Just like traditional LQR, the cost matrices must be tuned in much a similar fashion as traditional gains in classical control. In the LQR and LQG framework however, the gains are more intuitive as each correlates directly to a state or an input.

The System edit

The system is a linear time-invariant system, that can be represented in state space as shown below:

where represent the state vector, the measured output vector, and the output vector of interest, respectively, is the disturbance vector, and are the system matrices of appropriate dimension. To further define: is and is the state vector, is and is the state matrix, is and is the input matrix, is and is the exogenous input, is and are the output matrices, and and are and are the output and the output of interest, respectively.


and , and the system is controllable and observable.

The Data edit

The matrices and the noise signals .

The Optimization Problem edit

In the Linear Quadratic Gaussian (LQG) control problem, the goal is to minimize a quadratic cost function while the plant has random initial conditions and suffers white noise disturbance on the input and measurement.

There are multiple outputs of interest for this problem. They are defined by

For each of these outputs of interest, we associate a cost function:

Additionally, the matrices and must be found as the solutions to the following Riccati equations:

The optimization problem is to minimize over u subject to the measurability condition and the constraints . This optimization problem can be formulated as:

over , with:

The LMI: Multi-Criterion LQG edit

over , subject to the following constraints:

Conclusion: edit

The result of this LMI is the solution to the aforementioned Ricatti equations:

Implementation edit

This implementation requires Yalmip and Sedumi.

https://github.com/rezajamesahmed/LMImatlabcode/blob/master/multicriterionquadraticproblems.m

Related LMIs edit

  1. Inverse Problem of Optimal Control

External Links edit

Return to Main Page: edit

Inverse Problem of Optimal Control edit

User:ShakespeareFan00/Sandbox1

In some cases, it is needed to solve the inverse problem of optimal control within an LQR framework. In this inverse problem, a given controller matrix needs to be verified for the system by assuring that it is the optimal solution to some LQR optimization problem that is controllable and detectable. In other words: in this inverse problem, the controller is known and the LQR gain matrices are to be calculated such that the controller is the optimal solution.

The System edit

The system is a linear time-invariant system, that can be represented in state space as shown below:

where represent the state vector, the measured output vector, and the output vector of interest, respectively, is the disturbance vector, and are the system matrices of appropriate dimension. To further define: is and is the state vector, is and is the state matrix, is and is the input matrix, is and is the exogenous input, is and are the output matrices, and and are and are the output and the output of interest, respectively.

The Data edit

The matrices that define the system, and a given controller for which the inverse problem is to be solved.

The Optimization Problem edit

In this LMI, the following cost function is to be minimized for a given controller K by finding an optimal input:

the solution of the problem can be formulated as a state feedback controller given as:

The LMI: Inverse Problem of Optimal Control edit

the inverse problem of optimal control is the following: Given a matrix , determine if there exist and , such that is detectable and is the optimal control for the corresponding LQR problem. Equivalently, we seek and such that there exist nonnegative and positive-definite satisfying

Conclusion: edit

If the solution exists, then is the optimal controller for the LQR optimization on the matrices and

Implementation edit

This implementation requires Yalmip and Sedumi.

https://github.com/rezajamesahmed/LMImatlabcode/blob/master/inverseprob.m

Related LMIs edit

  1. Multi-Criterion LQG]

External Links edit

Return to Main Page: edit

Nonconvex Multi-Criterion Quadratic Problems edit

User:ShakespeareFan00/Sandbox1


The Non-Concex Multi-Criterion Quadratic linear matrix inequality will allow one to form an optimized controller, similar to that in an LQR framework, for a non-convex state space system based on several different criterions defined in the Q and R matrices, that are optimized as a part of the arbitrary cost function. Just like traditional LQR, the cost matrices must be tuned in much a similar fashion as traditional gains in classical control. In the LQR and LQG framework however, the gains are more intuitive as each correlates directly to a state or an input.


The System edit

The system for this LMI is a linear time invariant system that can be represented in state space as shown below:

where the system is assumed to be controllable.

where represents the state vector, respectively, is the disturbance vector, and are the system matrices of appropriate dimension. To further define: is and is the state vector, is and is the state matrix, is and is the input matrix, is and is the exogenous input.


for any input, we define a set cost indices by


Here the symmetric matrices,

,

are not necessarily positive-definite.

The Data edit

The matrices .

The Optimization Problem edit

The constrained optimal control problem is:

subject to

The LMI: Nonconvex Multi-Criterion Quadratic Problems edit

The solution to this problem proceeds as follows: We first define

where and for every , we define

then, the solution can be found by:

subject to

Conclusion: edit

If the solution exists, then is the optimal controller and can be solved for via an EVP in P.

Implementation edit

This implementation requires Yalmip and Sedumi.

https://github.com/rezajamesahmed/LMImatlabcode/blob/master/multicriterionquadraticproblems.m

Related LMIs edit

  1. Multi-Criterion LQG
  2. Inverse Problem of Optimal Control
  3. Nonconvex Multi-Criterion Quadratic Problems
  4. Static-State Feedback Problem

External Links edit

A list of references documenting and validating the LMI.


Return to Main Page: edit

Static-State Feedback Problem edit

User:ShakespeareFan00/Sandbox1
We are attempting to stabilizing The Static State-Feedback Problem

The System edit

Consider a continuous time Linear Time invariant system

The Data edit

are known matrices

The Optimization Problem edit

The Problem's main aim is to find a feedback matrix such that the system

and


is stable Initially we find the matrix such that is Hurwitz.

The LMI: Static State Feedback Problem edit

This problem can now be formulated into an LMI as Problem 1:

From the above equation and we have to find K

The problem as we can see is bilinear in

  • The bilinear in X and K is a common paradigm
  • Bilinear optimization is not Convex. To Convexify the problem, we use a change of variables.

Problem 2:

where and we find

The Problem 1 is equivalent to Problem 2

Conclusion edit

If the (A,B) are controllable, We can obtain a controller matrix that stabilizes the system.

Implementation edit

A link to the Matlab code for a simple implementation of this problem in the Github repository:

https://github.com/yashgvd/ygovada

Related LMIs edit

Hurwitz Stability

External Links edit

Return to Main Page: edit

Mixed H2 Hinf with desired pole location control edit

LMI for Mixed with desired pole location Controller

The mixed output feedback control has been known as an example of a multi-objective optimal control problem. In this problem, the control feedback should respond properly to several specifications. In the controller, the channel is used to improve the robustness of the design while the channel guarantees good performance of the system and additional constraint is used to place poles at desired location.

The System edit

We consider the following state-space representation for a linear system:


where

  • , are the state vector and the output vectors, respectively
  • , are the disturbance vector and the control vector
  • , ,, ,,,, and are the system coefficient matrices of appropriate dimensions

The Data edit

We assume that all the four matrices of the plant,, ,, ,,,, and are given.

The Optimization Problem edit

For the system with the following feedback law:

The closed loop system can be obtained as:

the transfer function matrices are and
Thus the performance and the performance requirements for the system are, respectiverly

and

. For the performance of the system response, we introduce the closed-loop eigenvalue location requirement. Let

It is a region on the complex plane, which can be used to restrain the closed-loop eigenvalue locations. Hence a state feedback control law is designed such that,

  • The performance and the performance are satisfied.
  • The closed-loop eigenvalues are all located in , that is,

.

The LMI: LMI for mixed / with desired Pole locations edit

The optimization problem discussed above has a solution if there exist two symmetric matrices and a matrix , satisfying

min
s.t

where and are the weighting factors.

Conclusion: edit

The calculated scalars and are the and norms of the system, respectively. The controller is extracted as

Implementation edit

A link to Matlab codes for this problem in the Github repository:

Related LMIs edit

Mixed H2 Hinf with desired pole location for perturbed system

External Links edit

Return to Main Page edit

LMIs in Control/Tools

Mixed H2 Hinf with desired pole location control for perturbed systems edit

LMI for Mixed with desired pole location Controller for perturbed system case

The mixed output feedback control has been known as an example of a multi-objective optimal control problem. In this problem, the control feedback should respond properly to several specifications. In the controller, the channel is used to improve the robustness of the design while the channel guarantees good performance of the system and additional constraint is used to place poles at desired location.

The System edit

We consider the following state-space representation for a linear system:


where

  • , are the state vector and the output vectors, respectively
  • , are the disturbance vector and the control vector
  • , ,, ,,,, and are the system coefficient matrices of appropriate dimensions.
  • and are real valued matrix functions which represent the time varying parameters uncertainities.

Furthermore, the parameter uncertainties and are in the form of where

  • , and are known matrices of appropriate dimensions.
  • is a matrix containing the uncertainty, which satisfies

The Data edit

We assume that all the four matrices of the plant,, , ,, ,,,, and are given.

The Optimization Problem edit

For the system with the following feedback law:

The closed loop system can be obtained as:

the transfer function matrices are and
Thus the performance and the performance requirements for the system are, respectiverly

and

. For the performance of the system response, we introduce the closed-loop eigenvalue location requirement. Let

It is a region on the complex plane, which can be used to restrain the closed-loop eigenvalue locations. Hence a state feedback control law is designed such that,

  • The performance and the performance are satisfied.
  • The closed-loop eigenvalues are all located in , that is,

.

The LMI: LMI for mixed / with desired Pole locations edit

The optimization problem discussed above has a solution if there exist scalars two symmetric matrices and a matrix , satisfying

min
s.t

where

and are the weighting factors.

Conclusion: edit

The calculated scalars and are the and norms of the system, respectively. The controller is extracted as

Implementation edit

A link to Matlab codes for this problem in the Github repository:

Related LMIs edit

Mixed H2 Hinf with desired poles controller

External Links edit

Return to Main Page edit

LMIs in Control/Tools

Robust H2 State Feedback Control edit

Robust State Feedback Control edit

For the uncertain linear system given below, and a scalar . The goal is to design a state feedback control in the form of such that the closed-loop system is asymptotically stable and satisfies.


The System edit

Consider System with following state-space representation.


where , , , . For state feedback control

and are real valued matrix functions that represent the time varying parameter uncertainties and of the form


where matrices and are some known matrices of appropriate dimensions, while is a matrix which contains the uncertain parameters and satisfies.


For the perturbation, we obviously have

, for
, for


The Problem Formulation: edit

The state feedback control problem has a solution if and only if there exist a scalar , a matrix , two symmetric matrices and satisfying the following LMI's problem.

The LMI: edit



where is the definition that is need for the above LMI.


Conclusion: edit

In this case, an state feedback control law is given by .


External Links edit

  • LMIs in Control Systems Analysis, Design and Applications - Duan and Yu
  • A course on LMIs in Control by Matthew Peet.
  • LMIs in Systems and Control Theory - A downloadable book on LMIs by Stephen Boyd.

LQ Regulation via H2 control edit

LQ Regulation via Control edit

The LQR design problem is to build an optimal state feedback controller for the system such that the following quadratic performance index.


is minimized, where


The following assumptions should hold for a traditional solution.

is stabilizable.
is observable, with .

Relation to performance edit

For the system given above an auxiliary system is constructed


where


Where represents an impulse disturbance. Then with state feedback controller the closed loop transfer function from disturbance to output is


Then the LQ problem and the norm of are related as


Then norm minimization leads minimization of .

Data edit

The state-representation of the system is given and matrices are chosen for the optimal LQ problem.

The Problem Formulation: edit

Let assumptions and hold, then the state feedback control of the form exists such that if and only if there exist , and . Then can be obtained by the following LMI.

The LMI: edit



Conclusion: edit

In this case, a feedback control law is given as .


External Links edit

  • LMIs in Control Systems Analysis, Design and Applications - Duan and Yu
  • A course on LMIs in Control by Matthew Peet.
  • LMIs in Systems and Control Theory - A downloadable book on LMIs by Stephen Boyd.

State Feedback edit

  1. H-infinity
  2. H-2
  3. Mixed
  4. Closed-Loop Robust Stability and Controller synthesis of Discrete-Time System with Polytopic Uncertainty

Optimal State Feedback edit

  1. Discrete Time Hinf Optimal Full State Feedback Control
  2. Discrete Time H2 Optimal Full State Feedback Control
  3. Discrete Time Mixed H2-Hinf Optimal Full State Feedback Control

Output Feedback edit

  1. H-infinity
  2. H-2
  3. Mixed

Static Output Feedback edit

  1. H-infinity
  2. H-2
  3. Mixed
  4. Discrete-Time Static Output Feedback Stabilizability

Optimal Output Feedback edit

  1. H-infinity
  2. H-2
  3. Mixed

Optimal Dynamic Output Feedback edit

  1. Discrete Time Hinf Optimal Dynamic Output Feedback Control
  2. Discrete Time H2 Optimal Dynamic Output Feedback Control
  3. Mixed

Discrete Time Stabilizability edit

Discrete-Time Stabilizability

A discrete time system operates on a discrete time signal input and produces a discrete time signal output. They are used in digital signal processing, such as digital filters for images or sound. The class of discrete time systems that are both linear and time invariant, known as discrete time LTI systems.

Discrete-Time LTI systems can be made stable using controller gain K, which can be found using LMI optimization, such that the close loop system is stable.

The System edit

Discrete-Time LTI System with state space realization

The Data edit

The matrices: System .

The Optimization Problem edit

The following feasibility problem should be optimized:

Maximize P while obeying the LMI constraints.
Then K is found.

The LMI: edit

Discrete-Time Stabilizability

The LMI formulation

Conclusion: edit

The system is stabilizable iff there exits a , such that . The matrix is Schur with

Implementation edit

A link to CodeOcean or other online implementation of the LMI
MATLAB Code

Related LMIs edit

[6] - Continuous Time Stabilizability

External Links edit

A list of references documenting and validating the LMI.

Return to Main Page: edit

Quadratic Schur Stabilization edit

LMI for Quadratic Schur Stabilization

A discrete-time system is said to be stable if all roots of its characteristic equation lie in the open unit disk. This provides a condition for the stability of discrete-time linear systems with polytopic uncertainties and a linear time-invariant system with this property is called a Schur stable system.


The System edit

Consider discrete time system

where , , at any .
The system consist of uncertainties of the following form

where ,, and

The Data edit

The matrices necessary for this LMI are , , and

The LMI: edit

There exists some X > 0 and Z such that

The Optimization Problem edit

The optimization problem is to find a matrix such that:

According to the definition of the spectral norms of matrices, this condition becomes equivalent to:

Using the Lemma 1.2 in LMI in Control Systems Analysis, Design and Applications (page 14), the aforementioned inequality can be converted into:

Conclusion: edit

The Controller gain matrix is extracted as

It follows that the trajectories of the closed-loop system (A+BK) are stable for any

Implementation edit

https://github.com/JalpeshBhadra/LMI/blob/master/quadratic_schur_stabilization.m

Related LMIs edit

Schur Complement
Schur Stabilization

External Links edit

Generic Insensitive Strip Region Design edit

Insensitive Strip Region Design


Suppose if one were interested in robust stabilization where closed-loop eigenvalues are placed in particular regions of the complex plane where the said regions has an inner boundary that is insensitive to perturbations of the system parameter matrices. This would be accomplished with the help of 2 design problems: the insensitive strip region design and insensitive disk region design (see link below for the latter).


The System edit

Suppose we consider the following continuous-time linear system that needs to be controlled:

where , , and are the state, output and input vectors respectively. Then the steps to obtain the LMI for insensitive strip region design would be obtained as follows.

The Data edit

Prior to obtaining the LMI, we need the following matrices: , , and .

The Optimization Problem edit

Consider the above linear system as well as 2 scalars and . Then the output feedback control law would be such that , where:

Letting being the solution to the above problem, then

where

The LMI: Insensitive Strip Region Design edit

Using the above info, we can simplify the problem by setting to for all practical applications. This then simplifies our problem and results in the following LMI:

Conclusion: edit

If the resulting solution from the LMI above produces a negative , then the output feedback controller is Hurwitz-stable. Hoewever, if is a really small positive number, then must be negative for the controller to be Hurwitz-stable.

Implementation edit

  • Example Code - A GitHub link that contains code (titled "InsensitiveStripRegion.m") that demonstrates how this LMI can be implemented using MATLAB-YALMIP.

Related LMIs edit

External Links edit

A list of references documenting and validating the LMI.

Return to Main Page: edit

Generic Insensitive Disk Region Design edit

Insensitive Disk Region Design


Similar to the insensitive strip region design problem, insensitive disk region design is another way with which robust stabilization can be achieved where closed-loop eigenvalues are placed in particular regions of the complex plane where the said regions has an inner boundary that is insensitive to perturbations of the system parameter matrices.


The System edit

Suppose we consider the following linear system that needs to be controlled:

where , , and are the state, output and input vectors respectively, and represents the differential operator (in the continuous-time case) or one-step shift forward operator (i.e., ) (in the discrete-time case). Then the steps to obtain the LMI for insensitive strip region design would be obtained as follows.

The Data edit

Prior to obtaining the LMI, we need the following matrices: , , and .

The Optimization Problem edit

Consider the above linear system as well as 2 positive scalars and . Then the output feedback control law would be designed such that:

Recalling the definition, we have:

and

Letting being the solution to the above problem, then

The LMI: Insensitive Strip Region Design edit

Using the above info, we can convert the given problem into an LMI, which - after using Schur compliment Lemma - results in the following:

Conclusion: edit

For Schur stabilization, we can choose to solve the problem with . Schur stability is achieved when . Alternately, if is greater than (but very close to) 1, then Schur stability is also achieved when .

Implementation edit

  • Example Code - A GitHub link that contains code (titled "InsensitiveDiskRegion.m") that demonstrates how this LMI can be implemented using MATLAB-YALMIP.

Related LMIs edit

External Links edit

A list of references documenting and validating the LMI.

Return to Main Page: edit

Design for Insensitive Strip Region edit

Insensitive Strip Region Design with Minimum Gain

When designing controllers with insensitive region conditions, the aim is to place the closed-loop poles of the system in a particular region defined by its inner boundary. These regions are specified based on their insensitivity to perturbations to the system parameter matrices.

One type of such design is the Insensitive Strip Region Design. In this section, building upon that, optimization problems will be provided that ensure that the conditions for insensitive strip region design are satisfied with some bounds on the gain of the closed-loop system.

The System edit

A state-space representation of a linear system as given below:

where , and are the system state, output, and the input vector respectively.

The Data edit

To solve the design optimization problem, the linear system matrices A,B,C are required. Furthermore, to define the strip region on the eigenvalue-space, two parameters and are required.

The Optimization Problem edit

The problem of designing an optimal controller that results in the closed loop system insensitive to a certain strip region involves two sub-problems:

  • Finding a control gain such that: .
  • The conditions for insensitive strip region design for the closed-loop system, as provided in the section Insensitive Strip Region Design are fulfilled.
  • The optimization goal is to minimize such that above two hold.

The LMI: Optimal Control Design for Insensitive Strip Region edit

The problem above has a solution if and only if the following optimization problem has a solution :

Conclusion: edit

By using the design problem provided here, an optimal controller is designed to make the closed-loop system robust to perturbations in the system matrices.

Implementation edit

To solve the optimization problem with LMI presented here, YALMIP toolbox is required for setting up the feasibility problem, and SeDuMi is required to solve the problem. The following link showcases an example of the feasibility problem:

https://github.com/smhassaan/LMI-Examples/blob/master/H2_Strip_example.m

Related LMIs edit

Insensitive Strip Region Design

External Links edit

A list of references documenting and validating the LMI.

Return to Main Page: edit

Design for Insensitive Disk Region edit

Insensitive Disk Region Design with Minimum Gain

Apart from the design for the insensitive strip region with minimum gain, another type of such design is the Insensitive Disk Region Design. In this section, optimization problems will be provided that ensure that the conditions for insensitive disk region design are satisfied with some bounds on the gain of the closed-loop system.

The System edit

A state-space representation of a linear system as given below:

where , and are the system state, output, and the input vector respectively. represents the differential operation for continuous time systems, or the one-step shift forward operator for discrete time case.

The Data edit

To solve the design optimization problem, the linear system matrices A,B,C are required. Furthermore, to define the disk region on the eigenvalue-space, its radius is required.

The Optimization Problem edit

The problem of designing an optimal controller that results in the closed loop system insensitive to a certain disk region involves two sub-problems:

  • Finding a control gain such that: .
  • The conditions for insensitive disk region design for the closed-loop system, as provided in the section Insensitive Disk Region Design are fulfilled.
  • The optimization goal is to minimize such that above two hold.

The LMI: Optimal Control Design for Insensitive Disk Region edit

The problem above has a solution if and only if the following optimization problem has a solution :

Conclusion: edit

By using the design problem provided here, an optimal controller is designed to make the closed-loop system robust to perturbations in the system matrices.

Implementation edit

To solve the optimization problem with LMI presented here, YALMIP toolbox is required for setting up the feasibility problem, and SeDuMi is required to solve the problem. The following link showcases an example of the feasibility problem:

https://github.com/smhassaan/LMI-Examples/blob/master/H2_Disk_example.m

Related LMIs edit

Insensitive Disk Region Design

External Links edit

A list of references documenting and validating the LMI.

Return to Main Page: edit

Quadratic Stability edit

User:ShakespeareFan00/Sandbox1


The System: edit

A TS fuzzy model allows the representation of a non-linear model as a set of local LTI (Linear Time Invariant) models , each one called subsystem. A subsystem is the local representation of the system in the space of premise variables = which are known and could depend on the state variables and input variables.

The Optimization Problem: edit

Let consider an autonomous system = with being a constant matrix. If we define the Lyapunov function =, then the system is stable if there exist such that condition is satisfied.

If we have a family of matrices (where is a parameter that is bounded by a polytope ∆) instead of a single matrix A, then the system equation becomes = and condition should be satisfied for all possible values of . If exists such that following condition is satisfied then the system is quadratically stable.

∈ ∆.

Since there are an infinite number of matrices A(δ(t)) there is also an infinite number of constraints like that for quadratic stability mentioned previously that should be fulfilled. From a practical point of view this makes the problem impossible to be solved. Let consider now that the system can be written in a polytopic form as a Takagi-Sugeno (TS) polytopic system with premise variables and a set of r subsystems for .

.

It can be proven that a polytopic autonomous system is quadratically stable if previous condition is satisfied in the vertices (subsystems) of the polytope. Therefore there is no need to check stability in an infinite number of matrices, but only in subsystems matrices .

∀i = 1, . . . , r.

Stability conditions can be applied to the closed-loop system and the following set of conditions are obtained.

∀i = 1, . . . , r.

∀i, j ∈ {1, . . . , r}, i < j.

where and .

In the special case where matrices Bi are constant (i.e. ), the first set of inequalities are enough to prove stability. Therefore, assuming constant B for all the subsystems, if there exist P > 0 such that conditions are fulfilled, then the polytopic TS model (2.2) with state feedback control is quadratically stable inside the polytope.

∀i = 1, . . . , r.

The assumption of constant B can be achieve using a prefiltering of the input. This change is not restrictive and the main consequence is the addition of some new state variables (the ones from the filter) to the TS model.



The LMI: edit

The design of the controller that stabilizes the closed-loop system boils down to solve the Linear Matrix Inequality (LMI) problem of finding a positive definite matrix P and a set of matrices such that conditions are fulfilled. However, since the constraints should be linear combinations of the unknown variable, the following change of variables is applied: where . The solution of the LMI problem is the set of matrices such that conditions are fulfilled.

. ∀i = 1, . . . , r.

The i-th controller is computed from the solution as =

Conclusion: edit

The LMI is feasible.

Implementation edit

References edit

  • Control, A. (2016). Gain-scheduling Control of a Quadrotor Using the Takagi-Sugeno Approach.

Apkarian Filter and State Feedback edit

User:ShakespeareFan00/Sandbox1


The System: edit

The number of LMI constraints needed to check quadratic stability is reduced if all the subsystems in the polytopic model has the same matrix . This can be achieved by adding an Apkarian filter in the input of the system.

The Optimization Problem: edit

Apkarian Filter

Let consider our TS-LIA model. This can be re written in linear form as:

The filter should be such that the equilibrium of the states are the input values and the dynamics should be fast, so we could assume the dynamics of the filter negligible (i.e. the input of the filter is equivalent to the input of the quadrotor). One possible filter is shown , where = −100, = 100 and is the identity matrix.

.

When applying the filter, we are imposing that the output of the filter is the new input of the TS-LIA model (i.e. = ). Then, the extended model is:

This prefiltering does not affect the procedure followed to obtain the TS-LIA model, so the premise variables, membership functions and activations functions remains the same.

State Feedback Controller Design

Let consider the state feedback control law for the extended TS-LIA model:, where the state feedback control laws are :, we get the closed loop system  :

The LMI: edit

The design of the controller is done by solving an LMI problem involving the quadratic stability constraints. In case we want D- stabilization, the following set of LMI constraints are needed:

∀i = 1, . . . , 32.

Conclusion: edit

The LMI is feasible.

Related LMIs edit

References edit

  • Control, A. (2016). Gain-scheduling Control of a Quadrotor Using the Takagi-Sugeno Approach.

Minimum Decay Rate in State Feedback edit

User:ShakespeareFan00/Sandbox1


The System: edit

The number of LMI constraints needed to check quadratic stability is reduced if all the subsystems in the polytopic model has the same matrix . This can be achieved by adding an Apkarian filter in the input of the system.

The Optimization Problem: edit

Apkarian Filter

Let consider our TS-LIA model. This can be re written in linear form as:

The filter should be such that the equilibrium of the states are the input values and the dynamics should be fast, so we could assume the dynamics of the filter negligible (i.e. the input of the filter is equivalent to the input of the quadrotor). One possible filter is shown , where = −100, = 100 and is the identity matrix.

.

When applying the filter, we are imposing that the output of the filter is the new input of the TS-LIA model (i.e. = ). Then, the extended model is:

This prefiltering does not affect the procedure followed to obtain the TS-LIA model, so the premise variables, membership functions and activations functions remains the same.

State Feedback Controller Design

Let consider the state feedback control law for the extended TS-LIA model:, where the state feedback control laws are :, we get the closed loop system  :

The LMI: edit

The design of the controller is done by solving an LMI problem involving the quadratic stability constraints. In case we want D- stabilization, the following set of LMI constraints are needed:

∀i = 1, . . . , 32.

A pair of conjugate complex poles s of the closed loop system can be written as = − where is the damping ratio, is the undamped natural frequency and is the frequency response defined as .Three different LMI regions have been considered, each one related with a performance specification regarding and :

Minimum Decay Rate:

If we want to set a minimum decay rate α in the closed loop system response, the poles should be inside the LMI region defined in : = [s = x + j y | x < − ].where > 0. In this case L = and M = 1.

Applying condition to the closed-loop system , the LMI condition associated to this LMI region is:

∀i = 1, . . . , 32.

Conclusion: edit

The LMI is feasible.

Related LMIs edit

References edit

  • Control, A. (2016). Gain-scheduling Control of a Quadrotor Using the Takagi-Sugeno Approach.

Maximum Natural Frequency in State Feedback edit

User:ShakespeareFan00/Sandbox1


The System: edit

The number of LMI constraints needed to check quadratic stability is reduced if all the subsystems in the polytopic model has the same matrix . This can be achieved by adding an Apkarian filter in the input of the system.

The Optimization Problem: edit

Apkarian Filter

Let consider our TS-LIA model. This can be re written in linear form as:

The filter should be such that the equilibrium of the states are the input values and the dynamics should be fast, so we could assume the dynamics of the filter negligible (i.e. the input of the filter is equivalent to the input of the quadrotor). One possible filter is shown , where = −100, = 100 and is the identity matrix.

.

When applying the filter, we are imposing that the output of the filter is the new input of the TS-LIA model (i.e. = ). Then, the extended model is:

This prefiltering does not affect the procedure followed to obtain the TS-LIA model, so the premise variables, membership functions and activations functions remains the same.

State Feedback Controller Design

Let consider the state feedback control law for the extended TS-LIA model:, where the state feedback control laws are :, we get the closed loop system  :

The LMI: edit

The design of the controller is done by solving an LMI problem involving the quadratic stability constraints. In case we want D- stabilization, the following set of LMI constraints are needed:

∀i = 1, . . . , 32.

A pair of conjugate complex poles s of the closed loop system can be written as = − where is the damping ratio, is the undamped natural frequency and is the frequency response defined as .Three different LMI regions have been considered, each one related with a performance specification regarding and :

Maximizing Natural Frequency:

Natural frequency is related with the maximum frequency response in the undamped case ( = 0). If we want to set a maximum condition, the LMI region associated is = [s = x + jy | |x + jy| < ], ::. Resulting LMI condition is:

∀i = 1, . . . , 32.

Conclusion: edit

The LMI is feasible.

Related LMIs edit

References edit

  • Control, A. (2016). Gain-scheduling Control of a Quadrotor Using the Takagi-Sugeno Approach.

Optimal Observer and State Estimation edit

{{:LMIs in Control/Observer Synthesis/Continuous Time/Optimal Observer and State Estimation}

Detectability LMI edit

Detectability LMI edit

Detectability is a weaker version of observability. A system is detectable if all unstable modes of the system are observable, whereas observability requires all modes to be observable. This implies that if a system is observable it will also be detectable. The LMI condition to determine detectability of the pair is shown below.

The System edit

where , , at any .

The Data edit

The matrices necessary for this LMI are and . There is no restriction on the stability of .

The LMI: Detectability LMI edit

is detectable if and only if there exists such that

.

Conclusion: edit

If we are able to find such that the above LMI holds it means the matrix pair is detectable. In words, a system pair is detectable if the unobservable states asymptotically approach the origin. This is a weaker condition than observability since observability requires that all initial states must be able to be uniquely determined in a finite time interval given knowledge of the input and output .

Implementation edit

This implementation requires Yalmip and Sedumi.

https://github.com/eoskowro/LMI/blob/master/Detectability_LMI.m

Related LMIs edit

Stabilizability LMI

Hurwitz Stability LMI

Controllability Grammian LMI

Observability Grammian LMI

External Links edit

A list of references documenting and validating the LMI.


Return to Main Page: edit

LMI for the Observability Grammian edit

LMI for the Observability Grammian

Observability is a system property which says that the state of the system can be reconstructed using the input and output on an interval . This is necessary when knowledge of the full state is not available. If observable, estimators or observers can be created to reconstruct the full state. Observability and controllability are dual concepts. Thus in order to investigate the observability of a system we can study the controllability of the dual system. Although system observability can be determined with multiple methods, one is to compute the rank of the observability grammian.

The System edit

where , , at any .

The Data edit

The matrices necessary for this LMI are and .

The LMI:LMI to Determine the Observability Grammian edit

is observable if and only if is the unique solution to

,

where is the observability grammian.

Conclusion: edit

The above LMI attempts to find the observability grammian of the system . If the problem is feasible and a unique is found, then the system is also observable. The observability grammian can also be computed as: . Due to the dual nature of observability and controllability this LMI can be determined by determining the controllability of the dual nature, which results in the above LMI. The Observability and Controllability matricies are written as and respectively. They are related as follows:

Hence is observable if and only if is controllable. Please refer to the section on controllability grammians.

Implementation edit

This implementation requires Yalmip and Sedumi.

https://github.com/eoskowro/LMI/blob/master/Observability_Gram_LMI.m

Related LMIs edit

Stabilizability LMI

Hurwitz Stability LMI

Detectability LMI

Controllability Grammian LMI

External Links edit

A list of references documenting and validating the LMI.


Return to Main Page: edit

H-infinity filtering edit

User:ShakespeareFan00/Sandbox1

For systems that have disturbances, filtering can be used to reduce the effects of these disturbances. Described on this page is a method of attaining a filter that will reduce the effects of the disturbances as completely as possible. To do this, we look to find a set of new coefficient matrices that describe the filtered system. The process to achieve such a new system is described below. The H-infinity-filter tries to minimize the maximum magnitude of error.

The System edit

For the application of this LMI, we will look at linear systems that can be represented in state space as

where represent the state vector, the measured output vector, and the output vector of interest, respectively, is the disturbance vector, and and are the system matrices of appropriate dimension.

To further define: is and is the state vector, is and is the state matrix, is and is the input matrix, is and is the exogenous input, is and is the output matrix, and are and are feedthrough matrices, and and are and are the output and the output of interest, respectively.

The Data edit

The data are (the disturbance vector), and and (the system matrices). Furthermore, the matrix is assumed to be stable

The Optimization Problem edit

We need to design a filter that will eliminate the effects of the disturbances as best we can. For this, we take a filter of the following form:

where is the state vector, is the estimation vector of z, and are the coefficient matrices of appropriate dimensions.

Note that the combined complete system can be represented as

where is the estimation error,

is the state vector of the system, and are the coefficient matrices, defined as:

In other words, for the system defined above we need to find such that

where is a positive constant, and

The LMI: H-inf Filtering edit

The solution can be obtained by finding matrices that obey the following LMIs:

Conclusion: edit

To find the corresponding filter, use the optimized matrices from the solution to find:

These matrices can then be used to produce to construct the filter described above, that will best eliminate the disturbances of the system.

Implementation edit

This implementation requires Yalmip and Sedumi.

https://github.com/rezajamesahmed/LMImatlabcode/blob/master/hinf_filtering.m

Related LMIs edit

H-2_filtering

External Links edit

This LMI comes from

  • [7] - "LMIs in Control Systems: Analysis, Design and Applications" by Guang-Ren Duan and Hai-Hua Yu

Other resources:


References edit

Duan, G. (2013). LMIs in control systems: analysis, design and applications. Boca Raton: CRC Press, Taylor & Francis Group.

Return to Main Page: edit

H2 filtering edit

User:ShakespeareFan00/Sandbox1

For systems that have disturbances, filtering can be used to reduce the effects of these disturbances. Described on this page is a method of attaining a filter that will reduce the effects of the disturbances as completely as possible. To do this, we look to find a set of new coefficient matrices that describe the filtered system. The process to achieve such a new system is described below. The H2-filter tries to minimize the average magnitude of error.

The System edit

For the application of this LMI, we will look at linear systems that can be represented in state space as

where represent the state vector, the measured output vector, and the output vector of interest, respectively, is the disturbance vector, and and are the system matrices of appropriate dimension. To further define: is and is the state vector, is and is the state matrix, is and is the input matrix, is and is the exogenous input, is and is the output matrix, and are and are feedthrough matrices, and and are and are the output and the output of interest, respectively.

The Data edit

The data are (the disturbance vector), and and (the system matrices). Furthermore, the matrix is assumed to be stable

The Optimization Problem edit

We need to design a filter that will eliminate the effects of the disturbances as best we can. For this, we take a filter of the following form:

where is the state vector, is the estimation vector, and are the coefficient matrices of appropriate dimensions.

Note that the combined complete system can be represented as

where is the estimation error,

is the state vector of the system, and are the coefficient matrices, defined as:

In other words, for the system defined above we need to find such that

where is a positive constant, and

The LMI: H-2 Filtering edit

For this LMI, the solution exists if one of the following sets of LMIs hold:

Matrices exist that obey the following LMIs:

or

Matrices exist that obey the following LMIs:

Conclusion: edit

To find the corresponding filter, use the optimized matrices from the first solution to find:

Or the second solution to find:

These matrices can then be used to produce to construct the final filter below, that will best eliminate the disturbances of the system.

Implementation edit

This implementation requires Yalmip and Sedumi.

https://github.com/rezajamesahmed/LMImatlabcode/blob/master/H2_Filtering.m

Related LMIs edit

H-infinity filtering

External Links edit

This LMI comes from

  • [8] - "LMIs in Control Systems: Analysis, Design and Applications" by Guang-Ren Duan and Hai-Hua Yu

Other resources:



References edit

Duan, G. (2013). LMIs in control systems: analysis, design and applications. Boca Raton: CRC Press, Taylor & Francis Group.

Return to Main Page: edit

H2 Optimal Observer edit

State observer is a system that provides estimates of internal states of a given real system, from measurements of the inputs and outputs of the real system.The goal of -optimal state estimation is to design an observer that minimizes the norm of the closed-loop transfer matrix from w to z. Kalman filter is a form of Optimal Observer.

The System edit

Consider the continuous-time generalized plant with state-space realization

The Data edit

The matrices needed as input are .

The Optimization Problem edit

The task is to design an observer of the following form:

The LMI: Optimal Observer edit

LMIs in the variables are given by:

Conclusion: edit

The -optimal observer gain is recovered by and the norm of T(s) is

Implementation edit

https://github.com/Ricky-10/coding107/blob/master/H2%20Optimal%20Observer


External Links edit

A list of references documenting and validating the LMI.

Return to Main Page: edit

HInf Optimal Observer edit

-Optimal observers yield robust estimates of some or all internal plant states by processing measurement data. Robust observers are increasingly demanded in industry as they may provide state and parameter estimates for monitoring and diagnosis purposes even in the presence of large disturbances such as noise etc. It is there where Kalman filters may tend to fail. State observer is a system that provides estimates of internal states of a given real system, from measurements of the inputs and outputs of the real system. The goal of -optimal state estimation is to design an observer that minimizes the norm of the closed-loop transfer matrix from w to z.

The System edit

Consider the continuous-time generalized plant with state-space realization

The Data edit

The matrices needed as input are .

The Optimization Problem edit

The observer gain is to be designed such that the of the transfer matrix from w to z, given by

is minimized. The form of the observer would be:

The LMI: Optimal Observer edit

The -optimal observer gain is synthesized by solving for , and that minimize subject to and

Conclusion: edit

The -optimal observer gain is recovered by and the norm of T(s) is .

Implementation edit

Link to the MATLAB code designing - Optimal Observer

https://github.com/Ricky-10/coding107/blob/master/HinfinityOptimalobserver


External Links edit

Return to Main Page: edit

Mixed H2 HInf Optimal Observer edit

The goal of mixed -optimal state estimation is to design an observer that minimizes the norm of the closed-loop transfer matrix from to , while ensuring that the norm of the closed-loop transfer matrix from to is below a specified bound.

The System edit

Consider the continuous-time generalized plant with state-space realization

where it is assumed that is detectable.

The Data edit

The matrices needed as input are .

The Optimization Problem edit

The observer gain L is to be designed to minimize the norm of the closed-loop transfer matrix from the exogenous input to the performance output while ensuring the norm of the closed-loop transfer matrix from the exogenous input to the performance output is less than , where

is minimized. The form of the observer would be:

is to be designed, where is the observer gain.

The LMI: Optimal Observer edit

The mixed -optimal observer gain is synthesized by solving for , and that minimize subject to ,


Conclusion: edit

The mixed -optimal observer gain is recovered by , the norm of is less than and the norm of T(s) is less than .

Implementation edit

Link to the MATLAB code designing - Optimal Observer

Code Optimal Observer


External Links edit

Related LMIs edit


Return to Main Page: edit

H2 Optimal Filter edit

Optimal filtering is a means of adaptive extraction of a weak desired signal in the presence of noise and interfering signals. Optimal filters normally are free from stability problems. There are simple operational checks on an optimal filter when it is being used that indicate whether it is operating correctly. Optimal filters are probably easier to make adaptive to parameter changes than suboptimal filters.The goal of optimal filtering is to design a filter that acts on the output of the generalized plant and optimizes the transfer matrix from w to the filtered output.

The System: edit

Consider the continuous-time generalized LTI plant with minimal states-space realization

where it is assumed that is Hurwitz.

The Data edit

The matrices needed as inputs are .

The Optimization Problem: edit

An -optimal filter is designed to minimize the norm of in following equation.

To ensure that has a finite norm, it is required that , which results in

The LMI: - Optimal filter edit

Solve for , and that minimize subject to .


Conclusion: edit

The filter is recovered by and .

Implementation edit

MATLAB code of Optimal filter

External links edit

HInf Optimal Filter edit

Optimal filtering is a means of adaptive extraction of a weak desired signal in the presence of noise and interfering signals. The goal of optimal filtering is to design a filter that acts on the output of the generalized plant and optimizes the transfer matrix from w to the filtered output.

The System: edit

Consider the continuous-time generalized LTI plant with minimal states-space realization

where it is assumed that is Hurwitz.

The Data edit

The matrices needed as inputs are .

The Optimization Problem: edit

An -optimal filter is designed to minimize the norm of in following equation.


The LMI: - Optimal filter edit

Solve for , and that minimize subject to .


Conclusion: edit

The filter is recovered by and .

Implementation edit

External links edit

FDI Filter Design For Systems With Sensor Faults: an LMI edit

FDI Filter Design For Systems With Sensor Faults: an LMI

Systems with faulty sensors are a very common type of systems. In many cases, redundancy is added in the form of additional sensors, but in certain cases it could be a costly solution. For general linear system models, the LMI in this section can be utilized to design state estimators which can detect and isolate faulty sensor readings in order to mitigate their effects.

The System edit

where is the state, is the control input, is the process noise, is the output and is the measurement noise.

The Data edit

The state space matrices are required to be known.


The Optimization LMI edit

The following LMI is used to design the Fault Detection and Isolation (FDI) filter:

Then the filter is .

Conclusion: edit

The LMI designed in this section is used to design filters that can work on systems that are prone to sensors getting damaged or faulty.

Implementation edit

To solve the feasibility LMI, YALMIP toolbox is required for setting up the feasibility problem, and SeDuMi is required to solve the problem. The following link showcases an example of the feasibility problem:

https://github.com/smhassaan/LMI-Examples/blob/master/FDI_Filter_example.m

Related LMIs edit

H-infinity Optimal Filter

H-infinity Optimal Observer

External Links edit

A list of references documenting and validating the LMI.


Return to Main Page: edit

H2 Optimal State estimation edit

User:ShakespeareFan00/Sandbox1

The H2 norm of a stable system H is the root-mean-square of the impulse response of the system. The H2 norm measures the steady-state covariance (or power) of the output response to unit noise input. In this module, the goal of H2 optimal state estimation is to design an observer that minimizes the H2 norm of the closed loop transfer matrix

The System edit

Consider the continuous-time generalized plant P with state-space realization

where it is assumed that (A,C2) is detectable. An observer of the form

The Data edit

  • n, l , m are respectively the state vector, the measured

output vector, and the output vector of interests

  • p and r are the disturbance vector and the control vector,

respectively

  • A, B1, B2, C1, C2, D1, and D2 are the system coefficient matrices of

appropriate dimensions

The Optimization Problem edit

Given the system and a positive scalar we have to find the matrix L such that

||||2 <

An observer of the form


is to be designed, where L is the observer gain.
Defining the error state as

The break dynamics are found to be


For the system we introduce a full state observer in the following form:
are the observation vector and the observer gain.
The transfer function for this case is

and thus the problem of state observer design is to find L such that
||

The LMI: LMI for H2 Observer estimation edit

The H2 state observer problem has a solution if and only if there exists a matrix , a symmetric matrix and a symmetric matrix such that




and from the solution of the above LMIs we can obtain the observer matrix as

Conclusion edit

Thus by formulation, we have converted the problem of H2 state observer design into an LMI feasibility problem by optimizing the above LMIs. In application we are often concerned with the problem of finding the minimal attenuation level

On implementation and optimization of the above LMI using YALMIP and MOSEK (or) SeDuMi we get 3 matrices as output, and also which is used to calculate which is the H2 norm of the system.



There exists another set of LMIs which holds true for the same optimization problem as above.




When a minimal is obtained, the minimal attenuation level is

Implementation edit

A link to the Matlab code for a simple implementation of this problem in the Github repository:

https://github.com/yashgvd/ygovada

Related LMIs edit

H State Observer Design
Discrete time H2 State Observer Design

External Links edit

Return to Main Page: edit

Hurwitz Detectability edit

User:ShakespeareFan00/Sandbox1


Hurwitz Detectability edit

Hurwitz detectability is a dual concept of Hurwitz stabilizability and is defined as the matrix pair , is said to be Hurwitz detectable if there exists a real matrix such that is Hurwitz stable.

The System edit

where , , , at any .

The Data edit

  • The matrices are system matrices of appropriate dimensions and are known.

The Optimization Problem edit

There exist a symmetric positive definite matrix and a matrix satisfying

There exists a symmetric positive definite matrix satisfying

with being the right orthogonal complement of .
There exists a symmetric positive definite matrix such that

for some scalar

The LMI: edit

Matrix pair , is Hurwitz detectable if and only if following LMI holds


Conclusion: edit

Thus by proving the above conditions we prove that the matrix pair is Hurwitz Detectable.

Implementation edit

Find the MATLAB implementation at this link below
Hurwitz detectability

Related LMIs edit

Links to other closely-related LMIs
LMI for Hurwitz stability
LMI for Schur stability
Schur Detectability

External Links edit

A list of references documenting and validating the LMI.

  • LMI Methods in Optimal and Robust Control - A course on LMIs in Control by Matthew Peet.
  • LMI Properties and Applications in Systems, Stability, and Control Theory - A List of LMIs by Ryan Caverly and James Forbes.
  • LMIs in Systems and Control Theory - A downloadable book on LMIs by Stephen Boyd.

Return to Main Page: edit

Full-Order State Observer edit

User:ShakespeareFan00/Sandbox1


Full-Order State Observer edit

The problem of constructing a simple full-order state observer directly follows from the result of Hurwitz detectability LMI's, Which essentially is the dual of Hurwitz stabilizability. If a feasible solution to the first LMI for Hurwitz detectability exist then using the results we can back out a full state observer such that is Hurwitz stable.

The System edit

where , , , at any .

The Data edit

  • The matrices are system matrices of appropriate dimensions and are known.

The Optimization Problem edit

The full-order state observer problem essential is finding a positive definite such that the following LMI conclusions hold.

The LMI: edit

1) The full-order state observer problem has a solution if and only if there exist a symmetric positive definite Matrix and a matrix that satisfy

Then the observer can be obtained as
2) The full-state state observer can be found if and only if there is a symmetric positive definite Matrix that satisfies the below Matrix inequality


In this case the observer can be reconstructed as . It can be seen that the second relation can be directly obtained by substituting in the first condition.

Conclusion: edit

Hence, both the above LMI's result in a full-order observer such that is Hurwitz stable.


External Links edit

A list of references documenting and validating the LMI.

  • LMIs in Control Systems Analysis, Design and Applications - Duan and Yu
  • LMI Methods in Optimal and Robust Control - A course on LMIs in Control by Matthew Peet.
  • LMI Properties and Applications in Systems, Stability, and Control Theory - A List of LMIs by Ryan Caverly and James Forbes.
  • LMIs in Systems and Control Theory - A downloadable book on LMIs by Stephen Boyd.

Return to Main Page: edit

Full-Order H-infinity State Observer edit

In this section, we design full order H- state observer.

The System edit

Given a state-space representation of a linear system

  • are the state vector, measured output vector and output vectors of interest.
  • are the disturbance vector and control vector respectively.


The Data edit

are system matrices

Definition edit

For the system , a full order state observer of the form of equation (1) is introduced and the estimate of interested output is given by .

 

 

 

 

(1)

The estimate of interested output is

 

 

 

 

(2)

Given the system and a positive scalar , L is found such that

 

 

 

 

(3)

LMI Condition edit

The state observers problem has a solution if and only if there exists a symmetric positive definite matrix and a matrix satisfying the below LMI

 

 

 

 

(4)

When such a pair of matrics is found, the solution is

 

 

 

 

(5)

Implementation edit

This implementation requires Yalmip and Mosek.

Conclusion edit

Thus, an state observer is designed such that the output vectors of interest are accurately estimated.

External Links edit

Reduced-Order State Observer edit

User:ShakespeareFan00/Sandbox1


Reduced Order State Observer edit

The Reduced Order State Observer design paradigm follows naturally from the design of Full Order State Observer.

The System edit

where , , , at any .

The Data edit

  • The matrices are system matrices of appropriate dimensions and are known.

The Problem Formulation edit

Given a State-space representation of a system given as above. First an arbitrary matrix is chosen such that the vertical augmented matrix given as

is nonsingular, then

Furthermore, let

then the matrix pair is detectable if and only if is detectable, then let

then a new system of the form given below can be obtained

once an estimate of is obtained the the full state estimate can be given as

the the reduced order observer can be obtained in the form.

Such that for arbitrary control and arbitrary initial system values, There holds

The value for can be obtain by solving the following LMI.

The LMI: edit

The reduced-order observer exists if and only if one of the two conditions holds.

1) There exist a symmetric positive definite Matrix and a matrix that satisfy

Then
2) There exist a symmetric positive definite Matrix that satisfies the below Matrix inequality


Then .

By using this value of we can reconstruct the observer state matrices as

Conclusion: edit

Hence, we are able to form a reduced-order observer using which we can back of full state information as per the equation given at the end of the problem formulation given above.


External Links edit

A list of references documenting and validating the LMI.

  • LMIs in Control Systems Analysis, Design and Applications - Duan and Yu
  • LMI Methods in Optimal and Robust Control - A course on LMIs in Control by Matthew Peet.
  • LMI Properties and Applications in Systems, Stability, and Control Theory - A List of LMIs by Ryan Caverly and James Forbes.
  • LMIs in Systems and Control Theory - A downloadable book on LMIs by Stephen Boyd.

Return to Main Page: edit

Optimal Observer; Mixed edit

User:ShakespeareFan00/Sandbox1

In many applications, perhaps even most, the state of the system cannot be directly known. In this case, you will need to strategically to measure key system outputs that will make the system states indirectly observable. Observers need to converge much faster than the system dynamics in order for their estimations to be accurate. Optimal observer synthesis is therefore advantageous. In this LMI, we seek to optimize both H2 and Hinf norms, to minimize both the average and the maximum error of the observer.

The System edit

where and is the state vector, and is the state matrix, and is the input matrix, and is the exogenous input, and is the output matrix, and is the feedthrough matrix, and is the output, and it is assumed that is detectable.



The Data edit

The matrices .

The Optimization Problem edit

An observer of the form:

is to be designed, where is the observer gain.

Defining the error state , the error dynamics are found to be

,

and the performance output is defined as

.

The observer gain is to be designed to minimize the norm of the closed loop transfer matrix from the exogenous input to the performance output is less than , where

The LMI: Discrete-Time Mixed H2-Hinf-Optimal Observer edit

The discrete-time mixed--optimal observer gain is synthesized by solving for , , , and that minimize J subject to ,

where refers to the trace of a matrix.

Conclusion: edit

The mixed--optimal observer gain is recovered by , the norm of is less than , and the norm of is less than . This result gives us a matrix of observer gains that allow us to optimally observe the states of the system indirectly as:

Implementation edit

This implementation requires Yalmip and Sedumi.

https://github.com/rezajamesahmed/LMImatlabcode/blob/master/mixedh2hinfobsdiscretetime.m

Related LMIs edit

Discrete-Time_Hinfinity-Optimal_Observer

Discrete-Time_H2-Optimal_Observer

External Links edit

This LMI comes from Ryan Caverly's text on LMI's (Section 5.3.2):

Other resources:

Return to Main Page: edit

Optimal Observer; H2 edit

User:ShakespeareFan00/Sandbox1

In many applications, perhaps even most, the state of the system cannot be directly known. In this case, you will need to strategically to measure key system outputs that will make the system states indirectly observable. Observers need to converge much faster than the system dynamics in order for their estimations to be accurate. Optimal observer synthesis is therefore advantageous. In this LMI, we seek to optimize the H2 norm, which conceptually is minimizing the average magnitude of error in the observer.

The System edit

where and is the state vector, and is the state matrix, and is the input matrix, and is the exogenous input, and is the output matrix, and is the feedthrough matrix, and is the output, and it is assumed that is detectable.

The Data edit

The matrices .

The Optimization Problem edit

An observer of the form:

is to be designed, where is the observer gain.

Defining the error state , the error dynamics are found to be

,

and the performance output is defined as

.

The observer gain is to be designed such that the of the transfer matrix from to , given by

is minimized.

The LMI: Discrete-Time H2-Optimal Observer edit

The discrete-time -optimal observer gain is synthesized by solving for , , , and that minimize subject to ,

where refers to the trace of a matrix.

Conclusion: edit

The -optimal observer gain is recovered by and the norm of is . The matrix is the observer gains that can be used to form the optimal observer:

Implementation edit

This implementation requires Yalmip and Sedumi.

https://github.com/rezajamesahmed/LMImatlabcode/blob/master/Discrete_Time_H2_Optimal_Observer_LMIs_Wikibook_Example.m

Related LMIs edit

Mixed H2-Hinfinity discrete time observer

Discrete-Time_Hinfinity-Optimal_Observer

External Links edit

This LMI comes from Ryan Caverly's text on LMI's (Section 5.1.2):

Other resources:

Return to Main Page: edit

Optimal Observer; Hinf edit

User:ShakespeareFan00/Sandbox1

In many applications, perhaps even most, the state of the system cannot be directly known. In this case, you will need to strategically to measure key system outputs that will make the system states indirectly observable. Observers need to converge much faster than the system dynamics in order for their estimations to be accurate. Optimal observer synthesis is therefore advantageous. In this LMI, we seek to optimize the H-infinity norm, which conceptually is minimizing the maximum magnitude of error in the observer.

The System edit

The system needed for this LMI is a discrete-time LTI plant , which has the state space realization:

where and is the state vector, and is the state matrix, and is the input matrix, and is the exogenous input, and is the output matrix, and is the feedthrough matrix, and is the output, and it is assumed that is detectable.

The Data edit

The matrices .

The Optimization Problem edit

An observer of the form:

is to be designed, where is the observer gain.

Defining the error state , the error dynamics are found to be

,

and the performance output is defined as

.

The observer gain is to be designed such that the of the transfer matrix from to , given by

is minimized.

The LMI: Discrete-Time Hinf-Optimal Observer edit

The discrete-time -optimal observer gain is synthesized by solving for , , and that minimize J subject to , and

Conclusion: edit

The -optimal observer gain is recovered by and the norm of is . This matrix of observer gains can then be used to form the optimal observer formulated by:

Implementation edit

This implementation requires Yalmip and Sedumi.

https://github.com/rezajamesahmed/LMImatlabcode/blob/master/Hinfobsdiscretetime.m

Related LMIs edit

Mixed H2-Hinfinity discrete time observer

Discrete-Time_H2-Optimal_Observer

External Links edit

This LMI comes from Ryan Caverly's text on LMI's (Section 5.2.2):

Other resources:

Return to Main Page: edit

Discrete Time Detectability edit

Discrete-Time Detectability

A discrete time system operates on a discrete time signal input and produces a discrete time signal output. They are used in digital signal processing, such as digital filters for images or sound. The class of discrete time systems that are both linear and time invariant, known as discrete time LTI systems.

Discrete-Time LTI systems can be made detectable using observer gain L, which can be found using LMI optimization, such that the close loop system is detectable.

The System edit

Discrete-Time LTI System with state space realization

The Data edit

The matrices: System .

The Optimization Problem edit

The following feasibility problem should be optimized:

Maximize P while obeying the LMI constraints.
Then L is found.

The LMI: edit

Discrete-Time Detectability

The LMI formulation

Conclusion: edit

The system is detectabe iff there exits a , such that . The matrix is Schur with

Implementation edit

A link to CodeOcean or other online implementation of the LMI
MATLAB Code

Related LMIs edit

[14] - Continuous time Detectability

External Links edit

A list of references documenting and validating the LMI.

Return to Main Page: edit

Schur Detectability edit

Schur Detectability

Schur detectability is a dual concept of Schur stabilizability and is defined as follows, the matrix pair is said to be Schur detectable if there exists a real matrix such that is Schur stable.

The System edit

We consider the following system:

where the matrices , , ,, , and are the state matrix, input matrix, state vector, and the input vector, respectively.

Moreover, represents time in the discrete-time system and is the next time step.

The state feedback control law is defined as follows:

where is the controller gain. Thus, the closed-loop system is given by:

The Data edit

  • The matrices are system matrices of appropriate dimensions and are known.

The Optimization Problem edit

There exist a symmetric matrix and a matrix W satisfying

There exists a symmetric matrix satisfying

with being the right orthogonal complement of .
There exists a symmetric matrix P such that


The LMI: edit

The LMI for Schur detecability can be written as minimization of the scalar, , in the following constraints:





Conclusion: edit

Thus by proving the above conditions we prove that the matrix pair is Schur Detectable.

Implementation edit

A link to Matlab codes for this problem in the Github repository: Schur Detectability

Related LMIs edit

LMI for Hurwitz stability
LMI for Schur stability
Hurwitz Detectability

External Links edit

  • [15] - LMI in Control Systems Analysis, Design and Applications

Return to Main Page edit

LMIs in Control/Tools

Robust Stabilization of Second-Order Systems edit

User:ShakespeareFan00/Sandbox1

Stabilization is a vastly important concept in controls, and is no less important for second order systems with perturbations. Such a second order system can be conceptualized most simply by the model of a mass-spring-damper, with added perturbations. Velocity and position are of course chosen as the states for this system, and the state space model can be written as it is below. The goal of stabilization in this context is to design a control law that is made up of two controller gain matrices , and . These allow the construction of a stabilized closed loop controller.

The System edit

In this LMI, we have an uncertain second-order linear system, that can be modeled in state space as:

where and are the state vector and the control vector, respectively, and are the derivative output vector and the proportional output vector, respectively, and are the system coefficient matrices of appropriate dimensions.

and are the perturbations of matrices and , respectively, are bounded, and satisfy

or

where and are two sets of given positive scalars, and are the i-th row and j-th collumn elements of matrices and , respectively. Also, the perturbation notations also satisfy the assumption that and .

To further define: is and is the state vector, is and is the state matrix on , is and is the state matrix on , is and is the state matrix on , is and is the input matrix, is and is the input, and are and are the output matrices, is and is the output from , and is and is the output from .

The Data edit

The matrices and perturbations describing the second order system with perturbations.

The Optimization Problem edit

For the system defined as shown above, we need to design a feedback control law such that the following system is Hurwitz stable. In other words, we need to find the matrices and in the below system.

However, to do proceed with the solution, first we need to present a Lemma. This Lemma comes from Appendix A.6 in "LMI's in Control systems" by Guang-Ren Duan and Hai-Hua Yu. This Lemma states the following: if , then the following is also true for the system described above:

The system is hurwitz stable if

,

or

the system is hurwitz stable if

, where are the numbers of nonzero elements in matrices respectively.

The LMI: Robust Stabilization of Second Order Systems edit

This problem is solved by finding matrices and that satisfy either of the following sets of LMIs.

or

Conclusion: edit

Having solved the above problem, the matrices and can be substituted into the input as to robustly stabilize the second order uncertain system. The new system is stable in closed loop.

Implementation edit

This implementation requires Yalmip and Sedumi.

https://github.com/rezajamesahmed/LMImatlabcode/blob/master/ROBstab2ndorder.m

Related LMIs edit

Stabilization of Second-Order Systems

External Links edit

This LMI comes from

  • [16] - "LMIs in Control Systems: Analysis, Design and Applications" by Guang-Ren Duan and Hai-Hua Yu

Other resources:

References edit

Duan, G. (2013). LMIs in control systems: analysis, design and applications. Boca Raton: CRC Press, Taylor & Francis Group.


Return to Main Page: edit

Robust Stabilization of Optimal State Feedback Control edit

Robust Full State Feedback Optimal Control edit

Additive uncertainty edit

Full State Feedback is a control technique which places a given system's closed loop system poles in locations specified by desired performance specifications. One can use methods to turn this into an optimization problem with the goal to minimize the impact of uncertain perturbations in a closed loop system while maintaining system stability. This is done by minimizing the norm of the uncertain closed loop system, which minimizes the worst case effect of the system disturbance or perturbation. This can be done for single-input single-output (SISO) or multiple-input multiple-output (MIMO) systems. Here we consider the case of a MIMO system with additive uncertainties.

The System edit

Consider linear system with uncertainty below:

Where is the state, is the output, is the exogenous input or disturbance vector, and is the actuator input or control vector, at any


and are real-valued matrices which represent the time-varying parameter uncertainties in the form:


Where

are known matrices with appropriate dimensions and is the uncertain parameter matrix which satisfies:


For additive perturbations:

Where

are the known system matrices and

are the perturbation parameters which satisfy


Thus, with

The Data edit

, , , , , , , , are known.

The LMI:Full State Feedback Optimal Control LMI edit

There exists and and scalar such that

.

Where

And .

Conclusion: edit

Once K is found from the optimization LMI above, it can be substituted into the state feedback control law to find the robustly stabilized closed loop system as shown below:

where is the state, is the output, is the exogenous input or disturbance vector, and is the actuator input or control vector, at any


Finally, the transfer function of the system is denoted as follows:

Implementation edit

This implementation requires Yalmip and Sedumi. https://github.com/rubindan/LMIcontrol/blob/master/HinfFilter.m

Related LMIs edit

Full State Feedback Optimal H_inf LMI

External Links edit


Return to Main Page: edit

LMIs in Control: https://en.wikibooks.org/wiki/LMIs_in_Control

Robust H inf State Feedback Control edit

Robust Full State Feedback Optimal Control edit

Additive uncertainty edit

Full State Feedback is a control technique which places a given system's closed loop system poles in locations specified by desired performance specifications. One can use methods to turn this into an optimization problem with the goal to minimize the impact of uncertain perturbations in a closed loop system while maintaining system stability. This is done by minimizing the norm of the uncertain closed loop system, which minimizes the worst case effect of the system disturbance or perturbation. This can be done for single-input single-output (SISO) or multiple-input multiple-output (MIMO) systems. Here we consider the case of a MIMO system with additive uncertainties.

The System edit

Consider linear system with uncertainty below:

Where is the state, is the output, is the exogenous input or disturbance vector, and is the actuator input or control vector, at any


and are real-valued matrices which represent the time-varying parameter uncertainties in the form:


Where

are known matrices with appropriate dimensions and is the uncertain parameter matrix which satisfies:


For additive perturbations:

Where

are the known system matrices and

are the perturbation parameters which satisfy


Thus, with

The Data edit

, , , , , , , , are known.

The LMI:Full State Feedback Optimal Control LMI edit

There exists and and scalar such that

.

Where

And .

Conclusion: edit

Once K is found from the optimization LMI above, it can be substituted into the state feedback control law to find the robustly stabilized closed loop system as shown below:

where is the state, is the output, is the exogenous input or disturbance vector, and is the actuator input or control vector, at any


Finally, the transfer function of the system is denoted as follows:

Implementation edit

This implementation requires Yalmip and Sedumi. https://github.com/rubindan/LMIcontrol/blob/master/HinfFilter.m

Related LMIs edit

Full State Feedback Optimal H_inf LMI

External Links edit


Return to Main Page: edit

LMIs in Control: https://en.wikibooks.org/wiki/LMIs_in_Control

LMI for Time-Delay system on delay Independent Condition edit

The System edit

The problem is to check the stability of the following linear time-delay system

where


is the initial condition
represents the time-delay
is a known upper-bound of

The Data edit

The matrices are known

The LMI: The Time-Delay systems (Delay Independent Condition) edit

From the given pieces of information, it is clear that the optimization problem only has a solution if there exists two symmetric matrices such that


This LMI has been derived from the Lyapunov function for the system. By Schur Complement we can see that the above matrix inequality is equivalent to the Riccati inequality

Conclusion: edit

We can now implement these LMIs to do stability analysis for a Time delay system on the delay independent condition

Implementation edit

The implementation of the above LMI can be seen here

https://github.com/yashgvd/LMI_wikibooks

Related LMIs edit

Time Delay systems (Delay Dependent Condition)

External Links edit

Return to Main Page: edit

LMI for Time-Delay system on delay Dependent Condition edit

The System edit

The problem is to check the stability of the following linear time-delay system on a delay dependent condition

where


is the initial condition
represents the time-delay
is a known upper-bound of

For the purpose of the delay dependent system we rewrite the system as

The Data edit

The matrices are known

The LMI: The Time-Delay systems (Delay Dependent Condition) edit

From the given pieces of information, it is clear that the optimization problem only has a solution if there exists a symmetric positive definite matrix
and a scalar such that


Here

This LMI has been derived from the Lyapunov function for the system. It follows that the system is asymptotically stable if



This is obtained by replacing with

Conclusion: edit

We can now implement these LMIs to do stability analysis for a Time delay system on the delay dependent condition

Implementation edit

The implementation of the above LMI can be seen here

https://github.com/yashgvd/LMI_wikibooks

Related LMIs edit

Time Delay systems (Delay Independent Condition)

External Links edit

Return to Main Page: edit

LMI for Stability of Retarded Differential Equation with Slowly-Varying Delay edit

User:ShakespeareFan00/Sandbox1

This page describes an LMI for stability analysis of a continuous-time system with a time-varying delay. In particular, a delay-independent condition is provided to test uniform asymptotic stability of a retarded differential equation through feasibility of an LMI. The system under consideration pertains a single discrete delay, with the extent of the delay at any time bounded by some known value. Moreover, the delay is assumed to vary only slowly in time, with a temporal derivative bounded by a value less than one. Solving the LMI for a particular value of this bound, uniform asymptotic stability can be shown for any time-delay satisfying this bound.

The System edit

The system under consideration is one of the form:

In this description, and are matrices in . The variable denotes a delay in the state at time , assuming a value no greater than some . Moreover, we assume that the function is differentiable at any time, with the derivative bounded by some value , assuring the delay to be slowly-varying in time.

The Data edit

To determine stability of the system, the following parameters must be known:

The Optimization Problem edit

Based on the provided data, uniform asymptotic stability can be determined by testing feasibility of the following LMI:

The LMI: Delay-Independent Uniform Asymptotic Stability for Continuous-Time TDS edit

Conclusion: edit

If the presented LMI is feasible, the system will be uniformly asymptotically stable for any delay function satisfying . That is, independent of the values of the delays and the starting time :

  • For any real number , there exists a real number such that:
  • There exists a real number such that for any real number , there exists a time such that:

Here, we let for denote the delayed state function at time . The norm of this function is defined as the maximal value of the vector norm assumed by the state over the delayed time interval, given by:

Obtaining a feasible point for the LMI, this result can be proven using a Lyapunov-Krasovkii functional:

Notably, if matrices prove feasibility of the LMI for the pair , these same matrices will also prove feasibility of the LMI for the pair . As such, feasibility of this LMI proves uniform asymptotic stability of both systems:

Moreover, since the result is independent of the value of the delay, it will also hold for a delay . Hence, if the LMI is feasible, the matrices will be Hurwitz.

Implementation edit

An example of the implementation of this LMI in Matlab is provided on the following site:

Note that this implementation requires packages for YALMIP with solver mosek, though a different solver can also be implemented.

Related LMIs edit

  • [19] - Delay-dependent stability LMI for continuous-time TDS
  • [20] - Stability LMI for delayed discrete-time system

External Links edit

The presented results have been obtained from:

  • Fridman E. 2014. Introduction to Time-Delay Systems, Analysis and Control. Springer. ISBN: 978-3-319-09392-5.

Additional information on LMI's in control theory can be obtained from the following resources:

Return to Main Page: edit

LMI for Robust Stability of Retarded Differential Equation with Norm-Bounded Uncertainty edit

User:ShakespeareFan00/Sandbox1

This page describes an LMI for stability analysis of an uncertain continuous-time system with a time-varying delay. In particular, a delay-independent condition is provided to test uniform asymptotic stability of a retarded differential equation with uncertain matrices through feasibility of an LMI. The system under consideration pertains a single discrete delay, with the extent of the delay at any time bounded by some known value. The matrices describing the system are assumed to be uncertain, with the norm of the uncertainty bounded by a value of one. In addition, the delay is assumed to vary only slowly in time, with a temporal derivative bounded by a value less than one. Solving the LMI for a particular value of this bound, uniform asymptotic stability can be shown for any time-delay satisfying this bound, independent of the value of the uncertainty function.

The System edit

The system under consideration is one of the form:

In this description, and are matrices in . The variable denotes a delay in the state at time , assuming a value no greater than some . Moreover, we assume that the function is differentiable at any time, with the derivative bounded by some value , assuring the delay to be slowly-varying in time. The uncertainty is also allowed to vary in time, but at any time must satisfy the inequality:

The uncertainty affects the system through matrices and , which are constant in time and assumed to be known.

The Data edit

To determine stability of the system, the following parameters must be known:

The Optimization Problem edit

Based on the provided data, uniform asymptotic stability can be determined by testing feasibility of the following LMI:

The LMI: Delay-Independent Robust Uniform Asymptotic Stability for Continuous-Time TDS edit

Conclusion: edit

If the presented LMI is feasible, the system will be uniformly asymptotically stable for any delay function satisfying , and any uncertainty satisfying . That is, independent of the values of the delays , uncertainties , and the starting time :

  • For any real number , there exists a real number such that:
  • There exists a real number such that for any real number , there exists a time such that:

Here, we let for denote the delayed state function at time . The norm of this function is defined as the maximal value of the vector norm assumed by the state over the delayed time interval, given by:

The proof of this result relies on the fact that the following inequality holds for any value and constant matrices of appropriate dimensions:

Using this inequality with and , the described LMI can then be derived from that presented in [21], corresponding to a situation without uncertainty.

Implementation edit

An example of the implementation of this LMI in Matlab is provided on the following site:

Note that this implementation requires packages for YALMIP with solver mosek, though a different solver can also be implemented.

Related LMIs edit

  • [22] - Stability LMI for continuous-time RDE with slowly-varying delay without uncertainty
  • [23] - LMI for quadratic stability of continuous-time system with norm-bounded uncertainty
  • [24] - Stability LMI for delayed discrete-time system

External Links edit

The presented results have been obtained from:

  • Fridman E. 2014. Introduction to Time-Delay Systems, Analysis and Control. Springer. ISBN: 978-3-319-09392-5.

Additional information on LMI's in control theory can be obtained from the following resources:

Return to Main Page: edit

Bounded Real Lemma under Slowly-Varying Delay edit

User:ShakespeareFan00/Sandbox1

This page describes a bounded real lemma for a continuous-time system with a time-varying delay. In particular, a condition is provided to obtain a bound on the -gain of a retarded differential system through feasibility of an LMI. The system under consideration pertains a single discrete delay, with the extent of the delay at any time bounded by some known value. This delay is only present in the state, with no direct delay in the effects of exogenous inputs on the state. In addition, the delay is assumed to vary only slowly in time, with a temporal derivative bounded by a value less than one, although results can also be attained if no bound is known. Solving the LMI for a particular value of the bound, while minimizing a scalar variable, an upper limit on the -gain of the system can be shown for any time-delay satisfying this bound.

The System edit

The system under consideration is one of the form:

In this description, and are constant matrices in . In addition, is a constant matrix in , and are constant matrices in where denote the number of exogenous inputs and regulated outputs respectively. The variable denotes a delay in the state at time , assuming a value no greater than some . Moreover, we assume that the function is differentiable at any time, with the derivative bounded by some value , assuring the delay to be slowly-varying in time.

The Data edit

To obtain a bound on the -gain of the system, the following parameters must be known:

The Optimization Problem edit

Based on the provided data, we can obtain a bound on the -gain of the system by testing feasibility of an LMI. In particular, the bounded real lemma states that if the LMI presented below is feasible for some , the -gain of the system is less than or equal to this . To attain a bound that is as small as possible, we minimize the value of while solving the LMI:

The LMI: L2-gain for TDS with Slowly-Varying Delay edit

In this notation, the symbols are used to indicate appropriate matrices to assure the overall matrix is symmetric.

Conclusion: edit

If the presented LMI is feasible for some , the system is internally stable, and will have an -gain less than . That is, independent of the values of the delays :

It should be noted that this result is conservative. That is, even when minimizing the value of , there is no guarantee that the bound obtained on the -gain is sharp.

In a scenario where no bound on the change in the delay is known, the above LMI can still be used to obtain a bound on the -gain. In particular, setting in the above LMI, a bound can be attained independent of the value of the derivative of the delay.

Implementation edit

An example of the implementation of this LMI in Matlab is provided on the following site:

Note that this implementation requires packages for YALMIP with solver mosek, though a different solver can also be implemented.

Related LMIs edit

  • [25] - Bounded real lemma for continuous-time system without delay
  • [26] - Bounded real lemma for discrete-time system without delay
  • [27] - Stability LMI for continuous-time RDE with slowly-varying delay

External Links edit

The presented results have been obtained from:

  • Fridman E. 2014. Introduction to Time-Delay Systems, Analysis and Control. Springer. ISBN: 978-3-319-09392-5.

Additional information on LMI's in control theory can be obtained from the following resources:

Return to Main Page: edit

LMI for L2-Optimal State-Feedback Control under Time-Varying Input Delay edit

User:ShakespeareFan00/Sandbox1

This page describes a method for constructing a full-state-feedback controller for a continuous-time system with a time-varying input delay. In particular, a condition is provided to obtain a bound on the -gain of closed-loop system under time-varying delay through feasibility of an LMI. The system under consideration pertains a single discrete delay in the actuator input, with the extent of the delay at any time bounded by some known value. Moreover, the delay is assumed to vary only slowly in time, with a temporal derivative bounded by a value less than one, although results may also be attained if no bound is known. Solving the LMI for a particular value of the bound, while minimizing a scalar variable, an upper limit on the -gain of the system can be shown for any time-delay satisfying this bound.

The System edit

The system under consideration is one of the form:

In this description, and are constant matrices in . In addition, is a constant matrix in , and is a constant matrix in , where denote the number of exogenous and actuator inputs respectively. Finally, and are constant matrices in and respectively, where denotes the number of regulated outputs. The variable denotes a delay in the actuator input at time , assuming a value no greater than some . Moreover, we assume that the function is differentiable at any time, with the derivative bounded by some value , assuring the delay to be slowly-varying in time.

The Data edit

To construct an -optimal controller of the system, the following parameters must be known:

In addition to these parameters, a tuning scalar is also implemented in the LMI.

The Optimization Problem edit

Based on the provided data, we can construct an -optimal full-state-feedback controller of the system by testing feasibility of an LMI. In particular, we note that if the LMI presented below is feasible for some and matrices and , implementing the state-feedback with , the -gain of the closed-loop system will be less than or equal to . To attain a bound that is as small as possible, we minimize the value of while solving the LMI:

The LMI: L2-Optimal Full-State-Feedback for TDS with Slowly-Varying Input Delay edit

In this notation, the symbols are used to indicate appropriate matrices to assure the overall matrix is symmetric.

Conclusion: edit

If the presented LMI is feasible for some , implementing the full-state-feedback controller , the closed-loop system will be asymptotically stable, and will have an -gain less than . That is, independent of the values of the delays , the system:

with:

will satisfy:

Here we note that is guaranteed to exist as is positive definite, and thus nonsingular.

It should be noted that the obtained result is conservative. That is, even when minimizing the value of , there is no guarantee that the bound obtained on the -gain is sharp, meaning that the actual -gain of the closed-loop can be (significantly) smaller than .

In a scenario where no bound on the change in the delay is known, or this bound is greater than one, the above LMI may still be used to construct a controller. In particular, if the presented LMI is feasible with , the closed-loop system imposing will be internally exponentially stable with an -gain less than independent of the value of .

Implementation edit

An example of the implementation of this LMI in Matlab is provided on the following site:

Note that this implementation requires packages for YALMIP with solver mosek, though a different solver can also be implemented.

Related LMIs edit

  • [28] - Bounded real lemma for continuous-time system with slowly-varying delay
  • [29] - LMI for Hinf-optimal full-state-feedback control in a non-delayed continuous-time system
  • [30] - LMI for Hinf-optimal output-feedback control in a non-delayed continuous-time system

External Links edit

The presented results have been obtained from:

  • Fridman E. 2014. Introduction to Time-Delay Systems, Analysis and Control. Springer. ISBN: 978-3-319-09392-5.

Additional information on LMI's in control theory can be obtained from the following resources:

Return to Main Page: edit

Discrete Time edit

User:ShakespeareFan00/Sandbox1

This page describes an LMI for stability analysis of a discrete-time system with a time-varying delay. In particular, a delay-dependent condition is provided to test asymptotic stability of a discrete-delay system through feasibility of an LMI. The system under consideration pertains a single discrete delay, with the extent of the delay at any time bounded by some known value. Solving the LMI for different values of this bound, a limit on the delay can be attained for which the system remains asymptotically stable.

The System edit

The system under consideration is one of the form:

In this description, and are matrices in . The variable denotes a delay in the state at discrete time , assuming a value no greater than some .

The Data edit

To determine stability of the system, the following parameters must be known:

The Optimization Problem edit

Based on the provided data, asymptotic stability can be determined by testing feasibility of the following LMI:

The LMI: Asymptotic Stability for Discrete-Time TDS edit

In this notation, the symbols are used to indicate appropriate matrices to assure the overall matrix is symmetric.

Conclusion: edit

If the presented LMI is feasible, the system will be asymptotically stable for any sequence of delays within the interval . That is, independent of the values of the delays at any time:

  • For any real number , there exists a real number such that:

Obtaining a feasible point for the LMI, this result can be proven using a Lyapunov-Krasovkii functional:

where:

Implementation edit

An example of the implementation of this LMI in Matlab is provided on the following site:

Note that this implementation requires packages for YALMIP with solver mosek, though a different solver can also be implemented.

Related LMIs edit

  • TDSDC – Delay-dependent stability LMI for continuous-time TDS

External Links edit

The presented results have been obtained from:

  • Fridman E. 2014. Introduction to Time-Delay Systems, Analysis and Control. Springer. ISBN: 978-3-319-09392-5.

Additional information on LMI's in control theory can be obtained from the following resources:

Return to Main Page: edit

LMI for Attitude Control of Nonrotating Missiles, Pitch Channel edit

LMI for Attitude Control of Nonrotating Missles, Pitch Channel

The dynamic model of a missile is very complicated and a simplified model is used. To do so, we consider a simplified attitude system model for the pitch channel in the system. We aim to achieve a non-rotating motion of missiles. It is worthwhile to note that the attitude control design for the pitch channel and the yaw/roll channel can be solved exactly in the same way while representing matrices of the system are different.


The System edit

The state-space representation for the pitch channel can be written as follows:

where , , , and are the state variable, control input, output, and disturbance vectors, respectively. The paprameters , , , , , , and stand for the attack angle, pitch angular velocity, the elevator deflection, the input actuator deflection, the overload on the side direction, the sideslip angle, and the yaw angular velocity, respectively.

The Data edit

In the aforementioned pitch channel system, the matrices and are given as:

where and are the system parameters. Moreover, is the speed of the missle and , , and are the rotary inertia of the missle corresponding to the body coordinates.

The Optimization Problem edit

The optimization problem is to find a state feedback control law such that:

1. The closed-loop system:

is stable.

2. The norm of the transfer function:

is less than a positive scalar value, . Thus:

The LMI: LMI for non-rotating missle attitude control edit

Using Theorem 8.1 in [1], the problem can be equivalently expressed in the following form:

Conclusion: edit

As mentioned, the aim is to attenuate the disturbance on the performance of the missile. The parameter is the disturbance attenuation level. When the matrices and are determined in the optimization problem, the controller gain matrix can be computed by:

Implementation edit

A link to Matlab codes for this problem in the Github repository:

https://github.com/asalimil/LMI-for-Non-rotating-Missle-Attitude-Control

Related LMIs edit

LMI for Attitude Control of Nonrotating Missles, Yaw/Roll Channel

External Links edit

  • [31] - LMI in Control Systems Analysis, Design and Applications

Return to Main Page edit

LMIs in Control/Tools

LMI for Attitude Control of Nonrotating Missiles, Yaw/Roll Channel edit

LMI for Attitude Control of Nonrotating Missles, Yaw/Roll Channel

Deriving the exact dynamic modeling of a missile is a very complicated procedure. Thus, a simplified model is used to model the missile dynamics. To do so, we consider a simplified attitude system model for the yaw/roll channel of the system. We aim to achieve a non-rotating motion of missiles. Note that the attitude control design for the yaw/roll channel and the pitch channel can be solved exactly in the same way except for different representing matrices of the system.


The System edit

The state-space representation for the yaw/roll channel can be written as follows:


where , , , and are the state variable, control input, output, and disturbance vectors, respectively. The paprameters , , , , , , and stand for the attack angle, pitch angular velocity, the elevator deflection, the input actuator deflection, the overload on the side direction, the sideslip angle, and the yaw angular velocity, respectively.

The Data edit

In the aforementioned yaw/roll channel system, the matrices and are given as:

where

and

where and are the system parameters. Moreover, is the speed of the missle and , , and are the rotary inertia of the missle corresponding to the body coordinates.

The Optimization Problem edit

The optimization problem is to find a state feedback control law such that:

1. The closed-loop system:

is stable.

2. The norm of the transfer function:

is less than a positive scalar value, . Thus:

The LMI: LMI for non-rotating missle attitude control edit

Using Theorem 8.1 in [1], the problem can be equivalently expressed in the following form:

Conclusion: edit

As mentioned, the aim is to attenuate the disturbance on the performance of the missile. The parameter is the disturbance attenuation level. When the matrices and are determined in the optimization problem, the controller gain matrix can be computed by:

Implementation edit

A link to Matlab codes for this problem in the Github repository:

https://github.com/asalimil/LMI-for-Attitude-Control-Nonrotating-Missle-Yaw-Roll-Channel

Related LMIs edit

LMI for Attitude Control of Nonrotating Missles, Pitch Channel

External Links edit

  • [32] - LMI in Control Systems Analysis, Design and Applications

Return to Main Page edit

LMIs in Control/Tools

LMI for H2/Hinf Polytopic Controller for Robot Arm on a Quadrotor edit

User:ShakespeareFan00/Sandbox1


The System: edit



The Optimization Problem: edit

Given a state space system of

where ,, and form the K matrix as defined in below. This, therefore, means that the Regulator system can be re-written as:

With the above 9-matrix representation in mind, the we can now derive the controller needed for solving the problem, which in turn will be accomplished through the use of LMI's. Firstly, we will be taking our /state-feedback control and make some modifications to it. More specifically, since the focus is modeling for worst-case scenario of a given parameter, we will be modifying the LMI's such that the mixed / controller is polytopic.

The LMI: edit

/ Polytopic Controller for Quadrotor with Robotic Arm.

Recall that from the 9-matrix framework , and represent our process and sensor noises respectively and represents our input channel. Suppose we were interested in modeling noise across all three of these channels. Then the best way to model uncertainty across all three cases would be modifying the matrix to , where ( parameters, , and is a constant noise value). This, in turn results in our - matrices to be modifified to -

Using the LMI's given for optimal /-optimal state-feedback controller from Peet Lecture 11 as reference, our resulting polytopic LMI becomes:

+

CD=0

where i=1,..,k,& and and:


After solving for both the optimal and gain ratios as well as , we can then construct our worst-case scenario controller by setting our matrix (and consequently our matrices) to the highest value. This results in the controller:

which is constructed by setting:

where:


Conclusion: edit

The LMI is feasible and the resulting controller is found to be stable under normal noise disturbances for all states.




Implementation edit

References edit

1. An LMI-Based Approach for Altitude and Attitude Mixed H2/Hinf-Polytopic Regulator Control of a Quadrotor Manipulator by Aditya Ramani and Sudhanshu Katarey.

An LMI for the Kalman Filter edit

User:ShakespeareFan00/Sandbox1


This is a An LMI for the Kalman Filter. The Kalman Filter is one of the most widely used state-estimation techniques. It has applications in multiple aspects of navigation (inertial, terrain-aided, stellar.)


The System edit

Continuous Time:

The process and sensor noises are given by and respectively.

Discrete Time:

The process and sensor noises are given by and respectively.

The Data edit

The data required for the Kalman Filter include a model of the system that the states are trying to be output and a measurement that is the output of the system dynamics being estimated.

The Filter edit

The Filter and Estimator equations can be written as:

Continuous Time

Discrete Time

The Error edit

The error dynamics evolve according to the following expression

Continuous Time

Discrete Time

The Optimization Problem edit

The Kalman Filtering (or LQE) problem is a Dual to the LQR problem. Replace the matrices from LQR with

The Kalman Filter chooses to minimize the cost This cost can be thought of as the covariance of the state error between the actual and estimated state. When the state error covariance is low the filter has converged and the estimate is good.

The Luenberger or Kalman gain can be computed from

The process and measurement noise covariances for the Kalman filter are given by

The matrix satisfies the following equality

We also cover the discrete Kalman Filter formulation which is more useful for real-life computer implementations.

The discrete Kalman filter chooses the gain where the PSDs of the process and sensor noises are given by

The steady-state covariance of the error in the estimated state is given by and satisfies the following Riccati equation.

  • Objective: State Estimate Error Covariance
  • Variables: Observer Gains
  • Constraints: Dynamics of System to be Estimated

The LMI: H2-Optimal Control Full-State Feedback to LQR to Kalman Filter edit

The Kalman Filter is a dual to the LQR problem which has been shown to be equivalent to a special case of H2-static state feedback.

Start with the H2-Optimal Control Full-State Feedback.

The following are equivalent

To solve the LQR problem using H2 optimal state-feedback control the following variable substitutions are required.

Then

This results in the following LMI.

To solve the Kalman Filtering problem using the LQR LMI replace with and This results in the following LMI.


The discrete-time Kalman Filtering LMI is saved for another page as it requires derivation of the Discrete-Time LQR LMI problem which was not covered in class.

Conclusion: edit

The LMI for the Kalman Filter allows us to calculate the optimal gain for state estimation. It is shown that it can be found as a special case of the H2-optimal state feedback with the appropriate substitution of matrices. The LMI gives us a different way of computing the optimal Kalman gain.

Implementation edit

A link to CodeOcean or other online implementation of the LMI

Related LMIs edit

Links to other closely-related LMIs

External Links edit

A list of references documenting and validating the LMI.

Return to Main Page: edit

Hinf Optimal Model Reduction edit

Given a full order model and an initial estimate of a reduced order model it is possible to obtain a reduced order model optimal in sense. This methods uses LMI techniques iteratively to obtain the result.


The System edit

Given a state-space representation of a system and an initial estimate of reduced order model .

Where and . Where are full order, reduced order, number of inputs and number of outputs respectively.

The Data edit

The full order state matrices and the reduced model order .

The Optimization Problem edit

The objective of the optimization is to reduce the norm distance of the two systems. Minimizing with respect to .

The LMI: The Lyapunov Inequality edit

Objective: .

Subject to::

It can be seen from the above LMI that the second matrix inequality is not linear in . But making constant it is linear in . And if are constant it is linear in . Hence the following iterative algorithm can be used.

(a) Start with initial estimate obtained from techniques like Hankel-norm reduction/Balanced truncation.

(b) Fix and optimize with respect to .

(c) Fix and optimize with respect to .

(d) Repeat steps (b) and (c) until the solution converges.

Conclusion: edit

The LMI techniques results in model reduction close to the theoretical limits set by the largest removed hankel singular value. The improvements are often not significant to that of Hankel-norm reduction. Due to high computational load it is recommended to only use this algorithm if optimal performance becomes a necessity.


External Links edit

A list of references documenting and validating the LMI.

  • Model order Reduction using LMIs - A conference paper by Helmersson, Anders, Proceedings of the 33rd IEEE Conference on Decision and Control, 1994, p. 3217-3222 vol.4


Return to Main Page: edit

An LMI for Multi-Robot Systems edit

An LMI for Multi-Robot Systems

  1. Consensus for Multi-Agent Systems

Helicopter Inner Loop LMI edit

User:ShakespeareFan00/Sandbox1


This is a Helicopter Inner Loop LMI. Optimization methods and optimal control have had difficulty gaining traction in the rotorcraft control law community. However, this LMI derived in the referenced paper attempts to address the issues with a LMI for Robust, Optimal Control.


The System edit

Continuous Time:

The Helicopter model is given by knowledge of the stability and control derivatives which populate the elements of the matrices in the dynamic equations above.

The state vector is given by the typical elements of a rigid 6-DOF body model. . The input vector is given by which pertain to the main rotor collective, longitudinal/lateral cyclic and tail rotor collective blade angles in radians.

The gust disturbance is denoted by and is assumed to be random in nature. The stability and control derivative matrices are modeled with uncertainty as follows:

The terms represent the uncertainties in the helicopter system model.

The Data edit

The Data required for this LMI are the stability and control derivatives that populate the A and B-matrices of the system above which can be obtained from linearizing non-linear models. It can also be obtained from experimental methods such as step responses and swept sines (System Identification.)

The Control Architecture edit

A control architecture for the inner loop of the helicopter model mentioned above is designed using a state feedback control law.

The objective for the inner loop control is to design a full state feedback law such that the closed-loop helicopter system satisfies the following 3 performance specifications.

The Optimization Problem edit

Objective 1: The closed-loop system is internally stable for any admissible uncertainty.

Objective 2: Poles of the close-loop system lie within the disk with center and radius , for any admissible uncertainty.

Objective 3: Given gust disturbance suppression index , for any admissible uncertainty, the effect of the gust disturbance to selected flight states and control input is in the given level, i.e.

where and are weighting matrices with appropriate dimensions and

It can be shown that the inner loop performance specifications listed in Objectives 1-3 can be met with a state feedback control law if the LMI described in the following section is true.

  • Objective: Objectives listed above
  • Variables: Controller Gains
  • Constraints: Rotorcraft Dynamics and Modeled Actuator Limits

The LMI: H-Inf Inner Loop D-Stabilization Optimization edit

The paper derives and LMI of the form below and asserts that the if there exists a constant , matrix with appropriate dimensions and a symmetric positive matrix , such that

where,

This LMI is shown to satisfy Objectives 1, 2,3, and the control law is given by

Conclusion: edit

The LMI for Helicopter Inner Loop Control design provides an optimization-based approach towards achieving Level 1 Handling Qualities per ADS-33E. This is an interesting way to approach a very difficult problem that has usually been approached through classical control methods and with extensive piloted simulation and flight test.

Implementation edit

A link to CodeOcean or other online implementation of the LMI

Related LMIs edit

Links to other closely-related LMIs

External Links edit

A list of references documenting and validating the LMI.

Return to Main Page: edit

Hinf LMI Satellite Attitude Control edit

User:ShakespeareFan00/Sandbox1


This is a LMI for Satellite Attitude Control. Satellite attitude control is necessary to allow satellites in orbit accomplish their mission. Poor satellite attitude control results in poor pointing performance which can result in increased cost, delayed service, and reduced lifetime of the satellite.


The System edit

The full derivation of the system from first principles is accomplished in the companion LMI for Satellite Attitude Control. The link to that page is at the bottom with the references.

Continuous Time:

The above model was derived by substituting satellite attitude kinematics into the attitude dynamics of a satellite. The following are definitions of the variables above:

  • Moments of inertia about the corresponding axis:
  • Euler Angles:
  • Disturbance Torques (flywheel, gravitational, and disturbance):
  • Rotational-angular velocity of the Earth:

The state-space representation of the system can be found by the following steps. Let

Introduce the notations

where stand for any element in . Then the state-space system is:

where the matrices in the above state-space representation are defined as follows:

The Data edit

Data required for this LMI include moments of inertia of the satellite being controlled and the angular velocity of the earth. Any knowledge of the disturbance torques would also facilitate solution of the problem.

The Optimization Problem edit

The idea is to design a state feedback control law for the previous satellite state-space system of the form

This control law is designed so that the closed-loop system is stable and the transfer function matrix from disturbance to output

satisfies

for a minimal positive scalar which represents the minimum attenuation level.

The idea here is to attenuate the disturbances as much as possible while still maintaining the ability of the satellite to track. This minimum attenuation level is found from the LMI in the following section.

  • Objective: Hinf norm
  • Variables: Controller Gains
  • Constraints: Satellite Attitude Dynamics and Kinematics. Maximum safe rotational rate of Satellite, maximum jet pulse thrust

The LMI: Feedback Control of the Satellite System edit

Duan and Yu approach the satellite system as follows. The minimum attenuation level from disturbance to output can be found by solving the following LMI optimization problem.

which is the same as Theorem 8.1 in Duan and Yu's Book, the solution to the problem.

Conclusion: edit

The Duan and Yu textbook takes as typical values of the satellite moment of inertias as:

They then proceed to solve the optimization problem to find a controller gain that yields an attenuation level of 0.0010. Though this value is very small and represents very good attenuation the optimized controller pushes the poles of the closed loop system very close to the imaginary axis, resulting in slow oscillatory behavior with a very long settling time.

To address this a second approach was used by the authors which involves modifying the final LMI in the expression above and requiring that it be constrained as follows

These results are planned verified in the linked code implementation using YALMIP, whereas the authors took advantage of the MATLAB LMI Toolbox to achieve their results.

Implementation edit

A link to CodeOcean or other online implementation of the LMI

Related LMIs edit

Links to other closely-related LMIs

External Links edit

A list of references documenting and validating the LMI.

H2 LMI Satellite Attitude Control edit

User:ShakespeareFan00/Sandbox1


This is a H2 LMI for Satellite Attitude Control

Satellite attitude control is important for military, civil, and scientific activities. Attitude control of a satellite involves fast maneuvering and accurate pointing in the presence of all kinds of disturbances and parameter uncertainties.

The System edit

The satellite state-space formulation is given in the LMI page for Satellite Attitude Control which is also in the applications section of this WikiBook. This section discusses the derivation of that state-space formulation based on first principles.

The attitude dynamics of a satellite in an inertial coordinate system can be described in terms of the time rate of change of its angular momentum and the sum of the external torques and moments acting on the system. That is:

where the following variables are defined as follows:

  • are the flywheel torque, the gravitational torque, and the disturbance torque.
  • is the total momentum/torque acting on the satellite
  • is the inertia matrix/tensor for the satellite
  • is the angular velocity vector of the satellite.

The time derivative of the total angular momentum in an arbitrary rotating reference frame (such as the body frame of the satellite) is given by:

which takes into the account of the angular velocity of the rotating reference frame relative to the inertial reference frame where Newton's laws are valid.

Combining equations, collecting terms and choosing the principle axes of the spacecraft so that the Inertia Tensor is diagonalized yields the following equations of motion:

Using the small angle approximation, the angular velocity of the satellite in the inertial coordinate system represented in the body coordinate system can be written as

These equations form the basis of the state-space representation used in the H-inf LMI for satellite attitude control. For clarity, they are repeated below.

The Data edit

Data required for this LMI include moments of inertia of the satellite being controlled and the angular velocity of the earth. Any knowledge of the disturbance torques would also facilitate solution of the problem.

The Optimization Problem edit

The optimization problem seeks to minimize the H2 norm of the transfer function from disturbance to output. Thus, we expect slightly different results than the H-inf case. Deriving the H2 control problem and setup also serves for useful setup for the mixed H-inf/H2 optimization that the book follows up with later.

  • Objective: H2 norm
  • Variables: Controller Gains
  • Constraints: Satellite Attitude Dynamics and Kinematics. Maximum safe rotational rate of Satellite, maximum jet pulse thrust

The LMI: H-2 Satellite Attitude Control edit

Duan and Yu use the following H-2 Satellite Attitude Control LMI to minimize the attenuation level from disturbance to output. Note that in the H2-case we are minimizing the integral of the magnitude of the bode plot transfer function whereas in the H-inf case the optimization is minimizing the maximum value of the bode plot magnitude.

To design an optimizing controller of the form

such that the closed-loop system is stable and the transfer function matrix

satisfies

for a minimal positive scalar .

This scalar is found from the solution of the following LMI

and the controller is given by

Conclusion: edit

The LMI for H-2 Satellite Attitude Control comes up with a different attenuation value for the disturbance vs the H-inf problem which is expected. It also serves for good preparation for the mixed H2/H-inf problem that Duan and Yu cover in a later section. Though no implementation is included for the mixed H2/H-inf optimization problem it is interesting to compare the results of all three cases for the satellite attitude control problem.

Implementation edit

A link to CodeOcean or other online implementation of the LMI

Related LMIs edit

Links to other closely-related LMIs

External Links edit

A list of references documenting and validating the LMI.

Problem of Space Rendezvous and LMI Approaches edit

User:ShakespeareFan00/Sandbox1


This is a Problem of Space Rendezvous and LMI Approaches

In Section 12.4 of their book LMIs in Control Systems: Analysis, Design, and Applications, Duan and Yu discuss the problem of space rendezvous and how it can be formulated into an LMI problem. Modeling and simulating space rendezvous is of importance because it is used for any cargo or passenger spacecraft traveling to and from earth-orbiting space stations and also for satellites servicing aging in-orbit satellites, and for potential missions to mine asteroids.

The System edit

Though Duan and Yu first mention space rendezvous in Example 7.14 of their book. In this example, they show that the relative orbital dynamic model of spacecraft rendezvous can be described by the famous Clohessy-Wiltshire equations.

where

  • are the components of the relative position between chaser and target
  • [rad/h] is the orbital angular velocity of the target satellite
  • is the mass of the chaser
  • is the i-th component of the control input force acting on the relative motion dynamics
  • is the i-th component of the external disturbance

The C-W equations give a first-order approximation of the chaser's motion in a target-centered coordinate system and is often used in planning space rendezvous problems (ISS, Salyut, and Tiangong space stations are just some examples.)

With appropriate definitions of states and variables the dynamic equations of motion for space-rendezvous can be converted into standard state-space form for LMI optimization as follows:

where the vectors in the above state-space representation are defined as follows:

and the matrices in the above state-space representation are defined as follows:

The Data edit

The data required are the mass properties of both the target and chaser vehicles for space rendezvous. Also required is the orbital angular velocities of the target and chasers and measurements of relative kinematics between the two.

The Optimization Problem edit

The optimization problem is trying to attenuate the disturbance to output transfer function using either the H-inf or H2 norm.

  • Objective: Hinf or H2 norm
  • Variables: Controller Gains
  • Constraints: Relative Dynamics/Kinematics between Chaser and Target in Orbit

The LMI: Space Rendezvous LMI Optimization edit

The space rendezvous problem can be approached with either H-inf or H-2 optimization formulations. Both formulations can achieve closed-loop stability which ensures that rendezvous occurs because the relative distance between target and chaser eventually approaches zero. The LMIs for the H-inf and H2 optimization problem are shown below which are easily solvable because the matrices for the space rendezvous problem are available above in standard form.

Duan and Yu approach the . The minimum attenuation level from disturbance to output can be found by solving the following LMI optimization problem.

which is the same as Theorem 8.1 in Duan and Yu's Book, the solution to the problem.

Conclusion: edit

The LMI for Space Rendezvous is a useful and interesting method to model and simulate practical problems in spacecraft engineering. Space Rendezvous usually requires very good vision-based navigation or an exceptional human operator that can close the gap for final mating of the two docking adapters.

Implementation edit

A link to CodeOcean or other online implementation of the LMI

Related LMIs edit

Links to other closely-related LMIs

External Links edit

A list of references documenting and validating the LMI.

Template edit

This methods uses LMI techniques iteratively to obtain the result.


The System edit

Given a state-space representation of a system and an initial estimate of reduced order model .

Where and .

The Data edit

The full order state matrices .

The Optimization Problem edit

The objective of the optimization is to reduce the norm .

The LMI: The Lyapunov Inequality edit

Objective: .

Subject to::

Conclusion: edit

The LMI techniques results in model reduction close to the theoretical bounds.


External Links edit

A list of references documenting and validating the LMI.