Skip to content

Commit

Permalink
remove initlaization of shared ptr and TODO log
Browse files Browse the repository at this point in the history
  • Loading branch information
SteveMacenski committed May 17, 2019
1 parent d7c9dc7 commit 973eab1
Showing 1 changed file with 1 addition and 2 deletions.
3 changes: 1 addition & 2 deletions nav2_motion_primitives/src/spin.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -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<geometry_msgs::msg::PoseWithCovarianceStamped>();
}

Spin::~Spin()
Expand All @@ -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;
Expand Down

0 comments on commit 973eab1

Please sign in to comment.