Skip to content

Commit

Permalink
Add missing header guards
Browse files Browse the repository at this point in the history
  • Loading branch information
matthew-reynolds authored and bmagyar committed Apr 9, 2020
1 parent 41e57da commit 7f83db8
Show file tree
Hide file tree
Showing 9 changed files with 29 additions and 4 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -36,6 +36,9 @@
* Author: Masaru Morita, Bence Magyar, Enrique Fernández
*/

#pragma once


#include <ackermann_steering_controller/odometry.h>
#include <controller_interface/controller.h>
#include <controller_interface/multi_interface_controller.h>
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -29,6 +29,9 @@

// NOTE: The contents of this file have been taken largely from the ros_control wiki tutorials

#pragma once


// ROS
#include <ros/ros.h>
#include <std_msgs/Float64.h>
Expand Down Expand Up @@ -197,7 +200,7 @@ class AckermannSteeringBot : public hardware_interface::RobotHW
}

private:

void cleanUp()
{
// wheel
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -28,6 +28,9 @@
/// \author Bence Magyar
/// \author Masaru Morita

#pragma once


#include <algorithm>
#include <cmath>
#include <mutex>
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -36,6 +36,9 @@
* Author: Bence Magyar, Enrique Fernández
*/

#pragma once


#include <control_msgs/JointTrajectoryControllerState.h>
#include <controller_interface/controller.h>
#include <diff_drive_controller/DiffDriveControllerConfig.h>
Expand Down Expand Up @@ -231,7 +234,7 @@ namespace diff_drive_controller{

/// Dynamic Reconfigure server
typedef dynamic_reconfigure::Server<DiffDriveControllerConfig> ReconfigureServer;

std::shared_ptr<ReconfigureServer> dyn_reconf_server_;

private:
Expand Down
3 changes: 3 additions & 0 deletions diff_drive_controller/test/diffbot.h
Original file line number Diff line number Diff line change
Expand Up @@ -27,6 +27,9 @@

// NOTE: The contents of this file have been taken largely from the ros_control wiki tutorials

#pragma once


// ROS
#include <ros/ros.h>
#include <std_msgs/Float64.h>
Expand Down
4 changes: 3 additions & 1 deletion diff_drive_controller/test/test_common.h
Original file line number Diff line number Diff line change
Expand Up @@ -27,6 +27,9 @@

/// \author Bence Magyar

#pragma once


#include <cmath>

#include <gtest/gtest.h>
Expand Down Expand Up @@ -157,4 +160,3 @@ inline tf::Quaternion tfQuatFromGeomQuat(const geometry_msgs::Quaternion& quat)
{
return tf::Quaternion(quat.x, quat.y, quat.z, quat.w);
}

Original file line number Diff line number Diff line change
Expand Up @@ -33,6 +33,9 @@
* POSSIBILITY OF SUCH DAMAGE.
*********************************************************************/

#pragma once


#include <controller_interface/multi_interface_controller.h>
#include <hardware_interface/joint_command_interface.h>
#include <pluginlib/class_list_macros.hpp>
Expand Down
3 changes: 3 additions & 0 deletions four_wheel_steering_controller/test/src/four_wheel_steering.h
Original file line number Diff line number Diff line change
@@ -1,5 +1,8 @@
// NOTE: The contents of this file have been taken largely from the ros_control wiki tutorials

#pragma once


// ROS
#include <ros/ros.h>
#include <std_msgs/Float64.h>
Expand Down
4 changes: 3 additions & 1 deletion four_wheel_steering_controller/test/src/test_common.h
Original file line number Diff line number Diff line change
Expand Up @@ -27,6 +27,9 @@

/// \author Bence Magyar

#pragma once


#include <cmath>

#include <gtest/gtest.h>
Expand Down Expand Up @@ -131,4 +134,3 @@ inline tf::Quaternion tfQuatFromGeomQuat(const geometry_msgs::Quaternion& quat)
{
return tf::Quaternion(quat.x, quat.y, quat.z, quat.w);
}

0 comments on commit 7f83db8

Please sign in to comment.