Public Member Functions | |
bool | initialize () |
void | joint_state_callback (const geometry_msgs::Pose &ik_pose, const std::vector< double > &joint_state, moveit_msgs::MoveItErrorCodes &error_code) |
Public Attributes | |
boost::shared_ptr < pluginlib::ClassLoader < kinematics::KinematicsBase > > | kinematics_loader |
kinematics::KinematicsBase * | kinematics_solver |
Definition at line 53 of file test_kinematics_as_plugin.cpp.
bool MyTest::initialize | ( | ) | [inline] |
Definition at line 56 of file test_kinematics_as_plugin.cpp.
void MyTest::joint_state_callback | ( | const geometry_msgs::Pose & | ik_pose, |
const std::vector< double > & | joint_state, | ||
moveit_msgs::MoveItErrorCodes & | error_code | ||
) | [inline] |
Definition at line 122 of file test_kinematics_as_plugin.cpp.
boost::shared_ptr<pluginlib::ClassLoader<kinematics::KinematicsBase> > MyTest::kinematics_loader |
Definition at line 138 of file test_kinematics_as_plugin.cpp.
Definition at line 136 of file test_kinematics_as_plugin.cpp.