Skip to content

Commit

Permalink
rearranged doxygen comments
Browse files Browse the repository at this point in the history
  • Loading branch information
alekskl01 committed Nov 7, 2023
1 parent 6bae14e commit 96b631b
Show file tree
Hide file tree
Showing 2 changed files with 13 additions and 12 deletions.
Original file line number Diff line number Diff line change
@@ -1,3 +1,10 @@
/**
* @file allocator_ros.hpp
* @brief ThrusterAllocator class, which
* allocates thrust to the ASV's thrusters based on the desired body frame
* forces.
*/

#ifndef VORTEX_ALLOCATOR_ALLOCATOR_ROS_HPP
#define VORTEX_ALLOCATOR_ALLOCATOR_ROS_HPP

Expand All @@ -9,12 +16,6 @@
#include <geometry_msgs/msg/wrench.hpp>
#include <vortex_msgs/msg/thruster_forces.hpp>

/**
* @file allocator_ros.hpp
* @brief ThrusterAllocator class, which
* allocates thrust to the ASV's thrusters based on the desired body frame
* forces.
*/
using namespace std::chrono_literals;

class ThrusterAllocator : public rclcpp::Node {
Expand Down
Original file line number Diff line number Diff line change
@@ -1,3 +1,9 @@
/**
* @file allocator_utils.hpp
* @brief This file contains utility functions for the thruster allocator
* module.
*/

#ifndef VORTEX_ALLOCATOR_ALLOCATOR_UTILS_HPP
#define VORTEX_ALLOCATOR_ALLOCATOR_UTILS_HPP

Expand All @@ -8,12 +14,6 @@

#include <vortex_msgs/msg/thruster_forces.hpp>

/**
* @file allocator_utils.hpp
* @brief This file contains utility functions for the thruster allocator
* module.
*/

/**
* @brief Check if the matrix has any NaN or INF elements.
*
Expand Down

0 comments on commit 96b631b

Please sign in to comment.