ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange
Ask Your Question
0

Unable to publish to /smoother_cmd_vel

asked 2022-09-22 07:56:58 -0500

zaid gravatar image

I am working on Bunker robot from Agile Robotics..

I can control the robot via RF transmitter and also through CAN protocol.I have created a python script through which I can pass on coordinates to the robot and it will move to that point. After enabling the Robot base frame, it seems that the topic that i need to publish my coordinates is "/smoother_cmd_vel". Below is my attach script but i still cant publish it.

import rospy
from nav_msgs.msg import Odometry
from tf.transformations import euler_from_quaternion
from geometry_msgs.msg import Point, Twist
from math import atan2

x = 0.0
y = 0.0 
theta = 0.0

def newOdom(msg):
  global x
  global y
  global theta

  x = msg.pose.pose.position.x
  y = msg.pose.pose.position.y

  rot_q = msg.pose.pose.orientation
  (roll, pitch, theta) = euler_from_quaternion([rot_q.x, rot_q.y, rot_q.z, rot_q.w])

rospy.init_node("speed_controller")

sub = rospy.Subscriber("/odom", Odometry, newOdom)
pub = rospy.Publisher("/smoother_cmd_vel", Twist, queue_size = 1)

speed = Twist()

r = rospy.Rate(4)

goal = Point()
goal.x = 5
goal.y = 5

while not rospy.is_shutdown():
     inc_x = goal.x -x
     inc_y = goal.y -y

     angle_to_goal = atan2(inc_y, inc_x)

     If abs(angle_to_goal - theta) > 0.1:
          speed.linear.x = 0.0
          speed.angular.z = 0.3
     else:
           speed.linear.x = 0.5
           speed.angular.z = 0.0

           pub.publish(speed)
           r.sleep()

looking for some suggestions.Thank you and good day

edit retag flag offensive close merge delete

1 Answer

Sort by ยป oldest newest most voted
1

answered 2022-09-22 18:48:51 -0500

zrahman gravatar image

Your pub.publish(speed) is inside the else condition. Most probably, else condition is not being satisfied. Bring it outside the condition like the following and it will publish the twist msg.

 If abs(angle_to_goal - theta) > 0.1:
      speed.linear.x = 0.0
      speed.angular.z = 0.3
 else:
       speed.linear.x = 0.5
       speed.angular.z = 0.0

 pub.publish(speed)
 r.sleep()
edit flag offensive delete link more

Question Tools

1 follower

Stats

Asked: 2022-09-22 07:56:58 -0500

Seen: 60 times

Last updated: Sep 22 '22