diff --git a/LaserPublisher.h b/LaserPublisher.h
index bd9f0fdee48afb0c2af10a9ffd988bdd9ef9f1d0..51a65d44dbabac8e006c5d0e2f45c014a75eb2d0 100644
--- a/LaserPublisher.h
+++ b/LaserPublisher.h
@@ -12,7 +12,7 @@ class ArTime;
 class LaserPublisher
 {
 public:
-  LaserPublisher(ArLaser* _l, ros::NodeHandle& _n, bool _broadcast_transform = true, const std::string& _tf_frame = "laser_frame", const std::string& _parent_tf_frame = "base_link", const std::string& _global_tf_frame = "map");
+  LaserPublisher(ArLaser* _l, ros::NodeHandle& _n, bool _broadcast_transform = true, const std::string& _tf_frame = "laser", const std::string& _parent_tf_frame = "base_link", const std::string& _global_tf_frame = "odom");
   ~LaserPublisher();
 protected:
   void readingsCB();