Skip to content

Commit 2f1e051

Browse files
refactor
Signed-off-by: Chiragkumar Makwana <[email protected]>
1 parent c85d4dd commit 2f1e051

File tree

1 file changed

+8
-2
lines changed

1 file changed

+8
-2
lines changed

nav2_dynamic_motion_model/include/nav2_dynamic_motion_model/motion_model_base.hpp renamed to nav2_dynamic_motion_model/include/nav2_dynamic_motion_model/motion_model_interface.hpp

Lines changed: 8 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -1,6 +1,7 @@
11
#ifndef NAV2_DYNAMIC_MOTION_MODEL__MOTION_MODEL_INTERFACE_HPP_
22
#define NAV2_DYNAMIC_MOTION_MODEL__MOTION_MODEL_INTERFACE_HPP_
33

4+
#include <memory>
45
#include <geometry_msgs/msg/pose.hpp>
56
#include <geometry_msgs/msg/pose_array.hpp>
67
#include <geometry_msgs/msg/twist.hpp>
@@ -13,16 +14,21 @@ namespace nav2_dynamic_motion_model
1314
class MotionModelInterface
1415
{
1516
public:
17+
using Ptr = std::shared_ptr<MotionModelInterface>;
18+
using ConstPtr = std::shared_ptr<const MotionModelInterface>;
19+
1620
virtual ~MotionModelInterface() = default;
1721

1822
virtual geometry_msgs::msg::Pose predictObstaclePose(
1923
const nav2_dynamic_msgs::msg::Obstacle &obstacle,
2024
double dt) const = 0;
2125

26+
2227
virtual geometry_msgs::msg::PoseArray predictObstaclePoseArray(
2328
const nav2_dynamic_msgs::msg::ObstacleArray &obstacle_array,
2429
double dt) const = 0;
2530
};
2631

27-
} //namespace
28-
#endif //NAV2_DYNAMIC_MOTION_MODEL__MOTION_MODEL_INTERFACE_HPP_
32+
} // namespace nav2_dynamic_motion_model
33+
34+
#endif // NAV2_DYNAMIC_MOTION_MODEL__MOTION_MODEL_INTERFACE_HPP_

0 commit comments

Comments
 (0)