#include <ros.h>
#include <ros/time.h>
#include <tf/tf.h>
#include <tf/transform_broadcaster.h>
Go to the source code of this file.
Functions | |
int | main (void) |
Variables | |
char | base_link [] = "/base_link" |
tf::TransformBroadcaster | broadcaster |
ros::NodeHandle | nh |
char | odom [] = "/odom" |
geometry_msgs::TransformStamped | t |
double | theta = 1.57 |
double | x = 1.0 |
double | y = 0.0 |