We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
1 parent 314f9ae commit b174281Copy full SHA for b174281
localization/autoware_pose_covariance_modifier/src/include/pose_covariance_modifier.hpp
@@ -65,7 +65,7 @@ class PoseCovarianceModifierNode : public rclcpp::Node
65
rclcpp::Publisher<std_msgs::msg::Float64>::SharedPtr pub_double_gnss_position_stddev_;
66
67
void callback_gnss_pose_with_cov(
68
- const geometry_msgs::msg::PoseWithCovarianceStamped::ConstSharedPtr & msg);
+ const geometry_msgs::msg::PoseWithCovarianceStamped::ConstSharedPtr & msg_pose_with_cov_in);
69
70
void callback_ndt_pose_with_cov(
71
const geometry_msgs::msg::PoseWithCovarianceStamped::ConstSharedPtr & msg_pose_with_cov_in);
0 commit comments