Skip to content

Commit

Permalink
cleanup
Browse files Browse the repository at this point in the history
  • Loading branch information
Marc-Morcos committed Jul 4, 2024
1 parent 39a675f commit 18b7a5a
Show file tree
Hide file tree
Showing 2 changed files with 0 additions and 12 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -31,8 +31,6 @@ namespace nav2_behavior_tree
class GetPoseFromPath : public BT::ActionNodeBase
{
public:
typedef std::vector<geometry_msgs::msg::PoseStamped> Goals;

GetPoseFromPath(
const std::string & xml_tag_name,
const BT::NodeConfiguration & conf);
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -44,16 +44,6 @@ class GetPoseFromPathTestFixture : public ::testing::Test
config_->blackboard->set<rclcpp::Node::SharedPtr>(
"node",
node_);
config_->blackboard->set<std::chrono::milliseconds>(
"server_timeout",
std::chrono::milliseconds(20));
config_->blackboard->set<std::chrono::milliseconds>(
"bt_loop_duration",
std::chrono::milliseconds(10));
config_->blackboard->set<std::chrono::milliseconds>(
"wait_for_service_timeout",
std::chrono::milliseconds(1000));
config_->blackboard->set<bool>("initial_pose_received", false);

BT::NodeBuilder builder =
[](const std::string & name, const BT::NodeConfiguration & config)
Expand Down

0 comments on commit 18b7a5a

Please sign in to comment.