34 #include <gtest/gtest.h> 38 TEST(LocalPlannerAdapter, unload_local_planner)
46 geometry_msgs::TransformStamped base_rel_map;
47 base_rel_map.child_frame_id =
"/base_link";
48 base_rel_map.header.frame_id =
"/map";
49 base_rel_map.transform.rotation.w = 1.0;
64 int main(
int argc,
char** argv)
67 testing::InitGoogleTest(&argc, argv);
68 return RUN_ALL_TESTS();
int main(int argc, char **argv)
void setUsingDedicatedThread(bool value)
bool setTransform(const geometry_msgs::TransformStamped &transform, const std::string &authority, bool is_static=false)
std::string getGlobalFrameID()
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
void initialize(std::string name, tf2_ros::Buffer *tf, costmap_2d::Costmap2DROS *costmap_ros) override
Load the nav_core2 local planner and initialize it.
used for employing a nav_core2 local planner (such as dwb) as a nav_core plugin, like in move_base...
TEST(LocalPlannerAdapter, unload_local_planner)