Skip to content

Commit

Permalink
Rename more headers
Browse files Browse the repository at this point in the history
  • Loading branch information
Flova committed Jan 19, 2024
1 parent aaf7384 commit 6a05fbe
Show file tree
Hide file tree
Showing 16 changed files with 40 additions and 41 deletions.
2 changes: 1 addition & 1 deletion bitbots_motion/bitbots_dynamic_kick/src/visualizer.cpp
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
#include "bitbots_dynamic_kick/visualizer.hpp"

#include <bitbots_splines/pose_spline.h>
#include <bitbots_splines/pose_spline.hpp>

namespace bitbots_dynamic_kick {

Expand Down
Original file line number Diff line number Diff line change
@@ -1,13 +1,13 @@
#ifndef BITBOTS_DYNUP_INCLUDE_BITBOTS_DYNUP_DYNUP_ENGINE_H_
#define BITBOTS_DYNUP_INCLUDE_BITBOTS_DYNUP_DYNUP_ENGINE_H_

#include <bitbots_splines/abstract_engine.h>
#include <bitbots_splines/pose_spline.h>
#include <bitbots_splines/smooth_spline.h>
#include <bitbots_splines/spline_container.h>
#include <tf2/convert.h>

#include <bitbots_dynup/msg/dynup_engine_debug.hpp>
#include <bitbots_splines/abstract_engine.hpp>
#include <bitbots_splines/pose_spline.hpp>
#include <bitbots_splines/smooth_spline.hpp>
#include <bitbots_splines/spline_container.hpp>
#include <cmath>
#include <optional>
#include <rclcpp/rclcpp.hpp>
Expand Down
Original file line number Diff line number Diff line change
@@ -1,11 +1,11 @@
#ifndef BITBOTS_DYNUP_INCLUDE_BITBOTS_DYNUP_DYNUP_IK_H_
#define BITBOTS_DYNUP_INCLUDE_BITBOTS_DYNUP_DYNUP_IK_H_

#include <bitbots_splines/abstract_ik.h>
#include <moveit/robot_model_loader/robot_model_loader.h>
#include <moveit/robot_state/robot_state.h>
#include <tf2/convert.h>

#include <bitbots_splines/abstract_ik.hpp>
#include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>

#include "dynup_utils.h"
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -27,10 +27,10 @@
#include <tf2_eigen/tf2_eigen.hpp>
#include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>

#include "bitbots_dynup/dynup_engine.h"
#include "bitbots_dynup/dynup_ik.h"
#include "bitbots_dynup/dynup_stabilizer.h"
#include "bitbots_dynup/visualizer.h"
#include "bitbots_dynup/dynup_engine.hpp"
#include "bitbots_dynup/dynup_ik.hpp"
#include "bitbots_dynup/dynup_stabilizer.hpp"
#include "bitbots_dynup/visualizer.hpp"
#include "bitbots_msgs/action/dynup.hpp"
#include "rclcpp_action/rclcpp_action.hpp"

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -9,8 +9,8 @@
#include <rclcpp/rclcpp.hpp>
#include <ros2_python_extension/serialization.hpp>

#include "bitbots_dynup/dynup_node.h"
#include "bitbots_dynup/dynup_utils.h"
#include "bitbots_dynup/dynup_node.hpp"
#include "bitbots_dynup/dynup_utils.hpp"

namespace py = pybind11;
using namespace ros2_python_extension;
Expand Down
Original file line number Diff line number Diff line change
@@ -1,10 +1,10 @@
#ifndef BITBOTS_DYNUP_INCLUDE_BITBOTS_DYNUP_DYNUP_STABILIZER_H_
#define BITBOTS_DYNUP_INCLUDE_BITBOTS_DYNUP_DYNUP_STABILIZER_H_

#include <bitbots_splines/abstract_stabilizer.h>
#include <rot_conv/rot_conv.h>

#include <Eigen/Geometry>
#include <bitbots_splines/abstract_stabilizer.hpp>
#include <control_toolbox/pid_ros.hpp>
#include <optional>
#include <sensor_msgs/msg/imu.hpp>
Expand Down
Original file line number Diff line number Diff line change
@@ -1,11 +1,11 @@
#ifndef BITBOTS_DYNUP_INCLUDE_BITBOTS_DYNUP_VISUALIZER_H_
#define BITBOTS_DYNUP_INCLUDE_BITBOTS_DYNUP_VISUALIZER_H_

#include <bitbots_splines/abstract_visualizer.h>
#include <bitbots_splines/smooth_spline.h>
#include <bitbots_splines/spline_container.h>
#include <tf2/LinearMath/Vector3.h>

#include <bitbots_splines/abstract_visualizer.hpp>
#include <bitbots_splines/smooth_spline.hpp>
#include <bitbots_splines/spline_container.hpp>
#include <geometry_msgs/msg/pose_stamped.hpp>
#include <rclcpp/rclcpp.hpp>
#include <string>
Expand Down
2 changes: 1 addition & 1 deletion bitbots_motion/bitbots_dynup/src/visualizer.cpp
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
#include "bitbots_dynup/visualizer.hpp"

#include <bitbots_splines/pose_spline.h>
#include <bitbots_splines/pose_spline.hpp>

namespace bitbots_dynup {
Visualizer::Visualizer(const std::string &base_topic, rclcpp::Node::SharedPtr node)
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -4,8 +4,8 @@

#include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>

#include "bitbots_quintic_walk/walk_utils.h"
#include "bitbots_splines/abstract_ik.h"
#include "bitbots_quintic_walk/walk_utils.hpp"
#include "bitbots_splines/abstract_ik.hpp"
namespace bitbots_quintic_walk {

class WalkIK : public bitbots_splines::AbstractIK<WalkResponse> {
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -42,12 +42,12 @@ The original files can be found at:
#include "bitbots_msgs/msg/foot_pressure.hpp"
#include "bitbots_msgs/msg/joint_command.hpp"
#include "bitbots_msgs/msg/robot_control_state.hpp"
#include "bitbots_quintic_walk/walk_engine.h"
#include "bitbots_quintic_walk/walk_ik.h"
#include "bitbots_quintic_walk/walk_stabilizer.h"
#include "bitbots_quintic_walk/walk_visualizer.h"
#include "bitbots_quintic_walk/walk_engine.hpp"
#include "bitbots_quintic_walk/walk_ik.hpp"
#include "bitbots_quintic_walk/walk_stabilizer.hpp"
#include "bitbots_quintic_walk/walk_visualizer.hpp"
#include "bitbots_quintic_walk_parameters.hpp"
#include "bitbots_splines/abstract_ik.h"
#include "bitbots_splines/abstract_ik.hpp"

namespace bitbots_quintic_walk {

Expand Down
Original file line number Diff line number Diff line change
@@ -1,18 +1,18 @@
#ifndef BITBOTS_QUINTIC_WALK_INCLUDE_BITBOTS_QUINTIC_WALK_WALK_STABILIZER_H_
#define BITBOTS_QUINTIC_WALK_INCLUDE_BITBOTS_QUINTIC_WALK_WALK_STABILIZER_H_

#include <bitbots_splines/abstract_stabilizer.h>
#include <rot_conv/rot_conv.h>

#include <Eigen/Geometry>
#include <bitbots_splines/abstract_stabilizer.hpp>
#include <control_toolbox/pid_ros.hpp>
#include <optional>
#include <rclcpp/logger.hpp>
#include <tf2_eigen/tf2_eigen.hpp>
#include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>

#include "bitbots_quintic_walk/walk_utils.h"
#include "bitbots_splines/abstract_stabilizer.h"
#include "bitbots_quintic_walk/walk_utils.hpp"
#include "bitbots_splines/abstract_stabilizer.hpp"

namespace bitbots_quintic_walk {

Expand All @@ -30,4 +30,4 @@ class WalkStabilizer : public bitbots_splines::AbstractStabilizer<WalkResponse>
};
} // namespace bitbots_quintic_walk

#endif // BITBOTS_QUINTIC_WALK_INCLUDE_BITBOTS_QUINTIC_WALK_WALK_STABILIZER_H_
#endif // BITBOTS_QUINTIC_WALK_INCLUDE_BITBOTS_QUINTIC_WALK_WALK_STABILIZER_H_
Original file line number Diff line number Diff line change
@@ -1,23 +1,23 @@
#ifndef BITBOTS_QUINTIC_WALK_INCLUDE_BITBOTS_QUINTIC_WALK_WALK_VISUALIZER_H_
#define BITBOTS_QUINTIC_WALK_INCLUDE_BITBOTS_QUINTIC_WALK_WALK_VISUALIZER_H_

#include <bitbots_quintic_walk/walk_engine.h>
#include <bitbots_quintic_walk/walk_utils.h>
#include <moveit/robot_state/robot_state.h>
#include <tf2/LinearMath/Matrix3x3.h>
#include <tf2/LinearMath/Quaternion.h>
#include <tf2/LinearMath/Transform.h>
#include <tf2/LinearMath/Vector3.h>

#include <bitbots_quintic_walk/walk_engine.hpp>
#include <bitbots_quintic_walk/walk_utils.hpp>
#include <moveit/robot_state/robot_state.hpp>
#include <moveit_msgs/msg/robot_state.hpp>
#include <rclcpp/rclcpp.hpp>
#include <tf2_eigen/tf2_eigen.hpp>
#include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>

#include "bitbots_quintic_walk/msg/walk_debug.hpp"
#include "bitbots_quintic_walk/msg/walk_engine_debug.hpp"
#include "bitbots_splines/abstract_ik.h"
#include "bitbots_splines/abstract_visualizer.h"
#include "bitbots_splines/abstract_ik.hpp"
#include "bitbots_splines/abstract_visualizer.hpp"

namespace bitbots_quintic_walk {
class WalkVisualizer : public bitbots_splines::AbstractVisualizer {
Expand Down Expand Up @@ -48,4 +48,4 @@ class WalkVisualizer : public bitbots_splines::AbstractVisualizer {
};
} // namespace bitbots_quintic_walk

#endif // BITBOTS_QUINTIC_WALK_INCLUDE_BITBOTS_QUINTIC_WALK_WALK_VISUALIZER_H_
#endif // BITBOTS_QUINTIC_WALK_INCLUDE_BITBOTS_QUINTIC_WALK_WALK_VISUALIZER_H_
Original file line number Diff line number Diff line change
@@ -1,9 +1,9 @@
#ifndef BITBOTS_SPLINES_INCLUDE_BITBOTS_SPLINES_ABSTRACT_VISUALIZER_H_
#define BITBOTS_SPLINES_INCLUDE_BITBOTS_SPLINES_ABSTRACT_VISUALIZER_H_

#include <bitbots_splines/pose_spline.h>
#include <tf2/LinearMath/Vector3.h>

#include <bitbots_splines/pose_spline.hpp>
#include <visualization_msgs/msg/marker.hpp>
#include <visualization_msgs/msg/marker_array.hpp>

Expand Down
Original file line number Diff line number Diff line change
@@ -1,12 +1,12 @@
#ifndef BITBOTS_SPLINES_INCLUDE_BITBOTS_SPLINES_POSE_SPLINE_H_
#define BITBOTS_SPLINES_INCLUDE_BITBOTS_SPLINES_POSE_SPLINE_H_

#include <bitbots_splines/smooth_spline.h>
#include <bitbots_splines/spline_container.h>
#include <tf2/LinearMath/Quaternion.h>
#include <tf2/LinearMath/Transform.h>
#include <tf2/LinearMath/Vector3.h>

#include <bitbots_splines/smooth_spline.hpp>
#include <bitbots_splines/spline_container.hpp>
#include <geometry_msgs/msg/point.hpp>
#include <geometry_msgs/msg/pose.hpp>
#include <geometry_msgs/msg/quaternion.hpp>
Expand Down
Original file line number Diff line number Diff line change
@@ -1,10 +1,10 @@
#ifndef BITBOTS_SPLINES_INCLUDE_BITBOTS_SPLINES_POSITION_SPLINE_H_
#define BITBOTS_SPLINES_INCLUDE_BITBOTS_SPLINES_POSITION_SPLINE_H_

#include <bitbots_splines/smooth_spline.h>
#include <bitbots_splines/spline_container.h>
#include <tf2/LinearMath/Vector3.h>

#include <bitbots_splines/smooth_spline.hpp>
#include <bitbots_splines/spline_container.hpp>
#include <geometry_msgs/msg/point.hpp>

namespace bitbots_splines {
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -6,9 +6,8 @@ The original files can be found at:
#ifndef BITBOTS_SPLINES_INCLUDE_BITBOTS_SPLINES_SPLINE_CONTAINER_H_
#define BITBOTS_SPLINES_INCLUDE_BITBOTS_SPLINES_SPLINE_CONTAINER_H_

#include <bitbots_splines/smooth_spline.h>

#include <algorithm>
#include <bitbots_splines/smooth_spline.hpp>
#include <fstream>
#include <map>
#include <set>
Expand Down

0 comments on commit 6a05fbe

Please sign in to comment.