24navigation/log/build_2024-03-13_21-28-28/pointcloud_to_laserscan/stderr.log

6.3 KiB
Raw Blame History

/home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp: In constructor pointcloud_to_laserscan::PointCloudToLaserScanNode::PointCloudToLaserScanNode(const rclcpp::NodeOptions&):
/home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:86:11: error: class tf2_ros::Buffer has no member named setTransformTolerance
86 | tf2_->setTransformTolerance(tf2::Duration::fromSec(tolerance_))
| ^~~~~~~~~~~~~~~~~~~~~
/home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:86:48: error: fromSec is not a member of tf2::Duration {aka std::chrono::duration<long int, std::ratio<1, 1000000000> >}
86 | tf2_->setTransformTolerance(tf2::Duration::fromSec(tolerance_))
| ^~~~~~~
/home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:90:35: error: timer_interface was not declared in this scope
90 | tf2_->setCreateTimerInterface(timer_interface);
| ^~~~~~~~~~~~~~~
/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):
/home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:183:60: error: no matching function for call to tf2_ros::Buffer::getLatestCommonTime(std::string&, const _frame_id_type&)
183 | tf2::TimePoint transform_time = tf2_->getLatestCommonTime(target_frame_,cloud_msg->header.frame_id);
| ~~~~~~~~~~~~~~~~~~~~~~~~~^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~
In file included from /opt/ros/humble/include/tf2_ros/tf2_ros/async_buffer_interface.h:39,
from /opt/ros/humble/include/tf2_ros/tf2_ros/buffer.h:41,
from /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/include/pointcloud_to_laserscan/pointcloud_to_laserscan_node.hpp:50,
from /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:41:
/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
422 | tf2::TF2Error getLatestCommonTime(
| ^~~~~~~~~~~~~~~~~~~
/opt/ros/humble/include/tf2/tf2/buffer_core.h:422:17: note: candidate expects 4 arguments, 2 provided
/home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:184:38: error: no matching function for call to toMsg(tf2::TimePoint&)
184 | scan_msg->header.stamp = tf2::toMsg(transform_time);
| ~~~~~~~~~~^~~~~~~~~~~~~~~~
In file included from /opt/ros/humble/include/tf2_ros/tf2_ros/buffer_interface.h:43,
from /opt/ros/humble/include/tf2_ros/tf2_ros/buffer.h:42,
from /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/include/pointcloud_to_laserscan/pointcloud_to_laserscan_node.hpp:50,
from /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:41:
/opt/ros/humble/include/tf2/tf2/convert.h:129:3: note: candidate: template<class A, class B> B tf2::toMsg(const A&)
129 | B toMsg(const A & a);
| ^~~~~
/opt/ros/humble/include/tf2/tf2/convert.h:129:3: note: template argument deduction/substitution failed:
/home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:184:38: note: couldnt deduce template parameter B
184 | scan_msg->header.stamp = tf2::toMsg(transform_time);
| ~~~~~~~~~~^~~~~~~~~~~~~~~~
In file included from /home/firmament/codes/24navigation/src/pointcloud_to_laserscan/src/pointcloud_to_laserscan_node.cpp:52:
/opt/ros/humble/include/tf2_sensor_msgs/tf2_sensor_msgs.hpp:119:31: note: candidate: sensor_msgs::msg::PointCloud2 tf2::toMsg(const PointCloud2&)
119 | sensor_msgs::msg::PointCloud2 toMsg(const sensor_msgs::msg::PointCloud2 & in)
| ^~~~~
/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> >&}
119 | _msgs::msg::PointCloud2 toMsg(const sensor_msgs::msg::PointCloud2 & in)
| ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~^~
 
gmake[2]: *** [CMakeFiles/pointcloud_to_laserscan.dir/build.make:76: CMakeFiles/pointcloud_to_laserscan.dir/src/pointcloud_to_laserscan_node.cpp.o] Error 1
gmake[1]: *** [CMakeFiles/Makefile2:197: CMakeFiles/pointcloud_to_laserscan.dir/all] Error 2
gmake: *** [Makefile:146: all] Error 2