6.7 KiB
6.7 KiB
[0.085s] Invoking command in '/home/firmament/codes/24navigation/build/pointcloud_to_laserscan': CMAKE_PREFIX_PATH=${CMAKE_PREFIX_PATH}:/opt/ros/humble /usr/bin/cmake --build /home/firmament/codes/24navigation/build/pointcloud_to_laserscan -- -j8 -l8
[0.178s] [ 20%] Built target laserscan_to_pointcloud
[0.195s] [ 40%] Built target pointcloud_to_laserscan_node
[0.200s] [ 60%] Built target laserscan_to_pointcloud_node
[0.211s] Consolidate compiler generated dependencies of target pointcloud_to_laserscan
[0.257s] [ 70%] Building CXX object CMakeFiles/pointcloud_to_laserscan.dir/src/pointcloud_to_laserscan_node.cpp.o
[3.559s] /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp: In constructor ‘pointcloud_to_laserscan::PointCloudToLaserScanNode::PointCloudToLaserScanNode(const rclcpp::NodeOptions&)’:
[3.559s] /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:88:11: error: ‘class tf2_ros::Buffer’ has no member named ‘setTransformTolerance’
[3.560s] 88 | tf2_->setTransformTolerance(transform_tolerance);
[3.560s] | ^~~~~~~~~~~~~~~~~~~~~
[3.607s] /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp: In member function ‘void pointcloud_to_laserscan::PointCloudToLaserScanNode::cloudCallback(sensor_msgs::msg::PointCloud2_<std::allocator<void> >::ConstSharedPtr)’:
[3.607s] /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:186:60: error: no matching function for call to ‘tf2_ros::Buffer::getLatestCommonTime(std::string&, const _frame_id_type&)’
[3.607s] 186 | tf2::TimePoint transform_time = tf2_->getLatestCommonTime(target_frame_,cloud_msg->header.frame_id);
[3.607s] | ~~~~~~~~~~~~~~~~~~~~~~~~~^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~
[3.607s] In file included from /opt/ros/humble/include/tf2_ros/tf2_ros/async_buffer_interface.h:39,
[3.607s] from /opt/ros/humble/include/tf2_ros/tf2_ros/buffer.h:41,
[3.607s] from /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/include/pointcloud_to_laserscan/pointcloud_to_laserscan_node.hpp:50,
[3.607s] from /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:41:
[3.607s] /opt/ros/humble/include/tf2/tf2/buffer_core.h:422:17: note: candidate: ‘tf2::TF2Error tf2::BufferCore::getLatestCommonTime(tf2::CompactFrameID, tf2::CompactFrameID, tf2::TimePoint&, std::string*) const’
[3.607s] 422 | tf2::TF2Error getLatestCommonTime(
[3.607s] | ^~~~~~~~~~~~~~~~~~~
[3.607s] /opt/ros/humble/include/tf2/tf2/buffer_core.h:422:17: note: candidate expects 4 arguments, 2 provided
[3.607s] /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:187:38: error: no matching function for call to ‘toMsg(tf2::TimePoint&)’
[3.607s] 187 | scan_msg->header.stamp = tf2::toMsg(transform_time);
[3.607s] | ~~~~~~~~~~^~~~~~~~~~~~~~~~
[3.608s] In file included from /opt/ros/humble/include/tf2_ros/tf2_ros/buffer_interface.h:43,
[3.608s] from /opt/ros/humble/include/tf2_ros/tf2_ros/buffer.h:42,
[3.608s] from /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/include/pointcloud_to_laserscan/pointcloud_to_laserscan_node.hpp:50,
[3.608s] from /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:41:
[3.608s] /opt/ros/humble/include/tf2/tf2/convert.h:129:3: note: candidate: ‘template<class A, class B> B tf2::toMsg(const A&)’
[3.608s] 129 | B toMsg(const A & a);
[3.608s] | ^~~~~
[3.608s] /opt/ros/humble/include/tf2/tf2/convert.h:129:3: note: template argument deduction/substitution failed:
[3.608s] /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:187:38: note: couldn’t deduce template parameter ‘B’
[3.608s] 187 | scan_msg->header.stamp = tf2::toMsg(transform_time);
[3.608s] | ~~~~~~~~~~^~~~~~~~~~~~~~~~
[3.608s] In file included from /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:52:
[3.608s] /opt/ros/humble/include/tf2_sensor_msgs/tf2_sensor_msgs.hpp:119:31: note: candidate: ‘sensor_msgs::msg::PointCloud2 tf2::toMsg(const PointCloud2&)’
[3.608s] 119 | sensor_msgs::msg::PointCloud2 toMsg(const sensor_msgs::msg::PointCloud2 & in)
[3.608s] | ^~~~~
[3.608s] /opt/ros/humble/include/tf2_sensor_msgs/tf2_sensor_msgs.hpp:119:75: note: no known conversion for argument 1 from ‘tf2::TimePoint’ {aka ‘std::chrono::time_point<std::chrono::_V2::system_clock, std::chrono::duration<long int, std::ratio<1, 1000000000> > >’} to ‘const PointCloud2&’ {aka ‘const sensor_msgs::msg::PointCloud2_<std::allocator<void> >&’}
[3.608s] 119 | _msgs::msg::PointCloud2 toMsg(const sensor_msgs::msg::PointCloud2 & in)
[3.608s] | ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~^~
[3.608s]
[6.101s] gmake[2]: *** [CMakeFiles/pointcloud_to_laserscan.dir/build.make:76: CMakeFiles/pointcloud_to_laserscan.dir/src/pointcloud_to_laserscan_node.cpp.o] Error 1
[6.101s] gmake[1]: *** [CMakeFiles/Makefile2:197: CMakeFiles/pointcloud_to_laserscan.dir/all] Error 2
[6.101s] gmake: *** [Makefile:146: all] Error 2
[6.103s] Invoked command in '/home/firmament/codes/24navigation/build/pointcloud_to_laserscan' returned '2': CMAKE_PREFIX_PATH=${CMAKE_PREFIX_PATH}:/opt/ros/humble /usr/bin/cmake --build /home/firmament/codes/24navigation/build/pointcloud_to_laserscan -- -j8 -l8
[0.178s] [ 20%] Built target laserscan_to_pointcloud
[0.195s] [ 40%] Built target pointcloud_to_laserscan_node
[0.200s] [ 60%] Built target laserscan_to_pointcloud_node
[0.211s] Consolidate compiler generated dependencies of target pointcloud_to_laserscan
[0.257s] [ 70%] Building CXX object CMakeFiles/pointcloud_to_laserscan.dir/src/pointcloud_to_laserscan_node.cpp.o
[3.559s] /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp: In constructor ‘pointcloud_to_laserscan::PointCloudToLaserScanNode::PointCloudToLaserScanNode(const rclcpp::NodeOptions&)’:
[3.559s] /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:88:11: error: ‘class tf2_ros::Buffer’ has no member named ‘setTransformTolerance’
[3.560s] 88 | tf2_->setTransformTolerance(transform_tolerance);
[3.560s] | ^~~~~~~~~~~~~~~~~~~~~
[3.607s] /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp: In member function ‘void pointcloud_to_laserscan::PointCloudToLaserScanNode::cloudCallback(sensor_msgs::msg::PointCloud2_<std::allocator<void> >::ConstSharedPtr)’:
[3.607s] /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:186:60: error: no matching function for call to ‘tf2_ros::Buffer::getLatestCommonTime(std::string&, const _frame_id_type&)’
[3.607s] 186 | tf2::TimePoint transform_time = tf2_->getLatestCommonTime(target_frame_,cloud_msg->header.frame_id);
[3.607s] | ~~~~~~~~~~~~~~~~~~~~~~~~~^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~
[3.607s] In file included from /opt/ros/humble/include/tf2_ros/tf2_ros/async_buffer_interface.h:39,
[3.607s] from /opt/ros/humble/include/tf2_ros/tf2_ros/buffer.h:41,
[3.607s] from /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/include/pointcloud_to_laserscan/pointcloud_to_laserscan_node.hpp:50,
[3.607s] from /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:41:
[3.607s] /opt/ros/humble/include/tf2/tf2/buffer_core.h:422:17: note: candidate: ‘tf2::TF2Error tf2::BufferCore::getLatestCommonTime(tf2::CompactFrameID, tf2::CompactFrameID, tf2::TimePoint&, std::string*) const’
[3.607s] 422 | tf2::TF2Error getLatestCommonTime(
[3.607s] | ^~~~~~~~~~~~~~~~~~~
[3.607s] /opt/ros/humble/include/tf2/tf2/buffer_core.h:422:17: note: candidate expects 4 arguments, 2 provided
[3.607s] /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:187:38: error: no matching function for call to ‘toMsg(tf2::TimePoint&)’
[3.607s] 187 | scan_msg->header.stamp = tf2::toMsg(transform_time);
[3.607s] | ~~~~~~~~~~^~~~~~~~~~~~~~~~
[3.608s] In file included from /opt/ros/humble/include/tf2_ros/tf2_ros/buffer_interface.h:43,
[3.608s] from /opt/ros/humble/include/tf2_ros/tf2_ros/buffer.h:42,
[3.608s] from /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/include/pointcloud_to_laserscan/pointcloud_to_laserscan_node.hpp:50,
[3.608s] from /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:41:
[3.608s] /opt/ros/humble/include/tf2/tf2/convert.h:129:3: note: candidate: ‘template<class A, class B> B tf2::toMsg(const A&)’
[3.608s] 129 | B toMsg(const A & a);
[3.608s] | ^~~~~
[3.608s] /opt/ros/humble/include/tf2/tf2/convert.h:129:3: note: template argument deduction/substitution failed:
[3.608s] /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:187:38: note: couldn’t deduce template parameter ‘B’
[3.608s] 187 | scan_msg->header.stamp = tf2::toMsg(transform_time);
[3.608s] | ~~~~~~~~~~^~~~~~~~~~~~~~~~
[3.608s] In file included from /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:52:
[3.608s] /opt/ros/humble/include/tf2_sensor_msgs/tf2_sensor_msgs.hpp:119:31: note: candidate: ‘sensor_msgs::msg::PointCloud2 tf2::toMsg(const PointCloud2&)’
[3.608s] 119 | sensor_msgs::msg::PointCloud2 toMsg(const sensor_msgs::msg::PointCloud2 & in)
[3.608s] | ^~~~~
[3.608s] /opt/ros/humble/include/tf2_sensor_msgs/tf2_sensor_msgs.hpp:119:75: note: no known conversion for argument 1 from ‘tf2::TimePoint’ {aka ‘std::chrono::time_point<std::chrono::_V2::system_clock, std::chrono::duration<long int, std::ratio<1, 1000000000> > >’} to ‘const PointCloud2&’ {aka ‘const sensor_msgs::msg::PointCloud2_<std::allocator<void> >&’}
[3.608s] 119 | _msgs::msg::PointCloud2 toMsg(const sensor_msgs::msg::PointCloud2 & in)
[3.608s] | ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~^~
[3.608s]
[6.101s] gmake[2]: *** [CMakeFiles/pointcloud_to_laserscan.dir/build.make:76: CMakeFiles/pointcloud_to_laserscan.dir/src/pointcloud_to_laserscan_node.cpp.o] Error 1
[6.101s] gmake[1]: *** [CMakeFiles/Makefile2:197: CMakeFiles/pointcloud_to_laserscan.dir/all] Error 2
[6.101s] gmake: *** [Makefile:146: all] Error 2
[6.103s] Invoked command in '/home/firmament/codes/24navigation/build/pointcloud_to_laserscan' returned '2': CMAKE_PREFIX_PATH=${CMAKE_PREFIX_PATH}:/opt/ros/humble /usr/bin/cmake --build /home/firmament/codes/24navigation/build/pointcloud_to_laserscan -- -j8 -l8