2.9 KiB
2.9 KiB
/home/firmament/codes/24navigation/src/linefit_ground_segementation_ros2/linefit_ground_segmentation_ros/src/ground_segmentation_node.cc: In constructor ‘SegmentationNode::SegmentationNode(const rclcpp::NodeOptions&)’:
/home/firmament/codes/24navigation/src/linefit_ground_segementation_ros2/linefit_ground_segmentation_ros/src/ground_segmentation_node.cc:87:70: error: no matching function for call to ‘SegmentationNode::create_publisher<sensor_msgs::msg::PointCloud2>(std::string&, rclcpp::QoS&, rclcpp::PublisherOptions&, int)’
87 | ground_pub_ = this->create_publisher<sensor_msgs::msg::PointCloud2>(
| ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~^
88 | ground_topic,qos,optionsqos,1000);
| ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~
In file included from /opt/ros/humble/include/rclcpp/rclcpp/executors/single_threaded_executor.hpp:28,
from /opt/ros/humble/include/rclcpp/rclcpp/executors.hpp:22,
from /opt/ros/humble/include/rclcpp/rclcpp/rclcpp.hpp:155,
from /opt/ros/humble/include/pcl_conversions/pcl_conversions.h:42,
from /home/firmament/codes/24navigation/src/linefit_ground_segementation_ros2/linefit_ground_segmentation_ros/src/ground_segmentation_node.cc:6:
/opt/ros/humble/include/rclcpp/rclcpp/node.hpp:195:3: note: candidate: ‘template<class MessageT, class AllocatorT, class PublisherT> std::shared_ptr<PublisherT> rclcpp::Node::create_publisher(const string&, const rclcpp::QoS&, const rclcpp::PublisherOptionsWithAllocator<AllocatorT>&)’
195 | create_publisher(
| ^~~~~~~~~~~~~~~~
/opt/ros/humble/include/rclcpp/rclcpp/node.hpp:195:3: note: template argument deduction/substitution failed:
/home/firmament/codes/24navigation/src/linefit_ground_segementation_ros2/linefit_ground_segmentation_ros/src/ground_segmentation_node.cc:87:70: note: candidate expects 3 arguments, 4 provided
87 | ground_pub_ = this->create_publisher<sensor_msgs::msg::PointCloud2>(
| ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~^
88 | ground_topic,qos,optionsqos,1000);
| ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~
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
/home/firmament/codes/24navigation/src/linefit_ground_segementation_ros2/linefit_ground_segmentation_ros/src/ground_segmentation_node.cc:87:70: error: no matching function for call to ‘SegmentationNode::create_publisher<sensor_msgs::msg::PointCloud2>(std::string&, rclcpp::QoS&, rclcpp::PublisherOptions&, int)’
87 | ground_pub_ = this->create_publisher<sensor_msgs::msg::PointCloud2>(
| ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~^
88 | ground_topic,qos,optionsqos,1000);
| ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~
In file included from /opt/ros/humble/include/rclcpp/rclcpp/executors/single_threaded_executor.hpp:28,
from /opt/ros/humble/include/rclcpp/rclcpp/executors.hpp:22,
from /opt/ros/humble/include/rclcpp/rclcpp/rclcpp.hpp:155,
from /opt/ros/humble/include/pcl_conversions/pcl_conversions.h:42,
from /home/firmament/codes/24navigation/src/linefit_ground_segementation_ros2/linefit_ground_segmentation_ros/src/ground_segmentation_node.cc:6:
/opt/ros/humble/include/rclcpp/rclcpp/node.hpp:195:3: note: candidate: ‘template<class MessageT, class AllocatorT, class PublisherT> std::shared_ptr<PublisherT> rclcpp::Node::create_publisher(const string&, const rclcpp::QoS&, const rclcpp::PublisherOptionsWithAllocator<AllocatorT>&)’
195 | create_publisher(
| ^~~~~~~~~~~~~~~~
/opt/ros/humble/include/rclcpp/rclcpp/node.hpp:195:3: note: template argument deduction/substitution failed:
/home/firmament/codes/24navigation/src/linefit_ground_segementation_ros2/linefit_ground_segmentation_ros/src/ground_segmentation_node.cc:87:70: note: candidate expects 3 arguments, 4 provided
87 | ground_pub_ = this->create_publisher<sensor_msgs::msg::PointCloud2>(
| ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~^
88 | ground_topic,qos,optionsqos,1000);
| ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~
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