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::KinematicsBasePtr | kinematics_solver_ |
Definition at line 57 of file test_kinematics_as_plugin.cpp.
|
inline |
Definition at line 60 of file test_kinematics_as_plugin.cpp.
|
inline |
Definition at line 139 of file test_kinematics_as_plugin.cpp.
boost::shared_ptr<pluginlib::ClassLoader<kinematics::KinematicsBase> > MyTest::kinematics_loader_ |
Definition at line 162 of file test_kinematics_as_plugin.cpp.
kinematics::KinematicsBasePtr MyTest::kinematics_solver_ |
Definition at line 159 of file test_kinematics_as_plugin.cpp.