You signed in with another tab or window. Reload to refresh your session.You signed out in another tab or window. Reload to refresh your session.You switched accounts on another tab or window. Reload to refresh your session.Dismiss alert
Copy file name to clipboardexpand all lines: localization/yabloc/yabloc_image_processing/include/yabloc_image_processing/graph_segment/graph_segment.hpp
+1-1
Original file line number
Diff line number
Diff line change
@@ -32,7 +32,7 @@ class GraphSegment : public rclcpp::Node
32
32
public:
33
33
using PointCloud2 = sensor_msgs::msg::PointCloud2;
Copy file name to clipboardexpand all lines: localization/yabloc/yabloc_image_processing/include/yabloc_image_processing/lanelet2_overlay/lanelet2_overlay.hpp
+1-1
Original file line number
Diff line number
Diff line change
@@ -47,7 +47,7 @@ class Lanelet2Overlay : public rclcpp::Node
47
47
using Image = sensor_msgs::msg::Image;
48
48
using Float32Array = std_msgs::msg::Float32MultiArray;
Copy file name to clipboardexpand all lines: localization/yabloc/yabloc_image_processing/include/yabloc_image_processing/line_segment_detector/line_segment_detector.hpp
+1-1
Original file line number
Diff line number
Diff line change
@@ -42,7 +42,7 @@ class LineSegmentDetector : public rclcpp::Node
42
42
using Image = sensor_msgs::msg::Image;
43
43
using PointCloud2 = sensor_msgs::msg::PointCloud2;
Copy file name to clipboardexpand all lines: localization/yabloc/yabloc_image_processing/include/yabloc_image_processing/line_segments_overlay/line_segments_overlay.hpp
+1-1
Original file line number
Diff line number
Diff line change
@@ -34,7 +34,7 @@ class LineSegmentsOverlay : public rclcpp::Node
34
34
using Image = sensor_msgs::msg::Image;
35
35
using LineSegment = pcl::PointXYZLNormal;
36
36
using LineSegments = pcl::PointCloud<LineSegment>;
Copy file name to clipboardexpand all lines: localization/yabloc/yabloc_image_processing/include/yabloc_image_processing/segment_filter/segment_filter.hpp
+1-1
Original file line number
Diff line number
Diff line change
@@ -39,7 +39,7 @@ class SegmentFilter : public rclcpp::Node
39
39
using PointCloud2 = sensor_msgs::msg::PointCloud2;
0 commit comments