instruction
stringlengths
40
28.9k
Hi, I followed the instructions to install the uvc_cam and pi_face_tracker but I have a problem installing pi_vision package. What should I do? The problem, I think, is that rosmake doesn't build all the packages required: tim@ubuntu:~/fuerte_workspace/sandbox$ rosmake pi_vision [ rosmake ] rosmake starting... [ rosmake ] Packages requested are: ['pi_vision'] [ rosmake ] Logging to directory /home/tim/.ros/rosmake/rosmake_output-20140205-151624 [ rosmake ] Expanded args ['pi_vision'] to: ['ros2opencv', 'pi_face_tracker_gui', 'pi_face_tracker'] [rosmake-0] Starting >>> geometry_msgs [ make ] [rosmake-0] Finished <<< geometry_msgs No Makefile in package geometry_msgs [rosmake-0] Starting >>> sensor_msgs [ make ] [rosmake-0] Finished <<< sensor_msgs No Makefile in package sensor_msgs [rosmake-0] Starting >>> rosbuild [ make ] [rosmake-0] Finished <<< rosbuild No Makefile in package rosbuild [rosmake-0] Starting >>> roslib [ make ] [rosmake-1] Starting >>> rosconsole [ make ] [rosmake-2] Starting >>> message_filters [ make ] [rosmake-0] Finished <<< roslib No Makefile in package roslib [rosmake-1] Finished <<< rosconsole No Makefile in package rosconsole [rosmake-1] Starting >>> roslang [ make ] [rosmake-1] Finished <<< roslang No Makefile in package roslang [rosmake-3] Starting >>> common_rosdeps [ make ] [rosmake-2] Finished <<< message_filters No Makefile in package message_filters [rosmake-1] Starting >>> roscpp [ make ] [rosmake-0] Starting >>> pluginlib [ make ] [rosmake-3] Finished <<< common_rosdeps ROS_NOBUILD in package common_rosdeps [rosmake-1] Finished <<< roscpp No Makefile in package roscpp [rosmake-0] Finished <<< pluginlib ROS_NOBUILD in package pluginlib [rosmake-3] Starting >>> ogre [ make ] [rosmake-3] Finished <<< ogre ROS_NOBUILD in package ogre [rosmake-3] Starting >>> ogre_tools [ make ] [rosmake-2] Starting >>> rostest [ make ] [rosmake-3] Finished <<< ogre_tools ROS_NOBUILD in package ogre_tools [rosmake-3] Starting >>> orocos_kdl [ make ] [rosmake-3] Finished <<< orocos_kdl ROS_NOBUILD in package orocos_kdl [rosmake-2] Finished <<< rostest No Makefile in package rostest [rosmake-0] Starting >>> image_transport [ make ] [rosmake-0] Finished <<< image_transport ROS_NOBUILD in package image_transport [rosmake-0] Starting >>> polled_camera [ make ] [rosmake-0] Finished <<< polled_camera ROS_NOBUILD in package polled_camera [rosmake-0] Starting >>> camera_calibration_parsers [ make ] [rosmake-0] Finished <<< camera_calibration_parsers ROS_NOBUILD in package camera_calibration_parsers [rosmake-0] Starting >>> bullet [ make ] [rosmake-2] Starting >>> camera_info_manager [ make ] [rosmake-2] Finished <<< camera_info_manager ROS_NOBUILD in package camera_info_manager [rosmake-1] Starting >>> python_orocos_kdl [ make ] [rosmake-1] Finished <<< python_orocos_kdl ROS_NOBUILD in package python_orocos_kdl [rosmake-3] Starting >>> kdl [ make ] [rosmake-0] Finished <<< bullet ROS_NOBUILD in package bullet [rosmake-1] Starting >>> angles [ make ] [rosmake-2] Starting >>> rospy [ make ] [rosmake-2] Finished <<< rospy No Makefile in package rospy [rosmake-2] Starting >>> mk [ make ] [rosmake-1] Finished <<< angles ROS_NOBUILD in package angles [rosmake-1] Starting >>> std_msgs [ make ] [rosmake-1] Finished <<< std_msgs No Makefile in package std_msgs [rosmake-1] Starting >>> rosservice [ make ] [rosmake-0] Starting >>> roswtf [ make ] [rosmake-3] Finished <<< kdl ROS_NOBUILD in package kdl No Makefile in package kdl [rosmake-3] Starting >>> diagnostic_msgs [ make ] [rosmake-3] Finished <<< diagnostic_msgs No Makefile in package diagnostic_msgs [rosmake-3] Starting >>> diagnostic_updater [ make ] [rosmake-1] Finished <<< rosservice No Makefile in package rosservice [rosmake-2] Finished <<< mk No Makefile in package mk [rosmake-2] Starting >>> ros2opencv [ make ] [rosmake-1] Starting >>> dynamic_reconfigure [ make ] [rosmake-1] Finished <<< dynamic_reconfigure ROS_NOBUILD in package dynamic_reconfigure [rosmake-0] Finished <<< roswtf No Makefile in package roswtf [rosmake-3] Finished <<< diagnostic_updater ROS_NOBUILD in package diagnostic_updater [rosmake-3] Starting >>> self_test [ make ] [rosmake-3] Finished <<< self_test ROS_NOBUILD in package self_test [rosmake-3] Starting >>> pi_face_tracker [ make ] [rosmake-0] Starting >>> tf [ make ] [rosmake-0] Finished <<< tf ROS_NOBUILD in package tf [rosmake-0] Starting >>> eigen_conversions [ make ] [rosmake-1] Starting >>> driver_base [ make ] [rosmake-0] Finished <<< eigen_conversions ROS_NOBUILD in package eigen_conversions [rosmake-0] Starting >>> pi_face_tracker_gui [ make ] [rosmake-1] Finished <<< driver_base ROS_NOBUILD in package driver_base [rosmake-1] Starting >>> uvc_cam [ make ] [ rosmake ] All 21 linesos2opencv: 0.7 sec ] [ pi... [ 4 Active 34/39 Complete ] {------------------------------------------------------------------------------- mkdir -p bin cd build && cmake -Wdev -DCMAKE_TOOLCHAIN_FILE=`rospack find rosbuild`/rostoolchain.cmake .. [rosbuild] Building package ros2opencv Failed to invoke /opt/ros/fuerte/bin/rospack deps-manifests ros2opencv [rospack] Error: package/stack ros2opencv depends on non-existent package opencv2 CMake Error at /opt/ros/fuerte/share/ros/core/rosbuild/public.cmake:129 (message): Failed to invoke rospack to get compile flags for package 'ros2opencv'. Look above for errors from rospack itself. Aborting. Please fix the broken dependency! Call Stack (most recent call first): /opt/ros/fuerte/share/ros/core/rosbuild/public.cmake:203 (rosbuild_invoke_rospack) CMakeLists.txt:12 (rosbuild_init) -- Configuring incomplete, errors occurred! -------------------------------------------------------------------------------} [ rosmake ] Output from build of package ros2opencv written to: [ rosmake ] /home/tim/.ros/rosmake/rosmake_output-20140205-151624/ros2opencv/build_output.log [rosmake-2] Finished <<< ros2opencv [FAIL] [ 0.83 seconds ] [ rosmake ] Halting due to failure in package ros2opencv. [ rosmake ] Waiting for other threads to complete. [ rosmake ] All 21 linesi_face_tracker: 0.8 sec ]... [ 3 Active 34/39 Complete ] {------------------------------------------------------------------------------- mkdir -p bin cd build && cmake -Wdev -DCMAKE_TOOLCHAIN_FILE=`rospack find rosbuild`/rostoolchain.cmake .. [rosbuild] Building package pi_face_tracker Failed to invoke /opt/ros/fuerte/bin/rospack deps-manifests pi_face_tracker [rospack] Error: package/stack ros2opencv depends on non-existent package opencv2 CMake Error at /opt/ros/fuerte/share/ros/core/rosbuild/public.cmake:129 (message): Failed to invoke rospack to get compile flags for package 'pi_face_tracker'. Look above for errors from rospack itself. Aborting. Please fix the broken dependency! Call Stack (most recent call first): /opt/ros/fuerte/share/ros/core/rosbuild/public.cmake:203 (rosbuild_invoke_rospack) CMakeLists.txt:12 (rosbuild_init) -- Configuring incomplete, errors occurred! -------------------------------------------------------------------------------} [ rosmake ] Output from build of package pi_face_tracker written to: [ rosmake ] /home/tim/.ros/rosmake/rosmake_output-20140205-151624/pi_face_tracker/build_output.log [rosmake-3] Finished <<< pi_face_tracker [FAIL] [ 0.83 seconds ] [ rosmake ] Halting due to failure in package pi_face_tracker. [ rosmake ] Waiting for other threads to complete. [ rosmake ] All 21 lines {------------------------------------------------------------------------------- mkdir -p bin cd build && cmake -Wdev -DCMAKE_TOOLCHAIN_FILE=`rospack find rosbuild`/rostoolchain.cmake .. [rosbuild] Building package pi_face_tracker_gui Failed to invoke /opt/ros/fuerte/bin/rospack deps-manifests pi_face_tracker_gui [rospack] Error: package/stack pi_face_tracker_gui depends on non-existent package rosbridge CMake Error at /opt/ros/fuerte/share/ros/core/rosbuild/public.cmake:129 (message): Failed to invoke rospack to get compile flags for package 'pi_face_tracker_gui'. Look above for errors from rospack itself. Aborting. Please fix the broken dependency! Call Stack (most recent call first): /opt/ros/fuerte/share/ros/core/rosbuild/public.cmake:203 (rosbuild_invoke_rospack) CMakeLists.txt:12 (rosbuild_init) -- Configuring incomplete, errors occurred! -------------------------------------------------------------------------------} [ rosmake ] Output from build of package pi_face_tracker_gui written to: [ rosmake ] /home/tim/.ros/rosmake/rosmake_output-20140205-151624/pi_face_tracker_gui/build_output.log [rosmake-0] Finished <<< pi_face_tracker_gui [FAIL] [ 0.83 seconds ] [ rosmake ] Halting due to failure in package pi_face_tracker_gui. [ rosmake ] Waiting for other threads to complete. [rosmake-1] Finished <<< uvc_cam [PASS] [ 3.04 seconds ] [ rosmake ] Results: [ rosmake ] Built 38 packages with 3 failures. [ rosmake ] Summary output to directory [ rosmake ] /home/tim/.ros/rosmake/rosmake_output-20140205-151624 Thanks Originally posted by timgivois on ROS Answers with karma: 1 on 2014-02-05 Post score: 0
Hello ROS community ! I have question about Time in ROS (I'm in Fuerte on Ubuntu 12.04). Let me explain the situation : I have a basic simulator written with ROS, that receive an /action topic, publish a /perception topic, with the relevant custom messages. On the other hand, I have two nodes, a Perceptive one, that transform perception into state, and a Controller that use state and compute an action, that is sent to the simulator. The connection is : Simulator -> /perceptiontopic -> (Percept -> /state -> Controller) -> /action -> Simulator All my nodes are firing Timers at a certain NODERATE that trigger (or not): world update for the Simulator : if the relevant time in second has gone, the world changes. The world change is independent from the NODERATE itself has the world evolution has its own "dynamic". Perception update and State publishing for the perceptive node : if we received a /perception message or some time in second has gone, we publish a /state message. The involved durations are also independent from NODERATE. Action computation for the Controller. When it receives a /state message, it computes the action message and publish it to the simulator. I'm wondering about the time consistency as my simulator doesn't publish a /clock topic (nor my others nodes subscribe to /clock). I had the same NODERATE for the simulator and others nodes and a certain behavior. I changed the Perceptive and Controller nodes' NODERATE (lower than simulation one) and now the behaviour is different. In my understanding, it shouldn't as the time aspects of my nodes are supposed to be independent. So : Is it necessary to have a /clock (from the simulator) to ensure time consistency between nodes that commuicate together ? If so, what time should my simulator publish ? A ros::Time::now() (+/use_sim_time setup) ? How my perceptive and control nodes handle that ? Should they explicitly subscribe to /clock and have a callback on that ? What's the difference with my ros::Timer ? I understand that no realtime is guaranteed with such tools, but what is the range of frequency / period ROS can handle without risk of inconsistency ? Thanks for reading, Erwan Originally posted by Erwan R. on ROS Answers with karma: 697 on 2014-02-05 Post score: 0
Hi, Tried three different computers, two different USB-2-Serial cables, but it never works. There is output on the screen, then a warning, followed by the iRobot Create being turned off with a single beep. Using ROS Hydro on Ubuntu 12.04 64-bit, with a Kinect on top of the iRobot Create. [WARN] [WallTime: 1391659582.260008] Create : robot not connected yet, sci not available The irobot_create_2_1 bumpGo.py demo DOES however work, on the same system and hardware. Full screen output here at gist.github.com / Alex-van-der-Peet / 8838247 (had to break it up, not allowed to post links). We set the environment variables specific to our robot: export TURTLEBOT_BASE=create export TURTLEBOT_STACKS=circles export TURTLEBOT_3D_SENSOR=kinect Thanks, Alex Originally posted by elrapido80 on ROS Answers with karma: 1 on 2014-02-05 Post score: 0
Hi, I have installed ROS and its packages using apt-get. I am interested to know the licenses of each package. I know that once option is to go to the wiki page of each package and check the licenses. But that could be a time taking process. I would like to know if there is way to find out the license information just from the debian files installed on my system. After a few google searches I found that license/copyright information of any installed debian binary can be found at location /usr/share/doc/XXXX/copyright . But I did not find any copyright file for any of the ROS debian binaries. For instance, at the location ' /usr/share/doc/ros-hydro-roscpp ', there is only changelog.Debian and no copyright file. I also checked the file /var/lib/dpkg/info/ros-hydro-roscpp.list, it did not mention about any copyright file. I have the following question: What would be the best way of finding the copyright/license of all the packages installed using apt-get ? Does ROS plans to add copyright information file to the debian binaires which be available when installed through apt-get ? Thanks in advance for the help. Originally posted by ss_robotics on ROS Answers with karma: 75 on 2014-02-05 Post score: 1
I'm new to Knowrob. I would like to install also the semantic map editor, and I followed the guide. Once I do rosmake knowrob_gui, I get many errors, like this: /home/lwr/Development/ros_workspace/ros/knowrob_gui/src/edu/tum/cs/ias/knowrob/map/SemanticMapEditorForms.java:589: cannot find symbol symbol : method getName() location: class controlP5.ControlEvent if(theControlEvent.getName().equals("rot_y")) { ^ /home/lwr/Development/ros_workspace/ros/knowrob_gui/src/edu/tum/cs/ias/knowrob/map/SemanticMapEditorForms.java:590: cannot find symbol symbol : class ObjectInstance location: class edu.tum.cs.ias.knowrob.map.SemanticMapEditorForms ObjectInstance cur = ((ObjectInstance) OWLThing.getOWLThingByShortname(t_id.getText())); ^ make[3]: Leaving directory `/home/lwr/Development/ros_workspace/ros/knowrob_gui/build' [ 99%] Built target _java_compile_1_12 make[3]: Entering directory `/home/lwr/Development/ros_workspace/ros/knowrob_gui/build' make[3]: Leaving directory `/home/lwr/Development/ros_workspace/ros/knowrob_gui/build' [ 99%] Built target _java_compile_1_13 make[3]: Entering directory `/home/lwr/Development/ros_workspace/ros/knowrob_gui/build' make[3]: Leaving directory `/home/lwr/Development/ros_workspace/ros/knowrob_gui/build' [ 99%] Built target _java_compile_1_14 make[3]: Entering directory `/home/lwr/Development/ros_workspace/ros/knowrob_gui/build' make[3]: Leaving directory `/home/lwr/Development/ros_workspace/ros/knowrob_gui/build' [ 99%] Built target _java_compile_1_15 make[3]: Entering directory `/home/lwr/Development/ros_workspace/ros/knowrob_gui/build' make[3]: Leaving directory `/home/lwr/Development/ros_workspace/ros/knowrob_gui/build' [ 99%] Built target _java_compile_1_16 make[3]: Entering directory `/home/lwr/Development/ros_workspace/ros/knowrob_gui/build' make[3]: Leaving directory `/home/lwr/Development/ros_workspace/ros/knowrob_gui/build' 100 errors [ 99%] Built target _java_compile_1_17 make[3]: Entering directory `/home/lwr/Development/ros_workspace/ros/knowrob_gui/build' make[3]: Leaving directory `/home/lwr/Development/ros_workspace/ros/knowrob_gui/build' make[3]: *** [../bin/edu/tum/cs/ias/knowrob/map/SemanticMapEditorForms.class] Error 1 make[3]: Leaving directory `/home/lwr/Development/ros_workspace/ros/knowrob_gui/build' make[2]: *** [CMakeFiles/_java_compile_1_53.dir/all] Error 2 make[2]: *** Waiting for unfinished jobs.... [ 99%] Built target _java_compile_1_18 make[2]: Leaving directory `/home/lwr/Development/ros_workspace/ros/knowrob_gui/build' make[1]: *** [all] Error 2 make[1]: Leaving directory `/home/lwr/Development/ros_workspace/ros/knowrob_gui/build' -------------------------------------------------------------------------------} [ rosmake ] Output from build of package knowrob_gui written to: [ rosmake ] /home/lwr/.ros/rosmake/rosmake_output-20140206-104442/knowrob_gui/build_output.log [rosmake-1] Finished <<< knowrob_gui [FAIL] [ 20.28 seconds ] [ rosmake ] Halting due to failure in package knowrob_gui. [ rosmake ] Waiting for other threads to complete. [ rosmake ] Results: [ rosmake ] Built 30 packages with 1 failures. [ rosmake ] Summary output to directory [ rosmake ] /home/lwr/.ros/rosmake/rosmake_output-20140206-104442 Can someone help me? Any suggestion is welcome! Maybe @moritz can help me :) Thank you Originally posted by Noah on ROS Answers with karma: 15 on 2014-02-05 Post score: 0
Hey there, I'm working with an ur10 arm in groovy using MoveIt. I can plan and excecute the position and orientation of the end effector without problems when i'm using rviz and moving the connectors with the mouse. But when i do the planning from c++ over the move_group interface i'm getting the warning "Orientation constraint for link 'right_arm_ee_link' is probably incorrect: 0.482316, 0.611794, 0.626960, 0.345908. Assuming identity instead." The arm moves in gazebo to the desired position but the orientation is all the time only the identity. Any thoughts? geometry_msgs::PoseStamped pose; rnd_pose.header.frame_id = "/ROBOT_BASE"; pose.pose.position.x = sensornode_.translation.x; pose.pose.position.y = sensornode_.translation.y; pose.pose.position.z = sensornode_.translation.z; pose.pose.orientation.w = sensornode_.rotation.w; pose.pose.orientation.x = sensornode_.rotation.x; pose.pose.orientation.y = sensornode_.rotation.y; pose.pose.orientation.z = sensornode_.rotation.z; group.setStartStateToCurrentState(); group.setGoalOrientationTolerance(0.1); group.setPoseTarget(pose); group.move(); Thank you, Matthias Originally posted by Equanox on ROS Answers with karma: 36 on 2014-02-06 Post score: 0
Hey Community, i'm a beginner. I need this packege: industrial_core. but sudo apt-get install industrial_core dont work. what should i do? Originally posted by sonyfuchs on ROS Answers with karma: 5 on 2014-02-06 Post score: 0
Hi RVIZ keeps segfaulting everytime i visualise a point cloud, I am not sure why. I have attached a pcd file test.jpg (text file , test.jpg rename this to test.pcd) which causes the following error in RVIZ rviz: ../../../../../src/glsl/ralloc.c:81: get_header: Assertion `info->canary == 0x5A1106' failed. Mostly it just segfaults everytime I try to visualise the pointcloud 2 rosrun pcl_ros pcd_to_pointcloud test.pcd 10 cloud_pcd:=Laser _frame_id:=/map I have been experimenting with the number of points. Set WIDTH and POINTS to N to visualise N points. When this number is 100 it segfaults and when its small I can see the pointcloud. for instance if WIDTH and POINTS = 10 then the segfault does not occur. If your gradually increase this number there is no segfault, but if you make this number large for the first time you publish the pointcloud eg 100 RVIZ segfaults Can anyone else visualise the same pointcloud? I am using ubantu 12.04 and groovy. This weird segfault error only started happening recently.... This bug started happening after I visualise a pcd file instead of a segfault and RVIZ crashing. My screen flashed several times all the task bars disappeared and screen started floating around. I had to restart my computer the fix the problem Do i need to reinstall RVIZ or ROS??? ALSO I noticed ros-groovy-rviz was updated the day before this bug started happening ... Edit Attempting to troubleshoot export LIBGL_ALWAYS_SOFTWARE=1 rosrun rviz rviz caused the following error *** glibc detected *** /opt/ros/groovy/lib/rviz/rviz: double free or corruption (!prev): 0x0000000004015ef0 *** Originally posted by Sentinal_Bias on ROS Answers with karma: 418 on 2014-02-06 Post score: 4
When I run bloom-release command, to release a package for the first time, everything goes well, until the automatic pull request to rosdistro, where i get: Failed to open pull request: KeyError - 'release'. This is what I get at the end of the file ~/.bloom_logs/bloom-release_current-date.log: [debug] /tmp/tmpIUPSBY:$ git ls-tree master:tracks.yaml [debug] /tmp/tmpIUPSBY:$ git show master:tracks.yaml [debug] Traceback (most recent call last): File "/usr/lib/pymodules/python2.7/bloom/commands/release.py", line 767, in perform_release pull_request_url = open_pull_request(track, repository, distro, ssh_pull_request) File "/usr/lib/pymodules/python2.7/bloom/commands/release.py", line 418, in open_pull_request updated_distribution_file = generate_ros_distro_diff(track, repository, distro) File "/usr/lib/pymodules/python2.7/bloom/commands/release.py", line 281, in generate_ros_distro_diff repo = distribution_dict['repositories'][repository]['release'] KeyError: 'release' [error] Failed to open pull request: KeyError - 'release' [error] SYS.EXIT Originally posted by czalidis on ROS Answers with karma: 25 on 2014-02-06 Post score: 1
Hey everyone, I am testing out some navigation software I developed and I am using AMCL for the localization and wheel odometry for its input. While I am testing I didn't want AMCL to adjust the robots position in the map, so I am publishing empty laserscans. The environment is just a large fabricated square map with no obstacles. From what I can tell, AMCL has no reason to adjust the robots position then, yet still it does. It will frequently jump around a little, from one spot over to the other. As I mentioned, there are no objects or walls nearby and the laserscans are empty, what could then be causing this jump? Best regards, Hans Originally posted by Hansg91 on ROS Answers with karma: 1909 on 2014-02-06 Post score: 0
hi , i am working with offlinedata to build gridmap using gmapping in ros. My query is why SlamGMapping::laserCallback is not getting called everytime it recieves a sensor_msgs::LaserScan. For mycase when i am publishing 107 sensor_msgs::LaserScan and 107 /tf and 107 nav_msgs::Odometry messages SlamGMapping::laserCallback is called only for 6 times for messages 0,1,18,65,78,99. tf::MessageFilter scan_filter_sub_ = new message_filters::Subscriber<sensor_msgs::LaserScan>(node_, "scan", 5); scan_filter_ = new tf::MessageFilter<sensor_msgs::LaserScan>(*scan_filter_sub_, tf_, odom_frame_, 5); scan_filter_->registerCallback(boost::bind(&SlamGMapping::laserCallback, this, _1)); SlamGMapping::laserCallback void SlamGMapping::laserCallback(const sensor_msgs::LaserScan::ConstPtr& scan) { laser_count_++; ROS_INFO("laser_count_= %d sequence =%d",laser_count_,scan->header.seq); why SlamGMapping::laserCallback is not getting called everytime it recieves sensor_msgs::LaserScan and /tf. How to make all the scans being processed. -- Thanks. Originally posted by bvbdort on ROS Answers with karma: 3034 on 2014-02-06 Post score: 1
I am very new to trying to develop my own robot arm; but work with Industrial robot arms on a normal basis. I am trying to determine how I can come up with a Kinematic model for the robot arm I develop. I need to instruct the robot to move in a linear motion relative to the end of the arm on a Cartesian coordinate system. I was curious if ROS would assists with this? I am very new to trying to work on a project like this; I am really just trying to understand how I can achieve the motion I am looking for from my 6 axis robot arm. Originally posted by DHCustomPak on ROS Answers with karma: 70 on 2014-02-06 Post score: 1
Hi there, When running the command ./src/catkin/bin/catkin_make_isolated --install I get the following error: This code block was moved to the following github gist: https://gist.github.com/answers-se-migration-openrobotics/7b5a9aed20274fa53774a1cc2568ba13 Any idea at all in what could be the problem in openni_grabber.cpp? Originally posted by TSC on ROS Answers with karma: 180 on 2014-02-06 Post score: 0
I am writing a catkin project in python. I would like to put nodes in the "node" directory, and other source files in the src/package_name directory. However when I did that and tried to import a python module in the node file (located in the node folder) from the source directory I got an error saying the module didn't exist. I couldn't find any tutorials on how to do this. Do I have to somehow tell catkin to export my src folder? Originally posted by Vladimir on ROS Answers with karma: 11 on 2014-02-06 Post score: 1
Hello, I have an external .cpp library that requires both the following libraries: atlas, llpack and lblas Now if for example, I compile using terminal (on the same machine) I can use the following: g++ main.cpp hmm.cpp -I /usr/include/atlas -L /usr/lib64/atlas/ -llapack -lblas This will work. I don't know how to include these libraries into the CMake list in ROS. I have, currently, the following: rosbuild_add_executable(build1 src/hmm.c) What would I have to add into my CMake list to make this work? Thanks Originally posted by Phorce on ROS Answers with karma: 97 on 2014-02-06 Post score: 0
Hello, Last week I updated my Ubuntu to use some new features with regards to my video card and I was already worried when I saw a lot of ros-groovy things passing by during the upgrades. Now after the upgrades it seems that Ros Groovy has been reinstalled and my setup.bash is missing from /opt/ros/groovy/ where it used to be. (my .bashrc still refers there but gives me file not found) Now I am trying to reinstall ros-groovy-desktop-full but I am getting impossible dependencies. ros-groovy-rviz is dependent on libogre-dev which is dependent on libboost1.49 but ros-groovy-rviz its other depencies depend on libboost1.53. $ sudo apt-get install ros-groovy-desktop-full Reading package lists... Done Building dependency tree Reading state information... Done Some packages could not be installed. This may mean that you have requested an impossible situation or if you are using the unstable distribution that some required packages have not yet been created or been moved out of Incoming. The following information may help to resolve the situation: The following packages have unmet dependencies: ros-groovy-desktop-full : Depends: ros-groovy-rqt-robot-plugins (= 0.3.1-0quantal-20140127-1116-+0000) but it is not going to be installed Depends: ros-groovy-visualization-tutorials (= 0.7.6-s1390816612~quantal) but it is not going to be installed Depends: ros-groovy-simulator-gazebo (= 1.7.13-s1390743952~quantal) but it is not going to be installed Depends: ros-groovy-rviz (= 1.9.34-0quantal-20140127-0905-+0000) but it is not going to be installed E: Unable to correct problems, you have held broken packages. Does anyone have any information regarding this so I can continue development for my project? Originally posted by Gullydwarf on ROS Answers with karma: 1 on 2014-02-07 Post score: 0 Original comments Comment by dornhege on 2014-02-07: As far as I know groovy isn't even released for 13.10, so the reason that setup.bash is missing is probably that everything is missing and you're just dealing with left-overs. Someone official might confirm this.
when i launch exf for my /odom data , the results are the same of input this is my lunch file : <launch> <node pkg="robot_pose_ekf" type="robot_pose_ekf" name="robot_pose_ekf"> <param name="output_frame" value="odom_combined2"/> <param name="freq" value="50.0"/> <param name="sensor_timeout" value="1.0"/> <param name="odom_used" value="true"/> <param name="imu_used" value="false"/> <param name="vo_used" value="false"/> <param name="debug" value="false" /> <param name="self_diagnose" value="true" /> </node> </launch> all of my topices are: /base_odometry/odometer /base_odometry/state /base_scan /clock /odom /robot_pose_ekf/odom_combined /rosout /rosout_agg /tf /tilt_scan /torso_lift_imu/data /torso_lift_imu/is_calibrated first of all, i launch ekf file and then use this rosbag play 2011-04-11-07-34-27.bag /base_odometry/odom:=/odom --clock command to run my dataset. Originally posted by Mahyar on ROS Answers with karma: 18 on 2014-02-07 Post score: 0
I am trying to do exactly as this other question, which is moving the nao arms using cartesian coordinates. I did follow AHormung answer and setup IKFast with MoveIt for both my nao's arms. My problem is, how do I use the resulting plugin/cpp generated with IKFast with ROS? In the previous question, he suggested to "feed the results into the nao_controller node, probably with some lightweight conversion of messages.", but I am not sure of what it clearly means. Originally posted by TopSecret on ROS Answers with karma: 37 on 2014-02-07 Post score: 3 Original comments Comment by Martin Günther on 2014-02-10: Which ROS distro are you using? Are you (planning on) using arm_navigation, MoveIt or something else? Comment by TopSecret on 2014-02-11: I am using Hydro. I wasn't planning on using any of these at the time I posted the question, but now I also want to use OMPL. In this case, I'd like to use both with MoveIt and not arm_navigation.
what does ROI mean? Can someone link me to something that points out how this is used? I see it has an OccupancyGrid in it. I'm looking for a little direction. Any help would be appreciated. Thanks. Originally posted by david.c.liebman on ROS Answers with karma: 125 on 2014-02-07 Post score: 0
when i write in terminal roslaunch urdf_tutorial display.launch model:=urdf/02-multipleshapes.urdf result IOError: [Errno 2] No such file or directory: u'urdf/02-multipleshapes.urdf' And no RViz display ,so and no robot i use groovy please i need help Originally posted by M Samir on ROS Answers with karma: 1 on 2014-02-07 Post score: 0
in the rqt_plot part of understandingTopic toturial http://wiki.ros.org/ROS/Tutorials/UnderstandingTopics the topic is /turtle1/pose/x /turtle1/pose/y /turtle1/pose/theta but I can only find the topic /turtle1/pose/ using command rostopic list (and rqt_plot doesn't work when only fill /turtle1/pose/ in the textbox) where can I find the x/y/theta? Originally posted by lanyusea on ROS Answers with karma: 279 on 2014-02-07 Post score: 0
Hi, I am trying to build a simple simulation that uses ROS, Gazebo and MoveIt. I am currently trying to implement joint trajectory controllers on the Gazebo model so that it can communicate with MoveIt. Its only a very simple model as I want to master the basics before building a more complicated robot in simulation. So far I have: loaded a 'joint_trajectory_controllers.yaml' file (defines the joints to be controlled with type:position_controllers/JointTrajectoryController ) onto parameter server passed the controller names to the node that spawns the controllers When I run the code, it fails to load the controller and returns the error: "This controller requires a hardware interface of type 'hardware_interface::PositionJointInterface'. Make sure this is registered in the hardware_interface::RobotHW class." I have tried to modify the hardware interface arguments in the transmissions but nothing seems to work?! Can someone who has done this before outline the discrete steps required to implement this controller and/or tell me how to fix this error. Or link me to a (preferably simple) example that works in Hydro - I have been using the Reem model as a reference so far and while it works perfectly, its complexity makes it hard to use for debugging my problem. Any help would be greatly appreciated! Thanks in advance Originally posted by M@verick on ROS Answers with karma: 1 on 2014-02-07 Post score: 0
I am having some trouble. I have found a resource online for the 'android_map_manager', for example. http://wiki.ros.org/android_map_manager I have figured out how to start the app from my program. Now I would like to use some of the services that the online resource says are available to me. I cannot see them (they are services) when I type 'rossrv list' and when I try to access them from my program I get a message like this: [ERROR] [WallTime: 1391876649.155091] [Client 0] [id: call_service:/android/list_maps:31] call_service InvalidServiceException: Service /android/list_maps does not exist I feel though that this should work, as I know the app manager is running. I have this in my logs: [WARN] [WallTime: 1391877076.029768] App Manager : an app is already running [turtlebot_core_apps/android_map_manager] If I could find out how to list the maps, I could figure out how to rename, delete, etc. My next goals are to implement services in the 'android_make_a_map' rapp and possibly the nav rapp too. I did notice that the map_store package is being started by the launcher. Is the map_store package working independently of the map_manager? The launcher that I'm using is a slightly modified version of the 'minimal_with_appmanager.launch' file. Thanks. Originally posted by david.c.liebman on ROS Answers with karma: 125 on 2014-02-08 Post score: 0
Are there any examples of creating environment hooks in catkin that work in both devel-space and install-space? From the CMake API, I saw that one of the two methods for handling conditionals inside of the template file is to use the basic CMake template engine or use empy with *.em files. I tried out empy, but wasn't sure how CMake variables are communicated. My next step is to dig a little more into the catkin docs and code to see what environment variables relate to devel-space and install-space. Originally posted by eacousineau on ROS Answers with karma: 174 on 2014-02-08 Post score: 1
i am building an underwater vehicle so needed opencv to work with it for image processing . How do i use it on hydro medusa . I am also new ros so could you tell me how to use opencv with it. Originally posted by deepak.shankar94 on ROS Answers with karma: 1 on 2014-02-08 Post score: 0
As I could see the ROS hydro version has the packages for irobot create: ros-hydro-create-dashboard ros-hydro-create-description ros-hydro-create-driver ros-hydro-create-gazebo-plugins ros-hydro-create-node But I couldn't manage to find a tutorial of how to run Create in gazebo simulator. Originally posted by INait on ROS Answers with karma: 220 on 2014-02-08 Post score: 1
This is my issue: When I launch costmap_node outside group tag all goes fine: <launch> ... <rosparam file="$(find vinter_utils)/launch/costmap_params.yaml" command="load" ns="costmap_node/costmap"/> <node name="costmap_node" type="costmap_2d_node" pkg="costmap_2d" output="screen"> <remap from="/map" to="/intersection/map"/> </node> ... </launch> But when I want to launch the node within a group tag, the costmap is not published: <launch> ... <group ns="intersection"> ... <rosparam file="$(find vinter_utils)/launch/costmap_params.yaml" command="load" ns="costmap_node/costmap"/> <node name="costmap_node" type="costmap_2d_node" pkg="costmap_2d" output="screen"> <remap from="/map" to="/intersection/map"/> </node> ... </group> ... </launch> I guess is something related with naming but I can't figure out what is this. This is the .yaml file: global_frame: "/map" robot_base_frame: "/intersection_0" update_frequency: 5.0 publish_frequency: 5.0 obstacle_range: 10 raytrace_range: 15 inflation_radius: 0.05 robot_radius: 0.03 observation_sources: "base_0 base_1 base_2 base_3" #North East Base laser base_0: topic: "/base_0/base_scan" data_type: "LaserScan" observation_persistence: 0.0 clearing: true #South East Base laser base_1: topic: "base_1/base_scan" data_type: "LaserScan" observation_persistence: 0.0 clearing: true #South West Base laser base_2: topic: "base_2/base_scan" data_type: "LaserScan" observation_persistence: 0.0 clearing: true #North West Base laser base_3: topic: "base_3/base_scan" data_type: "LaserScan" observation_persistence: 0.0 clearing: true static_map: true publish_voxel_map: true track_unknown_space: true Originally posted by gustavo.velascoh on ROS Answers with karma: 756 on 2014-02-08 Post score: 0 Original comments Comment by David Lu on 2014-02-09: What is the output of rosparam list? Comment by gustavo.velascoh on 2014-02-09: Hi David, I finally solve this. I was about to answer your question and launched both cases and they work well. Sorry, I don't know what happened before. One more question, Can you help me with this-> http://answers.ros.org/question/119051/local-costmap-empty-using-move_base_node/ :D
Hello all! I try to build urdf model robot. End I have error message: Invalid parameter "name" while expanding macro "bioloid_F10" I use 2 files, head.xacro and head_hardware.xacro. In head.xacro: <include filename="$(find robot_description)/urdf/head_hardware.xacro" /> <bioloid_F10 parent="bioloid_F4_head_10" name="head_tilt_bracket"> <origin xyz="0 0 0" rpy="0 0 0"/> </bioloid_F10_fixed> In head_hardware.xacro <macro name="bioloid_F10" params="parent number x_loc y_loc z_loc"> What is wrong? Originally posted by seredin on ROS Answers with karma: 45 on 2014-02-08 Post score: 1
I am in the process of building Hydro for Debian Weezy according to http://wiki.ros.org/hydro/Installation/Debian . I have a build problem (1) and a question (2): At step 4.3 "sudo checkinstall make install" gives error: [ 21%] Building CXX object keypoints/CMakeFiles/pcl_keypoints.dir/src/iss_3d.cpp.o c++: error trying to exec 'cc1plus': execvp: No such file or directory There is g++-4.7 installed on my system and g++ compiles c++ code if invoked directly from command line, although cc1plus is not in the $PATH. Should I somehow manually add it there? I am not sure how to do that. At the end of 4.3 it says "When running check-install rename the package as follows and provide lines to libpcl-all-dev to match the rosdep dependency." What does that "as follows" mean - PCL is not mentioned anywhere afterwards - and how one has to "provide lines" "to match rosdep dependency"? More clear explanation would be very much appreciated for those who are not familiar with building .deb packages and ROS, but still want to build ROS in Debian. Originally posted by AStudent on ROS Answers with karma: 43 on 2014-02-09 Post score: 0
I have Ubuntu 12.04 LTS and ROS Hydro. I installed Gazebo 1.9 and executed initial mobile robot tutorials with SDF. But my system gets very slow while running Gazebo. I have 1GB RAM with Intel Pentium (R) Dual CPU E2200@ 2.20 GHz*2. My motherboard is: ASUS P5KPL-AM EPU. Is there a minimum requirement for CPU and RAM while running Gazebo? What is that? Should I increase my RAM? Originally posted by mudassar on ROS Answers with karma: 22 on 2014-02-09 Post score: 0
Hello everyone, I am using ros fuerte on ubuntu 12.04 and have few questions: Does anyone know how rgbdslam and octomap cooperates? Is there any possibility to manipulate with map created by rgbdslam? Is there a possibility to build octomap with octomap_server out of rgbdslam algorithm and visualise it? Is there possibility to reduce the size of created map? for example to 1-2 meters around robot? Originally posted by Wilk on ROS Answers with karma: 67 on 2014-02-09 Post score: 0
In python, it's possible to use roslib.get_ros_home() to query the environment for the ROS_HOME environment variable, and fall back to HOME/.ros if it doesn't exist. This is very useful for finding a directory that ROS processes can use for storing their own logs or other temporary data. Is there any equivalent to this in C++? Originally posted by ahendrix on ROS Answers with karma: 47576 on 2014-02-09 Post score: 1
Hi, I was trying to visualize a sensor_msgs/Image message using Rviz and had no success. Then, I found image_viewer plugin in rqt (rqt_image_viewer) and the image was always there. Is this an issue in Rviz? Do I have to report it as a bug? or Do these tools work in different ways? P.D.: I'm using Hydro on Ubuntu 13.04 Originally posted by gustavo.velascoh on ROS Answers with karma: 756 on 2014-02-09 Post score: 0 Original comments Comment by ahendrix on 2014-02-09: I've seen this on OS X, and just assumed it was an OSX bug. Are you seeing it on Linux as well? Comment by gustavo.velascoh on 2014-02-09: Yes @ahendrix, I'm running Hydro on Ubuntu 13.04 Comment by ahendrix on 2014-02-09: This sounds like an rviz bug, then. I'll open a ticket.
Hi, iam trying to run the navigation stack with stage, but my move_base is not using the right data_type in its observation_sources. I get the following error: [ERROR] [1392014064.082396840, 3.200000000]: Client [/move_base] wants topic /base_scan to have datatype/md5sum [sensor_msgs/PointCloud/d8e9c3f5afbdd8a130fd1d2763945fca], but our version has [sensor_msgs/LaserScan/90c7ef2dc6895d81024acba2ac42f369]. Dropping connection. The common_costmap.yaml file: map_type: costmap transform_tolerance: 50 obstacle_range: 2.5 raytrace_range: 4.0 inscribed_radius: 0.35 circumscribed_radius: 0.4 inflation_radius: 0.6 cost_scaling_factor: 15.0 lethal_cost_threshold: 100 footprint: [[-0.25, -0.25], [-0.25, 0.25], [0.25, 0.25],[0.25, -0.25]] observation_sources: base_scan base_scan: {data_type: LaserScan, topic: /base_scan, marking: true, clearing: true} The parameters are used right, if i use rosparag get /move_base/local_costmap i get: base_scan: {clearing: true, data_type: LaserScan, marking: true, topic: /base_scan} circumscribed_radius: 0.4 cost_scaling_factor: 15.0 footprint: - [-0.25, -0.25] - [-0.25, 0.25] - [0.25, 0.25] - [0.25, -0.25] global_frame: /odom height: 4.0 inflation_radius: 0.6 inscribed_radius: 0.35 lethal_cost_threshold: 100 map_type: costmap observation_sources: base_scan obstacle_range: 2.5 publish_frequency: 1.0 raytrace_range: 4.0 resolution: 0.01 robot_base_frame: /base_footprint rolling_window: true static_map: false track_unknown_space: true transform_tolerance: 0.5 unknown_cost_value: 255 update_frequency: 1.0 width: 4.0 --EDIT: The Launch file i am using: <?xml version="1.0"?> <!-- ******************************************************************************* --> <!-- ********** START THE GMAPPING NODE ********** --> <!-- ******************************************************************************* --> <launch> <arg name="scan_topic" default="base_scan" /> <node pkg="gmapping" type="slam_gmapping" name="slam_gmapping" output="screen"> <param name="base_frame" value="base_footprint"/> <param name="odom_frame" value="odom"/> <param name="map_update_interval" value="0.5"/> <param name="maxUrange" value="16.0"/> <param name="sigma" value="0.05"/> <param name="kernelSize" value="1"/> <param name="lstep" value="0.05"/> <param name="astep" value="0.05"/> <param name="iterations" value="5"/> <param name="lsigma" value="0.075"/> <param name="ogain" value="3.0"/> <param name="lskip" value="0"/> <param name="srr" value="0.01"/> <param name="srt" value="0.02"/> <param name="str" value="0.01"/> <param name="stt" value="0.02"/> <param name="linearUpdate" value="0.01"/> <param name="angularUpdate" value="0.01"/> <param name="temporalUpdate" value="-1.0"/> <param name="resampleThreshold" value="0.5"/> <param name="particles" value="10"/> <param name="xmin" value="-4.0"/> <param name="ymin" value="-4.0"/> <param name="xmax" value="4.0"/> <param name="ymax" value="4.0"/> <param name="delta" value="0.01"/> <param name="llsamplerange" value="0.01"/> <param name="llsamplestep" value="0.01"/> <param name="lasamplerange" value="0.005"/> <param name="lasamplestep" value="0.005"/> <remap from="scan" to="$(arg scan_topic)"/> </node> <!-- ******************************************************************************* --> <!-- ********** START MOVE BASE ********** --> <!-- ******************************************************************************* --> <node pkg="move_base" type="move_base" respawn="false" name="move_base" output="screen"> <rosparam file="$(find simple_navigation)/param/common_costmap.yaml" command="load" ns="global_costmap" /> <rosparam file="$(find simple_navigation)/param/common_costmap.yaml" command="load" ns="local_costmap" /> <rosparam file="$(find simple_navigation)/param/local_costmap_params.yaml" command="load" /> <rosparam file="$(find simple_navigation)/param/global_costmap_params.yaml" command="load" /> <rosparam file="$(find simple_navigation)/param/base_local_planner_params.yaml" command="load" /> </node> </launch> I am using ubuntu 12.04 LTS 64 Bit. Running ROS-Groovy (have also installed ROS-Fuerte, but is not in use). I have read that it might be caused if the packages were build with an older message defenition, i have updated all of my ros-packages i am using, but the error do not dissapear. Does anyone know what i could do next ? If you need more information, just say. regards, Peter Originally posted by pkohout on ROS Answers with karma: 336 on 2014-02-09 Post score: 0 Original comments Comment by gustavo.velascoh on 2014-02-09: What distro are you using? Are you using a launch file? Comment by ahendrix on 2014-02-09: Which version of ROS are you using? There were some fairly major changes to the nav stack between Groovy and Hydro Comment by pkohout on 2014-02-09: I use Ubuntu 12.04 and ROS-Groovy, i also have installed Fuerte but do not use it. Yes i am using a Launch file (see edit)
I am taking part in a robotics project that is introducing ROS into its development. I have an existing library of classes that are used to pass information. My task is to integrate this library into ROS messages. I am unable to create a publisher using ros::Publisher controls_pub = nForPublishing.advertise<communication::messages>("controlChannel", 1000); where communication::messages is the library namespace/class. Below is the compiler error message I'm getting: In file included from /home/user/ros_catkin_ws/install_isolated/include/ros/serialization.h:37:0, from /home/user/ros_catkin_ws/install_isolated/include/ros/publisher.h:34, from /home/user/ros_catkin_ws/install_isolated/include/ros/node_handle.h:32, from /home/user/ros_catkin_ws/install_isolated/include/ros/ros.h:45, from /home/user/new_catkin_ws/src/demo_robot_ros_driver/src/demo_robot_ros_driver.cpp:1: /home/user/ros_catkin_ws/install_isolated/include/ros/message_traits.h: In instantiation of ‘static const char* ros::message_traits::MD5Sum<M>::value(const M&) [with M = communications::messages*]’: /home/user/ros_catkin_ws/install_isolated/include/ros/message_traits.h:255:104: required from ‘const char* ros::message_traits::md5sum(const M&) [with M = communications::messages*]’ /home/user/ros_catkin_ws/install_isolated/include/ros/publisher.h:112:7: required from ‘void ros::Publisher::publish(const M&) const [with M = communications::messages*]’ /home/user/new_catkin_ws/src/demo_robots_ros_driver/src/demo_robots_ros_driver.cpp:68:34: required from here /home/user/ros_catkin_ws/install_isolated/include/ros/message_traits.h:126:34: error: request for member ‘__getMD5Sum’ in ‘m’, which is of pointer type ‘communications::messages* const’ (maybe you meant to use ‘->’ ?) return m.__getMD5Sum().c_str(); From the tutorials, I understand how ROS Topics/Messages are created (MSG files). This is not practical in our situation as the library is quite large and undergoing further development. catkin_make pre-processes the MSG files to create header files. It is not practical to manually create MSG files for each class, due to maintenance issues, nor is it desirable to create a parsing program that generates MSG files from the library's code (ie rosJava). As it stands, all the classes have a to_string() method which I can use to serialise the objects, but I would like to have topics based on class structures not delimited strings. Would anyone be able to point me to a tutorial that explains how I can incorporate an existing library class into a topic? Originally posted by Nap on ROS Answers with karma: 302 on 2014-02-09 Post score: 0
hi everybody, kindly help me out to retrieve exact turtlebot's orientation. i have used yaw to determine the orientation but when the robot move the yaw become inaccurate. the yaw command the i used is as follows: yaw=atan2(2*(x*y+w*z), w*w + x*x - y*y - z*z); kindly,give me an advice on how to retrieve the exact turtlebot's orientation. thank you. Originally posted by nadal11 on ROS Answers with karma: 23 on 2014-02-09 Post score: 0
I was wondering if there was a clean way to find the path to a given ROS stack or package from the command line on Hydro, whether it is installed or just in the ROS_PACKAGE_PATH, i.e. what is probably used by roscd or roslaunch with the $(find ros_stack) arguments. If I try to find an uninstalled ROS stack with rospack find ros_stack, it fails, whereas rosstack find ros_stack succeeds. For now I use this trick which works for both packages and stacks, whether they are installed or just present in ROS_PACKAGE_PATH: $ ros_stack_path=`roscd ros_stack && pwd && cd - &>/dev/null` Is there a better one-liner for this? I also noticed something surprising. If I try both rospack and rosstack on a metapackage (e.g. navigation): $ rospack find navigation ---> fails $ rosstack find navigation ---> succeeds Is that the expected behavior? Originally posted by bchr on ROS Answers with karma: 596 on 2014-02-10 Post score: 1
Hi, I have a question about hector_slam. This link link text say "Use in place of gmapping". In this case, I edit my launch file how say the text: "param name="odom_frame" value="odom" . My question is, What do hector_slam with this topic (/odom)? In case that hector do something. Someone have a example tf.? Thanks. Originally posted by alex.filgueira on ROS Answers with karma: 62 on 2014-02-10 Post score: 0
Dear all, I correctly installed knowrob and knowrob tutorials. (No warning and errors!) then when I try to execute the tutorial and specifically to query for the individuals of Drawers, I get: ?-register_ros_package(ias_semantic_map). true. And ?- owl_has(A, rdf:type, knowrob:'Drawer'). false. While I whould get ?- owl_has(A, rdf:type, knowrob:'Drawer'). A = 'http://ias.cs.tum.edu/kb/knowrob.owl#Drawer1' ; A = 'http://ias.cs.tum.edu/kb/knowrob.owl#Drawer103' ; A = 'http://ias.cs.tum.edu/kb/knowrob.owl#Drawer109' ; true. I installed Knowrob by source as suggested. Thank you in advance, I think that @moritz can help me. And when I run: nearlab@Bazinga:~/Development/ros_workspace$ rosrun rosprolog rosprolog ias_semantic_map % library(swi_hooks) compiled into pce_swi_hooks 0.00 sec, 3,856 bytes % /home/nearlab/.plrc compiled 0.01 sec, 1,472 bytes % library(error) compiled into error 0.00 sec, 19,104 bytes % library(lists) compiled into lists 0.00 sec, 45,824 bytes % library(shlib) compiled into shlib 0.00 sec, 67,120 bytes % library(option) compiled into swi_option 0.00 sec, 14,768 bytes % library(process) compiled into process 0.00 sec, 99,664 bytes % /opt/ros/fuerte/stacks/knowrob/rosprolog/prolog/init.pl compiled 0.00 sec, 107,448 bytes Welcome to SWI-Prolog (Multi-threaded, 64 bits, Version 5.10.3) Copyright (c) 1990-2011 University of Amsterdam, VU Amsterdam SWI-Prolog comes with ABSOLUTELY NO WARRANTY. This is free software, and you are welcome to redistribute it under certain conditions. Please visit http://www.swi-prolog.org for details. For help, use ?- help(Topic). or ?- apropos(Word). ?- It seems no errors or warning! Originally posted by Noah on ROS Answers with karma: 15 on 2014-02-10 Post score: 0
I have an old ROS Fuerte project which code i wanted to reuse in an another ROS Hydro node, this code uses libserial library. I have a problem to find out the correct way to include this library into my new node via CMakeList.txt Here what i include in my header: #include <SerialStream.h> using namespace LibSerial; SerialStream fd; I'm not totally sure where the error comes from but doesn't the "undefined reference" mean that problem could be within the compiling and linking? Here is the error code: #### #### Running command: "make cmake_check_build_system" in "/home/x/Dropbox/catkin_ws/build" #### #### #### Running command: "make -j2 -l2" in "/home/x/Dropbox/catkin_ws/build" #### [ 0%] [ 0%] Built target std_msgs_generate_messages_cpp Built target std_msgs_generate_messages_py [ 20%] [ 20%] Built target std_msgs_generate_messages_lisp Built target serial_interface_generate_messages_cpp [ 60%] [ 80%] Built target serial_interface_generate_messages_py Built target serial_interface_generate_messages_lisp [ 80%] Built target serial_interface_generate_messages Linking CXX executable /home/x/Dropbox/catkin_ws/devel/lib/serial_interface/serial_interface /usr/lib/gcc/x86_64-linux-gnu/4.6/../../../x86_64-linux-gnu/crt1.o: In function `_start': (.text+0x20): undefined reference to `main' CMakeFiles/serial_interface.dir/src/serial_interface.cpp.o: In function `CA::RoverInterface::RoverInterface(ros::NodeHandle)': serial_interface.cpp:(.text+0x514): undefined reference to `LibSerial::SerialStream::Open(std::basic_string<char, std::char_traits<char>, std::allocator<char> >, std::_Ios_Openmode)' CMakeFiles/serial_interface.dir/src/serial_interface.cpp.o:(.rodata._ZTVN9LibSerial15SerialStreamBufE[vtable for LibSerial::SerialStreamBuf]+0x48): undefined reference to `LibSerial::SerialStreamBuf::showmanyc()' CMakeFiles/serial_interface.dir/src/serial_interface.cpp.o:(.rodata._ZTVN9LibSerial15SerialStreamBufE[vtable for LibSerial::SerialStreamBuf]+0x50): undefined reference to `LibSerial::SerialStreamBuf::xsgetn(char*, long)' CMakeFiles/serial_interface.dir/src/serial_interface.cpp.o:(.rodata._ZTVN9LibSerial15SerialStreamBufE[vtable for LibSerial::SerialStreamBuf]+0x58): undefined reference to `LibSerial::SerialStreamBuf::underflow()' CMakeFiles/serial_interface.dir/src/serial_interface.cpp.o:(.rodata._ZTVN9LibSerial15SerialStreamBufE[vtable for LibSerial::SerialStreamBuf]+0x68): undefined reference to `LibSerial::SerialStreamBuf::pbackfail(int)' CMakeFiles/serial_interface.dir/src/serial_interface.cpp.o:(.rodata._ZTVN9LibSerial15SerialStreamBufE[vtable for LibSerial::SerialStreamBuf]+0x70): undefined reference to `LibSerial::SerialStreamBuf::xsputn(char const*, long)' CMakeFiles/serial_interface.dir/src/serial_interface.cpp.o:(.rodata._ZTVN9LibSerial15SerialStreamBufE[vtable for LibSerial::SerialStreamBuf]+0x78): undefined reference to `LibSerial::SerialStreamBuf::overflow(int)' collect2: ld returned 1 exit status make[2]: *** [/home/x/Dropbox/catkin_ws/devel/lib/serial_interface/serial_interface] Error 1 make[1]: *** [serial_interface/CMakeFiles/serial_interface.dir/all] Error 2 make: *** [all] Error 2 EDIT 1: I have updated my CMakeList.txt file to be as follows with the new information I got from an answer: cmake_minimum_required(VERSION 2.8.3) project(serial_interface) find_package(catkin REQUIRED COMPONENTS roscpp rospy std_msgs message_generation ) include_directories(include ${catkin_INCLUDE_DIRS}) add_message_files( FILES Control.msg ) generate_messages( DEPENDENCIES std_msgs ) catkin_package( INCLUDE_DIRS include CATKIN_DEPENDS roscpp rospy std_msgs message_runtime ) add_executable(serial_interface src/serial_interface.cpp) add_dependencies(serial_interface serial_interface_generate_messages_cpp) target_link_libraries(serial_interface ${catkin_LIBRARIES} libserial0 ) install(DIRECTORY include/${PROJECT_NAME}/ DESTINATION ${CATKIN_PACKAGE_INCLUDE_DESTINATION} FILES_MATCHING PATTERN "*.h" PATTERN ".svn" EXCLUDE ) And if i run dpkg -L libserial0 I do get the following: /. /usr /usr/share /usr/share/doc /usr/share/doc/libserial0 /usr/share/doc/libserial0/copyright /usr/share/doc/libserial0/changelog.Debian.gz /usr/lib /usr/lib/libserial.so.0.0.0 /usr/lib/libserial.so.0 Therefore I should have the correct library installed on my system? Anyway i still receive this error while trying to run catkin_make. #### #### Running command: "make cmake_check_build_system" in "/home/x/Dropbox/catkin_ws/build" #### #### #### Running command: "make -j2 -l2" in "/home/x/Dropbox/catkin_ws/build" #### [ 0%] [ 0%] Built target std_msgs_generate_messages_cpp Built target std_msgs_generate_messages_py [ 0%] [ 20%] Built target std_msgs_generate_messages_lisp Built target serial_interface_generate_messages_cpp [ 40%] [ 80%] Built target serial_interface_generate_messages_lisp Built target serial_interface_generate_messages_py Linking CXX executable /home/x/Dropbox/catkin_ws/devel/lib/serial_interface/serial_interface [ 80%] Built target serial_interface_generate_messages /usr/bin/ld: cannot find -llibserial0 collect2: ld returned 1 exit status make[2]: *** [/home/x/Dropbox/catkin_ws/devel/lib/serial_interface/serial_interface] Error 1 make[1]: *** [serial_interface/CMakeFiles/serial_interface.dir/all] Error 2 make: *** [all] Error 2 Invoking "make" failed Originally posted by ajr_ on ROS Answers with karma: 97 on 2014-02-10 Post score: 0
I have a multithreaded piece of python code that moves the arms of my robot. The basic premise is that there is one thread for each arm, and threads block until each arm as finished it's movements (i.e., given two sets of joint positions, one for each arm, the program splits into two threads that loop until their respective arm has reached the specified joint positions). Here is the code that does that: def __moveToJointPos(self, instance, index): if instance >= self.numInstances(): raise Exception("Called with instance " + str(instance) + " but only " + str(self.numInstances()) + " instances exist") t = None if type(index) is tuple: #If this method is being called with 2 indices rather than one, that means we want to move both arms at the same time. #To do this, we spin off one of the indices to another thread, then execute as normal on the remaining one. #Then we wait until the other thread finishes before returning. if len(index) > 2: raise Exception("Can only call with a tuple of size 2, got a tuple of size " + str(len(index))) elif self.poss[instance][1][index[0]][0] == self.poss[instance][1][index[1]][0]: raise Exception("When calling with a tuple, must specify indices with different arms.") elif len(index) == 2: i2 = index[1] t = threading.Thread(target=self._Behavior__moveToJointPos, args = (instance, i2)) t.daemon = True t.start() mov = self.poss[instance][1][index[0]] else: mov = self.poss[instance][1][index] rate = rospy.Rate(10) if mov[0] == Behavior.RIGHT_ARM: arm = self.right_arm else: arm = self.left_arm done = False dd = [9999.0, 9999.0, 9999.0, 9999.0, 9999.0] while not done: arm.set_joint_positions(mov[1]) dist = 0.0 for j in arm.joint_names(): dist = dist + (mov[1][j] - arm.joint_angle(j))*(mov[1][j] - arm.joint_angle(j)) dist = math.sqrt(dist) ss = 0.0 for d in dd: ss = ss + math.fabs(d - dist) if ss < 0.01: done = True elif rospy.is_shutdown(): print("ROS shutdown, cancelled movement") done = True if baxter_external_devices.getch() in ['\x1b', '\x03']: print("stopped") done = True else: dd.append(dist) del dd[0] rate.sleep() if t is not None: t.join() I'll admit the code is rather messy, but this is just something I'm quickly hacking together to test out the robot. Here is the code that calls that function: print("a") self._Behavior__moveToJointPos(0,(ToTable.lHOME, ToTable.rHOME)) print("b") self._Behavior__moveToJointPos(0,(ToTable.lMID, ToTable.rMID)) print("c") self._Behavior__moveToJointPos(0,(ToTable.lTABLE, ToTable.rTABLE)) print("d") (the prints are added so that the effect on standard out is more clear). Here is what my terminal looks like: Here is the link to the image: http://i.imgur.com/1hdCq7f.png (you may need to open it in a separate tab to see it). There are a couple more calls to __moveToJointPos, which is why there is more text output, but the error starts with the set of commands above. As you can see, after "b" is printed, each successive line starts indented over as far as the end of the line before it. This trend continues through all the print statements, and even after the program exits, my terminal no longer works correctly. Pressing enter, which normally starts a new line, instead just prints the terminal prompt right after the prompt that is already there. Additionally, the terminal does not echo any of my key presses back to me. The only way I can find to fix this is to close the terminal and open a new one. This is not a ton of fun to have to do each time I run my program. I don't really have any idea what is going on here. If I change the calls to __moveToJointPos such that index is no longer a tuple (and thus that function does not spin off a helper thread), then everything works just fine. The error with standard out only occurs when there is multithreading involved. It's worthwhile to note that there are no calls to print while the program is running multiple threads, only before and after, so I'm not really sure what is happening. What am I doing wrong and does anyone know how to fix it? Thank you Originally posted by rse101 on ROS Answers with karma: 36 on 2014-02-10 Post score: 0
I am trying to run two cameras on one single board computer with ROS and OpenCV, but I do not want to run the cameras at the same time. I want to run camera A until a specific moment then turn camera A off and turn camera B on; then B off and A on, and so on... I am not sure how to do this effectively or at all really. I understand how to start up both cameras with a launch file or turn them off and on manually, but I want to do this automatically as certain parameters are met. Any ideas or advice? Thanks Ralff Originally posted by Ralff on ROS Answers with karma: 280 on 2014-02-10 Post score: 1
I'm trying to compile a new package with catkin_make_isolated but after visibly successful installation my I receive roscore and catkin_make, etc command not found. My only option is to reload from an earlier backup to restore my ROS. The steps I'm following: Installing roscopter on Hydro from here: ( https://github.com/epsilonorion/roscopter/wiki ) I place the roscore source in the /src library compile mavlink with sudo python setup.py install Run catkin_make: catkin_make_isolated --pkg <my_package_name> --install Roscore is still working until I don't restart, after that command not found The .bashrc does refer to the install_isolated/setup.bash, still no roscore or catkin_make, etc Originally posted by evk02 on ROS Answers with karma: 218 on 2014-02-10 Post score: 1 Original comments Comment by ahendrix on 2014-02-10: Which OS are you running? Have you installed ROS from debs or from source? Comment by evk02 on 2014-02-12: Sorry, I just saw this comment. The issue already got resolved (see details below), but in case others would read this later here is the answer to your question: OS: Raspbian Wheezy on a Raspberry Pi ROS is compiled from source
I'm using AR.Drone with Flight Recorder (witch enable geolocation using the GPS module). I installed ardrone_autonomy and very pleased with it. But there is no GPS data in topics published. However, using QGroundControl, I can connect to AR.Drone and get GPS data in GLOBAL_POSITION_INT packet, so I can get GPS data in my program with MAVLINK. The problem is that I can't use ardrone_autonomy and MAVLINK connection simultaniously. When I start ardrone_autonomy, I loose connection in QGroundControl (MAVLINK). So my question is about possibility of reading GPS data from AR.Drone with ardrone_autonomy or using ardrone_autonomy simultaniously with MAVLINK connection? Originally posted by Rr on ROS Answers with karma: 15 on 2014-02-10 Post score: 0
Following the UnderstandingServicesParams Tutorial I create another turtle using $ rosservice type spawn| rossrv show I can control the turtle2 by publish a topic to it directly. $ rostopic pub /turtle1/cmd_vel geometry_msgs/Twist -r 1 -- '[2.0, 0.0, 0.0]' '[0.0, 0.0, 1.8]' but I want to use $ rosrun turtlesim turtle_teleop_key then I can control it using my keyboard. So I think I should do a argument remapping. There should be a argument control which turtle I want to control.(just call it _id instead) so I can run $ rosrun turtlesim turtle_teleop_key _id:=turtle2 so I'm wondering how to find the argument's name.(i.e. what is the real name of "_id") Originally posted by lanyusea on ROS Answers with karma: 279 on 2014-02-10 Post score: 0
Hello community! I've got a question about tracking AR Tags with the "ar_track_alvar" package. I set up the package and subscrided to my kinect image topic. Everything runs fine. The tags, that come with the package (ID 0-20), are detected immediately and I see the corresponding TFs in rviz. So far, so good... But now I wanted to create my own AR Tags, that carry additional information beyond a number called "ID" (e.g. the name/number of a room) to use them as landmarks. But as it turns out, the ar track alvar node seems to recognize just some of my custom AR tags. Tags that contain real text information like "Room G 301" aren't recognized at all, and even Tags that just contain a pure ID (e.g. "167") are not recognized. But in some cases (e.g. "200"), the ID is recognized. I tried different sizes, distances, angles.... could not find a pattern. Does anyone know why the ar track alvar is so choosey in what it recognized and what not? regards psei Originally posted by psei on ROS Answers with karma: 318 on 2014-02-11 Post score: 0 Original comments Comment by miloup on 2014-03-30: Hi, I'm a beginner in ROS that I need it for my project. Is there a tutorial that explains how to 1-connect camera to ROS in order to see the frames captured. 2-Identify the AR Tags I'm looking for some code examples. I only found one that deals with CUBE/SPHERE...etc. Nothing about codes that detects AR tags. Thank you
Hi, I am trying to make use of actionlib between two packages in the same workspace, but when I "catkin_make" the workspace I get the following error: workspace/src/skills/src/master.cpp:63:33: fatal error: ur5_proxy/ur5Action.h: No such file or directory The ur5Action.h plus additional action files are created in another package called ur5_proxy, and is placed in a directory called workspace/devel/include/ur5_proxy So my question is how do I make use of actionfiles created in the ur5_proxy package in the skills package? I think the problem concerns the CMakelist or the package.xml. Originally posted by mortenpj on ROS Answers with karma: 70 on 2014-02-11 Post score: 0
I have run commands clone rosserial from the kforge repository. But later it turn out to this error rosmake rosserial_arduino Why is this happening? Originally posted by Ross Marry on ROS Answers with karma: 3 on 2014-02-11 Post score: 0
hi, i struggle a lot with using ros with eclipse first of all, i did all that is standing on the ros with IDE page. i can import the project to eclipse and build it. the indexer is absolutely not working (it recognizes rosnode etc, but i get errors like "namespace std is amgiguous" - i use eclipse kepler). however, for now i just ignored that, because i can still do some autocompletion stuff etc.. building works fine, but when it comes to debug the program, i have no clue what to do. the tutorial says: "Create a new launch configuration, by clicking on Run --> Run configurations... --> C/C++ Application (double click or click on New). Select the correct binary on the main tab (Search project should work when your binary was already built). Then in the environment tab, add (at least)" --> which binary? i cannot execute the binary directly, right? i have to use rosrun. so what should be in there? i dont see any binaries listed when i click on "search project" Originally posted by shangl on ROS Answers with karma: 11 on 2014-02-11 Post score: 0
I am using openni pkg on a PR2 that has a kinect sensor attached and running goovy. I need to be able to transform between the camera frame and the PR2 links. When I launch openni : roslaunch openni_launch openni.launch A different camera frame tree is created that is not connected to the PR2 I tried changing the camera parameter for the openni_launch to be head_mount_kinect but that din't bring the camera tf frames back on the tree. The only possible solution that I found is to add another fixed frame to tf specifying that the camera and the head_mount_kinect are the same frame with no translation or rotation between them. That seems to much of a hack, is there a more elegant solution? Originally posted by rleontie on ROS Answers with karma: 3 on 2014-02-11 Post score: 0
Good evening We are trying to "rosmake" the package usb_camera but rosmake fail. Here is the output : mkdir -p bin cd build && cmake -Wdev -DCMAKE_TOOLCHAIN_FILE=/opt/ros/groovy/share/ros/core/rosbuild/rostoolchain.cma$ -- The C compiler identification is GNU 4.6.3 -- The CXX compiler identification is GNU 4.6.3 -- Check for working C compiler: /usr/bin/gcc -- Check for working C compiler: /usr/bin/gcc -- works -- Detecting C compiler ABI info -- Detecting C compiler ABI info - done -- Check for working CXX compiler: /usr/bin/c++ -- Check for working CXX compiler: /usr/bin/c++ -- works -- Detecting CXX compiler ABI info -- Detecting CXX compiler ABI info - done -- Found PythonInterp: /usr/bin/python (found version "2.7.3") [rosbuild] Building package usb_cam Failed to invoke /opt/ros/groovy/bin/rospack deps-manifests usb_cam [rospack] Error: the rosdep view is empty: call 'sudo rosdep init' and 'rosdep update' CMake Error at /opt/ros/groovy/share/ros/core/rosbuild/public.cmake:129 (message): Failed to invoke rospack to get compile flags for package 'usb_cam'. Look above for errors from rospack itself. Aborting. Please fix the broken dependency! Call Stack (most recent call first): /opt/ros/groovy/share/ros/core/rosbuild/public.cmake:203 (rosbuild_invoke_rospack) CMakeLists.txt:5 (rosbuild_init) -- Configuring incomplete, errors occurred! make: *** [all] Error 1 I´ve tried to do sudo rosdep init and the rosdep update but the update also failed : pi@raspberrypi ~ $ rosdep update reading in sources list data from /etc/ros/rosdep/sources.list.d Hit https://github.com/ros/rosdistro/raw/master/rosdep/osx-homebrew.yaml Hit https://github.com/ros/rosdistro/raw/master/rosdep/gentoo.yaml Hit https://github.com/ros/rosdistro/raw/master/rosdep/base.yaml Hit https://github.com/ros/rosdistro/raw/master/rosdep/python.yaml Hit https://github.com/ros/rosdistro/raw/master/rosdep/ruby.yaml Hit https://github.com/ros/rosdistro/raw/master/releases/fuerte.yaml Query rosdistro index https://raw.github.com/ros/rosdistro/master/index.yaml ERROR: Rosdep experienced an error: Unable to handle 'index' format version '2', please update rosdistro Please go to the rosdep page [1] and file a bug report with the stack trace below. [1] : http://www.ros.org/wiki/rosdep rosdep version: 0.10.20 Traceback (most recent call last): File "/usr/lib/pymodules/python2.7/rosdep2/main.py", line 118, in rosdep_main exit_code = _rosdep_main(args) File "/usr/lib/pymodules/python2.7/rosdep2/main.py", line 261, in _rosdep_main return _no_args_handler(command, parser, options, args) File "/usr/lib/pymodules/python2.7/rosdep2/main.py", line 269, in _no_args_handler return command_handlerscommand File "/usr/lib/pymodules/python2.7/rosdep2/main.py", line 426, in command_update error_handler=update_error_handler) File "/usr/lib/pymodules/python2.7/rosdep2/sources_list.py", line 422, in update_sources_list for d, dist in get_index().distributions.iteritems(): File "/usr/lib/pymodules/python2.7/rosdep2/rosdistrohelper.py", line 58, in get_index _RDCache.index = rosdistro.get_index(_RDCache.index_url) File "/usr/lib/pymodules/python2.7/rosdistro/init.py", line 106, in get_index return Index(data, base_url) File "/usr/lib/pymodules/python2.7/rosdistro/index.py", line 51, in init assert int(data['version']) == 1, "Unable to handle '%s' format version '%d', please update rosdistro" % (Index._type, int(data['version'])) AssertionError: Unable to handle 'index' format version '2', please update rosdistro What´s happening? Can you help me please ? Originally posted by 4LV4R0 on ROS Answers with karma: 70 on 2014-02-11 Post score: 0 Original comments Comment by 4LV4R0 on 2014-02-11: I have also followed this " http://answers.ros.org/question/122266/how-can-i-fix-unable-to-handle-index-format-version-2-please-update-rosdistro/" but everything is up to date ... Comment by ahendrix on 2014-02-11: What are your ROS and OS versions? Comment by 4LV4R0 on 2014-02-11: Ros groovy and Raspbian wheezy Comment by ahendrix on 2014-02-11: It sounds like the version of python-rosdep that's available in the repository that you're using isn't up to date. I would try to get in contact with the repository maintainer. Comment by 4LV4R0 on 2014-02-12: Thanks for your help. I´ll try to get in contact witg him.
Hi there, I'm having quite a bit of trouble understanding how to get a package installed via catkin. I am hoping to run through the smach tutorials - and this seems to necessitate install the smach_tutorial package. I've noticed that this package is not available via apt-get, I found the source and have checked it out with svn. When trying to run catkin_make within the directory I am presented with: "The specified base path "/home/frontier/catkin_ws/src/smach_tutorials/src" contains a CMakeLists.txt but "catkin_make" must be invoked in the root of workspace" So I followed the ROS catkin tutorials, created a workspace, and created a package for the smach_tutorial. I then added the svn source to the src directory in this package and ran catkin_make install from my workspace. I was presented with: "Install the project... -- Install configuration: "" -- Installing: /home/frontier/catkin_ws/install/.catkin -- Installing: /home/frontier/catkin_ws/install/_setup_util.py -- Installing: /home/frontier/catkin_ws/install/env.sh -- Installing: /home/frontier/catkin_ws/install/setup.bash -- Installing: /home/frontier/catkin_ws/install/setup.sh -- Installing: /home/frontier/catkin_ws/install/setup.zsh -- Installing: /home/frontier/catkin_ws/install/.rosinstall -- Up-to-date: /home/frontier/catkin_ws/install/etc/catkin/profile.d/05.catkin_make.bash -- Up-to-date: /home/frontier/catkin_ws/install/etc/catkin/profile.d/05.catkin_make_isolated.bash -- Installing: /home/frontier/catkin_ws/install/lib/pkgconfig/beginner_tutorials.pc -- Installing: /home/frontier/catkin_ws/install/share/beginner_tutorials/cmake/beginner_tutorialsConfig.cmake -- Installing: /home/frontier/catkin_ws/install/share/beginner_tutorials/cmake/beginner_tutorialsConfig-version.cmake -- Up-to-date: /home/frontier/catkin_ws/install/share/beginner_tutorials/package.xml -- Installing: /home/frontier/catkin_ws/install/lib/pkgconfig/smach_tutorials.pc -- Installing: /home/frontier/catkin_ws/install/share/smach_tutorials/cmake/smach_tutorialsConfig.cmake -- Installing: /home/frontier/catkin_ws/install/share/smach_tutorials/cmake/smach_tutorialsConfig-version.cmake -- Installing: /home/frontier/catkin_ws/install/share/smach_tutorials/package.xml" I feel as though there is something obvious that I am missing. Is there a good example on downloading the source for a catkin package and installing it? Thanks. Originally posted by jkretzmer on ROS Answers with karma: 1 on 2014-02-11 Post score: 0 Original comments Comment by ahendrix on 2014-02-11: I'm not quite sure I understand the question. What are you expecting catkin_make install to do? Comment by evk02 on 2014-02-11: It looks to me everything works just fine, based on the logs you referred you are installing smach_tutorial.
Is KDL used by tf to do transforms or is it a supplement to explicitly do transforms by the programmer instead of letting tf do it? Please forgive my ignorance I've been trying to get a better understanding of tf but am confused by KDL. Originally posted by billtecteacher on ROS Answers with karma: 101 on 2014-02-11 Post score: 0
Recently it came to my attention that in the later ROS versions much of the complex image processing/handling has been offloaded to other sources such as OpenCV. The camera_pose_calibration package is hopelessly broken for later distros. I've recently stumbled on vision_opencv so I'm asking if anyone here has used OpenCV tos olve this problem. I've got three Kinects which I've been using through ROS. I have the ability to access each of their depth/RGB streams through the usual code from the tutorial. However, I want to use RViz or something similar and merge the live streams into one 3D stream using a universal coordinate frame. I've read about using checkerboards and have done intrinsic calibrations with them. Conceptually, I know what to do but as far as coding, most of the repos I find are from 2011 and either deprecated or severely bugged. Can anyone point me to tutorials or packages in which might help? I'm using two model 1473's and a 1414, so I'm not sure if I can get the 1473's to play nice but I should at least be able to get one 1473 and the 1414 to work. I'm in a time crunch, and I need to be able to get these streams in RViz simultaneously. The last few months I've hit a brick wall, so any knowledge would help. Originally posted by Athoesen on ROS Answers with karma: 429 on 2014-02-11 Post score: 0
Hi. I was using Groovy, now using Hydro on Ubuntu 12.04LTS. Navigation stack worked fine in Groovy, but in Hydro, robot can't avoid obstacles...(Laser is working fine!) I try the following refference. However, the problem isn't solved yet. http://answers.ros.org/question/83031/move_base-and-costmap_layers/ http://answers.ros.org/question/90501/no-local-costmap-published-after-hydro-migration/ Here is my yaml files. ---------common_params------------- obstacle_range: 2.5 raytrace_range: 3.0 robot_radius: 0.20 inflation_radius: 0.35 obstacles: observation_sources: laser_scan_sensor laser_scan_sensor: {sensor_frame: laser, data_type: LaserScan, topic: scan, marking: true, clearing: true} plugins: - {name: static_map, type: "costmap_2d::StaticLayer"} # - {name: footprint, type: "costmap_2d::FootprintLayer"} - {name: obstacles, type: "costmap_2d::ObstacleLayer"} - {name: inflater, type: "costmap_2d::InflationLayer"} --------------------------------base_local_planner--------------------------------------- TrajectoryPlannerROS: max_vel_x: 0.3 min_vel_x: 0.1 max_rotational_vel: 1.0 min_in_place_rotational_vel: 0.4 acc_lim_th: 3.2 acc_lim_x: 2.5 acc_lim_y: 2.5 holonomic_robot: false ---------------------------global_costmap------------------------------------ global_costmap: global_frame: /map robot_base_frame: /base_link update_frequency: 10.0 static_map: true plugins: - {name: static_map, type: "costmap_2d::StaticLayer"} ---------------------------local_costmap----------------------------------- local_costmap: global_frame: /map robot_base_frame: /base_link update_frequency: 10.0 publish_frequency: 2.0 static_map: false rolling_window: true width: 6.0 height: 6.0 resolution: 0.05 plugins: - {name: obstacles, type: "costmap_2d::ObstacleLayer"} # - {name: footprint, type: "costmap_2d::FootprintLayer"} - {name: inflater, type: "costmap_2d::InflationLayer"} Please advise me. update:1 "can't avoid obstacles" is that my robot can move from "initial_pose" to "goal", but can't avoid obstacles. Global costmap works.(Map is covered in Rviz). Local costmap probably doesn't work.(Map doesn't change.) I don't know why local costmap doesn't work... Originally posted by rosuke on ROS Answers with karma: 11 on 2014-02-11 Post score: 1 Original comments Comment by Tirjen on 2014-02-11: What do you mean by "can't avoid obstacles"? Are both global and local costmaps ok on rviz? Comment by rosuke on 2014-02-12: Dear Tirjin Thank you for your reply. "can't avoid obstacles" is that my robot can move from "initial_pose" to "goal", but can't avoid obstacles. Global costmap works.(Map is covered in Rviz). Local costmap probably doesn't work.(Map doesn't change.) I don't know why local costmap doesn't work... Comment by ahendrix on 2014-02-12: You should be able to use rviz to visualize the local costmap. When you do, do obstacles from your laser scanner show up on the local costmap? Do they agree with your laser scans?
I have connected the uEye_cam with ROS but the image is too large, so I want to zoom it out a little bit so that it can get more information from the environment. But the functions in uEye_cam don't have a "zoom" function. So I am wondering if this can be done using image_transport or image_pipeline or some other functions. Please help me. Thanks. Originally posted by Jianyuan Ma on ROS Answers with karma: 13 on 2014-02-11 Post score: 1
I've tested my hydro installation successfully with pr2 and the pr2_moveit_config and the demo.lauch file and I've updated my ur5 move_group.launch file with the requisite move_group/MoveGroupGetPlanningSceneService and indicated at groups.google.com/forum/#!topic/moveit-users/mUQqqFsGu9U however when I roslaunch the ur5 demo.lauch or the moveit_planning _execution.launch file rviz comes up for an instant and the I get an exit code -11. From what I've read this is a seg fault and I'll need to run gdb to further debug however I've tested this on two fresh installation of ubuntu 12.04 x64 and have the same result however the pr2 demo.launch seems to function normally. Can someone offer some guidance here? Originally posted by Rob Farrell on ROS Answers with karma: 26 on 2014-02-12 Post score: 0 Original comments Comment by gvdhoorn on 2014-02-12: Is your MoveIt config the one from the ROS-Industrial universal_robot repository? Or is it a custom made one? Comment by Rob Farrell on 2014-02-13: Currently I'm only trying to get the default ROS-industrial universal_robots hydro-dev repository to work. I have also tried my own universal_robots and Marco's from below. All give the same result.
Hello everybody, I looked for a solution in the forum, analyzing the different answers/questions but I still don't find a solution to my problem. Some basic information: Ubuntu 12.04 LTS 32 bit Groovy Turtlebot with Kobuki base I followed the guide and there are no problems for communication, teleoperation and so on. However, I am complitely not able to use the camera: basically, I don't acquire data information. At this step, I have problem (reference: turtlebot_bringup/Tutorials/groovy/3D Visualisation ) In netbook: roslaunch turtlebot_bringup 3dsensor.launch Workstation: roslaunch turtlebot_rviz_launchers view_robot.launch Everything seems ok but when I go in rviz, I have a warn in Image: No Image Received. I tried different solutions but no ones worked. I am going to explain you. First of all, kinect seems connected to my netbook. The light of kinect flashes green. I tried all the possible USB port (to avoid USB 3.0 problems) but the result is the same. turtlebot@turtlebot-W110ER:/opt/ros/groovy$ lsusb Bus 001 Device 001: ID 1d6b:0002 Linux Foundation 2.0 root hub Bus 002 Device 001: ID 1d6b:0002 Linux Foundation 2.0 root hub Bus 003 Device 001: ID 1d6b:0002 Linux Foundation 2.0 root hub Bus 004 Device 001: ID 1d6b:0003 Linux Foundation 3.0 root hub Bus 001 Device 002: ID 8087:0024 Intel Corp. Integrated Rate Matching Hub Bus 002 Device 002: ID 8087:0024 Intel Corp. Integrated Rate Matching Hub Bus 002 Device 003: ID 04f2:b34c Chicony Electronics Co., Ltd Bus 003 Device 014: ID 0403:6001 Future Technology Devices International, Ltd FT232 USB-Serial (UART) IC Bus 003 Device 032: ID 045e:02c2 Microsoft Corp. Bus 003 Device 035: ID 045e:02ad Microsoft Corp. Xbox NUI Audio Bus 003 Device 038: ID 045e:02ae Microsoft Corp. Xbox NUI Camera So...This is the list of rosnode list from workstation cvassall@hagurosan:groovy$ rosnode list /app_manager /bumper2pointcloud /camera/camera_nodelet_manager /camera/depth/metric /camera/depth/metric_rect /camera/depth/points /camera/depth/rectify_depth /camera/depth_registered/metric /camera/depth_registered/metric_rect /camera/depth_registered/rectify_depth /camera/depthimage_to_laserscan_loader /camera/disparity_depth /camera/disparity_depth_registered /camera/driver /camera/ir/rectify_ir /camera/openni_camera_loader /camera/points_xyzrgb /camera/points_xyzrgb_depth_rgb /camera/register_depth_rgb /camera/rgb/debayer /camera/rgb/rectify_color /camera/rgb/rectify_mono /camera_nodelet_manager /cmd_vel_mux /diagnostic_aggregator /master_sync_turtlebot_W110ER_7065_566021383 /mobile_base /mobile_base_nodelet_manager /robot_pose_ekf /robot_state_publisher /rosout /rqt_gui_py_node_11279 /rviz /zeroconf/zeroconf_avahi Then I tried to get the image directly from kinect using the command rosrun image_view image_view image:=/camera/rgb/image I obtain a white image. Then, the last try. I killed 3dsensor.launch and I runned cvassall@hagurosan:groovy$ rosrun openni_camera openni_node but in turtlebot-pc and workstation, the answer is the same: [ INFO] [1392211004.943802894]: Initializing nodelet with 4 worker threads. [ INFO] [1392211005.029530557]: No devices connected.... waiting for devices to be connected [ INFO] [1392211008.034147743]: No devices connected.... waiting for devices to be connected What can I do to solve the problem? I am beginner and maybe I skip some "basic" step about kinect but I followed everything in the Tutorial. Thanks a lot Originally posted by chri-vassallo on ROS Answers with karma: 11 on 2014-02-12 Post score: 1
Hi all, Today I have 2 questions. 1º: Where is the file with the Particle filter, or similar, in Hector_SLAM? I suppose that it is connected with hector_mapping but I don´t find the file. 2º: Can I change the number of particles used for Hector_SLAM? In gmapping we use the parameter "particle". If this is possible, where is this data? Thanks for all. Originally posted by alex.filgueira on ROS Answers with karma: 62 on 2014-02-12 Post score: 0
Hi everyone, It's been a while i've been on ROS (from electric, and now on hydro). I can't seem to get roscreate-stack to work. It simply says: roscreate-stack: command not found I understand this is not available in ros fuerte (as the wiki page says), but is it not available for Hydro too? I'm not fully understanding it. Thank you, everyone. Originally posted by Haikal Pribadi on ROS Answers with karma: 103 on 2014-02-12 Post score: 0
This is an old question, but I couldn't find any good solution. I have recently installed the latest (unrealesed) OpenCV 3.0 in my machine for some programs. Nothing related with ROS at all. This OpenCV version is installed at /usr/local as usual. The thing is that, when trying to compile my code, cmake always find the ROS groovy OpenCV version (2.X) and fails. The only way I can compile it is uninstalling ROS OpenCV version or renaming it. I have tried instead of: find_package( OpenCV REQUIRED ) target_link_libraries( foo ${OpenCV_LIBS} ) Using: include_directories(/usr/local/include usr/local/include/opencv2 usr/local/include/opencv) link_directories(/usr/local/lib) target_link_libraries( foo opencv_core opencv_highgui opencv_imgproc) But, no result. Any ideas? Originally posted by Jep on ROS Answers with karma: 195 on 2014-02-12 Post score: 3
Hi Guys! I was using rospack export to get the flags and compile my package outside the rosbuild system. But now, after a long time (ROS fuerte) I'm trying to do the same thing on ROS Hydro and rospack export results in nothing. If I type: rospack export --lang=cpp --attrib=cflags PACKAGE_NAME I got nothing no matter what is the package. For example: rospack export --lang=cpp --attrib=cflags rviz So, anyone knows if rospack export is no longer working? Originally posted by v3n0w on ROS Answers with karma: 1 on 2014-02-12 Post score: 0
Hi, I have a project that uses ROS but does not use catkin_make for compiling. I would like to be able to use the ROS message generation in my project but I am running into a problem with the message dependencies. For example, I have the following file layout: . ├── a_msgs │   ├── CMakeLists.txt │   └── msg │   └── A.msg ├── b_msgs │   ├── CMakeLists.txt │   └── msg │   └── B.msg └── CMakeLists.txt And the contents of the CMakeLists.txt are as follows: ./CMakeLists.txt: cmake_minimum_required(VERSION 2.8.3) project(my_msgs) add_subdirectory(a_msgs) add_subdirectory(b_msgs) ./a_msgs/CMakeLists.txt: cmake_minimum_required(VERSION 2.8.3) project(a_msgs) find_package(catkin REQUIRED) find_package(message_generation REQUIRED) add_message_files( DIRECTORY msg FILES A.msg ) generate_messages( DEPENDENCIES b_msgs ) ./a_msgs/CMakeLists.txt: cmake_minimum_required(VERSION 2.8.3) project(b_msgs) find_package(catkin REQUIRED) find_package(message_generation REQUIRED) add_message_files( DIRECTORY msg FILES B.msg ) generate_messages() If I were to include b_msgs then a_msgs it would compile without problems, but I cannot change that in our real project. Is there a way to get this to build? Thank you Originally posted by jbrindza on ROS Answers with karma: 11 on 2014-02-12 Post score: 0
Hello, I am trying to use amcl for localization of my robot from a pre-saved map. I am using a Hokuyo laser range finder. My command to start amcl is as below: rosrun hokuyo_node hokuyo_node rosrun map_server map_server test.yaml rosrun robot_setup_tf tf_broadcaster rosrun amcl amcl However, what I got is the warning code as below: [ WARN] [1392274402.961608347]: Message from [/hokuyo_node] has a non-fully-qualified frame_id [laser]. Resolved locally to [/laser]. This is will likely not work in multi-robot systems. This message will only print once. [ WARN] [1392274417.844748520]: No laser scan received (and thus no pose updates have been published) for 1392274417.844651 seconds. Verify that data is being published on the /scan topic. [ WARN] [1392274417.845193549]: Message Filter [target=/odom ]: Dropped 100.00% of messages so far. Please turn the [ros.amcl.message_notifier] ros console logger to DEBUG for more information. I have tried to run the amcl with both scan:=/scan and scan:=/base_scan before and the tf broadcaster transform the laser frame to base frame. I don't seems to see anything when I echoed amcl_pose. May I know what do I lack in running amcl? Thank you. Originally posted by zero1985 on ROS Answers with karma: 100 on 2014-02-12 Post score: 2
I've installed ROS from source for Hydro as the documentation states. I source that ROS workspace and then create a new workspace for MoveIt development that I overlay on top. The issue is that it cannot find urdfdom: CMake Error at /home/dave/ros/ws_ros_catkin/install_isolated/share/catkin/cmake/catkinConfig.cmake:72 (find_package): Could not find a configuration file for package urdfdom. Set urdfdom_DIR to the directory containing a CMake configuration file for urdfdom. The file will have one of the following names: urdfdomConfig.cmake urdfdom-config.cmake Call Stack (most recent call first): moveit_core/CMakeLists.txt:10 (find_package) CMake Error at /home/dave/ros/ws_ros_catkin/install_isolated/share/catkin/cmake/catkin_package.cmake:156 (message): catkin_package() DEPENDS on 'urdfdom' which must be find_package()-ed before. If it is a catkin package it can be declared as CATKIN_DEPENDS instead without find_package()-ing it. Call Stack (most recent call first): /home/dave/ros/ws_ros_catkin/install_isolated/share/catkin/cmake/catkin_package.cmake:98 (_catkin_package) moveit_core/CMakeLists.txt:63 (catkin_package) -- Configuring incomplete, errors occurred! Invoking "cmake" failed Digging around, I found that in my ROS source installation workspace it was missing a .cmake file and this entire folder: /home/dave/ros/ws_ros_catkin/install_isolated/share/urdfdom I don't know how it was able to build the rest of the packages without this. My solution was to manually build urdfdom: cd /home/dave/ros/ws_ros_catkin/src/urdfdom mkdir build && cd build cmake ../ make sudo make install Then I symlinked the following folder: ln -s /usr/local/share/urdfdom /home/dave/ros/ws_ros_catkin/src/urdfdom I'm shocked that it worked, but I feel like this is a bad solution. What did I do wrong and how do I fix it in the future? Thanks! Edit Here's the output of a catkin_make_isolated --install build: https://gist.github.com/davetcoleman/8987615 My ROS_PACKAGE_PATH is the following: ws_jsk2/src ws_moveit/src ws_ros_catkin/install_isolated/share ws_ros_catkin/install_isolated/stacks Did you install your hydro workspace before overlaying moveit? Yes, I ran setup.bash of my ros source install before starting to build moveit. Edit 2 In /home/dave/ros/ws_ros_catkin/src/urdfdom, tree output: https://gist.github.com/davetcoleman/8994392 Note that I made the build folder myself, as described above, after being unable to fix the issue myself Edit 3 My checkout of urdfdom is directly from the Github repo: git clone https://github.com/ros/urdfdom It appears there is no package.xml in that repo, I guess it is added as some patch? This is undocumented and seems like a messy way of doing things. What is the recommended way of making changes to urdfdom with ROS and committing it to Github? I now see where the package.xml comes from: https://github.com/ros-gbp/urdfdom-release/blob/master/hydro/package.xml Originally posted by Dave Coleman on ROS Answers with karma: 1396 on 2014-02-12 Post score: 1 Original comments Comment by Dirk Thomas on 2014-02-13: It works fine for me so it is likely not a problem with urdfdom itself. Can you please more information from your build, e.g. the CMake configure as well as the install output of your ROS hydro workspace (probably best via gist or something similar)? The fact that your first build did not result in having the share/urdfdom folder indicates that something went wrong. Your way of trying to patch the problem after the fact was incomplete and therefore it failed to find urdfdom later. Comment by Dave Coleman on 2014-02-13: I'm not sure how to get my CMake configure information, can you explain? I've added some more info, above. Thanks!
Hello all dear friends, I am new in ROS and Kinect, and I want to DETECT a COLORED OBJECT (i.e a res sphere), I need it's POSITION (x, y, z) but not in image (CMVISION does this already), I tried to see all the previous questions but I did not find my answer and also I read the tutorial I tried to use RGBD_SLAM, VISION_VISP ... but I had problem with them.. Any body had same experience? any short message also could help me a lot. Thank you Hamed Originally posted by Mobile_robot on ROS Answers with karma: 264 on 2014-02-12 Post score: 0
Hi! With the following code I am able to read and write ros message into binary files using c++. But I have to create first memory buffer to use the ros ros::serialization::OStream or ros::serialization::IStream is there a way how to stream messages directly into files similar to a std::ofstream? void LaserLineFilterNode::callback (const sensor_msgs::LaserScan::ConstPtr& _msg) { { // Write to File std::ofstream ofs("/tmp/filename.txt", std::ios::out|std::ios::binary); uint32_t serial_size = ros::serialization::serializationLength(*_msg); boost::shared_array<uint8_t> obuffer(new uint8_t[serial_size]); // This i like to avoid ros::serialization::OStream ostream(obuffer.get(), serial_size); // This i like to avoid ros::serialization::serialize(ostream, *_msg); // I would like to use the ofstream here? ofs.write((char*) obuffer.get(), serial_size); // This i like to avoid ofs.close(); } { // Read from File to msg_scan_ //sensor_msgs::LaserScan msg_scan_ --> is a class variable std::ifstream ifs("/tmp/filename.txt", std::ios::in|std::ios::binary); ifs.seekg (0, std::ios::end); std::streampos end = ifs.tellg(); ifs.seekg (0, std::ios::beg); std::streampos begin = ifs.tellg(); uint32_t file_size = end-begin; boost::shared_array<uint8_t> ibuffer(new uint8_t[file_size]); // This i like to avoid ifs.read((char*) ibuffer.get(), file_size); // This i like to avoid ros::serialization::IStream istream(ibuffer.get(), file_size); // I would like to use the ifstream here? ros::serialization::deserialize(istream, msg_scan_); // This i like to avoid ifs.close(); } .... Originally posted by Markus Bader on ROS Answers with karma: 847 on 2014-02-12 Post score: 2
Hi everyone, I was going through the tutorials on the ActionLib, when I recognized a missing file (description) on the Averaging Action. In the code explanation on the tutorial page (http://wiki.ros.org/actionlib_tutorials/Tutorials/SimpleActionClient%28Threaded%29#The_Code_Explained it says [...] This includes action message generated from the Averaging.action file show above. This is a header generated automatically from the AveragingAction.msg file. [...] , but there actually isn't any Averaging.action file shown on the page or previous pages. Also, the linked AveragingAction.msg (http://www.ros.org/doc/api/actionlib_tutorials/html/msg/AveragingAction.html) isn't existing. I worked around this with an improvised Averaging.action like this: #goal int32 samples --- #result int32 average int32 samplecount int32 stddeviation --- #feedback int32 samplenumber int32 currentaverage int32 currentstddeviation but I am not sure if it will work semantically correctly when I proceed with the tutorial. Could someone please update this? Thanks in advance! Originally posted by bnm-rc on ROS Answers with karma: 22 on 2014-02-12 Post score: 1
Hello, I found the youbot-navigation pakcage on the ROS Homepage: wiki.ros.org/youbot_navigation It mentions functionalities (for example the slam.launch) which are not included in the default navigation package included in the youbot-ros-pkg: github.com/youbot/youbot-ros-pkg. Where can I find this package (as nothing is mentioned in the wiki article) and is the package for Ros Fuerte or Groovy? Originally posted by Jabro on ROS Answers with karma: 5 on 2014-02-13 Post score: 0 Original comments Comment by Hamid on 2014-07-03: Hi, I'm trying to run the SLAM on youbot.. I'm having hard time on dealing with Costmaps parameters and Amcl... could you please help me? could you bring up the SLAM on this robot? or in rviz?
Hello, which Version of ROS would you recommend for the KUKA Youbot. The manufacturer ships it with ROS Fuerte, which seems to be quite old. I have seen that there are packages for ROS Groovy and also for ROS Hydro. Is it save and recommended to update? I am currently testing ROS Hydro on a youbot running Ubuntu 12.04 and will report my findings. Originally posted by Jabro on ROS Answers with karma: 5 on 2014-02-13 Post score: 0
Dear all, I am a newbie of ROS, and I am searching for the answer to this simple question since this morning. I have a rosbuild package, that generates some custom messages (headers are generated accordingly) and another, catkin-based, package that should use them. How should I do? In particular, I need to know: how to make the catkin build system aware of the location of the message headers how to be sure that the catkin build system will link the messages to my node Thanks, Originally posted by madmage on ROS Answers with karma: 293 on 2014-02-13 Post score: 1 Original comments Comment by dornhege on 2014-02-13: As far as I know that's impossible as catkin packages can only depend on catkin packages and not rosbuild packages. If that is correct, the simplest solution would be to convert the message package to catkin. Comment by madmage on 2014-02-13: Hi Christian, glad to see you here ;-) I see what you say http://wiki.ros.org/catkin/migrating_from_rosbuild#Prerequisites , granted that the only solution is to convert the rosbuild package to catkin, how do I add this dependency to the first package, so that I can include/link to my nodes? Comment by dornhege on 2014-02-13: The other way around works: rosbuild packages can depend on catkin packages. Comment by madmage on 2014-02-13: Ok, I finally have things working by hacking the CMakeLists.txt (with something similar to find_package). I just expected that catkin, newest, was back-compatible, instead of being the oldest forward-compatible :-D. Thanks. Comment by dornhege on 2014-02-14: It's somewhat the other way around :) If you can add what you did as an answer that might be helpful for others that stumble upon this.
I am having trouble finding the ros::init call in the documentation. I've followed a few of the tutorial links and tried searching through the documentation. Here are my main leads: http://docs.ros.org/hydro/api/roscpp/html/index.html http://wiki.ros.org/roscpp/Overview/Initialization%20and%20Shutdown -- The links here 404 Any suggestions? Thanks in advance. Originally posted by Constantin S on ROS Answers with karma: 296 on 2014-02-13 Post score: 0 Original comments Comment by Constantin S on 2014-02-13: I looked through the header and saw that my second link pretty much describes all of the init functionality. So I guess my question is just related to navigating the doxygen documentation ... am I doing it wrong or is ros::init really not in there?
Android 4.2.2, Android 4.1.2, Ubuntu 12.04, Android Studio 0.4.4, ROS Hydro Hi, I have recently tried to run the listener (obtained from Google Play) through Robot Remocon, but after the "Starting Listener" dialog box disappeared, no new view (window) is opened, it is still on the main layout of the Remocon, with the Listener highlighted blue (indicating running app), and the ability to stop the app. Apart from that, even though a new ROS topic is created under "/turtlebot/chatter", I can't see any data on my device (since apparently the rosTextView has failed to be opened?). I would really appreciate it if anyone can look into this. PS: I have tried to compile the code from "android_apps" under Android Studio myself, and the same problem has occurred. Originally posted by Hon Ng on ROS Answers with karma: 3 on 2014-02-13 Post score: 0 Original comments Comment by Daniel Stonier on 2014-02-17: Do you have your ROS_IP/ROS_HOSTNAME variables set? Comment by Hon Ng on 2014-02-18: Yes, otherwise, the Robot Remocon App will not connect successfully to the turtlebot, right?
Good evening partners First of all I want to apologise beacuse this is a similar question to this one I solved time ago: http://answers.ros.org/question/119031/rosserial_client-does-not-include-make_librarypy/ I have started the tutorial on a new Raspberry of my students´s group. We followed all steps. We found the same issue that in the question I asked wich it´s mencioned above: I'm given : [rosrun] Couldn't find executable named make_library.py below /home/pi/catkin_ws/install/share/rosserial_client. To solve it I did the same that time ago: EDIT 1(from the other post) : I have done the next cp -r ~/catkin_ws/src/rosserial/rosserial_client/src/rosserial_client/ /catkin_ws/install/share/rosserial_client/src/ Then I was able to call " rosrun rosserial_client make_library.py ~/sketchbook/libraries My_Msgs_Package" and create the header file but now when I type the call from above it seems that make_library.py does nothing beacuse it does not create the header file for My_Msgs_Package What´s worng ? Can you help me please? Thanks you so much Originally posted by 4LV4R0 on ROS Answers with karma: 70 on 2014-02-13 Post score: 0
Hi I like to record raw images using rosbag. rosbag record /front_camera/image_raw Works perfect and I can view the images with rosbag play my_bag.bag & rosrun image_view image_view /front_camera/image_raw But the bag files becomes get big very fast My question is now is there a way to record images loosless compressed? Currently I see the following topics /front_camera/image_raw /front_camera/image_raw/compressed /front_camera/image_raw/compressed/parameter_descriptions /front_camera/image_raw/compressed/parameter_updates /front_camera/image_raw/compressedDepth /front_camera/image_raw/compressedDepth/parameter_descriptions /front_camera/image_raw/compressedDepth/parameter_updates /front_camera/image_raw/theora /front_camera/image_raw/theora/parameter_descriptions /front_camera/image_raw/theora/parameter_updates I tried recording the /front_camera/image_raw/compressed or /front_camera/image_raw/theora butI was not able to view the recorded images using image_view. Thanks Markus Originally posted by Markus Bader on ROS Answers with karma: 847 on 2014-02-14 Post score: 3
I would like to communicate (mulitple) custom C++ classes between nodes. On the ROS wiki I have found how to adapt C++ types to be used with publish and subcribe: http://wiki.ros.org/roscpp/Overview/MessagesSerializationAndAdaptingTypes Using the approach above I can publish only one class for each topic. However, I would also like to use these C++ classes in the messages used by the SimpleActionServer/SimpleActionClient and send some additional information (so not only sending the class itself). Hence, I had to idea to use these classes inside a message file. I have tried to use a test class in an example message item_test.msg with some class Item, adapted as described on the ROS wiki. Item item This was to test if it is possible to use the adapted C++ classes with .msg/.srv/.action files. However, I got the following error when compiling: CMake Error at /home/mathijs/git/rose2_0/gui/build/gui_item_selector/cmake/gui_item_selector-genmsg.cmake:3 (message): Could not find messages which '/home/mathijs/git/rose2_0/gui/src/gui_item_selector/msg/item_test.msg' depends on. Did you forget to specify generate_messages(DEPENDENCIES ...)? Cannot locate message [Item]: unknown package [custom_classes] on search path [{{'geometry_msgs': ['/opt/ros/hydro/share/geometry_msgs/cmake/../msg'], 'gui_item_selector': ['/home/mathijs/git/rose2_0/gui/src/gui_item_selector/msg', '/home/mathijs/git/rose2_0/gui/devel/share/gui_item_selector/msg'], 'std_msgs': ['/opt/ros/hydro/share/std_msgs/cmake/../msg'], 'actionlib_msgs': ['/opt/ros/hydro/share/actionlib_msgs/cmake/../msg'],}}] Call Stack (most recent call first): /opt/ros/hydro/share/genmsg/cmake/genmsg-extras.cmake:303 (include) gui_item_selector/CMakeLists.txt:39 (generate_messages) I have specified generate_messages(DEPENDENCIES custom_classes) in the CMakelist, so that is not the fault. Is there a way to use the Item class in a .msg/.srv/.action file? Originally posted by mathijsdelangen on ROS Answers with karma: 88 on 2014-02-14 Post score: 4 Original comments Comment by dornhege on 2014-02-14: Is Item a ROS message? Comment by mathijsdelangen on 2014-02-15: Item is a C++ class which I have adapted for serialization (from http://wiki.ros.org/roscpp/Overview/MessagesSerializationAndAdaptingTypes) Comment by Okke on 2014-02-17: I am also looking for a method to uses custom classes as messages in pub/sub, services and GFR. I am building a datamanager node which retrieves data from disk or database and wraps this in an object, which I want to send to another node. Comment by Matias on 2014-10-21: I'm also looking for an answer to this. Comment by mathijsdelangen on 2014-10-22: For now, we have still have not found a solution for this. What we do at this moment is using the adaptions of C++ types as described above and sending only one class over topics and services. A big drawback for us is that you lose the interface to Python and introspection of topics/services. Comment by Matias on 2014-10-22: I just want to clear up that my problem was with services using adapted C++ types, not the multiple-class per-topic problem. In fact, I believe this is a limitation of ROS itself, where you publish one message type per topic.
I made the ros_package "cob_people_detection" in groovy and I got an error. [rospack] Error: package/stack 'cob_people_detection' depends on non-existent package 'kdl' and rosdep claims that it is not a system dependency. Check the ROS_PACKAGE_PATH or try calling 'rosdep update' CMake Error at /opt/ros/groovy/share/ros/core/rosbuild/public.cmake:129 (message): Failed to invoke rospack to get compile flags for package 'cob_people_detection'. Look above for errors from rospack itself. Aborting. Please fix the broken dependency! Call Stack (most recent call first): /opt/ros/groovy/share/ros/core/rosbuild/public.cmake:203 (rosbuild_invoke_rospack) CMakeLists.txt:16 (rosbuild_init) I have already installed the ros-groovy-kdl, but the error still exist. WHY? Originally posted by Jianyuan Ma on ROS Answers with karma: 13 on 2014-02-14 Post score: 0
I got a kinect and I am trying to follow the documentation http://wiki.ros.org/openni_launch/Tutorials/QuickStart However, I get the following output. $ roslaunch openni_launch openni.launch [openni.launch] is neither a launch file in package [openni_launch] nor is [openni_launch] a launch file name I am currently on Groovy. Should I update to Hydro? If yes, How? Or is it related to some other problem? Originally posted by expelliarmus on ROS Answers with karma: 28 on 2014-02-14 Post score: 0
I am getting the following warning and error messages while trying to start Kinect using openni in ROS Groovy. [ INFO] [1392447768.640379198]: Number devices connected: 1 [ INFO] [1392447768.640669716]: 1. device on bus 003:15 is a SensorV2 (2ae) from PrimeSense (45e) with serial id 'B00361702524042B' [ INFO] [1392447768.642870790]: Searching for device with index = 1 [ INFO] [1392447768.730364791]: Opened 'SensorV2' on bus 3:15 with serial number 'B00361702524042B' [ INFO] [1392447769.452707110]: rgb_frame_id = '/camera_rgb_optical_frame' [ INFO] [1392447769.452883894]: depth_frame_id = '/camera_depth_optical_frame' [ WARN] [1392447769.459691362]: Camera calibration file /home/piyush/.ros/camera_info/rgb_B00361702524042B.yaml not found. [ WARN] [1392447769.459921064]: Using default parameters for RGB camera calibration. [ WARN] [1392447769.460116262]: Camera calibration file /home/piyush/.ros/camera_info/depth_B00361702524042B.yaml not found. [ WARN] [1392447769.460288311]: Using default parameters for IR camera calibration. [ERROR] [1392447773.721890264]: Tried to advertise a service that is already advertised in this node [/camera/depth_registered/image_rect_raw/compressedDepth/set_parameters] [ERROR] [1392447773.820395404]: Tried to advertise a service that is already advertised in this node [/camera/depth_registered/image_rect_raw/compressed/set_parameters] [ERROR] [1392447773.995215849]: Tried to advertise a service that is already advertised in this node [/camera/depth_registered/image_rect_raw/theora/set_parameters] What should I do to resolve them? Thanks in advance. Originally posted by expelliarmus on ROS Answers with karma: 28 on 2014-02-14 Post score: 0
Hi, I've written a node with publishes (Successfully) and subscribes to cmd_vel messages. Problem I'm getting is that the call back is never being called. C++ code is very simple, as per tutorial - abridged version below: #include <ros/ros.h> #include <sensor_msgs/JointState.h> #include <sensor_msgs/Range.h> #include <sensor_msgs/LaserScan.h> #include <diagnostic_updater/diagnostic_updater.h> #include <std_msgs/Bool.h> #include <diagnostic_updater/publisher.h> #include <geometry_msgs/Twist.h> // For moving the robot on the map #include <tf/transform_broadcaster.h> #include <nav_msgs/Odometry.h> #include "Consts.h" #include "RobotInterface.h" #include "NetworkInterface.h" void cmd_vel_callback(const geometry_msgs::Twist& vel_cmd) { ROS_INFO("I heard: [%s]", vel_cmd.linear.y); cout << "Twist Received " << endl; } int main( int argc, char* argv[] ) { ros::init(argc, argv, "toeminator_publisher" ); ros::NodeHandle n_("~"); ros::NodeHandle n(""); ros::NodeHandle lSubscriber(""); ros::NodeHandle nIR(""); ros::NodeHandle nLaser(""); ros::Rate loop_rate(10); ros::Subscriber sub = lSubscriber.subscribe("/cmd_vel", 1000, cmd_vel_callback); ros::Time current_time, last_time; current_time = ros::Time::now(); last_time = ros::Time::now(); RobotData lRobotData; while( n.ok() ) { ros::spin(); } return 1; } The python publisher is basically the turtlebot's keyboard publisher and running rtq_graph shows the message link between the publisher and subscriber as expected (below) and "rostopic echo /cmd_vel" shows the message flowing Not sure where I've gone wrong here. Would welcome any pointers. Kind Regards Mark EDIT: Updated with full code. Also I neglected to mention (apologies) that the roscore and the C++ processes are running on a different machine to where the teleop keyboard process is running. That said publishing from the roscore machine to rviz etc on the telop machine is working with out issue (ROS_IP is set to the IP addresses of the respective machines - as mentioned in the networking setup tutorials) Originally posted by MarkyMark2012 on ROS Answers with karma: 1834 on 2014-02-15 Post score: 0 Original comments Comment by Pedro_85 on 2014-02-15: Can you please copy the rest of the code? That can help
I'm trying to create some example nodes that execute linear algebra commands. I wanted to try the TooN library (http://www.edwardrosten.com/cvd/toon.html). I was trying to follow what the package tum_ardrone has done in regards to this. I downloaded the folder containing the TooN library files and moved it to the the directory /thirdparty/TooN/include/. I added the following to my CMakeLists.txt file: set required libs and headers include_directories( ${PROJECT_SOURCE_DIR}/thirdparty/TooN/include ) Based on the file HelperFunctions.h located in /tum_ardrone/src I created a simple program to perform basic matrix operations. I will be using these functions later and since I'm not familiar with any library like this one I need to start from the basics. When I execute rosmake I get the following error: /home/pedro/fuerte_workspace/sandbox/controlador_ardrone/src/ejemploalgebralineal.cpp: In member function ‘void LinearAlgebra::InverseMatrix()’: /home/pedro/fuerte_workspace/sandbox/controlador_ardrone/src/ejemploalgebralineal.cpp:31:31: error: ‘struct TooN::Matrix<3>’ has no member named ‘inverse’ Here is the code I try to compile: #include <ros/ros.h> #include <std_msgs/Empty.h> #include <geometry_msgs/Twist.h> #include <math.h> #include <TooN/TooN.h> #include <TooN/so3.h> using namespace std; using namespace TooN; struct LinearAlgebra { ros::NodeHandle n; void InverseMatrix(){ TooN::Matrix<3,3> mat; mat = Data(1,2,3,4,5,6,7,8,9); TooN::SO3<> res = mat.inverse(); std::cout << "m3_4\n" << mat << "\nm3_5\n"<<res << std::endl; } void Commands(){ InverseMatrix(); } }; //////////// int main(int argc, char **argv) { ros::init(argc,argv,"Linear_Algebra_ROS"); LinearAlgebra linearalgebra; ros::Duration wait_time = ros::Duration(3,0); while(linearalgebra.n.ok()) { wait_time.sleep(); linearalgebra.Commands(); ros::spinOnce(); } return 0; Does anybody have experience with this library and/or other libraries that I can use? Any help is appreciated. Originally posted by Pedro_85 on ROS Answers with karma: 182 on 2014-02-15 Post score: 1
Hi everyone I am using a Khepera III robot which happens to use TCRT5000 IR sensors. I am trying to use ROS navigation package, but I don't know how to make the LaserScan message from the IR (which as far as I understand is possible). The IR lectures are more or less 3900 when an object is close to the sensor and more or less 100 when it is at 10 cm (4 inches). I have a function that, given the IR lecture, returns how far in meters is the object. I am going to use 6 IR sensors (the ones in the front and the ones in the side). How does this look to you? sensor_msgs::LaserScan scan; scan.header.stamp = ros::Time::now(); scan.header.frame_id = "laser_frame"; scan.angle_min = -1.57; scan.angle_max = 1.57; scan.angle_increment = 3.14 / 5;//six is the number of sensors scan.time_increment = (1 / 10) / (5); //assuming that we have 6 IR sensors and we want to make ten scans with the six sensors, would this be correct? (The time between the sensors measures is 3ms, but I only want to make a full scan ten times per second). scan.range_min = 0.0; scan.range_max = 0.1; scan.ranges.resize(6);//six is the number of sensors. //Now, the IR measures: scan.ranges[0]= infrared_left; //left sensor info (in meters) scan.ranges[1]= infrared_front_side_left; //front side left sensor info (in meters) scan.ranges[2]= infrared_front_left; //front left sensor info (in meters) scan.ranges[3]= infrared_front_right; scan.ranges[4]= infrared_front_side_right; scan.ranges[5]= infrared_right; I really don't know what to do with the scan.time_increment, or if I have to do something with the intensities array ( I suppose that nothing, but I have to ask). Thanks in advance. Originally posted by nanaky on ROS Answers with karma: 23 on 2014-02-15 Post score: 0
Hello all! I have Ubuntu 12.04, Groovy. I launch openni_launch and rviz I have a problem with Rviz. When I add pointcloud2, rviz is stop and update one per two second. but i haven't any errors. What is wrong? maybe it is tf? Update1 Also I have warn message: [ WARN] [1392574116.780493741]: TF exception: Lookup would require extrapolation into the future. Requested time 1392574116.741091059 but the latest data is at time 1392574116.679388999, when looking up transform from frame [/camera_depth_optical_frame] to frame [/camera_rgb_optical_frame] and I found this topic http://answers.ros.org/question/12930/dropped-sensor-messages-in-navigation-stack/ maybe improper timestamps relevant for my case? but I can't check it. This TF error in openni.launch file? Update2 I am use intel core i7. PID USER PR NI VIRT RES SHR S %CPU %MEM TIME+ COMMAND 19715 max 20 0 2085m 551m 63m R 82 18.3 1:04.19 rviz 19475 max 20 0 1543m 65m 22m S 74 2.2 0:44.53 nodelet Originally posted by seredin on ROS Answers with karma: 45 on 2014-02-16 Post score: 0 Original comments Comment by ahendrix on 2014-02-16: What is the CPU usage on your computer while rviz is running? Comment by seredin on 2014-02-16: I am use intel core i7. Comment by ahendrix on 2014-02-16: It looks like rviz is consuming most of a core. Do you have a dedicated graphics card, or are you using software OpenGL rendering? Comment by seredin on 2014-02-17: I am use OpenGL. Comment by ahendrix on 2014-02-17: Doing a minor editing to your question just to push it to the top of the queue is bad form. Comment by ahendrix on 2014-02-17: You still haven't stated if you have a dedicated graphics card or not. Comment by seredin on 2014-02-18: I am sorry for my push. No. I haven't a dedicated graphics card.
Hi there, I'm trying to install ROS Hydro on Ubuntu 13.10 from source and I get this error while builiding catkin_ws with rosdep install --from-paths src --ignore-src --rosdistro hydro -y : executing command [sudo apt-get install -y gazebo2] Reading package lists... Done Building dependency tree Reading state information... Done E: Unable to locate package gazebo2 ERROR: the following rosdeps failed to install apt: command [sudo apt-get install -y gazebo2] failed apt: Failed to detect successful installation of [gazebo2] Can someone point me out how can I get pass this dependency? (that means, how to make rosdep ignore gazebo2 package) Already tried rosdep install --from-paths src --ignore-src --rosdistro hydro -y -r (to ignore minor errors) but no luck. Thanks! Originally posted by TSC on ROS Answers with karma: 210 on 2014-02-16 Post score: 2 Original comments Comment by RagingBit on 2014-03-20: Hi all, I experienced the same problem and fixed it by first launching: sudo sh -c 'echo "deb http://packages.osrfoundation.org/gazebo/ubuntu saucy main" > /etc/apt/sources.list.d/gazebo-latest.list' wget http://packages.osrfoundation.org/gazebo.key -O - | sudo apt-key add
I'm getting into ROS and rosserial for my robot, which will use an Arduino for low level processing. Creating a custom message is important, but so far I've hit a roadblock in which rosserial cannot generate the header file for my custom message. I've been following the tutorials to create and build .msg files and after it all, rosmsg can find and display my messages correctly. However if I run make_libraries, only the standard messages from ROS are installed. ~/ros_workspace$ rosrun rosserial_arduino make_libraries.py ~/sketchbook/libraries Exporting to ~/sketchbook/libraries [my_project]: Not found ... The end result only says messages could not be generated for map_msgs, and does not include my package. I suspect I'm missing a source command somewhere, but my familiarity with ROS prevents me from knowing when and which folder to run it. Any help greatly appreciated! Originally posted by Wes G on ROS Answers with karma: 33 on 2014-02-16 Post score: 0
Hi, I have a bag file that contains IMU readings collected using the rosjava android sensors driver app. Apparently the rosjava implementation in the app is broken (http:// answers.ros.org/question/108956/cannot-convert-imu-messages-from-bagfile-to-csv-file/), which causes issues with some ROS tools, in my case 'rosbag filter'. Similar to the other question, I receive the following error: File "/opt/ros/hydro/bin/rosbag", line 35, in <module> rosbag.rosbagmain() File "/opt/ros/hydro/lib/python2.7/dist-packages/rosbag/rosbag_main.py", line 834, in rosbagmain cmds[cmd](argv[2:]) File "/opt/ros/hydro/lib/python2.7/dist-packages/rosbag/rosbag_main.py", line 299, in filter_cmd for topic, raw_msg, t in inbag.read_messages(raw=True): File "/opt/ros/hydro/lib/python2.7/dist-packages/rosbag/bag.py", line 2062, in read_messages yield self.seek_and_read_message_data_record((entry.chunk_pos, entry.offset), raw) File "/opt/ros/hydro/lib/python2.7/dist-packages/rosbag/bag.py", line 2198, in seek_and_read_message_data_record msg_type = _get_message_type(connection_info) File "/opt/ros/hydro/lib/python2.7/dist-packages/rosbag/bag.py", line 1309, in _get_message_type message_type = genpy.dynamic.generate_dynamic(info.datatype, info.msg_def)[info.datatype] File "/opt/ros/hydro/lib/python2.7/dist-packages/genpy/dynamic.py", line 151, in generate_dynamic for l in msg_generator(msg_context, spec, search_path): File "/opt/ros/hydro/lib/python2.7/dist-packages/genpy/generator.py", line 736, in msg_generator genmsg.msg_loader.load_depends(msg_context, spec, search_path) File "/opt/ros/hydro/lib/python2.7/dist-packages/genmsg/msg_loader.py", line 344, in load_depends return load_msg_depends(msg_context, spec, msg_search_path) File "/opt/ros/hydro/lib/python2.7/dist-packages/genmsg/msg_loader.py", line 313, in load_msg_depends depspec = load_msg_by_type(msg_context, resolved_type, search_path) File "/opt/ros/hydro/lib/python2.7/dist-packages/genmsg/msg_loader.py", line 119, in load_msg_by_type file_path = get_msg_file(package_name, base_type, search_path) File "/opt/ros/hydro/lib/python2.7/dist-packages/genmsg/msg_loader.py", line 78, in get_msg_file % (base_type, package, search_path)) genmsg.msg_loader.MsgNotFound: Cannot locate message [Header]: unknown package [std_msgs] on search path [{}] Any suggestions that would enable the filtering of the bag file would be fantastic! Thanks. Originally posted by marsdo on ROS Answers with karma: 1 on 2014-02-16 Post score: 0
I followed the Ubuntu 13.10 Indigo installation instructions BUT sudo apt-get install ros-indigo-desktop-full Fails, and I can verify this by looking at this URL: (NOTE: Not enough karma to paste this link in) <PACKAGES.ROS.ORG> /ros/ubuntu/dists/trusty/main/binary-amd64/Packages and seeing that it doesn't contain any packages that match ros-indigo-* So am I missing something? Thanks, Dan Originally posted by danp on ROS Answers with karma: 3 on 2014-02-16 Post score: 0
Hello, I'm getting the following error when trying to execute rosdep update on my youbot running ros hydro (hint: I also have ros fuerte installed) on an Ubuntu 12.04 LTS: `AssertionError: Unable to handle 'index' format version '2', please update rosdistro` The complete Stacktrace: File "/usr/local/lib/python2.7/dist-packages/rosdep2/main.py", line 121, in rosdep_main exit_code = _rosdep_main(args) File "/usr/local/lib/python2.7/dist-packages/rosdep2/main.py", line 264, in _rosdep_main return _no_args_handler(command, parser, options, args) File "/usr/local/lib/python2.7/dist-packages/rosdep2/main.py", line 272, in _no_args_handler return command_handlers[command](options) File "/usr/local/lib/python2.7/dist-packages/rosdep2/main.py", line 437, in command_update error_handler=update_error_handler) File "/usr/local/lib/python2.7/dist-packages/rosdep2/sources_list.py", line 433, in update_sources_list for d, dist in get_index().distributions.items(): File "/usr/local/lib/python2.7/dist-packages/rosdep2/rosdistrohelper.py", line 58, in get_index _RDCache.index = rosdistro.get_index(_RDCache.index_url) File "/usr/local/lib/python2.7/dist-packages/rosdistro/__init__.py", line 109, in get_index return Index(data, base_url) File "/usr/local/lib/python2.7/dist-packages/rosdistro/index.py", line 50, in __init__ assert int(data['version']) == 1, "Unable to handle '%s' format version '%d', please update rosdistro" % (Index._type, int(data['version'])) This question has been asked for ROS Groovy here: http://answers.ros.org/question/122266/how-can-i-fix-unable-to-handle-index-format-version-2-please-update-rosdistro/ and there is also a related question here: http://answers.ros.org/question/49143/problems-with-rqt-groovy-ubuntu/?answer=49153#post-id-49153 However the soulations provided in these questions don't fix the problem I have. Originally posted by Jabro on ROS Answers with karma: 5 on 2014-02-16 Post score: 0 Original comments Comment by ahendrix on 2014-02-16: Which OS is your youbot running? Which version of rosdep do you have installed? Comment by Jabro on 2014-02-17: I'm running Ubuntu 12.04 LTS, I'll check the rosdep verison later, when I have access to the robot Comment by Jabro on 2014-02-17: rosdep version is 0.10.25-1 for python 2.7 Comment by Dirk Thomas on 2014-02-17: The package is question is not rosdep but rosdistro. Please check the version of that pcakage - it must be 0.3.x. You can check with: python -c "import rosdistro; print(rosdistro.version)" Comment by Jabro on 2014-02-18: I checked it, the version is 0.2.17. I tried apt-get install --reinstall python-rosdistro, the console output stated that it is installing 0.3.4-1, but the error is still present and executing python -c "import rosdistro; print(rosdistro.version)" still leads to 0.2.17. How can I upgrade?
I've followed the tutorial [Getting Started with the Velodyne HDL-32E] and I can get a video in real time from velodyne doing: sudo ifconfig eth0 192.168.3.100 <-- IP for my PC sudo route add 192.168.18.108 eth0 <-- velodyne IP roslaunch velodyne_pointcloud 32e_points.launch calibration:=/home/vic/32db.yaml rosrun rviz rviz -f velodyne > configure as the tutorial said. It works fine, but I need to process the data from a static 360º scene, not from the video. So I need a program which do: capture a 360º from velodyne process the data again capture a new 360º scene Which ROS command should I use? Thanks in advance. Originally posted by marilia15 on ROS Answers with karma: 104 on 2014-02-16 Post score: 0
I need to install the package. I used the following command lines:- sudo apt-get install ros-fuerte-rosserial rosstack profile rospackage profile but it seem that rospckage profile command not found? What cause this? in before, all the installation went well. I use Ubuntu presice 12.04. Originally posted by Ross Marry on ROS Answers with karma: 3 on 2014-02-16 Post score: 0
Hi everyone, I'm facing an error when trying to build the tutorial on the pluginlib. I updated my CMakeLists.txt, package.xml and created a polygon_loader.xml as described in the tutorial, but when I try to build the project, it fails stating that in [my_workspace]/pluginlib_tutorials_/src/polygon_loader.cpp the included header file pluginlib_tutorials_/polygon_base.h could not be found. The funny thing is, if I change my CMakeLists.txt by adding the line target_link_libraries(polygon_loader polygon_plugins) my polygon_loader.cpp is fine, but my polygon_plugins.cpp throws the previous mentioned error. It seems I missed some configuring in the ROS toolchain I guess. Could please someone help me out? Thanks in advance, Roberto P.S.: Here are the relevant fragments, if something is missing, please ask! My file structure: catkin_ws_plugins/ -> build -> devel -> src --> CMakeList.txt --> pluginlib_tutorials_ ---> CMakeLists.txt ---> package.xml ---> polygon_plugins.xml ---> include ----> pluginlib_tutorials_ -----> polygon_base.h -----> polygon_plugins.h ---> src -----> polygon_loader.cpp -----> polygon_plugins.cpp catkin_ws_plugins/src/pluginlib_tutorials_/CMakeLists.txt: cmake_minimum_required(VERSION 2.8.3) project(pluginlib_tutorials_) find_package(catkin REQUIRED COMPONENTS pluginlib roscpp ) catkin_package() include_directories( ${catkin_INCLUDE_DIRS} ) add_library(polygon_plugins src/polygon_plugins.cpp) add_executable(polygon_loader src/polygon_loader.cpp) target_link_libraries(polygon_loader ${catkin_LIBRARIES}) catkin_ws_plugins/src/pluginlib_tutorials_/package.xml (only the changes): <export> <pluginlib_tutorials_ plugin="${prefix}/polygon_plugins.xml" /> </export> catkin_ws_plugins/src/pluginlib_tutorials_/polygon_plugins.xml: <library path="lib/libpolygon_plugins"> <class type="polygon_plugins::Triangle" base_class_type="polygon_base::RegularPolygon"> <description>This is a triangle plugin</description> </class> <class type="polygon_plugins::Square" base_class_type="polygon_base::RegularPolygon"> <description>This is a square plugin</description> </class> </library> Last but not least the line where the error occurs in catkin_ws_plugins/src/pluginlib_tutorials_/src/polygon_loader.cpp #include <pluginlib_tutorials_/polygon_base.h> Originally posted by bnm-rc on ROS Answers with karma: 22 on 2014-02-17 Post score: 0
when i do bellow tutorial,bellow error caused, what's problem? [ERROR] [1392637719.233332009]: Trajectory Server: Transform from /map to scanmatcher_frame failed: Frame id /map does not exist! Frames (1): [ERROR] [1392637719.467775930]: Trajectory Server: Transform from /map to scanmatcher_frame failed: Frame id /map does not exist! Frames (3): Frame /laser exists with parent /base_link. Frame /base_link exists with parent NO_PARENT. slam.launch <launch> <param name="/use_sim_time" value="false"/>ros <node pkg="rviz" type="rviz" name="rviz" args="-d $(find hector_slam_launch)/rviz_cfg/mapping_demo.vcg"/> <include file="$(find uprobotics)/launch/hector_mapping.launch"/> <include file="$(find uprobotics)/launch/geotiff_mapper.launch"> <arg name="trajectory_source_frame_name" value="scanmatcher_frame"/> </include> </launch> hector_mapping.launch <launch> <node pkg="hector_mapping" type="hector_mapping" name="hector_mapping" output="screen"> <param name="pub_map_odom_transform" value="true"/> <param name="map_frame" value="map" /> <param name="base_frame" value="base_link" /> <param name="odom_frame" value="base_link" /> <!-- Map size / start point --> <param name="map_resolution" value="0.025"/> <param name="map_size" value="2048"/> <param name="map_start_x" value="0.5"/> <param name="map_start_y" value="0.5" /> <param name="laser_z_min_value" value="-2.5" /> <param name="laser_z_max_value" value="7.5" /> <!-- Map update parameters --> <param name="update_factor_free" value="0.4"/> <param name="update_factor_occupied" value="0.7" /> <param name="map_update_distance_thresh" value="0.2"/> <param name="map_update_angle_thresh" value="0.06" /> </node> <node pkg="tf" type="static_transform_publisher" name="base_to_laser_broadcaster" args="0 0 0 0 0 0 /base_link /laser 100" /> </launch> geotiff_mapper.launch in this file was modified only thing is the path where you save the geotiff generated in this case / home / viki / Desktop / maps <launch> <arg name="trajectory_source_frame_name" default="/base_link"/> <arg name="trajectory_update_rate" default="4"/> <arg name="trajectory_publish_rate" default="0.25"/> <node pkg="hector_trajectory_server" type="hector_trajectory_server" name="hector_trajectory_server" output="screen"> <param name="target_frame_name" type="string" value="/map" /> <param name="source_frame_name" type="string" value="$(arg trajectory_source_frame_name)" /> <param name="trajectory_update_rate" type="double" value="$(arg trajectory_update_rate)" /> <param name="trajectory_publish_rate" type="double" value="$(arg trajectory_publish_rate)" /> </node> <node pkg="hector_geotiff" type="geotiff_node" name="hector_geotiff_node" output="screen" launch-prefix="nice -n 15"> <remap from="map" to="/dynamic_map" /> <param name="map_file_path" type="string" value="/home/viki/Desktop/maps" /> <param name="map_file_base_name" type="string" value="uprobotics" /> <param name="geotiff_save_period" type="double" value="0" /> <param name="draw_background_checkerboard" type="bool" value="true" /> <param name="draw_free_space_grid" type="bool" value="true" /> </node> </launch> and is run as follows $ roscore $ sudo chmod a+rw /dev/ttyACM0 $ rosrun hokuyo_node hokuyo_node $ uprobotics slam.launch Originally posted by programmer on ROS Answers with karma: 61 on 2014-02-17 Post score: 0
Hello everyone, I'm working on exploration of unknown maps with mobile robots. I would like to know if there is a way to update a costmap from a static map (e.g. the one created by gmapping) in place of using the observation_sources parameter, while also keeping the track_unknown_space parameter to true. I need this because otherwise sometimes my exploration costmap gets noisy. As an alternative can the clear_costmap_recovery be used for a custom costmap in order to reinitialize the map from a static map? Thank you in advance! Originally posted by Tirjen on ROS Answers with karma: 808 on 2014-02-17 Post score: 0
Hey, I'm working with two ur10 arms. i can easily set up a connection with the universal robot stack from github using the driver.py with one robot arm. I'm using the ipa320 fork (github.com/ipa320/universal_robot) with groovy. I'm sure both arms are reachable over the network and i can set up a connection with each arm individually. My problem is when i wont to establish the connections simultaniously.. when i'm connecting to the second ur10 the connection attempt fails. I'm not really familliar wit tcp and sockets but in my opinion the connection fails cause the ur10 box trys to establish the connection only through port 500001. I know that this python scripts tells the ur10 box to setup a connection. But i dont't know how to tell the box over whitch port the connection should be established. In the driver.py is a variable define REVERSE_PORT = 50001 but it is not used in the code. Does somebody has deeper insights in the connection process or already accomplished to set up a connection with two ur10's and moveit? Any help is appreciated. Thanks, Matthias. Originally posted by Equanox on ROS Answers with karma: 36 on 2014-02-17 Post score: 0 Original comments Comment by gvdhoorn on 2014-02-17: Is this with a single or dual controller setup? Comment by Equanox on 2014-02-18: dual controller
I have the package and the IDE installed, now I want to copy ros_lib from the rosserial package to the sketchbook library folder which is has been created. I used this command lines;- roscd rosserial_arduino/libraries cp -r ros_lib /libraries/ros_lib but unfortunately I get this error msg bash: sketchbook: No such file or directory Why is this happen? Originally posted by Ross Marry on ROS Answers with karma: 3 on 2014-02-17 Post score: 0 Original comments Comment by Kamiccolo on 2014-02-17: Are You sure, there is a sketchbook directory in Your current dir? You might just did a typo or something simple like that :) $ ls | grep sketchbook Comment by Ross Marry on 2014-02-17: There is nothing came out. Sorry, I'm still new to this. How can I get it into my current directory? Comment by Kamiccolo on 2014-02-17: Sorry, You should provide more information to get a clear answer. Why don't You try copy those files using Desktop Environment and File Manager like Nautilus or something like that?
I've installed the Arduino IDE 1.5.3 for a Galileo-Board. Following the instructions on the wiki, I installed rosserial from github, and "catkin_make"ed and "catkin_make install"ed my ws. Everything worked fine. When I came to run "rosrun rosserial_arduino make_libraries.py .", it stops with an error: *** Warning, failed to generate libraries for the following packages: *** map_msgs According to several posts and viewing the source of make_libraries.py, this should not be too bad, because generating the messages is the last thing done (correct?). Still, I'd be glad if someone knows how to fix this. My actual problem is when I compile any of the ROS examples, I get something like Arduino: 1.5.3 (Linux), Board: "Intel® Galileo" done xyz.cpp.o: In function `ArduinoHardware::init()': /home/moritz/Arduino/libraries/ros_lib/ArduinoHardware.h:96: undefined reference to `HardwareSerial::begin(unsigned long)' collect2: error: ld returned 1 exit status To me this looks like a linker error(?), but that does not help me any further. Compiling simple examples and uploading them to the board works fine. Any help would be appreciated! Originally posted by Moritz Maus on ROS Answers with karma: 16 on 2014-02-17 Post score: 0
Hi, After a refactoring of my code, my node segfaults, so I would like to debug it with gdb. I used roslaunch with gdb prefix as indicated in this tutorial. Nevertheless it seems that I'm able to see the error output. I have removed the "run" parameter to see if I can run it manually, add a breakpoint and so on. It works, but I cannot see neither what I type nor the standard output. For instance if I try typing the unexisting gdb command "hello", I see successfully: Undefined command: "hello". Try "help". But if I run a gdb command that is successfully executed (breakpoint main, print argc, or whatever....), the prompt does not display anything. I tried gdb --tty /dev/pts/4 but it redirects only my program, so gdb standard input and output are still invisible. Moreover I get the error warning: GDB: Failed to set controlling terminal: Operation not permitted and also [tcsetpgrp failed in terminal_inferior: Inappropriate ioctl for device]. The last error seems to be a bug of gdb, so I've installed the last version 7.7, it's now solved but I still get the first error and no display except stderr. What program do you use to debug your nodes? Any tip or trick to redirect the standard input/output in some terminal? Many thanks Originally posted by courrier on ROS Answers with karma: 454 on 2014-02-17 Post score: 0 Original comments Comment by Kamiccolo on 2014-02-17: Usually if an application does not crash/segfault's on GDB, it's some sort of race condition. Here some tiny manual from Adobe, how to debug multi-threaded applications with GDB. Also, Valgrind should be useful. One more thing, why the hell there are no automatic tests written, huh? You're going to burn in hell forever for missing that. Oh, one more thing. Usually system logs (dmesg | tail 100) contains some handy information about segfaults. Oh, another thing - instead of redirecting IO from Your program, You could attach to working process from another terminal with GDB as described here: http://stackoverflow.com/a/11965416/1150918 . gdb -p <pid_of_the_proccess>, for short. Comment by demmeln on 2014-02-17: Are you using the xterm variant from the linked tutorial?
I have checked out the hydro rviz visualization tutorials and compiled them without modification. While running rviz, if I try to add an Imu visualization type to the display, rviz crashes with the following error: rviz: /build/buildd/ogre-1.7.4/OgreMain/src/OgreSceneManager.cpp:807: virtual Ogre::SceneNode* Ogre::SceneManager::createSceneNode(): Assertion `mSceneNodes.find(sn->getName()) == mSceneNodes.end()' failed. Similarly, if I try to add a PlantFlag, I get a Segmentation fault (core dumped), with no additional info. This only happens when I compile from source. It works fine when I run the pre-compiled binaries. Any thoughts as to why this might be occurring? Originally posted by svozar on ROS Answers with karma: 26 on 2014-02-17 Post score: 1 Original comments Comment by demmeln on 2014-02-17: Without considering the actual error, are you sure that the you checked at the version of the tutorial that matches your install rviz verison? (correct branch)? Does you installed Ogre version match the one rviz is compiled with?
Hello everyone! So, I have been trying to install RGBDSLAM on Hydro for quite some time now, but just can't get it to work. I was finally able to install Hydro from source successfully in /opt/ros/hydro and then I setup a catkin workspace in ~/ros/. However, when I try to install the RGBDSLAM package I downloaded into~/ros/src, I get the following error: ERROR: the following packages/stacks could not have their rosdep keys resolved to system dependencies: rgbdslam: Missing resource roslang ROS path [0]=/opt/ros/hydro/ros_catkin_ws/install_isolated/share/ros ROS path [1]=/opt/ros/hydro/share ROS path [2]=/opt/ros/hydro/stacks ROS path [3]=/home/pb1/ros/src I can roscd into the RGBDSLAM directory just fine, but whenever I try to install it comes up with these errors. I suspect this all has to do with how my catkin overlay / ROS directory is configured, but I could be wrong. If anyone can help me through this, I'll really appreciate it. Thanks! P.S. I am working with Ubuntu ARM on a Pandaboard, if that is any help. Originally posted by AndrewLawson on ROS Answers with karma: 11 on 2014-02-17 Post score: 1
Hello, I am currently trying to install rosserial for ROS Fuerte, and I keep getting server time out message after the command hg clone htp://kforge.ros.org/rosserial/hg rosserial. I've followed the instruction from htp://wiki.ros.org/ rosserial_arduino/ Tutorials/Arduino%20IDE%20Setup. I'm currently using Raspberry-Pi with Fuerte installed. I'm a bit new in using Linux and ROS, what should I do ? Originally posted by WMHanif on ROS Answers with karma: 1 on 2014-02-17 Post score: 0