ros-perception / ar_track_alvar

AR tag tracking library for ROS
www.ros.org/wiki/ar_track_alvar
141 stars 129 forks source link

Branch Ros2 cannot be compiled in Humble #96

Closed RobinHeitz closed 1 year ago

RobinHeitz commented 1 year ago

Well, as the issue mentions it's currently not build-able in ros2.

CMake Error at CMakeLists.txt:9 (find_package):
  By not providing "Findcatkin.cmake" in CMAKE_MODULE_PATH this project has
  asked CMake to find a package configuration file provided by "catkin", but
  CMake did not find one.

  Could not find a package configuration file provided by "catkin" with any
  of the following names:

    catkinConfig.cmake
    catkin-config.cmake

  Add the installation prefix of "catkin" to CMAKE_PREFIX_PATH or set
  "catkin_DIR" to a directory containing one of the above files.  If "catkin"
  provides a separate development package or SDK, be sure it has been
  installed.

I'm new to ros2, seems for me that the packages are still for ros1?

Robin

RobinHeitz commented 1 year ago

I created a new ament_cmake package and copied the msg definition files in there. After changing Header header to std_msgs/Header header it can compile. At least ar_track_alvar_msgs.

I'm trying to convert ar_track_alvar too now - seems a lot harder.

RobinHeitz commented 1 year ago

Did not found a solution, but using another package which does basically the same: aruco_ros (can be installed as binary).