Gazebo | Ignition | Community
Ask Your Question
0

Error building gazebo ros Packages 1.9 from source in Groovy

asked 2014-06-24 04:45:51 -0500

elias gravatar image

updated 2014-06-25 19:43:08 -0500

scpeters gravatar image

On the way to control a PR2 Robot with MoveIt! in Gazebo im following this guide. Due to various reasons Ubuntu Precise with Groovy seems to be the right match for this mission.

In point 6 (Installing GazeboRosPackages) it is recommended to install the Gazebo ros packages. I followed the guide up to 7.2.3 building the gazeborospkgs for Groovy from source as there is no precompiled package for Groovy.

Catkin_make'ing I ran in a couple of issues of missing packages I was able to solve by myself. Unfortunately I now got stuck and don't know where to find a solution. To be honest, I don't understand the cause of the error.

Here is the command line output below. I verified all the mentioned .so-files are present where they belong. Any help is highly appreciated. Thanks!


`elias@Precise-Zeus:~/catkin_ws$ catkin\_make

[...]

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins

In file included from /home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins
src/gazebo_ros_hand_of_god.cpp:43:0:

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/include/gazebo_plugins/gazebo_ros_hand_of_god.h:60:30: error: ‘tf2_ros’ was not declared in this scope

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/include/gazebo_plugins/gazebo_ros_hand_of_god.h:60:45: error: template argument 1 is invalid

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/include/gazebo_plugins/gazebo_ros_hand_of_god.h:61:30: error: ‘tf2_ros’ was not declared in this scope

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/include/gazebo_plugins/gazebo_ros_hand_of_god.h:61:56: error: template argument 1 is invalid

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/include/gazebo_plugins/gazebo_ros_hand_of_god.h:62:30: error: ‘tf2_ros’ was not declared in this scope

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/include/gazebo_plugins/gazebo_ros_hand_of_god.h:62:59: error: template argument 1 is invalid

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/src/gazebo_ros_hand_of_god.cpp: In member function ‘virtual void gazebo::GazeboRosHandOfGod::Load(gazebo::physics::ModelPtr, sdf::ElementPtr)’:

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/src/gazebo_ros_hand_of_god.cpp:123:16: error: request for member ‘reset’ in ‘((gazebo::GazeboRosHandOfGod*)this)->gazebo::GazeboRosHandOfGod::tf_buffer_’, which is of non-class type ‘int’

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/src/gazebo_ros_hand_of_god.cpp:123:26: error: expected type-specifier before ‘tf2_ros’

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/src/gazebo_ros_hand_of_god.cpp:123:26: error: expected ‘)’ before ‘tf2_ros’

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/src/gazebo_ros_hand_of_god.cpp:124:18: error: request for member ‘reset’ in ‘((gazebo::GazeboRosHandOfGod*)this)->gazebo::GazeboRosHandOfGod::tf_listener_’, which is of non-class type ‘int’

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/src/gazebo_ros_hand_of_god.cpp:124:28: error: expected type-specifier before ‘tf2_ros’

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/src/gazebo_ros_hand_of_god.cpp:124:28: error: expected ‘)’ before ‘tf2_ros’

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/src/gazebo_ros_hand_of_god.cpp:125:21: error: request for member ‘reset’ in ‘((gazebo::GazeboRosHandOfGod*)this)->gazebo::GazeboRosHandOfGod::tf_broadcaster_’, which is of non-class type ‘int’

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/src/gazebo_ros_hand_of_god.cpp:125:31: error: expected type-specifier before ‘tf2_ros’

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/src/gazebo_ros_hand_of_god.cpp:125:31: error: expected ‘)’ before ‘tf2_ros’

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/src/gazebo_ros_hand_of_god.cpp: In member function ‘virtual void gazebo::GazeboRosHandOfGod ...
(more)
edit retag flag offensive close merge delete

3 Answers

Sort by » oldest newest most voted
0

answered 2014-06-26 10:03:57 -0500

Hi,

which branch are you using? you should make shure that the branch cloned from github is groovy-devel! This should be the branch for groovy and it does not contain the plugin that throws the errors.

So when cloning the repos from github try to add -b groovy-devel

This might fix your problem...

I think the seperation of hydro-devel and groovy-devel branches started after this tutorial was written...

edit flag offensive delete link more

Comments

Thanks, that was very useful, now catkinmake reaches [100%] Built target gazeboros_bumper

elias gravatar imageelias ( 2014-07-01 04:10:14 -0500 )edit
0

answered 2014-12-18 13:46:25 -0500

RoboC gravatar image

I am experiencing the problem mentioned by elias

/home/a9658007/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/src/gazebo_ros_openni_kinect.cpp: In member function ‘bool 
gazebo::GazeboRosOpenniKinect::FillPointCloudHelper(sensor_msgs::PointCloud2&, uint32_t, uint32_t, uint32_t, void*)’:
/home/a9658007/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/src/gazebo_ros_openni_kinect.cpp:376:3: error: ‘toROSMsg’ is not a member of ‘pcl’
make[2]: *** [gazebo_ros_pkgs/gazebo_plugins/CMakeFiles/gazebo_ros_openni_kinect.dir/src/gazebo_ros_openni_kinect.cpp.o] Error 1
make[1]: *** [gazebo_ros_pkgs/gazebo_plugins/CMakeFiles/gazebo_ros_openni_kinect.dir/all] Error 2
make[1]: *** Waiting for unfinished jobs....
Linking CXX shared library /home/a9658007/catkin_ws/devel/lib/libgazebo_ros_p3d.so
[ 10%] Built target gazebo_ros_p3d
make: *** [all] Error 2
make: INTERNAL: Exiting with 5 jobserver tokens available; should be 4!

The tutorial mentioned in the question has been moved to http://gazebosim.org/tutorials?tut=rosinstalling&ver=1.9%2B&cat=connectros.

I changed the cloning from -b hydro-devel to -b groovy-devel and am still facing the same problem. Any other suggestions?

edit flag offensive delete link more
0

answered 2014-07-01 04:21:12 -0500

elias gravatar image

Even progress is shown I still have some problems:

I was able to clone

ros-simulation/gazebo_ros_pkgs.git
ros-controls/ros_control.git
ros-controls/ros_controllers.git

from the groovy-devel branch.

Unfortunately

ros-controls/control_toolbox.git
ros-controls/realtime_tools.git

are not available in the devel branch and so I cloned it the ordinary way.

As mentioned above, catkin_make reaches now 98% but there seems some problem in the point cloud and camera package:

home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/src/gazebo_ros_openni_kinect.cpp:376:3: error: ‘toROSMsg’ is not a member of ‘pcl’

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/src/gazebo_ros_depth_camera.cpp:277:7: error: ‘toROSMsg’ is not a member of ‘pcl’

/home/elias/catkin_ws/src/gazebo_ros_pkgs/gazebo_plugins/src/gazebo_ros_depth_camera.cpp:437:3: error: ‘toROSMsg’ is not a member of ‘pcl’

I googled the problem but couldn't find an useful solution.

Thanks for your help!

edit flag offensive delete link more
Login/Signup to Answer

Question Tools

1 follower

Stats

Asked: 2014-06-24 04:45:51 -0500

Seen: 656 times

Last updated: Dec 18 '14