Skip to content

Commit

Permalink
refactor(stop_filter): apply static analysis (#7302)
Browse files Browse the repository at this point in the history
change to snake_case

Signed-off-by: a-maumau <[email protected]>
Co-authored-by: SakodaShintaro <[email protected]>
  • Loading branch information
a-maumau and SakodaShintaro authored Jun 6, 2024
1 parent 5006a4d commit 31c1672
Show file tree
Hide file tree
Showing 2 changed files with 3 additions and 3 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -52,6 +52,6 @@ class StopFilter : public rclcpp::Node
/**
* @brief set odometry measurement
*/
void callbackOdometry(const nav_msgs::msg::Odometry::SharedPtr msg);
void callback_odometry(const nav_msgs::msg::Odometry::SharedPtr msg);
};
#endif // STOP_FILTER__STOP_FILTER_HPP_
4 changes: 2 additions & 2 deletions localization/stop_filter/src/stop_filter.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -31,13 +31,13 @@ StopFilter::StopFilter(const rclcpp::NodeOptions & node_options)
wz_threshold_ = declare_parameter<double>("wz_threshold");

sub_odom_ = create_subscription<nav_msgs::msg::Odometry>(
"input/odom", 1, std::bind(&StopFilter::callbackOdometry, this, _1));
"input/odom", 1, std::bind(&StopFilter::callback_odometry, this, _1));

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

void StopFilter::callbackOdometry(const nav_msgs::msg::Odometry::SharedPtr msg)
void StopFilter::callback_odometry(const nav_msgs::msg::Odometry::SharedPtr msg)
{
tier4_debug_msgs::msg::BoolStamped stop_flag_msg;
stop_flag_msg.stamp = msg->header.stamp;
Expand Down

0 comments on commit 31c1672

Please sign in to comment.