diff --git a/rb_ws/src/buggy/launch/main.launch b/rb_ws/src/buggy/launch/main.launch
index 8bc6eed5..c68fa519 100755
--- a/rb_ws/src/buggy/launch/main.launch
+++ b/rb_ws/src/buggy/launch/main.launch
@@ -39,7 +39,4 @@
-
-
-
diff --git a/rb_ws/src/buggy/scripts/auton/dummy_node.py b/rb_ws/src/buggy/scripts/auton/dummy_node.py
deleted file mode 100755
index 79f39a6f..00000000
--- a/rb_ws/src/buggy/scripts/auton/dummy_node.py
+++ /dev/null
@@ -1,19 +0,0 @@
-#!/usr/bin/env python3
-
-import rospy
-
-# ROS Message Imports
-from std_msgs.msg import Float32, Float64, Bool
-
-def cb(msg):
- print(msg)
-
-
-# For test topic remapping
-# TODO: remove after rolls
-if __name__ == "__main__":
- rospy.init_node("dummy")
- rospy.Subscriber("/input/steering", Float64, cb)
- while (not rospy.is_shutdown()):
- rospy.sleep(1)
-