diff --git a/CMakeLists.txt b/CMakeLists.txt index d172173..3f67fbb 100644 --- a/CMakeLists.txt +++ b/CMakeLists.txt @@ -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 ) diff --git a/src/config_plugin.cpp b/src/config_plugin.cpp index 7666f0f..3aa341d 100644 --- a/src/config_plugin.cpp +++ b/src/config_plugin.cpp @@ -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("ros_node"), ros::init_options::NoSigintHandler);