Skip to content

Commit 9ff1c38

Browse files
authored
fix(autoware_stop_filter): fix bugprone-reserved-identifier (#9643)
* fix: bugprone-reserved-identifier Signed-off-by: kobayu858 <yutaro.kobayashi@tier4.jp> * fix: fmt Signed-off-by: kobayu858 <yutaro.kobayashi@tier4.jp> --------- Signed-off-by: kobayu858 <yutaro.kobayashi@tier4.jp>
1 parent fee8fe5 commit 9ff1c38

File tree

1 file changed

+1
-3
lines changed

1 file changed

+1
-3
lines changed

localization/autoware_stop_filter/src/stop_filter.cpp

+1-3
Original file line numberDiff line numberDiff line change
@@ -22,8 +22,6 @@
2222
#include <string>
2323
#include <utility>
2424

25-
using std::placeholders::_1;
26-
2725
namespace autoware::stop_filter
2826
{
2927
StopFilter::StopFilter(const rclcpp::NodeOptions & node_options)
@@ -33,7 +31,7 @@ StopFilter::StopFilter(const rclcpp::NodeOptions & node_options)
3331
wz_threshold_ = declare_parameter<double>("wz_threshold");
3432

3533
sub_odom_ = create_subscription<nav_msgs::msg::Odometry>(
36-
"input/odom", 1, std::bind(&StopFilter::callback_odometry, this, _1));
34+
"input/odom", 1, std::bind(&StopFilter::callback_odometry, this, std::placeholders::_1));
3735

3836
pub_odom_ = create_publisher<nav_msgs::msg::Odometry>("output/odom", 1);
3937
pub_stop_flag_ = create_publisher<tier4_debug_msgs::msg::BoolStamped>("debug/stop_flag", 1);

0 commit comments

Comments
 (0)