ros-drivers/ros2_ouster_drivers

ROS2 Galactic Desktop driver installation error

TZECHIN6 opened this issue · 2 comments

Environment setup:

  • Jetson Xavier
  • JetPack 5.0.2 (ubuntu 20.04)
  • ROS2 Galactic Desktop (pull from dustynv's repo)

To reproduce the error:

  1. git clone this repo with -b galactic
  2. cd ros2_ouster_drivers
  3. colcon build
--- stderr: ros2_ouster                                          
CMake Warning (dev) at /usr/share/cmake-3.24/Modules/FindPackageHandleStandardArgs.cmake:438 (message):
  The package name passed to `find_package_handle_standard_args` (PCL_COMMON)
  does not match the name of the calling package (PCL).  This can lead to
  problems in calling code that expects `find_package` result variables
  (e.g., `_FOUND`) to follow a certain pattern.
Call Stack (most recent call first):
  /usr/lib/aarch64-linux-gnu/cmake/pcl/PCLConfig.cmake:616 (find_package_handle_standard_args)
  CMakeLists.txt:17 (find_package)
This warning is for project developers.  Use -Wno-dev to suppress it.

/tmp/ros2_ws/ros2_ouster_drivers/ros2_ouster/src/ouster_driver.cpp: In constructor ‘ros2_ouster::OusterDriver::OusterDriver(std::unique_ptr<ros2_ouster::SensorInterface>, const rclcpp::NodeOptions&)’:
/tmp/ros2_ws/ros2_ouster_drivers/ros2_ouster/src/ouster_driver.cpp:41:37: warning: ‘const rclcpp::ParameterValue& rclcpp_lifecycle::LifecycleNode::declare_parameter(const string&)’ is deprecated: declare_parameter() with only a name is deprecated and will be deleted in the future.\nIf you want to declare a parameter that won't change type without a default value use:\n`node->declare_parameter<ParameterT>(name)`, where e.g. ParameterT=int64_t.\n\nIf you want to declare a parameter that can dynamically change type use:\n```\nrcl_interfaces::msg::ParameterDescriptor descriptor;\ndescriptor.dynamic_typing = true;\nnode->declare_parameter(name, rclcpp::ParameterValue{}, descriptor);\n``` [-Wdeprecated-declarations]
   41 |   this->declare_parameter("lidar_ip");
      |                                     ^
In file included from /tmp/ros2_ws/ros2_ouster_drivers/ros2_ouster/include/ros2_ouster/interfaces/lifecycle_interface.hpp:20,
                 from /tmp/ros2_ws/ros2_ouster_drivers/ros2_ouster/src/ouster_driver.cpp:22:
/opt/ros/galactic/install/include/rclcpp_lifecycle/lifecycle_node.hpp:369:3: note: declared here
  369 |   declare_parameter(const std::string & name);
      |   ^~~~~~~~~~~~~~~~~
/tmp/ros2_ws/ros2_ouster_drivers/ros2_ouster/src/ouster_driver.cpp:42:40: warning: ‘const rclcpp::ParameterValue& rclcpp_lifecycle::LifecycleNode::declare_parameter(const string&)’ is deprecated: declare_parameter() with only a name is deprecated and will be deleted in the future.\nIf you want to declare a parameter that won't change type without a default value use:\n`node->declare_parameter<ParameterT>(name)`, where e.g. ParameterT=int64_t.\n\nIf you want to declare a parameter that can dynamically change type use:\n```\nrcl_interfaces::msg::ParameterDescriptor descriptor;\ndescriptor.dynamic_typing = true;\nnode->declare_parameter(name, rclcpp::ParameterValue{}, descriptor);\n``` [-Wdeprecated-declarations]
   42 |   this->declare_parameter("computer_ip");
      |                                        ^
In file included from /tmp/ros2_ws/ros2_ouster_drivers/ros2_ouster/include/ros2_ouster/interfaces/lifecycle_interface.hpp:20,
                 from /tmp/ros2_ws/ros2_ouster_drivers/ros2_ouster/src/ouster_driver.cpp:22:
/opt/ros/galactic/install/include/rclcpp_lifecycle/lifecycle_node.hpp:369:3: note: declared here
  369 |   declare_parameter(const std::string & name);
      |   ^~~~~~~~~~~~~~~~~
---
Finished <<< ros2_ouster [1min 37s]

Summary: 2 packages finished [1min 56s]
  1 package had stderr output: ros2_ouster

Sorry I am not so familiarize with the build procedure, could some one help on this? Great appreciate.

Finished <<< ros2_ouster [1min 37s]

Summary: 2 packages finished [1min 56s]
1 package had stderr output: ros2_ouster

Does this mean the installation is fine? those are just the warning nor error... Thanks!

Latest PR resolves