We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
There was an error while loading. Please reload this page.
1 parent 4154508 commit b98f199Copy full SHA for b98f199
include/control_filters/low_pass_filter.hpp
@@ -87,7 +87,8 @@ bool LowPassFilter<T>::configure()
87
try
88
{
89
parameter_handler_ =
90
- std::make_shared<low_pass_filter::ParamListener>(this->params_interface_);
+ std::make_shared<low_pass_filter::ParamListener>(this->params_interface_,
91
+ this->param_prefix_);
92
}
93
catch (rclcpp::exceptions::ParameterUninitializedException & ex) {
94
RCLCPP_ERROR((*logger_), "LowPass filter cannot be configured: %s", ex.what());
0 commit comments