24 lines
2.9 KiB
Plaintext
24 lines
2.9 KiB
Plaintext
|
[01m[K/home/firmament/codes/24navigation/src/linefit_ground_segementation_ros2/linefit_ground_segmentation_ros/src/ground_segmentation_node.cc:[m[K In constructor ‘[01m[KSegmentationNode::SegmentationNode(const rclcpp::NodeOptions&)[m[K’:
|
|||
|
[01m[K/home/firmament/codes/24navigation/src/linefit_ground_segementation_ros2/linefit_ground_segmentation_ros/src/ground_segmentation_node.cc:87:70:[m[K [01;31m[Kerror: [m[Kno matching function for call to ‘[01m[KSegmentationNode::create_publisher<sensor_msgs::msg::PointCloud2>(std::string&, rclcpp::QoS&, rclcpp::PublisherOptions&, int)[m[K’
|
|||
|
87 | ground_pub_ = [01;31m[Kthis->create_publisher<sensor_msgs::msg::PointCloud2>([m[K
|
|||
|
| [01;31m[K~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~^[m[K
|
|||
|
88 | [01;31m[K ground_topic,qos,optionsqos,1000)[m[K;
|
|||
|
| [01;31m[K~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~[m[K
|
|||
|
In file included from [01m[K/opt/ros/humble/include/rclcpp/rclcpp/executors/single_threaded_executor.hpp:28[m[K,
|
|||
|
from [01m[K/opt/ros/humble/include/rclcpp/rclcpp/executors.hpp:22[m[K,
|
|||
|
from [01m[K/opt/ros/humble/include/rclcpp/rclcpp/rclcpp.hpp:155[m[K,
|
|||
|
from [01m[K/opt/ros/humble/include/pcl_conversions/pcl_conversions.h:42[m[K,
|
|||
|
from [01m[K/home/firmament/codes/24navigation/src/linefit_ground_segementation_ros2/linefit_ground_segmentation_ros/src/ground_segmentation_node.cc:6[m[K:
|
|||
|
[01m[K/opt/ros/humble/include/rclcpp/rclcpp/node.hpp:195:3:[m[K [01;36m[Knote: [m[Kcandidate: ‘[01m[Ktemplate<class MessageT, class AllocatorT, class PublisherT> std::shared_ptr<PublisherT> rclcpp::Node::create_publisher(const string&, const rclcpp::QoS&, const rclcpp::PublisherOptionsWithAllocator<AllocatorT>&)[m[K’
|
|||
|
195 | [01;36m[Kcreate_publisher[m[K(
|
|||
|
| [01;36m[K^~~~~~~~~~~~~~~~[m[K
|
|||
|
[01m[K/opt/ros/humble/include/rclcpp/rclcpp/node.hpp:195:3:[m[K [01;36m[Knote: [m[K template argument deduction/substitution failed:
|
|||
|
[01m[K/home/firmament/codes/24navigation/src/linefit_ground_segementation_ros2/linefit_ground_segmentation_ros/src/ground_segmentation_node.cc:87:70:[m[K [01;36m[Knote: [m[K candidate expects 3 arguments, 4 provided
|
|||
|
87 | ground_pub_ = [01;36m[Kthis->create_publisher<sensor_msgs::msg::PointCloud2>([m[K
|
|||
|
| [01;36m[K~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~^[m[K
|
|||
|
88 | [01;36m[K ground_topic,qos,optionsqos,1000)[m[K;
|
|||
|
| [01;36m[K~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~[m[K
|
|||
|
gmake[2]: *** [CMakeFiles/ground_segmentation_node.dir/build.make:76: CMakeFiles/ground_segmentation_node.dir/src/ground_segmentation_node.cc.o] Error 1
|
|||
|
gmake[1]: *** [CMakeFiles/Makefile2:140: CMakeFiles/ground_segmentation_node.dir/all] Error 2
|
|||
|
gmake: *** [Makefile:146: all] Error 2
|