You are on page 1of 8

Proceedings of the ASME 2014 Dynamic Systems and Control Conference

DSCC2014
October 22-24, 2014, San Antonio, TX, USA

DSCC2014-5979

ADAPTIVE SLIDING MODE SPACECRAFT ATTITUDE CONTROL

Yizhou Wang, Xu Chen∗, Masayoshi Tomizuka


Mechanical Systems Control Laboratory
Department of Mechanical Engineering
University of California
Berkeley, California 94720
Email: {yzhwang, maxchen, tomizuka}@berkeley.edu

ABSTRACT velocity feedback similar to a proportional derivative con-


An adaptive sliding mode spacecraft attitude controller is troller [1]. Model-based control techniques are also investigated
derived in this paper. It has the advantage of not requiring such as sliding-mode control [2], and adaptive control [3].
knowledge of the inertia of the spacecraft, and rejecting unex- Sliding-mode control was investigated for the purpose of robust
pected external disturbances, with global asymptotic position attitude tracking for various attitude parameterizations (Ro-
and velocity tracking. The sliding manifold is designed using op- drigues parameters [4, 5], Modified Rodrigues parameters [6],
timal control analysis of the quaternion kinematics. The sliding quaternions [7–9]). Adaptive attitude tracking control based
mode control law and the parameter adaptation law are designed on Lyapunov stability was studied for quaternions [10, 11] and
using Lyapunov stability. Numerical simulations are performed rotation matrices [12].
to demonstrate both the nominal and the robust performance.
In this paper, we develop an adaptive sliding-mode attitude
tracking controller. A similar methodology has been applied to
1 INTRODUCTION control of robot manipulators by Slotine et. al. [13]. Although
The attitude control problem has attracted much attention as the attitude dynamics cannot be directly transformed to the
it involves highly nonlinear characteristics of the governing mo- form of robot dynamics, the design of sliding manifold and the
tion equations. From the perspective of control, feedback control construction of a Lyapunov function in the present work achieve
laws are sought for the purpose of asymptotic trajectory tracking, similar performance specifications. Compared with the existing
with the ability to reject unexpected external disturbances, and sliding-mode attitude controller, our approach does not require
be insensitive to parameter variations. Previous efforts have any inertial information. The use of a sliding manifold reduces
been devoted to developing both open-loop and closed-loop the design complexity and makes the controller have a simple
control strategies. Although the open-loop formulation makes form.
it easier to incorporate some optimal criterion, the resulting
performance is inevitably sensitive to system uncertainties. Unit quaternion is used to parameterize rotations since it is
Closed-loop control has been investigated to deal with both the minimal singularity-free rotation representation. Based on
single-axis small angle rotations and three-axis large angle the quaternion kinematic relation, a sliding manifold is chosen
maneuvers. The latter problem is much more challenging as a according to the optimality criterion proposed in [14]. The
larger region of operations makes the linear approximation of dynamic equations of motion of the spacecraft actuated by
nonlinear dynamics invalid. either thrusters or momentum wheels are considered. Global
asymptotic stability is shown using Lyapunov stability analysis.
The simplest large-angle maneuver uses quaternion and
The remainder of the paper is organized as follows. In
Sec.2, the quaternion kinematics and the spacecraft dynamics
∗ Xu Chen is now an Assistant Professor in Department of Mechanical Engi-

neering, University of Connecticut.

1 Copyright © 2014 by ASME

Downloaded From: http://proceedings.asmedigitalcollection.asme.org/ on 01/27/2016 Terms of Use: http://www.asme.org/about-asme/terms-of-use


tion is given by,

1
q̇ = Ξ(q)ω (3)
2

where
 
q4 I3×3 + [ρ×]
Ξ(q) =
−ρ T
 
0 −a3 a2
FIGURE 1. Definitions of the coordinate frames [a×] =  a3 0 −a1  , a ∈ R3
−a2 a1 0
are reviewed. In Sec.3, an optimal sliding manifold is presented
along with its optimality proof and stability analysis. Then, a The matrix Ξ(•) obeys the following properties,
Lyapunov stability analysis is used to derive an asymptotically
stabilizing sliding control law and a parameter adaptation law. ΞT (q)Ξ(q) = I3×3
A robust controller is designed to reject external disturbances.
In Sec.4, numerical simulations are shown to demonstrate the ΞT (a)a = 03×1 , ∀a ∈ R4 (4)
closed-loop performance of the proposed controller. d T
Ξ (q)q̇ = ΞT (q)q̈

dt

2 PRELIMINARIES From these properties, one can show that if the desired attitude
2.1 Coordinate frames trajectory is specified by qd = [ρdT , q4d ]T , the desired angular ve-
We define three coordinate frames of interest. The inertial locity ωd must obey,
frame of reference, in which Newton’s law is satisfied, is
denoted as Fr . We attach three mutually perpendicular axes ωd = 2ΞT (qd )q̇d
to the spacecraft, and call this the body-fixed frame Fb . The (5)
spacecraft is modeled as a rigid body actuated by either thrusters ω̇d = 2ΞT (qd )q̈d
or momentum wheels in three orthogonal directions. The body
axes are chosen to coincide the directions of actuations. The From the quaternion definition, one can see that q and −q repre-
desired spacecraft attitude is described by a frame denoted Fd . sent the same physical rotation. Hence compared with algebraic
The frame definitions are depicted in Figure 1. subtraction, the error calculated from quaternion multiplication
provides a better way because it resolves the sign ambiguity. The
quaternion error and multiplication are defined as,

     T 
2.2 Kinematics δρ Ξ (qd )q
δq = q ⊗ q−1 −1 −1
= Ξ(qd ), qd q = =
The unit quaternion is used to describe the spacecraft atti- d δ q4 qT qd
tude,   (6)
−1 −ρd
qd =
qd4
   
ρ ê sin(θ /2)
q= = (1)
q4 cos(θ /2) δ q represents the rotation from Fd to Fb .

where ê is a unit vector representing the axis of rotation, θ is the 2.3 Dynamics
angle of rotation from Fr to Fb . It has to satisfy the following For a spacecraft having its three thrusters aligned with the
unity norm constraint, body axes, the dynamic equations of motion are given by

||q||22 = ρ T ρ + q24 = 1 (2) J ω̇ = −[ω×]Jω + u (7)

If the angular velocity of the spacecraft with respect to Fr , ex- where J is the positive definite inertial matrix of the spacecraft,
pressed in Fb , is denoted as ω, the quaternion kinematic equa- u is the torque generated by the thrusters.

2 Copyright © 2014 by ASME

Downloaded From: http://proceedings.asmedigitalcollection.asme.org/ on 01/27/2016 Terms of Use: http://www.asme.org/about-asme/terms-of-use


1 2 T 1 T
Lagrangian L(q, ω,t) 2 r δ ρ δ ρ + 2 (ω − ωd ) (ω − ωd )
If the spacecraft has three orthogonal momentum wheels
instead, the equations of motion become, Lagrange multipliers λ ∈ R4
Hamiltonian H(q, λ , ω,t) L + 12 λ T Ξ(q)ω
(J − Jw )ω̇ = −[ω×](Jω + Jw v) − u State equation q̇ = 21 Ξ(q)ω
(8)
Jw (ω̇ + v̇) = u
Costate equation λ̇ = − ∂∂Hq
∂H
where Jw is the diagonal inertial matrix of the wheels, v is the Stationary condition ∂ω =0
wheel angular velocity, and u now is the torque applied to the Boundary condition δ q(∞) = [ 0, 0, 0, 1]T
wheel.
TABLE 1. The necessary conditions for optimality from calculus of
Eqn. (3) and one of (7) or (8) complete the dynamic model of variations
the plant. The control objective is to make q → qd and ω → ωd
as t → ∞.
dynamic programming (the principle of optimality).

3 METHODOLOGY
We apply sliding mode control for controller synthesis. The
idea of sliding mode control is to allow the transformation of a 3.1 Calculus of variations
controller design problem for a general n-th order system to a In [16], the necessary conditions for optimality are derived
simple stabilization problem with reduced order, i.e., stabilizing from calculus of variations. For the functional minimization
the dynamics associated with the switching function. Then for problem in Eqn.(9), the necessary conditions are summarized in
the equivalent reduced-order system, intuitive feedback control Table 1. It can be shown by direct substitution that the following
strategies can be applied. optimal angular velocity ω ∗ ,

Sliding mode control design consists of two steps: (i) de-


ω ∗ = ωd − rΞT (qd )q (11)
sign a stable sliding manifold on which the control objective is
achieved, and (ii) design a reaching law and the corresponding
control input so that the switching function is attracted to 0. with λ ∗ = −2rqd , satisfies all the conditions except the boundary
condition. To prove the satisfaction of the boundary condition,
Crassidis et. al. proposed an optimal sliding manifold [14]. The we use the kinematic equation for δ q,
optimality is evaluated when we only consider the quaternion
kinematic equation and treat ω as the input. The following 1 1
δ ρ̇ = δ q4 (ω − ωd ) + [δ ρ×](ω + ωd )
functional is minimized, 2 2 (12)
1
δ q̇4 = − (ω − ωd )T ΞT (qd )q
Z ∞  2

1 2 T
J ∗ (q(t),t) = min r δ ρ δ ρ + (ω − ωd )T (ω − ωd ) dτ
ω t 2
(9) and a Lyapunov function candidate,
subject to the kinematic constraint,
1
V = δ ρT δ ρ (13)
1 2
q̇ = Ξ(q)ω
2
The Lie derivative taken with respect to the kinematic relation is,
and the endpoint constraint,
1
V̇ = − rδ q4 δ ρ T δ ρ ≤ 0 (14)
2
δ q(∞) = [ 0, 0, 0, 1]T (10)
The Lyapunov function value will keep decreasing until δ ρ =
where r > 0 is the weighting factor, qd and ωd satisfy Eqn.(5). 03×1 and δ q4 = ±1. From Eqn.(12) and the minimizer ω ∗ , δ q4
Without loss of generality, we only consider δ q4 (t) ≥ 0. can converge only to 1 since,

There exists two main approaches to optimal control [15], 1


via the calculus of variations (the maximum principle) or δ q̇4 = r(1 − δ q24 ) ≥ 0, = 0 only if δ q4 = 1 (15)
2

3 Copyright © 2014 by ASME

Downloaded From: http://proceedings.asmedigitalcollection.asme.org/ on 01/27/2016 Terms of Use: http://www.asme.org/about-asme/terms-of-use


Therefore, all the necessary conditions are satisfied. The optimal 3.4 Linearity in system parameters
value J ∗ (q(t),t) can be derived to be, In Eqns (7) and (8), the inertia parameters Ji j , Jwi j , where
i, j = 1, 2, 3, appear linearly. To make this more explicit, we fol-
Z ∞ low [10] to use the following linear operator L : R3 7→ R3×6 act-
J ∗ (q(t),t) = r2 (1 − δ q24 )dτ ing on any three-dimension vector a = [a1 , a2 , a3 ]T by,
t
r
Z ∞
= 2r (1 − δ q24 )dτ 
a1 0 0 0 a3 a2

t 2 (16)
Z ∞
L(a) =  0 a2 0 a3 0 a1  (22)
= 2r δ q̇4 τ 0 0 a3 a2 a1 0
t
= 2r(1 − δ q4 (t))
For J = J T , it follows easily that,
3.2 Dynamic programming  
We can also prove optimality by showing that ω ∗ satisfies J11
J22 
the following Hamilton-Jacobi-Bellman partial differential equa-
 
J11 J12 J13  
J33 
tion, J21 J22 J23 a = L(a) 
  (23)
J23 
J31 J32 J33 
J13 

∂ J∗ ∂ J ∗ (q,t) ∗
| {z }
(q,t) = −H(q, , ω ,t) (17) J J12
∂t ∂q | {z }
J

∂ J∗
Proof : We expand ∂t (q,t) by the chain rule, We denote the column vector of the inertia parameters as J.

∂ J ∗ (q,t) dqd 3.5 Sliding mode controller and parameter adaptation


LHS =
∂ qd dt (18) law
= −rqT Ξ(qd )ωd After finding a stable sliding manifold, we need to design a
sliding control law and a parameter adaptation law to make the
∗ sliding manifold attractive. We propose the following laws for
On the other hand, by substituting ∂∂Jq = −2rqd into the Hamil- the thruster model,
tonian, the right-hand side becomes,
u = −F Ĵ − Ks
H(q, −2rqd , ω ∗ ,t) = r2 δ ρ T δ ρ − rqTd Ξ(q)(ωd − rΞT (qd )q) (24)
Ĵ˙ = Γ−1 F T s
= −rqT Ξ(qd )ωd
(19) where

3.3 Optimal sliding surface F = −[ω×]L(ω) − L(ω̇d ) + L(rsgn[δ q4 ]δ ρ̇) (25)


For optimal tracking performance, it is natural to select the
following sliding manifold s(q, ω,t) = 03×1 , Γ, K are constant positive-definite matrices of compatible
dimensions, Ĵ is the on-line estimate of the spacecraft inertia.
s(q, ω,t) = (ω − ωd ) + rsgn[δ q4 ]ΞT (qd )q = 03×1 (20)
Proposition: The proposed control law achieves asymp-
totic trajectory tracking.
Note that sgn[δ q4 (t)] is added for generality. The stability of
this sliding manifold has already been seen from the boundary Proof : Assume that δ q4 is non-zero for a finite time, we
condition, i.e. q → qd as t → ∞. In view of the sliding condition, have the time derivative of the switching function,
we can further show the velocity tracking,
ṡ = ω̇ − ω̇d + rsgn[δ q4 ]δ ρ̇ (26)
ω = ωd − r ΞT (qd )q → ωd , t →∞ (21)
| {z }
δ ρ→0 Define the parameter estimate error to be J̃ = J − Ĵ. We assume
that the inertial matrix of the spacecraft J is constant, then
Therefore, both of the control objectives are satisfied as long as
q and ω are confined in the sliding manifold. J̃˙ = −Ĵ˙ (27)

4 Copyright © 2014 by ASME

Downloaded From: http://proceedings.asmedigitalcollection.asme.org/ on 01/27/2016 Terms of Use: http://www.asme.org/about-asme/terms-of-use


Consider the following Lyapunov function candidate, which is a The same stability analysis can be performed by using the fol-
positive-definite function of the switching function and the pa- lowing slightly modified Lyapunov function candidate V 0 ,
rameter error,
1 1 1
1 1 V 0 = sT Js + J̃T ΓJ̃ + J̃Tw ΓJ̃w (35)
V = sT Js + J̃T ΓJ̃ (28) 2 2 2
2 2
where J̃w = Jw − Ĵw represents the estimate error of the wheel
Its Lie derivative can be written as, inertia.
  
V̇ = sT J ω̇ − ω̇d + rsgn[δ q4 ]δ ρ̇ + J̃T ΓJ̃˙ In summary, we have used the Lyapunov stability theory
  to show that the sliding manifold is always attractive under the
proposed sliding control law and the parameter adaptation law.
= sT FJ + u − J̃T ΓĴ˙
(29) The control objective is achieved. Note that we do not require
  the knowledge of the inertial matrix. Also we note that although
= sT F J̃ − Ks − J̃T ΓΓ−1 F T s the parameter adaptation law is converging to a constant, that
estimate does not necessarily converge to the true inertia of the
= −sT Ks spacecraft. The system should be subject to persistent excitation.

which shows that V̇ is negative semi-finite. Hence s and Jˆ are 3.6 Robust controller
bounded. Invoke Barbalat’s lemma, To take into account unexpected external disturbances in
practice, we slightly modify Eqn. (7) by adding a combined dis-
V̈ = −2sT K ṡ (30) turbance input d that can be from air drag, solar pressure, gravity
gradient, magnetic field, spherical harmonics,
The boundedness of ṡ can be seen by combing Eqns.(7), (24)
and (26). This implies the uniform continuity of V̇ , hence we J ω̇ = −[ω×]Jω + u + d (36)
conclude that V̇ → 0. Equivalently s → 0 as t → ∞. Furthermore,
to analyze the convergence of parameter estimation, we consider
Although d is unknown, but its magnitude has known bounds
D ∈ R3 ,
J ṡ + Ks = F J̃ (31)
|di (t)| ≤ Di , ∀t > 0, i = {1, 2, 3} (37)
All the terms except ṡ are uniformly continuous. Thus ṡ is uni-
formly continuous. From Barbalat’s lemma again, ṡ → 0. There-
fore, The robust sliding mode controller is given by,

F J̃ → 0 (32) u = −F Ĵ − Ks − ksgn(s) (38)

To enforce the asymptotic parameter estimation, i.e. J̃ → 0, the where ki = Di + ηi for i = 1, 2, 3 and ηi ’s are non-negative con-
following persistent excitation condition must be satisfied, stants. With the same Lyapunov function used before, we can
show that the Lie derivative is now,
Z t+T
F T (δ q, ω, ωd , ω̇d )F(δ q, ω, ωd , ω̇d )dτ ≥ εI6×6 , ∀t ≥ to 3
t
(33) V̇ ≤ − ∑ ηi |si | − sT Ks (39)
i=1
where T,to , ε are some positive scalars.

For the momentum wheel model, the sliding control law Again, the state variables are guaranteed to reach the sliding
and parameter adaptation laws are, manifold regardless of unknown disturbances. To avoid control
chattering after reaching the sliding manifold, saturation func-
tions can replace sign functions [2].
u = −F Ĵ − GĴw − Ks
Ĵ˙ = Γ−1 F T s
(34) 4 Numerical Simulations
Ĵ˙ w = Γ−1 GT s In this section, we show the proposed controller perfor-
G = −[ω×]L(v) + L(ω̇d ) − L(rsgn[δ q4 ]δ ρ̇) mance through numerical simulations. The proposed controller

5 Copyright © 2014 by ASME

Downloaded From: http://proceedings.asmedigitalcollection.asme.org/ on 01/27/2016 Terms of Use: http://www.asme.org/about-asme/terms-of-use


is used to control the attitude of the Microwave Anisotropy Probe 2.5
(MAP) spacecraft [6]. We assume that quaternions and angular
velocities are available for full-state feedback. The desired atti-
2
tude profile is specified in 3-1-3 Euler angles {φ , θ , ψ},

1.5

||s(t)||
φ̇ = 0.001745 rad/sec
θ = 0.3927 rad (40) 1
ψ̇ = 0.04859 rad/sec
0.5
Then φ , ψ can be obtained by integration. The desired quaternion
trajectory can be computed by converting Euler angle parameter- 0
0 5 10 15
ization to unit quaternions,
time (sec)

sin( θ2 ) cos( φ −ψ
 
2 ) FIGURE 2. Plot of the norm of switching funciton s(t) which con-
φ −ψ 
 sin( θ2 ) sin( 2 ) 

qd =  (41) verges to 0
 cos( θ2 ) sin( φ +ψ

2 )

cos( θ2 ) cos( φ +ψ
2 )
1 1
By numerically differentiating qd , we can compute q̇d , q̈d and
0.8
ωd ,ω̇d by Eqn. (5). We let the actual inertial matrix J be, 0.5

q1

q2
0.6
  0
20 5 1 0.4
J =  5 17 3  (42) 0.2 −0.5
1 3 15 0 10 20 30 0 10 20 30
time (sec) time (sec)
0.8 1
Our proposed controller does not require knowledge of the inertia
ˆ of the inertia
of the spacecraft, so we use an initial estimate J(0) 0.6
0.8
with 30% error,

q4
q3

0.4
0.6 qd (t)
0.2

26 1.6 1.4
 q(t)
0 0.4
ˆ = 1.6 13 1.2
J(0) (43) 0 10 20 30 0 10 20 30
time (sec) time (sec)
1.4 1.2 8.5

√ √ √
Furthermore, 90o error angle is used along [1/ 3, 1/ 3, 1/ 3]T FIGURE 3. Plot of q(t) and qd (t) showing asymptotic quaternion
as the initial condition, tracking

√1
 
3
sin(π/4)
 √1 sin(π/4) and consequently the control objectives are achieved. The con-
 ⊗ qd (0)
 3
q(0) =  1 (44) vergence of the switching function is shown in Figure 2. The

√ sin(π/4)
3 asymptotic quaternion and velocity tracking performance are
cos(π/4) plotted in Figures 3 and 4 respectively. The controlled thruster
torque is shown in Figure 5.
and the spacecraft is at rest initially ω(0) = [0, 0, 0]T . The
controller parameters are set to be, r = 3, K = 10 · I3×3 , Q = I6×6 .
4.2 Robust performance
If the spacecraft is subject to disturbances, the robust sliding
mode controller in Eqn. (38) should be used. In our simulation,
the following disturbance is used,
4.1 Nominal performance
Without external disturbance, we have shown that the state  T
will be driven to the sliding manifold using Barbalat’s lemma, d(t) = sin(t), −1, cos(t) (45)

6 Copyright © 2014 by ASME

Downloaded From: http://proceedings.asmedigitalcollection.asme.org/ on 01/27/2016 Terms of Use: http://www.asme.org/about-asme/terms-of-use


0.6
1 1
δω1
0.5 δω2 0.8
δω3 0.5
ω − ωd (rad/sec)

q2
q1
0.4 0.6
0
0.3 0.4

0.2 0.2 −0.5


0 10 20 30 0 10 20 30
0.1
time (sec) time (sec)

0.8 1
0
0.6
−0.1 0.8
0 5 10 15

q3

q4
0.4
time (sec) q d (t)
0.6
0.2 q (t)

FIGURE 4. Plot of the error velocity δ ω = ω − ωd showing asymp- 0 0.4


0 10 20 30 0 10 20 30
totic velocity tracking time (sec) time (sec)

5 FIGURE 6. Plot of q(t) and qd (t) with the presence of disturbances

0
0.6
u1 δω1
u(N · m)

−5 u2 0.5 δω2
u3 δω3

ω − ωd (rad/sec)
0.4
−10

0.3
−15
0.2

−20 0.1
0 5 10 15
time (sec)
0

−0.1
FIGURE 5. Plot of the controlled thruster torque 0 5 10 15
time (sec)

Therefore, in the controller design Di = 1, i = {1, 2, 3}. η is cho-


FIGURE 7. Plot of the error velocity δ ω with the presence of distur-
sen to be 03×1 for simplicity. The robsut quaternion and velocity
bances
tracking are shown in Figures 6 and 7. The robust control input
is shown in Figure 8.
REFERENCES
[1] Wie, B., and Barba, P. M., 1985. “Quaternion feedback for
5 CONCLUSION spacecraft large angle maneuvers”. Journal of Guidance,
In this paper, an adaptive sliding mode attitude controller is Control, and Dynamics, 8(3), pp. 360–365.
designed for asymptotic quaternion and velocity tracking, which [2] Slotine, J.-J. E., Li, W., et al., 1991. Applied nonlinear
assumes no inertial information and can reject unknown external control, Vol. 199. Prentice-Hall Englewood Cliffs, NJ.
disturbances. The stability was shown through a Lyapunov anal- [3] Narendra, K. S., and Annaswamy, A. M., 2012. Stable
ysis. Both the nominal performance and the robust performance adaptive systems. Courier Dover Publications.
are demonstrated in numerical simulations. [4] DWYER, III, T. A., and Sira-Ramirez, H., 1988. “Variable-
structure control of spacecraft attitude maneuvers”. Journal
of Guidance, Control, and Dynamics, 11(3), pp. 262–270.
ACKNOWLEDGMENT [5] Chen, Y.-P., and Lo, S.-C., 1993. “Sliding-mode con-
The authors would like to thank King Abdulaziz City of Sci- troller design for spacecraft attitude tracking maneuvers”.
ence and Technology for supporting this research. Aerospace and Electronic Systems, IEEE Transactions on,

7 Copyright © 2014 by ASME

Downloaded From: http://proceedings.asmedigitalcollection.asme.org/ on 01/27/2016 Terms of Use: http://www.asme.org/about-asme/terms-of-use


topics in control theory, University of California Berkeley.
10
u1 [16] Crassidis, J. L., and Junkins, J. L., 2011. Optimal estima-
u2 tion of dynamic systems. CRC press.
5 u3

0
u(N · m)

−5

−10

−15

−20
0 5 10 15
time (sec)

FIGURE 8. Plot of the robust control input

29(4), pp. 1328–1333.


[6] Crassidis, J. L., and Markley, F. L., 1996. “Sliding mode
control using modified rodrigues parameters”. Journal of
Guidance, Control, and Dynamics, 19(6), pp. 1381–1383.
[7] Vadali, S., 1986. “Variable-structure control of spacecraft
large-angle maneuvers”. Journal of Guidance, Control, and
Dynamics, 9(2), pp. 235–239.
[8] Lo, S.-C., and Chen, Y.-P., 1995. “Smooth sliding-mode
control for spacecraft attitude tracking maneuvers”. Jour-
nal of Guidance, Control, and Dynamics, 18(6), pp. 1345–
1349.
[9] Robinett, R. D., and Parker, G. G., 1996. “Spacecraft eu-
ler parameter tracking of large-angle maneuvers via sliding
mode control”. Journal of guidance, control, and dynamics,
19(3), pp. 702–703.
[10] Ahmed, J., Coppola, V. T., and Bernstein, D. S., 1998.
“Adaptive asymptotic tracking of spacecraft attitude motion
with inertia matrix identification”. Journal of Guidance,
Control, and Dynamics, 21(5), pp. 684–691.
[11] Costic, B., Dawson, D., De Queiroz, M., and Kapila, V.,
2001. “Quaternion-based adaptive attitude tracking con-
troller without velocity measurements”. Journal of Guid-
ance, Control, and Dynamics, 24(6), pp. 1214–1222.
[12] Sanyal, A., Fosbury, A., Chaturvedi, N., and Bernstein, D.,
2009. “Inertia-free spacecraft attitude tracking with distur-
bance rejection and almost global stabilization”. Journal of
Guidance, Control, and Dynamics, 32(4), pp. 1167–1178.
[13] Slotine, J.-J. E., and Li, W., 1987. “On the adaptive con-
trol of robot manipulators”. The International Journal of
Robotics Research, 6(3), pp. 49–59.
[14] Crassidis, J. L., Vadali, S. R., and Markley, F. L., 2000.
“Optimal variable-structure control tracking of spacecraft
maneuvers”. Journal of Guidance, Control, and Dynamics,
23(3), pp. 564–566.
[15] S.S.Sastry, 1996. “Lectures in optimal control and dynam-
ics games”. Notes for the course EECS290A, Advanced

8 Copyright © 2014 by ASME

Downloaded From: http://proceedings.asmedigitalcollection.asme.org/ on 01/27/2016 Terms of Use: http://www.asme.org/about-asme/terms-of-use

You might also like