Skip to content

Commit c6fde95

Browse files
kobayu858chtseng
authored and
chtseng
committed
fix(compare_map_segmentation): fix funcArgNamesDifferent (autowarefoundation#8077)
fix:funcArgNamesDifferent Signed-off-by: kobayu858 <yutaro.kobayashi@tier4.jp> Signed-off-by: chtseng <chtseng@itri.org.tw>
1 parent 02ab246 commit c6fde95

File tree

1 file changed

+1
-1
lines changed

1 file changed

+1
-1
lines changed

perception/compare_map_segmentation/src/voxel_grid_map_loader/voxel_grid_map_loader.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -196,7 +196,7 @@ class VoxelGridDynamicMapLoader : public VoxelGridMapLoader
196196
rclcpp::Node * node, double leaf_size, double downsize_ratio_z_axis,
197197
std::string * tf_map_input_frame, std::mutex * mutex,
198198
rclcpp::CallbackGroup::SharedPtr main_callback_group);
199-
void onEstimatedPoseCallback(nav_msgs::msg::Odometry::ConstSharedPtr pose);
199+
void onEstimatedPoseCallback(nav_msgs::msg::Odometry::ConstSharedPtr msg);
200200

201201
void timer_callback();
202202
bool should_update_map() const;

0 commit comments

Comments
 (0)