No version for distro humble. Known supported distros are highlighted in the buttons above.
No version for distro jazzy. Known supported distros are highlighted in the buttons above.
No version for distro rolling. Known supported distros are highlighted in the buttons above.

Package Summary

Tags No category tags.
Version 0.0.0
License TODO: License declaration
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/vortex-co/vauv.git
VCS Type git
VCS Version master
Last Updated 2022-02-13
Dev Status UNMAINTAINED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

AUV tracking control software using LQR

Additional Links

No additional links.

Maintainers

  • mohamedd

Authors

No additional authors.

Overview ——

Linear Quadratic Regulator for 6DOF AUV tracking control problem.


Table of contents ——


Prerequisites ——

  • ROS2 - Eloquent.

Dependencies ——


Nodes ——

controller_node

  • Subscribed topics:
    • /odometry/filtered of type nav_msgs/msg/Odometry. The current state of the vehicle [pose η, velocity ν].
    • /LQR/cmd_waypoint of type geometry_msgs/msg/Point. A desired 3D waypoint.
    • /LQR/cmd_attitude of type geometry_msgs/msg/Point. A desired 3D attitude [rpy].
    • /LQR/cmd_roll of type std_msgs/msg/Float32. A desired roll-angle.
    • /LQR/cmd_pitch of type std_msgs/msg/Float32. A desired pitch-angle.
    • /LQR/cmd_yaw of type std_msgs/msg/Float32. A desired yaw-angle.
    • /LQR/cmd_hold of type std_msgs/msg/Float32. A station keeping command.
  • Published topics:
    • /swift/thruster_manager/input_stamped of type geometry_msgs::msg::WrenchStamped. The output control forces and moments.
  • Service Clients:
  • control_pwm of type custom_ros_interfaces/srv/PWM. Output control PWM to the autopilot Pixhawk4.

Usage ——

  • Launching the node:
  $ ros2 launch trajectory_tracking_lqr lqr.launch.py

  • Sending a reference waypoint in ENU inertial frame:
  $ ros2 topic pub --once /LQR/cmd_waypoint geometry_msgs/msg/Point "{x: 48.5 , y: 35.5, z: -40.0}"

  • Sending a reference roll-angle in ENU inertial frame:
  $ ros2 topic pub --once /LQR/cmd_roll std_msgs/msg/Float32 "{data: 0.5}"

  • Sending a reference pitch-angle in ENU inertial frame:
  $ ros2 topic pub --once /LQR/cmd_pitch std_msgs/msg/Float32 "{data: 0.7071}"

  • Sending a reference yaw-angle in ENU inertial frame:
  $ ros2 topic pub --once /LQR/cmd_yaw std_msgs/msg/Float32 "{data: 0.52}"


Documentation ——

Notations

The motion of a marine craft in 6DOF is represented by the pose η = [x y z φ θ ψ] and velocity ν = [u v w p q r] vectors according to the SNAME notation

SNAME

AUV state space model

For the autonomous underwater vehicle system the the 6 DOF nonlinear equations of motion can be written as:

6dof

Constructing the linear parameter varying state space ẋ = A(t)x + B(t)u where the state vector x is column vector [η ν] and u is the control input to the system. The kinematics equation from the previous nonlinear equations of motion is already in this format but the kinetics equations requires a little manipulation

lpv

The system matrix A and control matrix B can be written as

ab

LQR Design for Trajectory Tracking

The LQR computes a control law for a given system linear system such that a certain optimality criterion is achieved. This is usually a quadratic cost function that depends on the state and control variables. For the trajectory tracking problem the LQR is designed to track a time-varying reference trajectory xd =[ηd νd] for this purpose we augment the state space model to the form ė = Ae + Bu where e = x-xd is the tracking error. The optimal feedback control law is computed as u = -Ke where K is the optimal control gain founded by minimizing the quadratic performance index

cost

Impelementation

  • Trajectory Class wrappes the methods provided by ruckig library for the generation of smooth time-varying trajectory.
  • LOS Class impelements the line-of-sight guidance for automatic steering of the AUV by calculating an appropriate reference yaw-angle ψd
  • LQR Class contains a method for solving the LQR problem and some methods for kinematics and kinetics calculation.
  • Controller Class wrappes the ROS interfacing methods.

References ——

[1] Handbook of Marine Craft Hydrodynamics and Motion Control, Thor I. Fossen.

CHANGELOG
No CHANGELOG found.

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

No known dependants.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged trajectory_tracking_lqr at Robotics Stack Exchange

No version for distro noetic. Known supported distros are highlighted in the buttons above.
No version for distro ardent. Known supported distros are highlighted in the buttons above.
No version for distro bouncy. Known supported distros are highlighted in the buttons above.
No version for distro crystal. Known supported distros are highlighted in the buttons above.
No version for distro eloquent. Known supported distros are highlighted in the buttons above.
No version for distro dashing. Known supported distros are highlighted in the buttons above.
No version for distro galactic. Known supported distros are highlighted in the buttons above.
No version for distro foxy. Known supported distros are highlighted in the buttons above.
No version for distro iron. Known supported distros are highlighted in the buttons above.
No version for distro lunar. Known supported distros are highlighted in the buttons above.
No version for distro jade. Known supported distros are highlighted in the buttons above.
No version for distro indigo. Known supported distros are highlighted in the buttons above.
No version for distro hydro. Known supported distros are highlighted in the buttons above.
No version for distro kinetic. Known supported distros are highlighted in the buttons above.
No version for distro melodic. Known supported distros are highlighted in the buttons above.