ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange
Ask Your Question
0

Buildfarm failures for Kinetic "move_base_to_manip"

asked 2017-03-06 09:05:20 -0500

AndyZe gravatar image

updated 2017-03-06 10:52:39 -0500

gvdhoorn gravatar image

I'd appreciate some help clearing up these build failures (click on Jenkins jobs (13)). I hate to be the cause of multiple failures. The buildfarm output with some numbered error messages follows. I'm confused about multiple things:


Message 1

/opt/ros/kinetic/include/moveit/robot_model_loader/robot_model_loader.h: In member function ‘const ModelSharedPtr& robot_model_loader::RobotModelLoader::getSRDF() const’:
/opt/ros/kinetic/include/moveit/robot_model_loader/robot_model_loader.h:120:12: error: ‘rdf_loader_’ was not declared in this scope
     return rdf_loader_->getSRDF();

Message 2

In file included from /tmp/binarydeb/ros-kinetic-move-base-to-manip-1.0.6/src/move_base_to_manip.cpp:4:0:
/tmp/binarydeb/ros-kinetic-move-base-to-manip-1.0.6/include/move_base_to_manip.h: At global scope:
/tmp/binarydeb/ros-kinetic-move-base-to-manip-1.0.6/include/move_base_to_manip.h:13:195: warning: ‘MoveGroup’ is deprecated [-Wdeprecated-declarations]
   const double cartesian_motion(const std::vector<geometry_msgs::Pose>& waypoints, moveit_msgs::RobotTrajectory& trajectory, moveit::planning_interface::MoveGroup& moveGroup, ros::NodeHandle& nh);

Message 3

In file included from /tmp/binarydeb/ros-kinetic-move-base-to-manip-1.0.6/include/move_base_to_manip.h:7:0,
                 from /tmp/binarydeb/ros-kinetic-move-base-to-manip-1.0.6/src/move_base_to_manip.cpp:4:
/opt/ros/kinetic/include/moveit/move_group_interface/move_group.h:56:7: note: declared here
 class MoveGroup : public MoveGroupInterface

Message 4

/tmp/binarydeb/ros-kinetic-move-base-to-manip-1.0.6/src/move_base_to_manip.cpp:87:213: warning: ‘MoveGroup’ is deprecated [-Wdeprecated-declarations]
 const double move_base_to_manip::cartesian_motion(const std::vector<geometry_msgs::Pose>& waypoints, moveit_msgs::RobotTrajectory& trajectory, moveit::planning_interface::MoveGroup& moveGroup, ros::NodeHandle &nh)

Message 5

In file included from /tmp/binarydeb/ros-kinetic-move-base-to-manip-1.0.6/include/move_base_to_manip.h:7:0,
                 from /tmp/binarydeb/ros-kinetic-move-base-to-manip-1.0.6/src/move_base_to_manip.cpp:4:
/opt/ros/kinetic/include/moveit/move_group_interface/move_group.h:56:7: note: declared here
 class MoveGroup : public MoveGroupInterface

Message 6

/tmp/binarydeb/ros-kinetic-move-base-to-manip-1.0.6/src/move_base_to_manip.cpp: In function ‘int main(int, char**)’:
/tmp/binarydeb/ros-kinetic-move-base-to-manip-1.0.6/src/move_base_to_manip.cpp:111:68: warning: ‘MoveGroup’ is deprecated [-Wdeprecated-declarations]
   moveit::planning_interface::MoveGroup moveGroup( move_group_name );

Message 7

In file included from /tmp/binarydeb/ros-kinetic-move-base-to-manip-1.0.6/include/move_base_to_manip.h:7:0,
                 from /tmp/binarydeb/ros-kinetic-move-base-to-manip-1.0.6/src/move_base_to_manip.cpp:4:
/opt/ros/kinetic/include/moveit/move_group_interface/move_group.h:56:7: note: declared here
 class MoveGroup : public MoveGroupInterface

Message 8

/tmp/binarydeb/ros-kinetic-move-base-to-manip-1.0.6/src/move_base_to_manip.cpp: In function ‘const double move_base_to_manip::cartesian_motion(const std::vector<geometry_msgs::Pose_<std::allocator<void> > >&, moveit_msgs::RobotTrajectory&, moveit::planning_interface::MoveGroup&, ros::NodeHandle&)’:
/tmp/binarydeb/ros-kinetic-move-base-to-manip-1.0.6/src/move_base_to_manip.cpp:92:45: warning: ignoring return value of ‘int system(const char*)’, declared with attribute warn_unused_result [-Wunused-result]
     system("rosservice call /clear_octomap");
edit retag flag offensive close merge delete

2 Answers

Sort by » oldest newest most voted
0

answered 2017-03-06 14:18:46 -0500

AndyZe gravatar image

updated 2017-03-06 14:38:25 -0500

Dirk Thomas gravatar image

DT helped me figure out how to handle the splitting of a branch. The devel_branch parameter in tracks.yaml of the release repo needs to be updated from e.g. 'null' to 'indigo'.

Now there's just that move_group error to figure out...

edit flag offensive delete link more

Comments

1

Can you please clarify which message # is still unclear.

Dirk Thomas gravatar image Dirk Thomas  ( 2017-03-06 14:40:29 -0500 )edit

Message #1

AndyZe gravatar image AndyZe  ( 2017-03-06 15:59:56 -0500 )edit
1

The error happens when your code includes robot_model_loader.h. The upstream code looks good. So it might be related to the code using it. Have you successfully build the same code locally? Can you post more context around the error message? Can you link to the failing job?

Dirk Thomas gravatar image Dirk Thomas  ( 2017-03-06 16:26:43 -0500 )edit

Yes, I did build it locally with catkin_make & catkin build. And it builds even with "robot_model_loader.h" commented. Hmm.. well, problem solved. I will just remove that header.

AndyZe gravatar image AndyZe  ( 2017-03-08 10:06:44 -0500 )edit
0

answered 2017-03-06 09:12:04 -0500

AndyZe gravatar image

updated 2017-03-08 10:09:01 -0500

Actually I think I can answer much of my own question. The rosdistro version is outdated by a few tags:

release:
  tags:
    release: release/kinetic/{package}/{version}
  url: https://github.com/UTNuclearRoboticsPublic/move_base_to_manip-release.git
  version: 1.0.6-2  (<-- should be 1.0.9-0)

But I'm still confused about Message #1.

edit flag offensive delete link more

Comments

1

The version element is typically handled by Bloom. Is there something going wrong in your release process?

gvdhoorn gravatar image gvdhoorn  ( 2017-03-06 11:00:41 -0500 )edit

I think Bloom's version counter was screwed up after I split into two branches (Indigo and Kinetic).

AndyZe gravatar image AndyZe  ( 2017-03-06 11:57:28 -0500 )edit

Question Tools

1 follower

Stats

Asked: 2017-03-06 09:05:20 -0500

Seen: 211 times

Last updated: Mar 08 '17