Skip to content

Commit

Permalink
Fixed documentation generation.
Browse files Browse the repository at this point in the history
  • Loading branch information
peci1 committed Dec 12, 2024
1 parent e503dcd commit 8274d53
Show file tree
Hide file tree
Showing 6 changed files with 22 additions and 2 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -51,6 +51,7 @@ class UniversalAzimuthSubscriber :
/**
* \brief Constructor
*
* \param log Logger.
* \param nh The ros::NodeHandle to use for subscribing.
* \param topic The topic to subscribe to.
* \param queueSize Queue size of the subscription.
Expand Down Expand Up @@ -245,6 +246,7 @@ class CompassFilter : public message_filters::SimpleFilter<compass_msgs::Azimuth
* \param[in] azimuthInput The message filter producing azimuth messages.
* \param[in] unit The output azimuth unit.
* \param[in] orientation The output azimuth orientation.
* \param[in] reference The output azimuth reference.
*/
template<class AzimuthInput>
CompassFilter(const cras::LogHelperPtr& log, const std::shared_ptr<CompassConverter>& converter,
Expand Down
4 changes: 2 additions & 2 deletions magnetic_model/include/magnetic_model/magnetic_model.h
Original file line number Diff line number Diff line change
Expand Up @@ -109,8 +109,8 @@ class MagneticModel : public cras::HasLogger
const sensor_msgs::NavSatFix& fix, const ros::Time& stamp) const;

/**
* \brief Get the magnetic field components on the provided place on Earth.
* \param[in] fix The place for which magnetic field components are queried. Timestamp from the message is ignored.
* \brief Get the components of the measured magnetic field.
* \param[in] field The measured magnetic field.
* \param[in] stamp The time for which magnetic field components are queried.
* \return The magnetic field components.
*/
Expand Down
1 change: 1 addition & 0 deletions magnetometer_compass/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -52,6 +52,7 @@
<test_depend>rostest</test_depend>

<export>
<rosdoc config="rosdoc.yaml" />
<nodelet plugin="${prefix}/nodelets.xml" />
</export>
</package>
8 changes: 8 additions & 0 deletions magnetometer_compass/rosdoc.yaml
Original file line number Diff line number Diff line change
@@ -0,0 +1,8 @@
# SPDX-License-Identifier: BSD-3-Clause
# SPDX-FileCopyrightText: Czech Technical University in Prague

- builder: doxygen
required: True
file_patterns: '*.h *.hpp *.hh *.dox /README.md'
use_mdfile_as_mainpage: 'README.md'
generate_treeview: True
1 change: 1 addition & 0 deletions magnetometer_pipeline/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -43,6 +43,7 @@
<test_depend>rostest</test_depend>

<export>
<rosdoc config="rosdoc.yaml" />
<nodelet plugin="${prefix}/nodelets.xml" />
</export>
</package>
8 changes: 8 additions & 0 deletions magnetometer_pipeline/rosdoc.yaml
Original file line number Diff line number Diff line change
@@ -0,0 +1,8 @@
# SPDX-License-Identifier: BSD-3-Clause
# SPDX-FileCopyrightText: Czech Technical University in Prague

- builder: doxygen
required: True
file_patterns: '*.h *.hpp *.hh *.dox /README.md'
use_mdfile_as_mainpage: 'README.md'
generate_treeview: True

0 comments on commit 8274d53

Please sign in to comment.