4 #include "geometry_msgs/Twist.h" 6 #include "geometry_msgs/PoseWithCovarianceStamped.h" 7 #include "nav_msgs/Odometry.h" 14 #ifndef MOBILE_ROBOT_SIMULATOR 15 #define MOBILE_ROBOT_SIMULATOR 48 void vel_callback(
const geometry_msgs::Twist::ConstPtr& msg);
51 void init_pose_callback(
const geometry_msgs::PoseWithCovarianceStamped::ConstPtr& msg);
ros::Subscriber init_pose_sub
std::string velocity_topic
MobileRobotSimulator(ros::NodeHandle *nh)
tf::StampedTransform odom_trans
void update_odom_from_vel(geometry_msgs::Twist vel, ros::Duration time_diff)
std::string odometry_topic
tf::StampedTransform map_trans
std::string base_link_frame
bool publish_map_transform
void get_tf_from_odom(nav_msgs::Odometry odom)
tf::TransformBroadcaster tf_broadcaster
void init_pose_callback(const geometry_msgs::PoseWithCovarianceStamped::ConstPtr &msg)
void update_loop(const ros::TimerEvent &event)
void vel_callback(const geometry_msgs::Twist::ConstPtr &msg)