#include "ros/ros.h"
#include "std_msgs/Float32MultiArray.h"
#include "aubo_msgs/GoalPoint.h"
#include "aubo_msgs/TraPoint.h"
Go to the source code of this file.
Functions | |
void | chatterCallback (const aubo_msgs::TraPoint::ConstPtr &msg) |
void | chatterCallback1 (const aubo_msgs::GoalPoint::ConstPtr &msg) |
int | main (int argc, char **argv) |
void | timerCallback (const ros::TimerEvent &e) |
Variables | |
ros::Publisher | cmd_pub |
ros::Publisher | cmd_pub2 |
aubo_msgs::GoalPoint | goal |
ros::Publisher | goal_pub |
std_msgs::Float32MultiArray | joints_cmd |
bool | recv_flag = false |
ros::Timer | timer |
aubo_msgs::TraPoint | traj_point |
void chatterCallback | ( | const aubo_msgs::TraPoint::ConstPtr & | msg | ) |
Definition at line 21 of file trajectory_goal.cpp.
void chatterCallback1 | ( | const aubo_msgs::GoalPoint::ConstPtr & | msg | ) |
Definition at line 43 of file trajectory_goal.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 103 of file trajectory_goal.cpp.
void timerCallback | ( | const ros::TimerEvent & | e | ) |
Definition at line 58 of file trajectory_goal.cpp.
Definition at line 12 of file trajectory_goal.cpp.
Definition at line 13 of file trajectory_goal.cpp.
aubo_msgs::GoalPoint goal |
Definition at line 7 of file trajectory_goal.cpp.
Definition at line 8 of file trajectory_goal.cpp.
std_msgs::Float32MultiArray joints_cmd |
Definition at line 11 of file trajectory_goal.cpp.
bool recv_flag = false |
Definition at line 18 of file trajectory_goal.cpp.
Definition at line 19 of file trajectory_goal.cpp.
aubo_msgs::TraPoint traj_point |
Definition at line 16 of file trajectory_goal.cpp.