(Help) Why does moving Turtlebot3 to a specific goal by using /move_base_simple/goal not work?

I’m sorry if this is not the correct place to publish this, but i don’t know where else i should publish my problem…

Software

Turtlebot3 with the turtlebot3_navigation node

Control Environment

I use Ubuntu 20.04 with Melodic and turtlebot3_libraries

Software Description

#!/usr/bin/env python3

import rospy
from geometry_msgs.msg import PoseStamped

rospy.init_node(‘goal_publisher’)

Create a publisher for the goal location

goal_publisher = rospy.Publisher(‘/move_base_simple/goal’, PoseStamped, queue_size=10)

Create a PoseStamped message

goal_pose = PoseStamped()

Set the position of the goal

goal_pose.pose.position.x = 1.951
goal_pose.pose.position.y = -0.022
goal_pose.pose.position.z = 0.010

Set the orientation of the goal (as a quaternion)

goal_pose.pose.orientation.x = -0.000
goal_pose.pose.orientation.y = -0.001
goal_pose.pose.orientation.z = 0.996
goal_pose.pose.orientation.w = -0.093

Set the header of the PoseStamped message (optional)

goal_pose.header.frame_id = ‘base_link’ # Set the appropriate frame ID

Publish the goal location

goal_publisher.publish(goal_pose)

Issue Description

I want to navigate my robot to a specific goal with a python script. I see that it works on rviz but my script does not do it. Even though i got no error when executing my script.
It seems that my code is not working. I provide a video link so you can see my steps exactly.

Additional Information/Attachments