23#include <gtest/gtest.h>
26#include <rclcpp/rclcpp.hpp>
41 warehouse_ros::DatabaseConnection::Ptr
db_;
42 std::shared_ptr<moveit::planning_interface::MoveGroupInterface>
move_group_;
48 std::thread spin_thread_;
49 std::atomic<bool> is_spinning_;
Test fixture to spin up a node to start a move group with.
~MoveGroupFixture() override
rclcpp::Node::SharedPtr node_
warehouse_ros::DatabaseConnection::Ptr db_
std::string move_group_name_
std::shared_ptr< moveit::planning_interface::MoveGroupInterface > move_group_