Guided velocity doesnt match my velocity

Hello i am using ardurover 4.5.7. I am on gps denied enviroment.I am on develop ros. I send cmd vel but when i see on mavlink inspector pwm servo1 and servo 2 its always going to top. So its incorrect i set speed 0.1 and does not match desired velocity.I send fake gps its also same. I also set slam and change parametrs on ekf3 source etc. like ardupilot integration with ros but its same

ros2 topic pub -10 mavros/setpoint_velocity/cmd_vel geometry_msgs/msg/TwistStamped “{header: {frame_id: ‘base_link’}, twist: {linear: {x: 1.0, y: 0.0, z: 0.0}, angular: {x: 0.0, y: 0.0, z: 0.0}}}”
/////
ros2 topic pub -r 10 /mavros/setpoint_raw/local mavros_msgs/PositionTarget “{header: {stamp: {sec: 0, nanosec: 0}, frame_id: ‘base_link’}, coordinate_frame: 1,
type_mask: 3527, velocity: {x: 0.05, y: 0.0, z: 0.0}, yaw: 0.0}”
i tested also setpoint_raw and its going full throttle and now one servo going full and other servo going down 1000. Can someone help me? I equiped skid steer tank