Closed VictorLamoine closed 7 years ago
Seems like it is just a build order problem. Message is being generated after trying to compile robot_status.cpp
.
If I run catkin build
and then run the tests it goes fine.
In any case this should not happen.
Perhaps something changed in Kinetic, or catkin_tools
. simple_message/CMakeLists.txt does declare the dependency on industrial_msgs
.
I can't find what's wrong.
$ catkin --version
catkin_tools 0.4.3 (C) 2014-2017 Open Source Robotics Foundation
catkin_tools is released under the Apache License, Version 2.0 (http://www.apache.org/licenses/LICENSE-2.0)
---
Using Python 2.7.12 (default, Nov 19 2016, 06:48:10) [GCC 5.4.0 20160609]
gcc version 6.2.0 20160901 (Ubuntu 6.2.0-3ubuntu11~16.04)
@VictorLamoine: I'm going to chalk this one up to catkin_tools
doing weird things sometime and close the issue.
industrial_msgs_EXPORTED_TARGETS
does actually contain all the necessary targets:
industrial_msgs_generate_messages_cpp;industrial_msgs_generate_messages_lisp;industrial_msgs_generate_messages_py;std_msgs_generate_messages_cpp;std_msgs_generate_messages_lisp;std_msgs_generate_messages_py;trajectory_msgs_generate_messages_cpp;trajectory_msgs_generate_messages_lisp;trajectory_msgs_generate_messages_py;std_msgs_generate_messages_cpp;std_msgs_generate_messages_lisp;std_msgs_generate_messages_py;geometry_msgs_generate_messages_cpp;geometry_msgs_generate_messages_lisp;geometry_msgs_generate_messages_py;std_msgs_generate_messages_cpp;std_msgs_generate_messages_lisp;std_msgs_generate_messages_py
I agree with you that using run_tests
directly should result in catkin
first building all pkgs in the correct order though.
It would seem this is a catkin_tools
issue and not with this package.
I tested again and I cannot reproduce the issue so it's fine that you closed it.
Create a workspace:
Run tests with catkin tools:
Errors:
See here for an example build: https://gitlab.com/InstitutMaupertuis/ros_additive_manufacturing/builds/10605384