Gazebo | Ignition | Community
Ask Your Question

RoboC's profile - activity

2015-04-06 00:01:38 -0500 received badge  Notable Question (source)
2015-04-06 00:01:38 -0500 received badge  Popular Question (source)
2015-04-06 00:01:38 -0500 received badge  Famous Question (source)
2014-12-19 06:22:01 -0500 received badge  Editor (source)
2014-12-19 05:35:49 -0500 asked a question openni kinect causing source build error in Gazebo 1.9 with Groovy ROS

I am building Gazebo 1.9 with Groovy ROS. I followed the instructions pertaining to Hydro source installation here.

I changed git clone https://github.com/ros-simulation/gazebo_ros_pkgs.git -b hydro-devel to git clone https://github.com/ros-simulation/gazebo_ros_pkgs.git -b groovy-devel.

The rosdep check was ok saying that all dependencies are met. When I run catkin_make to build the pacakages this errors keep appearing:

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

Can anyone provide a solution?

2014-12-18 13:46:25 -0500 answered a question Error building gazebo ros Packages 1.9 from source in Groovy

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?