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

ADIROSGAZ's profile - activity

2019-04-07 22:34:49 -0500 marked best answer I want to control 10 dynamixel motors using ROS Python. I am succeeding up to 6 motors at a time but not all

I want to control 10 Dynamixel motors using ROS PYTHON, I am succeeded to control 6 motors at a time. But while not all 10. What should i do to move them using my slider control program, As i started my executing my code ALL MOTORS ARE MOVING IN RANDOM DIRECTION

HERE IS MY CODE

#!/usr/bin/env python
import sys
import time
import rospy
from std_msgs.msg import Float64
from Tkinter import *

rospy.init_node('adi', anonymous=True)
pub1 = rospy.Publisher('/joint1/command', Float64, queue_size=10)
.
.
.
pub10 = rospy.Publisher('/joint10/command', Float64, queue_size=10)

def a():
    pub1.publish(3)   # It sets the motor to center position
.
.
.
.
    pub10.publish(3)
    print  w1.get(), w2.get() , w3.get(), w4.get() , w5.get() , w6.get() , w7.get() , w8.get() , w9.get() , w10.get() 
    pub1.publish(w1.get()*0.01)
    .
.
.
.
         pub10.publish(w10.get()*0.01)


master = Tk()
master.title("ADI")
w1 = Scale(master, from_=-360, to=360, orient=HORIZONTAL,length=300)
w1.pack()
.
.
.
w10 = Scale(master, from_=-360, to=360, orient=HORIZONTAL,length=300)
w10.pack()
Button(master, text='Move', command=a).pack()
a()
master.mainloop()
2018-03-15 02:08:12 -0500 answered a question I want to control 10 dynamixel motors using ROS Python. I am succeeding up to 6 motors at a time but not all

I used 2 different files a1.py & a2.py to write 2 different functions of five arguments (for each motor) in each py

2018-03-15 02:02:06 -0500 commented answer I want to control 10 dynamixel motors using ROS Python. I am succeeding up to 6 motors at a time but not all

Thanks for your reply, But it is not related to the Voltage drop. I didn't find any voltage drop in it & i am using

2017-06-08 00:45:48 -0500 marked best answer ImportError: No module named msg

While i am launching roslaunch my_dynamixel_tutorial controller_manager.launch i am getting this error. It works fine till yesterday & i controlled dynamixel motors with my algorithm. But all of sudden it appears today after i run catkin_make

F File "/home/adirosgaz/catkin_ws/src/dynamixel_motor/dynamixel_controllers/nodes/controller_manager.py", line 52, in <module> from dynamixel_driver.dynamixel_serial_proxy import SerialProxy File "/home/adirosgaz/catkin_ws/src/dynamixel_motor/dynamixel_driver/src/dynamixel_driver/dynamixel_serial_proxy.py", line 63, in <module> from dynamixel_msgs.msg import MotorState ImportError: No module named msg

Thanks for all, for your valuable suggestions & support.

i am working with ros & dynamixel motors for past 10 months. few days back i observed dynamixel_sdk & dynamixel_workbench packages & i installed it to see what extra features in it. As a process of installing, i cloned some files form git hub, in that files some consists of same package. while i am running my code it is calling that file instead of the original file. After a long detailed observation i found this.

I resolved my issue now.

Once again thanks for all.

2017-06-08 00:41:48 -0500 answered a question ImportError: No module named msg

Thanks for all, for your valuable suggestions & support. i am working with ros & dynamixel motors for past 10 m

2017-06-07 11:10:43 -0500 commented question ImportError: No module named msg

@gvdhoorn i found my error & i updated the same in question with how i resolved the error

2017-06-07 11:10:17 -0500 commented question ImportError: No module named msg

@gvdhoorn i found my error & i updated the same in question with the same

2017-06-07 08:15:14 -0500 received badge  Famous Question (source)
2017-06-07 06:08:28 -0500 edited question ImportError: No module named msg

ImportError: No module named msg While i am launching roslaunch my_dynamixel_tutorial controller_manager.launch i am get

2017-06-06 05:26:33 -0500 commented question ImportError: No module named msg

i did that but there is no change in that error

2017-06-06 04:06:46 -0500 received badge  Famous Question (source)
2017-06-06 04:06:40 -0500 received badge  Notable Question (source)
2017-06-06 03:27:41 -0500 received badge  Popular Question (source)
2017-06-06 00:49:45 -0500 edited question ImportError: No module named msg

ImportError: No module named msg While i am launching roslaunch my_dynamixel_tutorial controller_manager.launch i am get

2017-06-06 00:49:42 -0500 edited question ImportError: No module named msg

File "/home/aditya/catkin_ws/src/dynamixel_motor/dynamixel_driver/src/dynamixel_driver/dynamixel_serial_proxy.py", line

2017-06-06 00:49:09 -0500 asked a question ImportError: No module named msg

File "/home/aditya/catkin_ws/src/dynamixel_motor/dynamixel_driver/src/dynamixel_driver/dynamixel_serial_proxy.py", line

2017-06-03 21:22:10 -0500 edited question I want to control 10 dynamixel motors using ROS Python. I am succeeding up to 6 motors at a time but not all

I want to control 10 dynamixel motors using ROS Python. I am succeeding up to 6 motors at a time but not all I want to c

2017-06-03 21:22:10 -0500 received badge  Editor (source)
2017-06-03 21:20:30 -0500 received badge  Notable Question (source)
2017-06-03 14:52:34 -0500 received badge  Popular Question (source)
2017-06-03 06:22:36 -0500 edited question I want to control 10 dynamixel motors using ROS Python. I am succeeding up to 6 motors at a time but not all

I WANT TO CONTROL 10 DYNAMIXEL MOTORS USING ROS PYTHON I AM SUCCEDING UP TO 6 MOTORS AT A TIME BUT NOR ALL I want to con

2017-06-03 06:15:27 -0500 asked a question I want to control 10 dynamixel motors using ROS Python. I am succeeding up to 6 motors at a time but not all

I WANT TO CONTROL 10 DYNAMIXEL MOTORS USING ROS PYTHON I AM SUCCEDING UP TO 6 MOTORS AT A TIME BUT NOR ALL I WANT TO CON