Quantcast
Channel: ROS Answers: Open Source Q&A Forum - RSS feed
Viewing all 1441 articles
Browse latest View live

Can't find benchmark log

$
0
0
Hi I am having trouble locating the log file produced by benchmarking. Benchmarking runs successfully and says that the file is saved at this location: " /home/ben/.ros/log/f7246612-ccb8-11e4-b983-28924a3bbb97/moveit_benchmark_ben_HP_Pavilion_g7_Notebook_PC_13276_4760253108015977966-2*.log " However when I look in the folder it is supposed to be located in the file is nowhere to be found. Is there something else i have to do to ensure the log file is saved? Many Thanks Ben

Moveit! planning and collision detection with multiple robots

$
0
0
Hi everyone, I know this question did appear once in MoveIt Google Groups newsletter, but I am still curious in this topic. https://groups.google.com/forum/#!topic/moveit-users/NZfk2PfnxWM I have to make path planning for an industrial robot cell with ROS and I thought it would be a good idea to setup all of this in Rviz and Moveit first. I had the idea to make a big urdf with my robots and set up the environment in this. I attached the base links of all parts to a virtual "world" link with planar joints. This is possible, but unfortunately I get strange collisions with my robots in free space. Does anyone have an idea why this happens? Maybe the error is due to internal MoveIt collision checks? Is this even possible or should I try to use different tf_prefixes for each robot and import the environment parts as scene objects? I would greatly appreciate any help as I am eager to fix this issue. I am sure there are more people interested in this topic. I can provide more information if necessary. Thanks! Greetings, Almin

Why does my ikfast solver work outisde of MoveIt! but not within?

$
0
0
Hi, I'm steadily making progress with my project to control a 3DOF arm but there is this problem that been annoying me for the last couple of days. I'm trying to make a ikfast plugin for MoveIt! following the official tutorial. Everything seems to be working well, I test the solver using the compute program as instructed [here (section 6)]( http://wiki.ros.org/Industrial/Tutorials/Create_a_Fast_IK_Solution ) and everything seems to be working fine. I first test by using the fk solver, I then use the position returned by the fk solver to test the ik solver. As you can see, it seems to work well. ![image description](/upfiles/1426750244940220.png) When I proceed to build the moveit plugin however and attempt to move the robot arm in a python script, the planning fails - as shown below. I've tried everything, I've tried setting the tolerances higher, I've tried using the same pose returned by get current pose. Nothing seems to work. ![image description](/upfiles/14267502681382096.png) Here is the code I'm using: ![image description](/upfiles/14267503326170323.png) Does anyone know what the problem might be? I'm kind of stuck at the moment. Billy ifast plugin tutorial: http://wiki.ros.org/Industrial/Tutorials/Create_a_Fast_IK_Solution python commander tutorial: http://docs.ros.org/indigo/api/pr2_moveit_tutorials/html/planning/scripts/doc/move_group_python_interface_tutorial.html

move_base and object manipulation

$
0
0
We have a square-shaped differential drive robot with two grippers installed at its corners. We want to use it for gripping cylinder-like objects in a relatively narrow space environment. The problem is that move_base is able only to construct and follow path from the center of the robot to any point, as far as I know, but not from robot's gripper to the object. Is there any way to change the behavior of move_base or use Moveit! with diff drive robot? ![image description](/upfiles/14267648457129459.jpg)

Grasp a box with youbot

$
0
0
Hello I am currently trying to grasp several small boxes with the youbot. I have set it up with MoveIt, but I cannot figure out how to give it valid a valid pose. I am not concerning myself with proper object recognition(via sensors), so I am trying to get the object position from Gazebo and give it to MoveIt to move the arm next to the box. Currently I am getting the position of the box using the GetModelState service call. But if I feed the pose it returns me to moveit it once again tells me that I have specified a wrong pose. Here is the code: robot = moveit_commander.RobotCommander() scene = moveit_commander.PlanningSceneInterface() arm = moveit_commander.MoveGroupCommander("arm") def listener(): rospy.init_node('listener',anonymous=True) rospy.wait_for_service("/gazebo/get_model_state") try: gms = rospy.ServiceProxy("/gazebo/get_model_state",GetModelState) response = gms("box","youbot::arm_link_5") youbot_node.plan(response) except rospy.ServiceException, e: print "Service call failsed: %s"%e def plan(targetPose): pose_target = geometry_msgs.msg.PoseStamped() pose_target.header.stamp = rospy.Time.now() pose_target.header.frame_id = "/odom" pose_target.pose = targetPose.pose print "=============================" print pose_target arm.go(pose_target) So any idea what I should do to move my arm to the proper position, and then grasp the box?

Has anyone been able to create a IKFast plugin for a Cyton robotic arm?

$
0
0
I keep on getting the following error: "Joint numbers mismatch: URDF has 7 and IKFast has 6" and I have defined a --freeindex

Error when trying to connect with robot controller

$
0
0
I have installed MotoROS into my Motoman robot controller, but when I try to connect it with doing: Warehouse Host: 192.168.255.1 (controller ip) and port: 50240 I get this error DBClientCursor::init call() failed [ERROR] [1427203508.542909786]: Exception caught while processing action 'connect to database' And Warehouse Host: 192.168.255.1 (controller ip) and port: 50241 I get: Tue Mar 24 08:33:16.723 ERROR: MessagingPort::call() wrong id got:1 expect:3 toSend op: 2004 response msgid:15 response len: 144 response op: 0 remote: 192.168.255.1:50241 Tue Mar 24 08:33:16.723 Assertion failure false src/mongo/util/net/message_port.cpp 246 0xa29b5540 0xa29b6918 0xa29ab744 0xa29bc5df 0xa29bc8a1 0xa296675d 0xa29873a5 0xa29654c4 0xa296d97f 0xa29656b2 0xa2965bf2 0xa296a9da 0xa296aaeb 0xa29624f4 0xa2ea0cce 0xa2ea7a4c 0xa2e922b7 0xa2e925f2 0xa3190dc3 0xa3164e91 /opt/ros/indigo/lib/libwarehouse_ros.so(_ZN5mongo15printStackTraceERSo+0x30) [0xa29b5540] /opt/ros/indigo/lib/libwarehouse_ros.so(_ZN5mongo10logContextEPKc+0x58) [0xa29b6918] /opt/ros/indigo/lib/libwarehouse_ros.so(_ZN5mongo12verifyFailedEPKcS1_j+0xd4) [0xa29ab744] /opt/ros/indigo/lib/libwarehouse_ros.so(_ZN5mongo13MessagingPort4recvERKNS_7MessageERS1_+0x2af) [0xa29bc5df] /opt/ros/indigo/lib/libwarehouse_ros.so(_ZN5mongo13MessagingPort4callERNS_7MessageES2_+0x41) [0xa29bc8a1] /opt/ros/indigo/lib/libwarehouse_ros.so(_ZN5mongo18DBClientConnection4callERNS_7MessageES2_bPSs+0x3d) [0xa296675d] /opt/ros/indigo/lib/libwarehouse_ros.so(_ZN5mongo14DBClientCursor4initEv+0xb5) [0xa29873a5] /opt/ros/indigo/lib/libwarehouse_ros.so(_ZN5mongo12DBClientBase5queryERKSsNS_5QueryEiiPKNS_7BSONObjEii+0x244) [0xa29654c4] /opt/ros/indigo/lib/libwarehouse_ros.so(_ZN5mongo18DBClientConnection5queryERKSsNS_5QueryEiiPKNS_7BSONObjEii+0x7f) [0xa296d97f] /opt/ros/indigo/lib/libwarehouse_ros.so(_ZN5mongo17DBClientInterface5findNERSt6vectorINS_7BSONObjESaIS2_EERKSsNS_5QueryEiiPKS2_i+0x92) [0xa29656b2] /opt/ros/indigo/lib/libwarehouse_ros.so(_ZN5mongo17DBClientInterface7findOneERKSsRKNS_5QueryEPKNS_7BSONObjEi+0x92) [0xa2965bf2] /opt/ros/indigo/lib/libwarehouse_ros.so(_ZN5mongo20DBClientWithCommands10runCommandERKSsRKNS_7BSONObjERS3_i+0x9a) [0xa296a9da] /opt/ros/indigo/lib/libwarehouse_ros.so(_ZN5mongo18DBClientConnection10runCommandERKSsRKNS_7BSONObjERS3_i+0x3b) [0xa296aaeb] /opt/ros/indigo/lib/libwarehouse_ros.so(_ZN5mongo20DBClientWithCommands5countERKSsRKNS_7BSONObjEiii+0x134) [0xa29624f4] /opt/ros/indigo/lib/libmoveit_warehouse.so(_ZN9mongo_ros17MessageCollectionIN11moveit_msgs14PlanningScene_ISaIvEEEE10initializeERKSsS7_S7_jf+0x29e) [0xa2ea0cce] /opt/ros/indigo/lib/libmoveit_warehouse.so(_ZN9mongo_ros17MessageCollectionIN11moveit_msgs14PlanningScene_ISaIvEEEEC2ERKSsS7_S7_jf+0x20c) [0xa2ea7a4c] /opt/ros/indigo/lib/libmoveit_warehouse.so(_ZN16moveit_warehouse20PlanningSceneStorage17createCollectionsEv+0x77) [0xa2e922b7] /opt/ros/indigo/lib/libmoveit_warehouse.so(_ZN16moveit_warehouse20PlanningSceneStorageC1ERKSsjd+0x72) [0xa2e925f2] /opt/ros/indigo/lib/libmoveit_motion_planning_rviz_plugin_core.so(_ZN18moveit_rviz_plugin19MotionPlanningFrame35computeDatabaseConnectButtonClickedEv+0x203) [0xa3190dc3] /opt/ros/indigo/lib/libmoveit_motion_planning_rviz_plugin_core.so(_ZN5boost6detail8function26void_function_obj_invoker0INS_3_bi6bind_tIvNS_4_mfi3mf0IvN18moveit_rviz_plugin19MotionPlanningFrameEEENS3_5list1INS3_5valueIPS8_EEEEEEvE6invokeERNS1_15function_bufferE+0x21) [0xa3164e91] [ERROR] [1427203996.729533547]: Exception caught while processing action 'connect to database' I don't know how to fix it. Thank you.

moveit inverse_kinematics C++ API

$
0
0
I have been trying to use the inverse kinematic from the moveit package on my URDF hand model. I have used the setup "moveit setup assistance" to generate all the configuration files necessary and I have tried out the demo.launch which is generated by the config assistant and tried out some planning. All works fine. What I am trying to do is to move the fingers of my model via the [moveit C++ API](http://docs.ros.org/hydro/api/pr2_moveit_tutorials/html/kinematics/src/doc/kinematics_tutorial.html). Before going into the specifics of my problem, here is the setup for the index finger: ![Hand model URDF](/upfiles/14272099893621726.png) The index has 4 Revolute joints and one fixed joint at the tip of the finger. I have created two groups, one is index and the other is index_tip as suggested in this [tutorial](http://moveit.ros.org/wiki/PR2/Setup_Assistant/Quick_Start). The last fixed joint is the which I want to use as the tip for the target of the inverse kinematics. Eigen::Affine3d target = kinematic_state->getGlobalLinkTransform("index_dof3_joint"); target(0,3) = target(0,3) + dx; target(1,3) = target(1,3) + dx; target(2,3) = target(2,3) + dx; if(kinematic_state->setFromIK(joint_model_group[INDEX],target,5,0.1)) When I run this the value returned from setFromIK is **false** and fails to find a solution. Now the distance between the current position and target is very small, so I don't think the solution is unfeasible. I have also set in my kinematics.yaml file "position_only_ik: True", since I only want to do position IK on the finger tip. It does return true when the target is equal to the current and no motion is required. There are a few things that I have not quite understood yet. In the moveit setup assistant I am told to create two groups, one for the chain an one for the end-effector. However I do not see how this relation is used in the Moveit C++ API. Also if someone knows how to to set a parameter similar to "position_only_ik" for KDL I would be grateful.

Problem with pick and place

$
0
0
Dear all: Now I am using Moveit to try Pick-and-Place using the UBR-1 Perception Pipeline. I want to detect the object and using fake arm to pick it. Every thing running is Ok now, but the arm cannot to move when I rosrun the real_pick_and_place. py.[link text](https://github.com/pirobot/rbx2/blob/hydro-devel/rbx2_arm_nav/scripts/real_pick_and_place.py)(I change the joint name to my own robot, and others not change) MOVEIT give me the following information: [ WARN] [1427382424.384843024]: All supplied grasps failed. Retrying last grasp in verbose mode.[ INFO] [1427382424.385064701]: Re-added last failed plan for pipeline 'pick'. Queue is now of size 1[ INFO] [1427382424.440629389]: IK failed[ INFO] [1427382424.550250480]: Sampler failed to produce a state[ INFO] [1427382424.550305236]: Manipulation plan 6 failed at stage 'reachable & valid pose filter' on thread 2[ INFO] [1427382424.550887476]: Pickup planning completed after 0.380653 seconds[ INFO] [1427382424.550887476]: Pickup planning completed after 0.380653 seconds[ INFO] [1427382427.559309342]: Combined planning and execution request received for MoveGroup action. Forwarding to planning and execution pipeline.[ INFO] [1427382427.559569041]: Planning attempt 1 of at most 1[ INFO] [1427382427.561431598]: RRTConnect: Starting with 1 states[ INFO] [1427382427.576248357]: RRTConnect: Created 4 states (2 start + 2 goal)[ INFO] [1427382427.576450160]: Solution found in 0.015339 seconds[ INFO] [1427382427.576672882]: Path simplification took 0.000019 seconds[ INFO] [1427382429.783690405]: Combined planning and execution request received for MoveGroup action. Forwarding to planning and execution pipeline.[ INFO] [1427382429.783846634]: Goal constraints are already satisfied. No need to plan or execute any motions I really cannot understand what is wrong. Could anyone give me some suggestions? I use Ubuntu12.04 hydro Many thanks,

Using moveit! alongside ros_contol

$
0
0
Hi guys, I want to use moveit! with my simulated robot over Gazebo 2.2 and ROS indigo. So, I've launched moveit! setup assistant, made a configuration package for my custom robot and changed my 'ros_control' controllers to be of type: "position_controllers/JointTrajectoryController", like so (this is my yaml file): arm_controller: type: "position_controllers/JointTrajectoryController" joints: - komodo_base_rotation_joint - komodo_shoulder_joint - komodo_elbow1_joint - komodo_elbow2_joint - komodo_wrist_joint gains: komodo_base_rotation_joint: {p: 400.0, d: 0.0, i: 0.0, i_clamp: 0.0} komodo_shoulder_joint: {p: 400.0, d: 0.0, i: 0.0, i_clamp: 0.0} komodo_elbow1_joint: {p: 700.0, d: 0.0, i: 0.0, i_clamp: 0.0} komodo_elbow2_joint: {p: 700.0, d: 0.0, i: 0.0, i_clamp: 0.0} komodo_wrist_joint: {p: 400.0, d: 0.0, i: 0.0, i_clamp: 0.0} From here, I launched Gazebo with my robot (as usual), the controllers loaded successfully, with the following topics: /komodo/arm_controller/command /komodo/arm_controller/follow_joint_trajectory/cancel /komodo/arm_controller/follow_joint_trajectory/feedback /komodo/arm_controller/follow_joint_trajectory/goal /komodo/arm_controller/follow_joint_trajectory/result /komodo/arm_controller/follow_joint_trajectory/status /komodo/arm_controller/state Now, when I launch "moveit_planing_execution" I get these errors: [ INFO] [1427391777.591530773, 16.714000000]: MoveitSimpleControllerManager: Waiting for arm/joint_trajectory_action to come up [ INFO] [1427391782.603431714, 21.714000000]: MoveitSimpleControllerManager: Waiting for arm/joint_trajectory_action to come up [ERROR] [1427391787.615310407, 26.714000000]: MoveitSimpleControllerManager: Action client not connected: arm/joint_trajectory_action [ INFO] [1427391787.683849921, 26.782000000]: Returned 0 controllers in list [ INFO] [1427391787.699500489, 26.797000000]: Trajectory execution is managing controllers Rviz then launches, and I can plan trajectories, However once I attempt to execute them, I get: [ INFO] [1427393489.592196869, 62.858000000]: Returned 0 controllers in list [ERROR] [1427393489.592233438, 62.858000000]: Unable to identify any set of controllers that can actuate the specified joints: [ komodo_base_rotation_joint komodo_elbow1_joint komodo_elbow2_joint komodo_shoulder_joint komodo_wrist_joint ] [ERROR] [1427393489.592254160, 62.858000000]: Known controllers and their joints: [ERROR] [1427393489.592284538, 62.858000000]: Apparently trajectory initialization failed Obviously, I'm missing something here.. 1. Am I responsible to implement 'JointTrajectoryAction' server? Isn't 'ros_control' implement it for me, by choosing "JointTrajectoryController" type? 2. If I do need to create one myself, can someone please point me to a simple example? 3. Can someone please elaborate on how Moveit! should interface with ros_control? Many Thanks, David

Angular movement with Moveit?

$
0
0
Hello, I would like to move my robot directly from Moveit, giving just the joints' degrees. Is that possible without a kinematic transformation? Thank you!

pluginlib/class_loader does not load the correct class.

$
0
0
Hi all, For background, I'm trying to create two IKFast plugins for MoveIt! The problem I have is that MoveIt! only loads and uses one of the plugins. (I have confirmed this with print statements and have followed the trail all the way down to this [line (github source code)](https://github.com/ros-planning/moveit_ros/blob/indigo-devel/planning/kinematics_plugin_loader/src/kinematics_plugin_loader.cpp#L145) of the "kinematics_plugin_loader.cpp" file of MoveIt! This is the line of code: result.reset(kinematics_loader_->createUnmanagedInstance(it->second[i])); It uses the `pluginlib::ClassLoader` of ROS. To try and figure what is going on, I place some print statements around the code. I print out the library path and the argument name and everything looks OK (The names are different and the library paths are different). Yet when I call the method - named "testing" - of each library. They output the same message. What they should do is output different messages. So, it clearly executing the same library... But this is strange because I print out the library path and its different... I have no idea what going on... Can anyone help? Billy The code looks like this : ROS_INFO_STREAM("trying to load - "<second[i]); result.reset(kinematics_loader_->createUnmanagedInstance(it->second[i])); result->testing(); ROS_INFO_STREAM("printing path - "<getClassLibraryPath(it->second[i])); ROS_INFO_STREAM("after - "<second[i]); The output looks like this: [ INFO] [1427495868.777012914]: rviz version 1.11.7 [ INFO] [1427495868.777129943]: compiled against OGRE version 1.8.1 (Byatis) [ INFO] [1427495868.919105126]: Stereo is NOT SUPPORTED [ INFO] [1427495868.919228039]: OpenGl version: 3 (GLSL 1.3). [ INFO] [1427495869.578403687]: trying to load - thex3_l1_kinematics/IKFastKinematicsPlugin [ INFO] [1427495869.629037635]: this is a test plugin 1 [ INFO] [1427495869.675017046]: printing path - /home/billy/moveit/devel/lib//libthex3_l1_moveit_ikfast_plugin.so [ INFO] [1427495869.675101183]: after - thex3_l1_kinematics/IKFastKinematicsPlugin [ INFO] [1427495869.681656644]: this is a test plugin 1 [ INFO] [1427495869.681832825]: trying to load - thex3_r2_kinematics/IKFastKinematicsPlugin [ INFO] [1427495869.681905655]: this is a test plugin 1 [ INFO] [1427495869.730896859]: printing path - /home/billy/moveit/devel/lib//libthex3_r2_moveit_ikfast_plugin.so [ INFO] [1427495869.730995835]: after - thex3_r2_kinematics/IKFastKinematicsPlugin [ INFO] [1427495869.737139491]: this is a test plugin 1 [ INFO] [1427495871.880978103]: Publishing maintained planning scene on 'monitored_planning_scene' [ INFO] [1427495871.891378640]: MoveGroup debug mode is ON

[2D Navigation (3D Outdoor, Hills etc...) ] What package to use?

$
0
0
Hi, I would like to know about the best ways to navigate with 2D in a 3D Environment (Outdoor) (GPS, IMU, Odometry). Is nav2D still state of the art or is using something else more recommended? Is there a way to navigate a robot with MoveIt? Examples? Thanks!

MotionPlanning in Moveit only partly works?

$
0
0
Hello List, Using Indigo I created a setup with moveit setup assistent and an urdf for our crustcrawler arm. The urdf is adapted from the smart_arm_robot.xacro from ua-ros-pkg. The urdf works fine using rviz and joint_state_publisher. But with Planning Request in Moveit/Rviz the eef-joint (wrist_roll_joint) gets DETACHED from the rest of the arm. Normally the rest of the arm should follow, but it does NOT move while the (moved) eff-joint immediatly turns red. The moveit-command however DOES work. I can see the moves in Rviz when I give e.g. "go rand". Also the pr2 example does work perfectly. You can find my setup in http://fwn06.housing.rug.nl/ros I only used the setup wizard and used an urdf I am fairly confidant about. Why does the planning in MotionPlanning not work ? Thanks in advance, Sietse

Cannot find controller (following PR2/Gazebo/Quick Start recipe)

$
0
0
Using this recipe (with Indigo) from http://moveit.ros.org/wiki/PR2/Gazebo/Quick_Start I try to get my (crustcrawler/dynamixel) arm working in gazebo. For my complete config see http://fwn06.housing.rug.nl/ros/my_movit. I start gazebo and then "roslaunch my_movit smart_arm_moveit_planning_execution.launch" During the start I get the following error:
       ........
[ INFO] [1427716093.344226043, 51.360000000]: MoveitSimpleControllerManager: Waiting for arm_controller/follow_joint_trajectory to come up
[ INFO] [1427716096.761115168, 54.769000000]: Loading robot model 'smart_arm'...
[ INFO] [1427716096.761200375, 54.769000000]: No root joint specified. Assuming fixed joint
[ERROR] [1427716098.358135532, 56.360000000]: MoveitSimpleControllerManager: Action client not connected: arm_controller/follow_joint_trajectory
    .......
My controller.yaml is
controller_manager_ns: smart_arm_controller_manager
controller_list:
 - name: arm_controller
   action_ns: follow_joint_trajectory
   type: FollowJointTrajectory
   default: true
   joints:
      [ shoulder_pan_joint, shoulder_pitch_joint, elbow_flex_joint,  wrist_roll_joint ]
The setting of name and action_ns is a bit of a guess, and I think that the question is how to connect this to the description in my smart_arm.urdf. Does it has to do with the value of robotSimType in the gazebo-plugin setting? Can anybody give me a pointer? Thanks in advance, Sietse

simple FIFO stack (queue) for MoveIt in ROS

$
0
0
Hi, I want to use a simple queue (FIFO stack) to give a list of waypoints to MoveIt. I looked at the tutorial : [Callbacks_and_Spinning](http://wiki.ros.org/roscpp/Overview/Callbacks%20and%20Spinning) and the class [CallbackQueue](http://docs.ros.org/diamondback/api/roscpp/html/classros_1_1CallbackQueue.html) but it looks like we can use it only with Publisher/Subscriber. Is there any existing simple queue or must I create it from array? Thanks

moveit robotiq gripper Inappropriate ioctl for device

$
0
0
Hi, I am trying to add the robotiq 3 finger gripper to my Husky description The visualization in Rviz is good but I got this error when I launch moveit : [tcsetpgrp failed in terminal_inferior: Inappropriate ioctl for device] I added the non-fixed joints of the gripper in the passive joints of the urdf. What do I need to add? I tried to reconfigure MoveIt params with the moveit assistant, but I still got the ioctl error. Any idea? Thanks

MoveIt! 2DOF Robot

$
0
0
Hi all, I am trying to complete a small project with a 2 DOF planar manipulator. I decided to use MoveIt! for path planning, and will ultimately add a series of points for the robot to move to using a Cartesian trajectory. As shown below, in the MoveIt demo after successfully importing my URDF a random, valid pose can be chosen and a path planned to it: ![image description](/upfiles/14282415973794625.png) In my cpp code it appears that I have to specify each piece of the pose (xyz/rpy). Thus, since I only care about the xy position and not any other parameters, I don't want to set that in this segment of my code: geometry_msgs::Pose target_pose1; target_pose1.position.x = 0.20; target_pose1.position.y = 0.25; group.setPoseTarget(target_pose1); moveit::planning_interface::MoveGroup::Plan my_plan; bool success = group.plan(my_plan); Do any options exist for me to query a valid pose for the robot with x and y specified, while simultaneously not caring about the final z (constant) or orientation? Thanks!

Problem converting simple urdf file in collada

$
0
0
Hi all, I have a problem converting a very simple urdf file in collada (.dae) to use ikfast. I have a more complicated robot but I started to have this error even with a very simple urdf file: I/O error : No such file or directory I/O error : No such file or directory error : xmlNewTextWriterFilename : cannot open uri Document successfully written to prova.dae but the prova.dae file does not exist. The prova.urdf file that I am trying to convert is: so just pure kinematics. I am using ros indigo with openrave compiled from source (latest_stable branch). I am using the command: rosrun collada_urdf urdf_to_collada prova.urdf prova.dae in the same folder of the urdf file. My machine is running Ubuntu 14.04. thanks for your help!

Raspbian Jessie ROS INDIGO download image

$
0
0
Hello all, during christmas vacation I compiled ROS INDIGO on a Raspbian Jessie image with the following features / packages installed: C-BERRY TFT framebuffer driver
ROS INDIGO
- ROS base
- RQT
- imageview
- geometry
- moveit
- rviz
- robot model
Here is the link for downloading:
https://drive.google.com/open?id=0Bzu4fg52rneFX1V3REhKTmM2VWc&authuser=0
Viewing all 1441 articles
Browse latest View live


Latest Images

<script src="https://jsc.adskeeper.com/r/s/rssing.com.1596347.js" async> </script>