#include <string>
#include <ros/ros.h>
#include <sensor_msgs/JointState.h>
#include <aubo_msgs/JointPos.h>
#include <tf/transform_broadcaster.h>
Go to the source code of this file.
Functions | |
void | chatterCallback1 (const aubo_msgs::JointPos::ConstPtr &msg) |
int | main (int argc, char **argv) |
Variables | |
aubo_msgs::JointPos | cur_pos |
void chatterCallback1 | ( | const aubo_msgs::JointPos::ConstPtr & | msg | ) |
Definition at line 9 of file real_state_rviz.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 21 of file real_state_rviz.cpp.
aubo_msgs::JointPos cur_pos |
Definition at line 7 of file real_state_rviz.cpp.