diff --git a/src/moveit_sorting_controller.cpp b/src/moveit_sorting_controller.cpp
index 59965a095b7a88d45156da36a8ccdd86eaa9cfc7..6f86b3245ac93540b6382113ffc7870451ac8785 100644
--- a/src/moveit_sorting_controller.cpp
+++ b/src/moveit_sorting_controller.cpp
@@ -60,10 +60,6 @@ int main(int argc, char **argv)
   controller.loadScene(getPrivateParameter<std::string>("scene", ros::package::getPath("ccf_immersive_sorting") +
       "/config/config_scene_ceti-table-placeworld.json"));
 
-  // TODO check if this is required (since loadScene already sends the scene)
-  ROS_INFO_STREAM("Sending initial scene after loading it.");
-  controller.sendScene();
-
   std::optional<std::string> currentlyPickedBox{};
 
   ros::Subscriber sub = n.subscribe<std_msgs::Empty>("send_scene", 1000, [&controller](