8.1 Feedback control systems for underwater vehicles

6 min readjuly 30, 2024

Underwater vehicles need precise control to navigate the depths. Feedback control systems are key, using sensors, controllers, and to keep vehicles on course. These systems continuously measure the vehicle's state and make adjustments to reach desired positions and orientations.

PID controllers are widely used in underwater robotics. They calculate control inputs based on error signals, helping vehicles maintain depth, heading, and speed. Tuning PID gains is crucial for optimal performance, balancing and stability in challenging underwater environments.

Feedback Control for Underwater Vehicles

Principles and Components of Feedback Control

  • Feedback control systems continuously measure the output of a system and compare it to a desired reference value or setpoint
    • The difference between the measured output and the setpoint is the error signal
    • Feedback control enables underwater vehicles to operate autonomously by automatically correcting for disturbances and uncertainties in the environment or vehicle dynamics
  • The three main components of a feedback control loop for underwater vehicles:
    • Sensors to measure the controlled variable (pressure sensor for depth, compass or gyro for heading, DVL for velocity)
    • Controller to compute the required actuator inputs based on the error signal (PID, state-space, )
    • Actuators to generate forces and moments to correct the vehicle's state (thrusters, control surfaces, variable buoyancy)

Types of Control Systems

  • Open-loop control applies predetermined inputs without regard to the system's actual output
    • Example: A thruster commanded to run at a fixed rpm regardless of the vehicle's resulting speed
  • Closed-loop control continuously adjusts the inputs based on measured output
    • Example: A depth controller that adjusts thruster rpm based on the difference between the desired and actual depth from a pressure sensor
  • Underwater vehicles primarily rely on closed-loop feedback control to maintain depth, heading, velocity and other parameters in the presence of disturbances like currents, waves and changing payloads

PID Controller Design for AUVs

PID Control Algorithm

  • Proportional-Integral-Derivative (PID) control is a widely used feedback control method that calculates actuator inputs as a weighted sum of the error signal, its integral, and derivative

    • The proportional term (KpK_p) provides a restoring force proportional to the current error
      • Example: A large depth error generates a large thruster command to quickly correct the depth
    • The integral term (KiK_i) accumulates error over time to eliminate steady-state offset
      • Example: A small persistent depth error is integrated to generate an additional thruster command that corrects for buoyancy changes
    • The derivative term (KdK_d) responds to the rate of change of error to improve transient response and stability
      • Example: A rapidly changing depth error produces a counteracting thruster command to prevent overshoot
  • The PID control law in the time domain is: u(t)=Kpe(t)+Ki0te(τ)dτ+Kddedtu(t) = K_p e(t) + K_i \int_{0}^{t} e(\tau) d\tau + K_d \frac{de}{dt}

    where uu is the control input and ee is the error signal

PID Tuning and Implementation

  • PID gains (KpK_p, KiK_i, KdK_d) must be carefully tuned to achieve the desired control performance in terms of rise time, overshoot, settling time, and steady-state error
    • Tuning methods include manual iteration, Ziegler-Nichols, and optimization algorithms
    • Example: Increasing KpK_p speeds up the response but may lead to overshoot, while increasing KdK_d dampens overshoot but slows the response
  • Implementing PID control for underwater vehicles requires:
    • Defining the control variables and setpoints (depth, heading, surge velocity)
    • Selecting appropriate sensors and actuators with sufficient bandwidth and authority
    • Developing the control software to execute the PID algorithm at an appropriate sample rate
    • Integrator anti-windup logic to handle actuator saturation
      • Example: Preventing the integral term from accumulating when thrusters are at maximum rpm
  • Separate decoupled PID loops are commonly used for each degree of freedom, but coupling between axes (pitch affects depth) may require MIMO control methods
  • Nonlinear PID variants such as gain scheduling can provide improved performance over a wide operating envelope
    • Example: Reducing gains at high speeds where drag is higher to prevent oscillations

Stability and Performance of Underwater Robot Control

Stability Analysis

  • The stability of a closed-loop system refers to its ability to converge to an equilibrium point from different initial conditions and in response to disturbances
    • An unstable system will have diverging oscillations or unbounded outputs
    • Example: An improperly tuned depth controller causing the AUV to repeatedly overshoot and undershoot the target depth
  • For linear time-invariant (LTI) systems, stability can be analyzed using the locations of the closed-loop poles in the s-plane
    • A system is stable if all poles are in the left-half plane
    • Example: A system with poles at s=1s=-1 and s=2s=-2 is stable, while a system with poles at s=1s=1 and s=1s=-1 is unstable
  • quantify how close the system is to instability under variations in gain or phase
    • Gain margin is the factor by which the gain can be increased before instability
    • Phase margin is the additional phase lag at the gain crossover frequency required for instability
    • Example: A gain margin of 6 dB means the controller gain can be doubled before the system goes unstable

Performance Metrics

  • Time-domain performance specifications for control systems include:
    • Rise time: time to reach a specified fraction of the steady-state value
    • Overshoot: how much the response exceeds the final value
    • Settling time: time for the response to converge within a percentage of the final value
    • Steady-state error: difference between the setpoint and actual value after transients die out
    • Example: A depth controller with a 5 second rise time, 10% overshoot, 20 second settling time, and 0.1 m steady-state error
  • Frequency-domain analysis using Bode plots shows the magnitude and phase response of the system over a range of input frequencies
    • Bandwidth is the frequency at which the output magnitude drops by 3 dB
    • Higher bandwidth improves disturbance rejection and tracking
    • Example: A heading controller with a 1 Hz bandwidth can effectively reject wave disturbances but not high frequency sensor noise
  • Underwater vehicle dynamics are inherently nonlinear, so local linearization or describing functions must be used to apply linear stability and performance metrics
    • Global stability of nonlinear systems is difficult to guarantee

Challenges in Underwater Vehicle Control

Nonlinear Vehicle Dynamics

  • Hydrodynamic drag forces on underwater vehicles are nonlinear functions of velocity, usually modeled as a quadratic drag law
    • Linear approximations are only valid for small deviations from the operating point
    • Example: Drag force FD=12ρCDAvvF_D = -\frac{1}{2} \rho C_D A v |v|, where ρ\rho is water density, CDC_D is the drag coefficient, AA is the frontal area, and vv is velocity
  • Underwater vehicles experience added mass forces which are proportional to acceleration
    • This increases the effective inertia of the vehicle and cannot be neglected in the equations of motion
    • Example: Added mass force FA=mav˙F_A = -m_a \dot{v}, where mam_a is the added mass coefficient and v˙\dot{v} is acceleration
  • Control fin and thruster actuators often have position and rate limits, introducing saturation nonlinearities
    • Anti-windup logic or control allocation schemes are needed to manage saturations
    • Example: A thruster with a maximum rpm of 1000 cannot generate the 1200 rpm commanded by the , so the integral term must be limited

Environmental Disturbances

  • Ocean currents act as a disturbance to the vehicle's velocity relative to the water
    • Current profiles can vary with depth and time
    • Feedforward control or estimation of current velocities can mitigate the effects
    • Example: A 0.5 m/s tidal current causes an AUV to deviate from its desired track if not accounted for in the control system
  • Waves generate oscillatory disturbances to the vehicle's position and orientation
    • Wave filtering or adaptive control techniques may be needed for shallow water operations
    • Example: Heave and pitch motions from surface waves can disrupt an AUV trying to hold a constant depth
  • The vehicle's buoyancy, weight, and center of gravity can change during a mission due to varying payloads or water density
    • Trim and ballast systems or adaptive control can compensate for these changes
    • Example: An AUV deploying a 10 kg payload becomes more positively buoyant, requiring the depth controller to adjust the thruster forces

Sensor Limitations

  • Sensor noise, bias, and delays degrade the accuracy of feedback measurements
    • State estimators (Kalman filters) can fuse data from multiple sensors to improve feedback signal quality
    • Example: Compass measurements corrupted by electric motor noise can be filtered and combined with gyro data for a cleaner heading feedback signal

Key Terms to Review (16)

Actuators: Actuators are devices that convert energy into motion, enabling the movement of mechanisms or systems. They play a crucial role in underwater vehicles by providing the necessary force to perform actions such as propulsion, steering, and stabilizing. By receiving control signals, actuators execute precise movements to achieve desired positions or orientations, making them essential for effective feedback control systems.
Adaptive control: Adaptive control is a method used in control systems that adjusts its parameters automatically to cope with changes in the system dynamics or the environment. This approach allows systems, especially in complex fields like underwater robotics, to maintain performance despite uncertainties or variations, enhancing their ability to operate effectively under diverse conditions.
Autonomous navigation: Autonomous navigation refers to the ability of underwater vehicles to navigate and make decisions without human intervention, using various sensors and algorithms to understand their environment. This technology has evolved significantly over time, integrating advancements in positioning systems, machine learning, and feedback control systems to enhance the efficiency and reliability of underwater exploration and tasks.
Bode Plot: A Bode plot is a graphical representation of a linear, time-invariant system's frequency response, displaying the gain and phase shift as functions of frequency. It consists of two plots: one for magnitude (gain) in decibels versus frequency on a logarithmic scale, and another for phase shift in degrees versus frequency. This visualization is crucial for analyzing and designing feedback control systems for underwater vehicles, as it helps engineers understand how the system responds to different frequencies, aiding in stability and performance assessments.
Dynamics model: A dynamics model is a mathematical representation that describes the motion and behavior of a system, particularly how it responds to forces and changes over time. In the context of underwater vehicles, this model helps predict how the vehicle will behave in different conditions, considering factors like buoyancy, drag, and propulsion. It serves as a foundation for designing effective control strategies to ensure stability and maneuverability in aquatic environments.
Environmental Disturbances: Environmental disturbances refer to unexpected changes or disruptions in an ecosystem that can significantly affect the behavior and operation of underwater robotic systems. These disturbances can include natural events like storms, currents, and temperature changes, as well as human-induced factors like pollution or underwater construction. Understanding these disturbances is crucial for optimizing control strategies in robotic systems to ensure stability and efficiency during operations.
Hovering stability: Hovering stability refers to the ability of an underwater vehicle to maintain its position in the water column without drifting or losing altitude. This characteristic is crucial for performing tasks that require precision, such as inspections or data collection. Hovering stability relies on effective feedback control systems that adjust buoyancy and thrust to counteract any disturbances caused by currents, vehicle dynamics, or external forces.
Kinematic Equations: Kinematic equations are mathematical formulas that describe the motion of objects in terms of their velocity, acceleration, displacement, and time. These equations allow for the prediction of an object's future position and speed based on its initial conditions, which is essential in analyzing motion in underwater robotics. Understanding these equations is crucial for effective navigation and control, enabling vehicles to make accurate adjustments during operation.
Nonlinear dynamics: Nonlinear dynamics refers to the study of systems whose behavior is governed by nonlinear equations, where the output is not directly proportional to the input. In such systems, small changes can lead to drastically different outcomes, making prediction and control more complex. This characteristic is particularly important in areas involving feedback control and adaptive strategies, as it emphasizes the need for robust methods to handle unexpected behaviors and maintain stability in response to varying conditions.
PID Controller: A PID controller is a control loop feedback mechanism widely used in industrial control systems to maintain a desired output by adjusting a process variable. It combines three types of control actions: Proportional, Integral, and Derivative, allowing for precise control of dynamic systems like underwater vehicles by continuously calculating an error value as the difference between a setpoint and a measured process variable.
Response Time: Response time refers to the duration it takes for a system to react to a given input or stimulus. This concept is crucial in control systems as it reflects the effectiveness of the system in adapting to changes and ensuring stability, particularly in dynamic environments like underwater robotics. Understanding response time helps in designing systems that can adjust quickly to varying conditions, which is vital for safety, efficiency, and performance.
Robust Control: Robust control is a design methodology that ensures a control system maintains performance and stability in the presence of uncertainties and variations in system parameters. This approach is crucial for dealing with the unpredictable nature of underwater environments, where factors like currents and changes in buoyancy can affect vehicle behavior. By utilizing robust control strategies, engineers can create systems that effectively handle disturbances and maintain desired performance levels, making them reliable in dynamic conditions.
Simulation: Simulation refers to the process of creating a virtual representation of a real-world system or process in order to study its behavior under various conditions. It allows for experimentation and analysis without the risks and costs associated with physical trials, making it particularly useful in fields like underwater robotics where testing in actual environments can be challenging. Through simulations, engineers can fine-tune their designs and control algorithms to enhance performance and reliability.
Stability Margins: Stability margins refer to the thresholds that indicate how stable a system is in the presence of disturbances or uncertainties. In underwater vehicles, these margins help determine how well a vehicle can maintain its intended path and orientation while dealing with external forces like currents or waves. Understanding stability margins is essential for designing effective feedback control systems that ensure the vehicle operates safely and efficiently in various underwater environments.
System Identification: System identification is the process of developing mathematical models of dynamical systems based on measured data. This is crucial in designing effective feedback control systems for underwater vehicles, as it allows engineers to understand and predict system behavior, ensuring that the vehicle can respond appropriately to changing underwater conditions. By accurately identifying system parameters, engineers can create controllers that maintain stability and performance in complex environments.
Transfer Function: A transfer function is a mathematical representation that defines the relationship between the input and output of a system in the frequency domain. It captures how a system responds to various inputs, allowing engineers to analyze and design control systems effectively. In the context of feedback control systems for underwater vehicles, the transfer function helps in understanding the dynamic behavior of these vehicles, including stability, responsiveness, and the influence of feedback on performance.
© 2024 Fiveable Inc. All rights reserved.
AP® and SAT® are trademarks registered by the College Board, which is not affiliated with, and does not endorse this website.