File tree Expand file tree Collapse file tree 1 file changed +8
-2
lines changed
nav2_dynamic_motion_model/include/nav2_dynamic_motion_model Expand file tree Collapse file tree 1 file changed +8
-2
lines changed Original file line number Diff line number Diff line change 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
1314class MotionModelInterface
1415{
1516public:
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_
You can’t perform that action at this time.
0 commit comments