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 | |
std::shared_ptr< pluginlib::ClassLoader< kinematics::KinematicsBase > > | kinematics_loader_ |
boost::shared_ptr< kinematics::KinematicsBase > | kinematics_solver_ |
Definition at line 52 of file test_kinematics_as_plugin.cpp.
|
inline |
Definition at line 55 of file test_kinematics_as_plugin.cpp.
|
inline |
Definition at line 120 of file test_kinematics_as_plugin.cpp.
std::shared_ptr<pluginlib::ClassLoader<kinematics::KinematicsBase> > MyTest::kinematics_loader_ |
Definition at line 137 of file test_kinematics_as_plugin.cpp.
boost::shared_ptr<kinematics::KinematicsBase> MyTest::kinematics_solver_ |
Definition at line 134 of file test_kinematics_as_plugin.cpp.