Skip to content
This repository has been archived by the owner on Jan 23, 2024. It is now read-only.

Commit

Permalink
Fix linting
Browse files Browse the repository at this point in the history
  • Loading branch information
Flova committed Oct 26, 2023
1 parent 8a0f304 commit e6bb23f
Showing 1 changed file with 3 additions and 2 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -12,6 +12,7 @@
#include <tf2/LinearMath/Quaternion.h>
#include <tf2/LinearMath/Transform.h>
#include <tf2/convert.h>
#include <tf2/time.h>
#include <tf2/utils.h>
#include <tf2_ros/buffer.h>
#include <tf2_ros/message_filter.h>
Expand Down Expand Up @@ -143,7 +144,7 @@ class Localization : public rclcpp::Node {
private:
// Declare parameter listener and struct from the generate_parameter_library
bitbots_localization::ParamListener param_listener_;
// Datastructure to hold all parameters, which is build from the schema in the 'parameters.yaml'
// Data structure to hold all parameters, which is build from the schema in the 'parameters.yaml'
bitbots_localization::Params config_;

rclcpp::Subscription<sm::msg::PointCloud2>::SharedPtr line_point_cloud_subscriber_;
Expand Down Expand Up @@ -251,7 +252,7 @@ class Localization : public rclcpp::Node {
rclcpp::Publisher<visualization_msgs::msg::Marker>::SharedPtr &publisher);

/**
* Updates the messurements for all classes
* Updates the measurements for all classes
*/
void updateMeasurements();

Expand Down

0 comments on commit e6bb23f

Please sign in to comment.