From 438316c18ed55baa3b87c549a4690036d7323378 Mon Sep 17 00:00:00 2001 From: Taekjin LEE Date: Wed, 3 Jul 2024 17:42:44 +0900 Subject: [PATCH] refactor: update ransac tester Signed-off-by: Taekjin LEE --- .../ground_segmentation/test/test_ransac_ground_filter.cpp | 4 ++-- 1 file changed, 2 insertions(+), 2 deletions(-) diff --git a/perception/ground_segmentation/test/test_ransac_ground_filter.cpp b/perception/ground_segmentation/test/test_ransac_ground_filter.cpp index 79e28b6b1ccd8..fb66ba9e05b6d 100644 --- a/perception/ground_segmentation/test/test_ransac_ground_filter.cpp +++ b/perception/ground_segmentation/test/test_ransac_ground_filter.cpp @@ -12,11 +12,11 @@ // See the License for the specific language governing permissions and // limitations under the License. +#include "../src/ransac_ground_filter/node.hpp" #include "ament_index_cpp/get_package_share_directory.hpp" #include "tf2_ros/transform_broadcaster.h" #include -#include #include "geometry_msgs/msg/transform_stamped.hpp" #include @@ -68,7 +68,7 @@ class RansacGroundFilterTestSuite : public ::testing::Test void TearDown() { (void)rclcpp::shutdown(); } }; -class RansacGroundFilterTest : public ground_segmentation::RANSACGroundFilterComponent +class RansacGroundFilterTest : public autoware::ground_segmentation::RANSACGroundFilterComponent { public: explicit RansacGroundFilterTest(const rclcpp::NodeOptions & options)