#include <vector>
#include <string>
#include <csignal>
#include <ros/ros.h>
#include <sensor_msgs/JointState.h>
#include <robotiq_s_model_control/SModel_robot_input.h>
#include <robotiq_s_model_control/SModel_robot_output.h>
Go to the source code of this file.
Classes | |
class | Finger |
class | Robotiq3 |
Functions | |
int | main (int argc, char *argv[]) |
Variables | |
const double | DEG_TO_RAD = M_PI/180.0 |
Subscribes to Robotiq state messages on "SModelRobotInput" topic, converts the data to joint values, and publishes sensor_msgs/JointState messages on "joint_states" topic for Robotiq S-model.
'rosrun robotiq_joint_state_publisher s_model_joint_states <gripper_prefix>'
Definition in file s_model_joint_states.cpp.
int main | ( | int | argc, |
char * | argv[] | ||
) |
Main method.
Definition at line 179 of file s_model_joint_states.cpp.
const double DEG_TO_RAD = M_PI/180.0 |
Definition at line 46 of file s_model_joint_states.cpp.