From a195c61599e52b98b30502525f2e5c2e027077a4 Mon Sep 17 00:00:00 2001 From: Mike Purvis Date: Wed, 4 Feb 2015 23:53:14 -0500 Subject: [PATCH] Remove extraneous comments, add wiki link to readme. --- CMakeLists.txt | 126 ++++--------------------------------------------- README.rst | 4 +- package.xml | 38 --------------- 3 files changed, 11 insertions(+), 157 deletions(-) diff --git a/CMakeLists.txt b/CMakeLists.txt index d8212d9..40e634a 100644 --- a/CMakeLists.txt +++ b/CMakeLists.txt @@ -1,127 +1,17 @@ cmake_minimum_required(VERSION 2.8.3) project(nmea_msgs) -## Find catkin macros and libraries -## if COMPONENTS list like find_package(catkin REQUIRED COMPONENTS xyz) -## is used, also find other catkin packages find_package(catkin REQUIRED COMPONENTS std_msgs message_generation) -## System dependencies are found with CMake's conventions -# find_package(Boost REQUIRED COMPONENTS system) - - -## Uncomment this if the package has a setup.py. This macro ensures -## modules and global scripts declared therein get installed -## See http://ros.org/doc/api/catkin/html/user_guide/setup_dot_py.html -# catkin_python_setup() - -####################################### -## Declare ROS messages and services ## -####################################### - -# Generate messages in the 'msg' folder - add_message_files( - DIRECTORY msg - FILES - Sentence.msg - ) - -## Generate services in the 'srv' folder -# add_service_files( -# FILES -# Service1.srv -# Service2.srv -# ) - -# Generate added messages and services with any dependencies listed here - generate_messages( - DEPENDENCIES - std_msgs - ) - -################################### -## catkin specific configuration ## -################################### -## The catkin_package macro generates cmake config files for your package -## Declare things to be passed to dependent projects -## INCLUDE_DIRS: uncomment this if you package contains header files -## LIBRARIES: libraries you create in this project that dependent projects also need -## CATKIN_DEPENDS: catkin_packages dependent projects also need -## DEPENDS: system dependencies of this project that dependent projects also need -catkin_package( CATKIN_DEPENDS std_msgs message_runtime ) - -########### -## Build ## -########### - -## Specify additional locations of header files -## Your package locations should be listed before other locations -# include_directories(include) -include_directories( - ${catkin_INCLUDE_DIRS} +add_message_files( + FILES + Sentence.msg ) -## Declare a cpp library -# add_library(nmea_msgs -# src/${PROJECT_NAME}/nmea_msgs.cpp -# ) - -## Declare a cpp executable -# add_executable(nmea_msgs_node src/nmea_msgs_node.cpp) - -## Add cmake target dependencies of the executable/library -## as an example, message headers may need to be generated before nodes -# add_dependencies(nmea_msgs_node nmea_msgs_generate_messages_cpp) - -## Specify libraries to link a library or executable target against -# target_link_libraries(nmea_msgs_node -# ${catkin_LIBRARIES} -# ) - -############# -## Install ## -############# - -# all install targets should use catkin DESTINATION variables -# See http://ros.org/doc/api/catkin/html/adv_user_guide/variables.html - -## Mark executable scripts (Python etc.) for installation -## in contrast to setup.py, you can choose the destination -# install(PROGRAMS -# scripts/my_python_script -# DESTINATION ${CATKIN_PACKAGE_BIN_DESTINATION} -# ) - -## Mark executables and/or libraries for installation -# install(TARGETS nmea_msgs nmea_msgs_node -# ARCHIVE DESTINATION ${CATKIN_PACKAGE_LIB_DESTINATION} -# LIBRARY DESTINATION ${CATKIN_PACKAGE_LIB_DESTINATION} -# RUNTIME DESTINATION ${CATKIN_PACKAGE_BIN_DESTINATION} -# ) - -## Mark cpp header files for installation -# install(DIRECTORY include/${PROJECT_NAME}/ -# DESTINATION ${CATKIN_PACKAGE_INCLUDE_DESTINATION} -# FILES_MATCHING PATTERN "*.h" -# PATTERN ".svn" EXCLUDE -# ) - -## Mark other files for installation (e.g. launch and bag files, etc.) -# install(FILES -# # myfile1 -# # myfile2 -# DESTINATION ${CATKIN_PACKAGE_SHARE_DESTINATION} -# ) - -############# -## Testing ## -############# +generate_messages( + DEPENDENCIES + std_msgs +) -## Add gtest based cpp test target and link libraries -# catkin_add_gtest(${PROJECT_NAME}-test test/test_nmea_msgs.cpp) -# if(TARGET ${PROJECT_NAME}-test) -# target_link_libraries(${PROJECT_NAME}-test ${PROJECT_NAME}) -# endif() +catkin_package(CATKIN_DEPENDS std_msgs message_runtime) -## Add folders to be run by python nosetests -# catkin_add_nosetests(test) diff --git a/README.rst b/README.rst index 08257a1..1e896af 100644 --- a/README.rst +++ b/README.rst @@ -1,4 +1,6 @@ nmea_msgs -=============== +========= This package contains message definitions for working with NMEA data. + +Please see the ROS Wiki: http://wiki.ros.org/nmea_msgs diff --git a/package.xml b/package.xml index b793911..f837e6d 100644 --- a/package.xml +++ b/package.xml @@ -3,55 +3,17 @@ nmea_msgs 0.1.0 The nmea_msgs package contains messages related to data in the NMEA format. - - - - Eric Perko - - - - - BSD - - - - - http://ros.org/wiki/nmea_msgs - - - - - Eric Perko - - - - - - - - - - - - catkin std_msgs message_generation std_msgs message_runtime - - - - - - -