Skip to content

Commit b174281

Browse files
authored
fix(autoware_pose_covariance_modifier): fix funcArgNamesDifferent (autowarefoundation#8007)
fix:funcArgNamesDifferent Signed-off-by: kobayu858 <yutaro.kobayashi@tier4.jp>
1 parent 314f9ae commit b174281

File tree

1 file changed

+1
-1
lines changed

1 file changed

+1
-1
lines changed

localization/autoware_pose_covariance_modifier/src/include/pose_covariance_modifier.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -65,7 +65,7 @@ class PoseCovarianceModifierNode : public rclcpp::Node
6565
rclcpp::Publisher<std_msgs::msg::Float64>::SharedPtr pub_double_gnss_position_stddev_;
6666

6767
void callback_gnss_pose_with_cov(
68-
const geometry_msgs::msg::PoseWithCovarianceStamped::ConstSharedPtr & msg);
68+
const geometry_msgs::msg::PoseWithCovarianceStamped::ConstSharedPtr & msg_pose_with_cov_in);
6969

7070
void callback_ndt_pose_with_cov(
7171
const geometry_msgs::msg::PoseWithCovarianceStamped::ConstSharedPtr & msg_pose_with_cov_in);

0 commit comments

Comments
 (0)