Public Member Functions | Public Attributes | List of all members
MyTest Class Reference

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::KinematicsBasekinematics_solver_
 

Detailed Description

Definition at line 52 of file test_kinematics_as_plugin.cpp.

Member Function Documentation

bool MyTest::initialize ( )
inline

Definition at line 55 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 120 of file test_kinematics_as_plugin.cpp.

Member Data Documentation

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.


The documentation for this class was generated from the following file:


pr2_moveit_tests
Author(s): Sachin Chitta
autogenerated on Sun Nov 17 2019 03:24:53