6 from geometry_msgs.msg
import Twist
10 self.
pub = rospy.Publisher(
"cmd_vel", Twist, queue_size=10)
12 rospy.Subscriber(
"teleop/cmd_vel", Twist, callback=self.
on_human_cmd)
20 self.pub.publish(twist)
25 self.pub.publish(twist)
28 rospy.init_node(
"cmd_vel_mux")
def on_human_cmd(self, twist)
def on_autonomous_cmd(self, twist)