#include <ros/ros.h>
#include <gtest/gtest.h>
#include <pluginlib/class_loader.h>
#include <moveit/kinematics_constraint_aware/kinematics_constraint_aware.h>
#include <moveit/robot_model/robot_model.h>
#include <moveit/robot_state/robot_state.h>
#include <moveit/robot_state/joint_state_group.h>
#include <moveit/planning_scene/planning_scene.h>
#include <moveit/rdf_loader/rdf_loader.h>
#include <moveit/robot_model_loader/robot_model_loader.h>
#include <eigen_conversions/eigen_msg.h>
#include <urdf/model.h>
#include <srdfdom/model.h>
Go to the source code of this file.
Functions | |
int | main (int argc, char **argv) |
TEST (ConstraintAwareKinematics, getIK) |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 126 of file test_constraint_aware_kinematics.cpp.
TEST | ( | ConstraintAwareKinematics | , |
getIK | |||
) |
Used to load the robot model
Definition at line 53 of file test_constraint_aware_kinematics.cpp.