#include <geometry_msgs/PoseStamped.h>#include <geometry_msgs/TwistStamped.h>#include <tf/tf.h>#include <ros/ros.h>#include <jaco_driver/JacoPositionConfig.h>#include <dynamic_reconfigure/server.h>
Go to the source code of this file.
Functions | |
| void | callback (jaco_driver::JacoPositionConfig &config, uint32_t level) |
| int | main (int argc, char **argv) |
| void | TimerCallback (const ros::TimerEvent &) |
Variables | |
| ros::Publisher * | pub |
| float | rx_pose = 0 |
| float | ry_pose = 0 |
| float | rz_pose = 0 |
| float | x_pose = 0 |
| float | y_pose = 0 |
| float | z_pose = 0 |
| void callback | ( | jaco_driver::JacoPositionConfig & | config, |
| uint32_t | level | ||
| ) |
Definition at line 38 of file test_jaco_arm_controller.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
String containing the topic name for cartesian commands
Definition at line 73 of file test_jaco_arm_controller.cpp.
| void TimerCallback | ( | const ros::TimerEvent & | ) |
Definition at line 54 of file test_jaco_arm_controller.cpp.
Definition at line 28 of file test_jaco_arm_controller.cpp.
| float rx_pose = 0 |
Definition at line 33 of file test_jaco_arm_controller.cpp.
| float ry_pose = 0 |
Definition at line 34 of file test_jaco_arm_controller.cpp.
| float rz_pose = 0 |
Definition at line 35 of file test_jaco_arm_controller.cpp.
| float x_pose = 0 |
Definition at line 30 of file test_jaco_arm_controller.cpp.
| float y_pose = 0 |
Definition at line 31 of file test_jaco_arm_controller.cpp.
| float z_pose = 0 |
Definition at line 32 of file test_jaco_arm_controller.cpp.