From 01cdc2c226298489b4d16d870faf626723e8235a Mon Sep 17 00:00:00 2001 From: Christoph Froehlich Date: Fri, 8 Nov 2024 20:48:57 +0000 Subject: [PATCH] Minor include cleanup --- include/control_filters/low_pass_filter.hpp | 7 ------- 1 file changed, 7 deletions(-) diff --git a/include/control_filters/low_pass_filter.hpp b/include/control_filters/low_pass_filter.hpp index 4601076c..3eb236e1 100644 --- a/include/control_filters/low_pass_filter.hpp +++ b/include/control_filters/low_pass_filter.hpp @@ -15,11 +15,8 @@ #ifndef CONTROL_FILTERS__LOW_PASS_FILTER_HPP_ #define CONTROL_FILTERS__LOW_PASS_FILTER_HPP_ -#include -#include #include #include -#include #include "filters/filter_base.hpp" #include "geometry_msgs/msg/wrench_stamped.hpp" @@ -36,8 +33,6 @@ namespace control_filters This class implements a low-pass filter for various data types based on an Infinite Impulse Response Filter. - For vector elements, the filtering is applied separately on - each element of the vector. In particular, this class implements a simplified version of an IIR filter equation : @@ -96,7 +91,6 @@ class LowPassFilter : public filters::FilterBase bool update(const T & data_in, T & data_out) override; private: - rclcpp::Clock::SharedPtr clock_; std::shared_ptr logger_; std::shared_ptr parameter_handler_; low_pass_filter::Params parameters_; @@ -106,7 +100,6 @@ class LowPassFilter : public filters::FilterBase template bool LowPassFilter::configure() { - clock_ = std::make_shared(RCL_SYSTEM_TIME); logger_.reset( new rclcpp::Logger(this->logging_interface_->get_logger().get_child(this->filter_name_)));