Skip to content

Commit

Permalink
Removed include dir from cmake
Browse files Browse the repository at this point in the history
  • Loading branch information
pooyanjamshidi committed Apr 18, 2018
1 parent eb11d79 commit c4a9540
Show file tree
Hide file tree
Showing 2 changed files with 1 addition and 2 deletions.
1 change: 0 additions & 1 deletion CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -128,7 +128,6 @@ generate_messages(
## CATKIN_DEPENDS: catkin_packages dependent projects also need
## DEPENDS: system dependencies of this project that dependent projects also need
catkin_package(
INCLUDE_DIRS include
LIBRARIES brass_gazebo_config_manager
CATKIN_DEPENDS gazebo_plugins roscpp roslib rospy std_msgs
)
Expand Down
2 changes: 1 addition & 1 deletion src/config_plugin.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -44,7 +44,7 @@ private: const char * home = getenv("HOME");

// check if the ros is up!
if (!ros::isInitialized()){
ROS_RED_STREAM("Initializing ROS.");
ROS_RED_STREAM("Initializing ROS...");
int argc = 0;
char **argv = NULL;
ros::init(argc, argv, _sdf->Get<std::string>("ros_node"), ros::init_options::NoSigintHandler);
Expand Down

0 comments on commit c4a9540

Please sign in to comment.