Sourced Gazebo ROS pkg cannot compile
Hello,
I am currently using Gazebo 1.9.3. I am trying to install the gazebo ros packages via source. I followed the tutorial for the ros hydro version (http://gazebosim.org/wiki/Tutorials/1.9/InstallinggazeborosPackages#Installgazeborospkgs).
When I get to building the gazebo ros package I get a error:
[100%] Building CXX object gazeborospkgs/gazeboroscontrol/CMakeFiles/gazeboroscontrol.dir/src/gazeboroscontrolplugin.cpp.o /home/code8200/catkinws/src/gazeborospkgs/gazeboroscontrol/src/defaultrobothwsim.cpp:471:3: error: ‘PositionJointSaturationInterface’ in namespace ‘jointlimitsinterface’ does not name a type /home/code8200/catkinws/src/gazeborospkgs/gazeboroscontrol/src/defaultrobothwsim.cpp:474:3: error: ‘VelocityJointSoftLimitsInterface’ in namespace ‘jointlimitsinterface’ does not name a type /home/code8200/catkinws/src/gazeborospkgs/gazeboroscontrol/src/defaultrobothwsim.cpp: In member function ‘virtual void gazeboroscontrol::DefaultRobotHWSim::writeSim(ros::Time, ros::Duration)’: /home/code8200/catkinws/src/gazeborospkgs/gazeboroscontrol/src/defaultrobothwsim.cpp:274:5: error: ‘pjsatinterface’ was not declared in this scope /home/code8200/catkinws/src/gazeborospkgs/gazeboroscontrol/src/defaultrobothwsim.cpp:277:5: error: ‘vjlimitsinterface’ was not declared in this scope /home/code8200/catkinws/src/gazeborospkgs/gazeboroscontrol/src/defaultrobothwsim.cpp: In member function ‘void gazeboroscontrol::DefaultRobotHWSim::registerJointLimits(const string&, const hardwareinterface::JointHandle&, gazeboroscontrol::DefaultRobotHWSim::ControlMethod, const ros::NodeHandle&, const urdf::Model, int, double, double, double)’: /home/code8200/catkin_ws/src/gazebo_ros_pkgs/gazebo_ros_control/src/default_robot_hw_sim.cpp:426:19: error: ‘VelocityJointSoftLimitsHandle’ in namespace ‘joint_limits_interface’ does not name a type /home/code8200/catkin_ws/src/gazebo_ros_pkgs/gazebo_ros_control/src/default_robot_hw_sim.cpp:428:13: error: ‘vj_limits_interface_’ was not declared in this scope /home/code8200/catkin_ws/src/gazebo_ros_pkgs/gazebo_ros_control/src/default_robot_hw_sim.cpp:428:49: error: ‘limits_handle’ was not declared in this scope /home/code8200/catkin_ws/src/gazebo_ros_pkgs/gazebo_ros_control/src/default_robot_hw_sim.cpp:446:19: error: ‘PositionJointSaturationHandle’ in namespace ‘joint_limits_interface’ does not name a type /home/code8200/catkin_ws/src/gazebo_ros_pkgs/gazebo_ros_control/src/default_robot_hw_sim.cpp:448:13: error: ‘pj_sat_interface_’ was not declared in this scope /home/code8200/catkin_ws/src/gazebo_ros_pkgs/gazebo_ros_control/src/default_robot_hw_sim.cpp:448:46: error: ‘sat_handle’ was not declared in this scope make[2]: [gazeborospkgs/gazeboroscontrol/CMakeFiles/defaultrobothwsim.dir/src/defaultrobothwsim.cpp.o] Error 1 make[1]: [gazebo_ros_pkgs/gazebo_ros_control/CMakeFiles/default_robot_hw_sim.dir/all] Error 2 make[1]: Waiting for unfinished jobs.... Linking CXX shared library /home/code8200/catkinws/devel/lib/libgazeboroscontrol.so [100%] Built target gazeboros_control make: * [all] Error 2 Invoking "make" failed
From what I can see the problem is that there are files missing from which this gazebo package expects to do something with. I checked to see if all my ros depencies where covered for this package and the rosdep ...