Public Member Functions | |
void | run () |
TrajectoryCommandExecutionTester () | |
~TrajectoryCommandExecutionTester () | |
Definition at line 27 of file test_trajectory_command_sine_node.cpp.
|
inline |
Definition at line 30 of file test_trajectory_command_sine_node.cpp.
|
inline |
Definition at line 59 of file test_trajectory_command_sine_node.cpp.
|
inline |
Definition at line 62 of file test_trajectory_command_sine_node.cpp.
KDL::JntArray TrajectoryCommandExecutionTester::derived_simpson_q_dot_ |
Definition at line 164 of file test_trajectory_command_sine_node.cpp.
unsigned int TrajectoryCommandExecutionTester::dof_ |
Definition at line 168 of file test_trajectory_command_sine_node.cpp.
KDL::JntArray TrajectoryCommandExecutionTester::euler_q_ |
Definition at line 163 of file test_trajectory_command_sine_node.cpp.
unsigned int TrajectoryCommandExecutionTester::idx_ |
Definition at line 169 of file test_trajectory_command_sine_node.cpp.
boost::shared_ptr<SimpsonIntegrator> TrajectoryCommandExecutionTester::integrator_ |
Definition at line 166 of file test_trajectory_command_sine_node.cpp.
ros::NodeHandle TrajectoryCommandExecutionTester::nh_ |
Definition at line 151 of file test_trajectory_command_sine_node.cpp.
ros::Publisher TrajectoryCommandExecutionTester::output_derived_simpson_q_dot_pub_ |
Definition at line 158 of file test_trajectory_command_sine_node.cpp.
ros::Publisher TrajectoryCommandExecutionTester::output_euler_q_pub_ |
Definition at line 157 of file test_trajectory_command_sine_node.cpp.
ros::Publisher TrajectoryCommandExecutionTester::output_q_dot_pub_ |
Definition at line 155 of file test_trajectory_command_sine_node.cpp.
ros::Publisher TrajectoryCommandExecutionTester::output_q_pub_ |
Definition at line 154 of file test_trajectory_command_sine_node.cpp.
ros::Publisher TrajectoryCommandExecutionTester::output_simpson_q_pub_ |
Definition at line 156 of file test_trajectory_command_sine_node.cpp.
KDL::JntArray TrajectoryCommandExecutionTester::q_ |
Definition at line 160 of file test_trajectory_command_sine_node.cpp.
KDL::JntArray TrajectoryCommandExecutionTester::q_dot_ |
Definition at line 161 of file test_trajectory_command_sine_node.cpp.
KDL::JntArray TrajectoryCommandExecutionTester::simpson_q_ |
Definition at line 162 of file test_trajectory_command_sine_node.cpp.
ros::Publisher TrajectoryCommandExecutionTester::trajectory_pub_ |
Definition at line 152 of file test_trajectory_command_sine_node.cpp.