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