From 973eab13c338a32604641627b1f41ef870ccc39c Mon Sep 17 00:00:00 2001 From: Steve Date: Fri, 17 May 2019 15:29:17 -0700 Subject: [PATCH] remove initlaization of shared ptr and TODO log --- nav2_motion_primitives/src/spin.cpp | 3 +-- 1 file changed, 1 insertion(+), 2 deletions(-) diff --git a/nav2_motion_primitives/src/spin.cpp b/nav2_motion_primitives/src/spin.cpp index 6b5b97c15e..895bbb7eaf 100644 --- a/nav2_motion_primitives/src/spin.cpp +++ b/nav2_motion_primitives/src/spin.cpp @@ -43,7 +43,6 @@ Spin::Spin(rclcpp::Node::SharedPtr & node) goal_tolerance_angle_ = 0.17; direction_ = 1.0; commanded_dist_ = 0.0; - initial_pose_ = std::make_shared(); } Spin::~Spin() @@ -66,7 +65,7 @@ nav2_tasks::TaskStatus Spin::onRun(const nav2_tasks::SpinCommand::SharedPtr comm "will only spin in Z."); } - // gets unsigned distance and turning direction TODO + // gets unsigned distance and turning direction if (commanded_dist_ < 0.0) { commanded_dist_ += 2 * M_PI; direction_ = -1.0;