46 #include <gtest/gtest.h> 51 static const std::string
LOGNAME =
"jog_cpp_interface_test";
72 std::unique_ptr<ros::NodeHandle>
nh_;
88 int main(
int argc,
char** argv)
90 testing::InitGoogleTest(&argc, argv);
91 ros::init(argc, argv,
"jog_cpp_interface_test_test");
96 int result = RUN_ALL_TESTS();
planning_scene_monitor::PlanningSceneMonitorPtr planning_scene_monitor_
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
TEST_F(TestJogCppInterface, InitTest)
std::unique_ptr< ros::NodeHandle > nh_
int main(int argc, char **argv)
static const std::string LOGNAME
ROSCPP_DECL void shutdown()