Skip to content

Commit 1669bf8

Browse files
committed
refactor: update ransac tester
Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp>
1 parent 8445a2f commit 1669bf8

File tree

1 file changed

+2
-2
lines changed

1 file changed

+2
-2
lines changed

perception/ground_segmentation/test/test_ransac_ground_filter.cpp

+2-2
Original file line numberDiff line numberDiff line change
@@ -12,11 +12,11 @@
1212
// See the License for the specific language governing permissions and
1313
// limitations under the License.
1414

15+
#include "../src/ransac_ground_filter/node.hpp"
1516
#include "ament_index_cpp/get_package_share_directory.hpp"
1617
#include "tf2_ros/transform_broadcaster.h"
1718

1819
#include <experimental/random>
19-
#include <ground_segmentation/ransac_ground_filter_nodelet.hpp>
2020

2121
#include "geometry_msgs/msg/transform_stamped.hpp"
2222
#include <sensor_msgs/msg/point_cloud2.hpp>
@@ -68,7 +68,7 @@ class RansacGroundFilterTestSuite : public ::testing::Test
6868
void TearDown() { (void)rclcpp::shutdown(); }
6969
};
7070

71-
class RansacGroundFilterTest : public ground_segmentation::RANSACGroundFilterComponent
71+
class RansacGroundFilterTest : public autoware::ground_segmentation::RANSACGroundFilterComponent
7272
{
7373
public:
7474
explicit RansacGroundFilterTest(const rclcpp::NodeOptions & options)

0 commit comments

Comments
 (0)