Skip to content

Commit

Permalink
Reorganize test directory and split CMakeLists.txt (#1173) (#1262)
Browse files Browse the repository at this point in the history
Signed-off-by: Stephen Brawner <brawner@gmail.com>
  • Loading branch information
brawner committed Aug 19, 2020
1 parent 75f3d54 commit 8bfc8e6
Show file tree
Hide file tree
Showing 53 changed files with 441 additions and 439 deletions.
434 changes: 1 addition & 433 deletions rclcpp/CMakeLists.txt

Large diffs are not rendered by default.

434 changes: 434 additions & 0 deletions rclcpp/test/CMakeLists.txt

Large diffs are not rendered by default.

Original file line number Diff line number Diff line change
Expand Up @@ -12,8 +12,8 @@
// See the License for the specific language governing permissions and
// limitations under the License.

#ifndef NODE_INTERFACES__NODE_WRAPPER_HPP_
#define NODE_INTERFACES__NODE_WRAPPER_HPP_
#ifndef RCLCPP__NODE_INTERFACES__NODE_WRAPPER_HPP_
#define RCLCPP__NODE_INTERFACES__NODE_WRAPPER_HPP_

#include <memory>
#include <string>
Expand Down Expand Up @@ -61,4 +61,4 @@ class NodeWrapper
rclcpp::Node::SharedPtr node;
};

#endif // NODE_INTERFACES__NODE_WRAPPER_HPP_
#endif // RCLCPP__NODE_INTERFACES__NODE_WRAPPER_HPP_
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
File renamed without changes.
Original file line number Diff line number Diff line change
Expand Up @@ -22,8 +22,8 @@

#include "statistics_msgs/msg/metrics_message.hpp"

#ifndef TOPIC_STATISTICS__TEST_TOPIC_STATS_UTILS_HPP_
#define TOPIC_STATISTICS__TEST_TOPIC_STATS_UTILS_HPP_
#ifndef RCLCPP__TOPIC_STATISTICS__TEST_TOPIC_STATS_UTILS_HPP_
#define RCLCPP__TOPIC_STATISTICS__TEST_TOPIC_STATS_UTILS_HPP_

namespace rclcpp
{
Expand Down Expand Up @@ -149,4 +149,4 @@ class MetricsMessageSubscriber : public rclcpp::Node, public PromiseSetter
} // namespace topic_statistics
} // namespace rclcpp

#endif // TOPIC_STATISTICS__TEST_TOPIC_STATS_UTILS_HPP_
#endif // RCLCPP__TOPIC_STATISTICS__TEST_TOPIC_STATS_UTILS_HPP_

0 comments on commit 8bfc8e6

Please sign in to comment.