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

phmferreira's profile - activity

2016-11-30 18:12:08 -0500 received badge  Famous Question (source)
2016-10-24 09:54:46 -0500 received badge  Famous Question (source)
2014-01-06 01:51:16 -0500 received badge  Notable Question (source)
2013-10-01 00:47:06 -0500 received badge  Notable Question (source)
2013-10-01 00:47:02 -0500 received badge  Notable Question (source)
2013-06-26 11:27:11 -0500 received badge  Popular Question (source)
2013-04-28 00:53:49 -0500 received badge  Popular Question (source)
2013-04-19 03:22:15 -0500 received badge  Popular Question (source)
2013-04-18 10:28:53 -0500 asked a question How to start the etherCAT hand

I follewed the instructions on the pages below:

http://www.ros.org/wiki/shadow_robot_etherCAT (Shadow Robot etherCAT) and http://www.ros.org/wiki/sr_edc_launch/Tutorials/Starting%20the%20EtherCAT%20Hand (Starting the EtherCAT Hand)

there are 3 errors happening

xterm -e roscore & rxconsole & rosrun robot_monitor robot_monitor & 

Unable to register with master node [http://localhost:11311]: master may not be running yet. Will keep trying.

roslaunch sr_edc_launch sr_edc.launch

ERROR: cannot launch node of type [pr2_etherCAT/pr2_etherCAT]: can't locate node [pr2_etherCAT] in package [pr2_etherCAT]

roslaunch sr_hand srh_etherCAT.launch

ERROR: cannot launch node of type [sr_hand/shadowhand_ethercat]: can't locate node [shadowhand_ethercat] in package [sr_hand]

How to start the shadow robot etherCAT?

And the file /opt/ros/fuerte/stacks/sr_config/bashrc/env_variable.bashrc must have been loaded in the ~/.bashrc?

2013-04-08 08:24:03 -0500 asked a question How to import sr_robot_msgs in Python

I tried to run this code but doesn't work.


#!/usr/bin/env python

import roslib; roslib.load_manifest('rospy_tutorials')

import rospy
from std_msgs.msg import *
from stacks.shadow_robot.sr_robot_msgs.msg import JointControllerState

def callback(data):
    rospy.loginfo(rospy.get_caller_id()+"I heard %s", data)

def listener():

    rospy.init_node('listener', anonymous=True)

    rospy.Subscriber("sh_ffj3_mixed_position_velocity_controller/command", JointControllerState, callback)

    # spin() simply keeps python from exiting until this node is stopped
    rospy.spin()

if __name__ == '__main__':
    listener()

the answer for this is:


Traceback (most recent call last):
  File "/home/paulo/ros_workspace/sandbox/beginner_tutorials/scripts/listener.py", line 7, in <module>
    from stacks.shadow_robot.sr_robot_msgs.msg import JointControllerState
ImportError: No module named stacks.shadow_robot.sr_robot_msgs.msg

How to import sr_robot_msgs?

2013-04-08 03:23:09 -0500 received badge  Popular Question (source)
2013-04-04 04:30:04 -0500 received badge  Editor (source)
2013-04-04 04:28:38 -0500 asked a question moving sr_hand ros fuerte with code

I tried to move de hand with rostopic and this work very well

 rostopic pub /sh_ffj3_mixed_position_velocity_controller/command std_msgs/Float64 -- 10

And I tried to make this with code.

 
import roslib; roslib.load_manifest('rospy_tutorials')

import rospy
from std_msgs.msg import *

def talker():
    pub = rospy.Publisher('sh_ffj3_mixed_position_velocity_controller/command', Float64)
    rospy.init_node('ffj3Control')    
    value = 10
    rospy.loginfo(value)
    pub.publish(Float64(value))

if __name__ == '__main__':
    try:
        talker()
    except rospy.ROSInterruptException: pass

But this didn't work. The model in the gazebo gui does not move.

This the result of this execution:


/opt/ros/fuerte/share/rospy_tutorials$ rosrun beginner_tutorials talker.py[INFO] [WallTime: 1365084692.814065] [0.000000] 10

Anyone knows what is wrong?

2013-04-04 01:26:30 -0500 received badge  Scholar (source)
2013-04-03 07:31:01 -0500 asked a question moving sr_hand ros fuerte

I tried to move the shadow hand with this command

Blockquote rostopic pub /srh/sendupdate sr_robot_msgs/sendupdate {sendupdate_length: 1 ,sendupdate_list: [{joint_name: FFJ0,joint_target: 180}]}"

but it doesn't work.


I saw with the command rostopic list -v that there aren't any /srh/sendupdate

Blockquote Published topics: * /lfmiddle_bumper [gazebo_msgs/ContactsState] 1 publisher * /lfmetacarpal_bumper [gazebo_msgs/ContactsState] 1 publisher * /camera/depth_registered/points [sensor_msgs/PointCloud2] 1 publisher * /sh_ffj4_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /rfmiddle_bumper [gazebo_msgs/ContactsState] 1 publisher * /rfproximal_bumper [gazebo_msgs/ContactsState] 1 publisher * /camera/image_raw/compressed [sensor_msgs/CompressedImage] 1 publisher * /tf [tf/tfMessage] 1 publisher * /lfknuckle_bumper [gazebo_msgs/ContactsState] 1 publisher * /sh_rfj3_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /camera/image_raw/theora [theora_image_transport/Packet] 1 publisher * /camera/image_raw/theora/parameter_descriptions [dynamic_reconfigure/ConfigDescription] 1 publisher * /sh_thj5_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /mfmiddle_bumper [gazebo_msgs/ContactsState] 1 publisher * /sh_lfj5_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /mfdistal_bumper [gazebo_msgs/ContactsState] 1 publisher * /sh_wrj1_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /r_arm_joint_trajectory_controller/state [pr2_controllers_msgs/JointTrajectoryControllerState] 1 publisher * /sa_ss_position_controller/state [pr2_controllers_msgs/JointControllerState] 1 publisher * /ffmiddle_bumper [gazebo_msgs/ContactsState] 1 publisher * /ffproximal_bumper [gazebo_msgs/ContactsState] 1 publisher * /camera/image_raw/compressedDepth [sensor_msgs/CompressedImage] 1 publisher * /sa_sr_position_controller/state [pr2_controllers_msgs/JointControllerState] 1 publisher * /sa_er_position_controller/state [pr2_controllers_msgs/JointControllerState] 1 publisher * /lfproximal_bumper [gazebo_msgs/ContactsState] 1 publisher * /thmiddle_bumper [gazebo_msgs/ContactsState] 1 publisher * /thproximal_bumper [gazebo_msgs/ContactsState] 1 publisher * /gazebo/parameter_descriptions [dynamic_reconfigure/ConfigDescription] 1 publisher * /mfproximal_bumper [gazebo_msgs/ContactsState] 1 publisher * /ffknuckle_bumper [gazebo_msgs/ContactsState] 1 publisher * /camera/image_raw/compressed/parameter_descriptions [dynamic_reconfigure/ConfigDescription] 1 publisher * /depth/image_raw [sensor_msgs/Image] 1 publisher * /lfdistal_bumper [gazebo_msgs/ContactsState] 1 publisher * /rfknuckle_bumper [gazebo_msgs/ContactsState] 1 publisher * /palm_bumper [gazebo_msgs/ContactsState] 1 publisher * /thbase_bumper [gazebo_msgs/ContactsState] 1 publisher * /sh_ffj0_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /sh_thj2_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /depth/camera_info [sensor_msgs/CameraInfo] 1 publisher * /sh_mfj0_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /camera/camera_info [sensor_msgs/CameraInfo] 1 publisher * /sa_es_position_controller/state [pr2_controllers_msgs/JointControllerState] 1 publisher * /rfdistal_bumper [gazebo_msgs/ContactsState] 1 publisher * /rosout [rosgraph_msgs/Log] 6 publishers * /sh_lfj3_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /mechanism_statistics [pr2_mechanism_msgs/MechanismStatistics] 1 publisher * /mfknuckle_bumper [gazebo_msgs/ContactsState] 1 publisher * /rosout_agg [rosgraph_msgs/Log] 1 publisher * /camera/image_raw/compressedDepth/parameter_descriptions [dynamic_reconfigure/ConfigDescription] 1 publisher * /sh_rfj4_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /camera/image_raw/compressedDepth/parameter_updates [dynamic_reconfigure/Config] 1 publisher * /r_arm_cartesian_pose_controller/state/error [geometry_msgs/Twist] 1 publisher * /r_arm_cartesian_pose_controller/state/pose [geometry_msgs/PoseStamped] 1 publisher * /camera/image_raw/theora/parameter_updates [dynamic_reconfigure/Config] 1 publisher * /sh_rfj0_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /camera/image_raw/compressed/parameter_updates [dynamic_reconfigure/Config] 1 publisher * /gazebo/joint_states [sensor_msgs/JointState] 1 publisher * /thdistal_bumper [gazebo_msgs/ContactsState] 1 publisher * /sh_lfj4_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /sh_ffj3_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /sh_thj1_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /ffdistal_bumper [gazebo_msgs/ContactsState] 1 publisher * /thhub_bumper [gazebo_msgs/ContactsState] 1 publisher * /gazebo/link_states [gazebo_msgs/LinkStates] 1 publisher * /sh_mfj3_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /sh_thj4_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /sh_lfj0_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /gazebo/model_states [gazebo_msgs/ModelStates] 1 publisher * /clock [rosgraph_msgs/Clock] 1 publisher * /camera/image_raw [sensor_msgs/Image] 1 publisher * /sh_thj3_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /sh_mfj4_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /sh_wrj2_mixed_position_velocity_controller/state [sr_robot_msgs/JointControllerState] 1 publisher * /gazebo/parameter_updates [dynamic_reconfigure/Config] 1 publisher Subscribed topics: * /sh_mfj0_mixed_position_velocity_controller/command [std_msgs/Float64] 1 subscriber * /sh_lfj0_mixed_position_velocity_controller/command [std_msgs/Float64] 1 subscriber * /gazebo/set_link_state [gazebo_msgs/LinkState] 1 ...

(more)