#include <ros/ros.h>#include <aubo_msgs/JointPos.h>#include <std_msgs/Float32MultiArray.h>#include "jointcontrolapi.h"
Go to the source code of this file.
Functions | |
| void | chatterCallback (const std_msgs::Float32MultiArray::ConstPtr &msg) |
| int | main (int argc, char **argv) |
Variables | |
| int | can_int_flag = 0 |
| const char * | CanDev = "/dev/pcan32" |
| void chatterCallback | ( | const std_msgs::Float32MultiArray::ConstPtr & | msg | ) |
Definition at line 10 of file joint_control_pcan.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 34 of file joint_control_pcan.cpp.
| int can_int_flag = 0 |
Definition at line 8 of file joint_control_pcan.cpp.
| const char* CanDev = "/dev/pcan32" |
Definition at line 6 of file joint_control_pcan.cpp.