38 #include <gtest/gtest.h>
60 move_group_.setStartState(*(move_group_.getCurrentState()));
61 move_group_.setJointValueTarget(std::vector<double>({ 0.0, 0.0 }));
62 move_group_.setPlanningTime(5.0);
65 EXPECT_GT(my_plan_.trajectory_.joint_trajectory.points.size(), 0u);
66 EXPECT_EQ(error_code.val, moveit::core::MoveItErrorCode::SUCCESS);
69 int main(
int argc,
char** argv)
71 testing::InitGoogleTest(&argc, argv);
72 ros::init(argc, argv,
"chomp_moveit_test_panda");
74 ros::AsyncSpinner spinner(1);
76 int ret = RUN_ALL_TESTS();
int main(int argc, char **argv)
TEST_F(CHOMPMoveitTest, jointSpaceGoodGoal)
moveit::planning_interface::MoveGroupInterface::Plan my_plan_
moveit::planning_interface::MoveGroupInterface move_group_
a wrapper around moveit_msgs::MoveItErrorCodes to make it easier to return an error code message from...
Client class to conveniently use the ROS interfaces provided by the move_group node.
The representation of a motion plan (as ROS messages)