8 from mbf_msgs.msg
import GetPathAction, GetPathGoal, GetPathResult
12 """Verifies that move_base can handle our plugin"""
15 """Check that server is online
17 In this simple setup, we don't really want to generate a plan.
18 Instread, we can ask for a plan on our planner (gpp_gp), and verify,
19 that the generated error-message is not INVALID_PLUGIN
21 See https://github.com/magazino/move_base_flex/blob/596ed881bfcbd847e9d296c6d38e4d3fa3b74a4d/mbf_msgs/action/GetPath.action
26 self.assertTrue(get_path.wait_for_server(rospy.Duration(60)),
27 "{} server offline".format(get_path.action_client.ns))
31 goal.planner =
'gpp_gp'
32 get_path.send_goal_and_wait(goal, rospy.Duration(1))
33 result = get_path.get_result()
36 self.assertNotEqual(result.outcome, GetPathResult.INVALID_PLUGIN)
39 if __name__ ==
'__main__':
40 rospy.init_node(
"test_mbf_costmap_nav")
41 rostest.rosrun(
'gpp_plugin',
'test_mbf_costmap_nav', TestMbfCostmapNav)