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

On the step 2.1.2 "rosdep install --from-paths src --ignore-src --rosdistro indigo -y" the ROS-full installation fails with details below. Can anyone help?

$
0
0
executing command [brew install gazebo] Warning: osrf/simulation/gazebo1-1.9.7 already installed > ERROR: the following rosdeps failed to install homebrew: Failed to detect successful installation of [gazebo] ---------- System Details: Mid2010 Mac mini OSX 10.10.5

catkin_make image_view failed,cvtColorForDisplay’ is not a member of ‘cv_bridge’

$
0
0
Hello,I am using Indigo(Ubuntu14.04) When I git clone from [here](https://github.com/ros-perception/image_pipeline) then,I run:`catkin_make`,Error occurred as below: ![image description](http://) /home/exbot/catkin_ws/src/image_pipeline/image_view/src/nodes/image_view.cpp: In function ‘void imageCb(const ImageConstPtr&)’: /home/exbot/catkin_ws/src/image_pipeline/image_view/src/nodes/image_view.cpp:59:20: error: ‘cvtColorForDisplay’ is not a member of ‘cv_bridge’ g_last_image = cv_bridge::cvtColorForDisplay(cv_bridge::toCvShare(msg), "", ^ /home/exbot/catkin_ws/src/image_pipeline/image_view/src/nodelets/image_nodelet.cpp: In member function ‘void image_view::ImageNodelet::imageCb(const ImageConstPtr&)’: /home/exbot/catkin_ws/src/image_pipeline/image_view/src/nodelets/image_nodelet.cpp:165:87: error: ‘cvtColorForDisplay’ was not declared in this scope last_image_ = cvtColorForDisplay(cv_bridge::toCvShare(msg), "", do_dynamic_scaling)->image; please help me,thx

Controller_manager not launching

$
0
0
Hello everybody, I am a few problem to control my robot in Gazebo. I am on Ubuntu 14.04. At the beginning I was using Gazebo 5 with ros Jade. But there was some problems (png import problem in Gazebo 5 and no ros_control in Jade) so I moved on Gazebo 6 with ros Indigo (I know that normally indigo is made to be fully operational with Gazebo 2). I have ros-indigo-gazebo6-ros-control and ros-indigo-gazebo6-ros-pkgs installed but when I use my launch file, I have this warning after a few seconds : Controller Spawner couldn't find the expected controller_manager ROS interface. And indeed I have no controller_manager when I check with rosservice list. There is some parts of my files: myRobot.urdf.xacro /myRobot/myRobotbody_arch_fixed, body_bottom_fixed, arch_top_laser, body_rear_laser, bottom_left_aux_wheel, bottom_right_aux_wheel, bottom_left_rear_wheel, bottom_right_rear_wheel50true my launch file: ["/myRobot/joint_states"] So what I have forgotten ? Thanks in advance

Failed to process package 'cv_bridge':

$
0
0
I am installing Indigo on a Raspberry Pi 2 B running Rasbian Jessie. I am using the instructions at: http://wiki.ros.org/ROSberryPi/Installing%20ROS%20Indigo%20on%20Raspberry%20Pi I am trying to run the command sudo ./src/catkin/bin/catkin_make_isolated --install -DCMAKE_BUILD_TYPE=Release --install-space /opt/ros/indigo I am getting the following error. [ 33%] Building CXX object src/CMakeFiles/cv_bridge.dir/cv_bridge.cpp.o Linking CXX shared library /home/pi/ros_catkin_ws/devel_isolated/cv_bridge/lib/libcv_bridge.so [ 33%] Built target cv_bridge Scanning dependencies of target cv_bridge_boost [100%] [100%] Building CXX object src/CMakeFiles/cv_bridge_boost.dir/module_opencv2.cpp.o Building CXX object src/CMakeFiles/cv_bridge_boost.dir/module.cpp.o /home/pi/ros_catkin_ws/src/vision_opencv/cv_bridge/src/module_opencv2.cpp:124:16: error: cannot declare variable ‘g_numpyAllocator’ to be of abstract type ‘NumpyAllocator’ NumpyAllocator g_numpyAllocator; ^ /home/pi/ros_catkin_ws/src/vision_opencv/cv_bridge/src/module_opencv2.cpp:71:7: note: because the following virtual functions are pure within ‘NumpyAllocator’: class NumpyAllocator : public cv::MatAllocator ^ In file included from /usr/local/include/opencv2/core.hpp:59:0, from /usr/local/include/opencv2/core/core.hpp:48, from /home/pi/ros_catkin_ws/src/vision_opencv/cv_bridge/include/cv_bridge/cv_bridge.h:43, from /home/pi/ros_catkin_ws/src/vision_opencv/cv_bridge/src/module.hpp:22, from /home/pi/ros_catkin_ws/src/vision_opencv/cv_bridge/src/module_opencv2.cpp:35: /usr/local/include/opencv2/core/mat.hpp:417:23: note: virtual cv::UMatData* cv::MatAllocator::allocate(int, const int*, int, void*, size_t*, int, cv::UMatUsageFlags) const virtual UMatData* allocate(int dims, const int* sizes, int type, ^ /usr/local/include/opencv2/core/mat.hpp:419:18: note: virtual bool cv::MatAllocator::allocate(cv::UMatData*, int, cv::UMatUsageFlags) const virtual bool allocate(UMatData* data, int accessflags, UMatUsageFlags usageFlags) const = 0; ^ /usr/local/include/opencv2/core/mat.hpp:420:18: note: virtual void cv::MatAllocator::deallocate(cv::UMatData*) const virtual void deallocate(UMatData* data) const = 0; ^ /home/pi/ros_catkin_ws/src/vision_opencv/cv_bridge/src/module_opencv2.cpp: In function ‘int convert_to_CvMat2(const PyObject*, cv::Mat&)’: /home/pi/ros_catkin_ws/src/vision_opencv/cv_bridge/src/module_opencv2.cpp:206:11: error: ‘class cv::Mat’ has no member named ‘refcount’ m.refcount = refcountFromPyObject(o); ^ src/CMakeFiles/cv_bridge_boost.dir/build.make:77: recipe for target 'src/CMakeFiles/cv_bridge_boost.dir/module_opencv2.cpp.o' failed make[2]: *** [src/CMakeFiles/cv_bridge_boost.dir/module_opencv2.cpp.o] Error 1 make[2]: *** Waiting for unfinished jobs.... CMakeFiles/Makefile2:678: recipe for target 'src/CMakeFiles/cv_bridge_boost.dir/all' failed make[1]: *** [src/CMakeFiles/cv_bridge_boost.dir/all] Error 2 Makefile:127: recipe for target 'all' failed make: *** [all] Error 2 <== Failed to process package 'cv_bridge': Command '['/opt/ros/indigo/env.sh', 'make', '-j4', '-l4']' returned non-zero exit status 2 Reproduce this error by running: ==> cd /home/pi/ros_catkin_ws/build_isolated/cv_bridge && /opt/ros/indigo/env.sh make -j4 -l4 Command failed, exiting. I have tried searching this and other sites and have not found a similar problem reported. The closest problem I found referenced changing the size of the swap file as the solution, but that did not help. Thanks,

ROS Keyserver Down?

$
0
0
I've just installed ROS Indigo on a brand new installation of Ubuntu 14.04 per the instructions on the [wiki](http://wiki.ros.org/indigo/Installation/Ubuntu). Unfortunately, I ran into trouble setting up my keys. Every time that I ran
sudo apt-key adv --keyserver hkp://pool.sks-keyservers.net --recv-key 0xB01FA116
I got the following output:
Executing: gpg --ignore-time-conflict --no-options --no-default-keyring --homedir /tmp/tmp.pmoKA9JVGs --no-auto-check-trustdb --trust-model always --keyring /etc/apt/trusted.gpg --primary-keyring /etc/apt/trusted.gpg --keyserver hkp://pool.sks-keyservers.net --recv-key 0xB01FA116
gpg: requesting key B01FA116 from hkp server pool.sks-keyservers.net
?: pool.sks-keyservers.net: Network is unreachable
gpgkeys: HTTP fetch error 7: couldn't connect: Network is unreachable
gpg: no valid OpenPGP data found.
gpg: Total number processed: 0
Is the keyserver down? If so, will it come back up? Googling for help, I've found [several](http://answers.ros.org/question/212254/ros-indigo-key-server-down/) [other](http://answers.ros.org/question/214911/ros-indigo-installation-error/) [questions](http://answers.ros.org/question/65623/ros-installation-instructions-broken/) describing experiences similar to my own. I was able to get the key by running the following command:
wget https://raw.githubusercontent.com/ros/rosdistro/master/ros.key -O - | sudo apt-key add -
After that, the installation process proceeded smoothly, and ROS is running just fine. I'm also able to ping both the keyserver site and packages.ros.org. That being said, I think this begs the question of whether the installation instructions are incorrect/out-of-date/incomplete. Does someone--it's okay if it's me--need to make an update to the wiki, or is this problem actually a transient one (and thus might not warrant a change to the official instructions)? The only reason I ask is that I've been getting this error for several consecutive days now and others seem to have had this problem multiple times in the past. I'd like to help others avoid this little hiccup if possible. Thanks in advance!

Dependencies not satisfied: ros-indigo-gazebo5-msgs?

$
0
0
I am releasing a package via Bloom into ROS Indigo that depends on `gazebo_msgs`. Since the Indigo-supported version of Gazebo `v2.x`, I am confused where the buildfarm is finding the dependency of `gazebo5_msgs`. How do I explicitly state that this package does not depend on `gazebo5_msgs`?
Relevant build failure snippit: Reading package lists... Building dependency tree... Need to get 1,263 B of source archives. Get:1 http://repos.ros.org/repos/building/ trusty/main ros-indigo-baxter-sim-kinematics 1.2.1-0trusty (dsc) [1,263 B] Fetched 1,263 B in 0s (27.5 kB/s) Download complete and in download only mode package ros-indigo-baxter-sim-kinematics does not have dependency [ros-indigo-gazebo5-msgs] Dependencies not satisfied for packages: ['ros-indigo-gazebo5-msgs'] URL for complete buildfarm console output:
http://jenkins.ros.org/job/ros-indigo-baxter-sim-kinematics_binarydeb_trusty_amd64/9/console
URL for repo's package.xml:
https://github.com/RethinkRobotics/baxter_simulator/blob/master/baxter_sim_kinematics/package.xml

Subscriber topics with differents samplig time

$
0
0
Hi guys, I am new to ROS Indigo and am trying to work with rosbag file who contains messages from topic with different sampling time (images and IMU data). The rosbag info returns the following information : path: data2-03-11-15.bag version: 2.0 duration: 2:29s (149s) start: Nov 03 2015 14:58:15.74 (1446559095.74) end: Nov 03 2015 15:00:45.04 (1446559245.04) size: 4.0 GB messages: 77540 compression: none [3982/3982 chunks] types: geometry_msgs/PoseStamped [d3812c3cbc69362b77dc0b19b345f8f5] sensor_msgs/CameraInfo [c9a58c1b0b154e0e6da7578cb991d214] sensor_msgs/Image [060021388200f6f0f447d0fcd9c64743] sensor_msgs/Imu [6a62c6daae103f4ff57a132d6f95cec2] visensor_node/visensor_calibration [ed589a2fd70bfbada27d1d4266e0dea2] visensor_node/visensor_time_host [d74fe546f2f8fbb3e0cfaff8b959c212] topics: /MT09/pose 17821 msgs : geometry_msgs/PoseStamped /cam0/calibration 2986 msgs : visensor_node/visensor_calibration /cam0/camera_info 2986 msgs : sensor_msgs/CameraInfo /cam0/image_raw 2986 msgs : sensor_msgs/Image /cam1/calibration 2986 msgs : visensor_node/visensor_calibration /cam1/camera_info 2986 msgs : sensor_msgs/CameraInfo /cam1/image_raw 2986 msgs : sensor_msgs/Image /left/image_rect 2986 msgs : sensor_msgs/Image /mpu0 14930 msgs : sensor_msgs/Imu /right/image_rect 2986 msgs : sensor_msgs/Image /time_host 5972 msgs : visensor_node/visensor_time_host The rostopic hz on IMU and image topics are : rostopic hz /mpu0 subscribed to [/mpu0] average rate: 105.713 min: 0.000s max: 0.103s std dev: 0.02714s window: 100 rostopic hz /right/image_rect subscribed to [/right/image_rect] average rate: 20.053 min: 0.041s max: 0.058s std dev: 0.00322s window: 20 rostopic hz /left/image_rect subscribed to [/left/image_rect] average rate: 20.114 min: 0.041s max: 0.054s std dev: 0.00269s window: 19 From my understanding, the IMU message are sent at 100Hz and images (left and right) are sent at 20Hz. I would like to deal with stereo images left and right and in the same time work with the IMU data. I did a program with subscribers, based on ApproximateTime for images (in order to have images at the “same time”) and classical subscriber for the IMU. My program is the following : void callback_image(const ImageConstPtr& image1, const ImageConstPtr& image2) { ROS_INFO("Image 1 at [%d]", image1->header.seq); ROS_INFO("Image 2 at [%d]", image2->header.seq); } void callback_gyro(const sensor_msgs::Imu::ConstPtr& imu) { ROS_INFO("Imu gyro Seq: [%d]", imu->header.seq); } int main(int argc, char** argv) { ROS_INFO("Start !") ; ros::init(argc, argv, "vision_node"); ros::NodeHandle nh; //Suscriber for images message_filters::Subscriber image1_sub(nh, "/left/image_rect", 1); message_filters::Subscriber image2_sub(nh, "/right/image_rect", 1); typedef sync_policies::ApproximateTime MySyncPolicy; Synchronizer sync(MySyncPolicy(10), image1_sub, image2_sub); sync.registerCallback(boost::bind(&callback_image, _1, _2 )); //Suscriber for IMU ros::Subscriber sub3 = nh.subscribe("/mpu0", 1000, callback_gyro); ros::spin(); return 0; } When I start my program, I obtain the following result on my console : [ INFO] [1452419480.048670407]: Start ! [ INFO] [1452419480.323157479]: Image 1 at [113965] [ INFO] [1452419480.323209657]: Image 2 at [113710] [ INFO] [1452419480.328795802]: Imu gyro Seq: [566209] [ INFO] [1452419480.328853778]: Imu gyro Seq: [566210] [ INFO] [1452419480.328887739]: Imu gyro Seq: [566211] [ INFO] [1452419480.328918985]: Imu gyro Seq: [566212] [ INFO] [1452419480.328954773]: Imu gyro Seq: [566213] [ INFO] [1452419480.328989697]: Imu gyro Seq: [566214] [ INFO] [1452419480.329022374]: Imu gyro Seq: [566215] [ INFO] [1452419480.329055960]: Imu gyro Seq: [566216] [ INFO] [1452419480.329088443]: Imu gyro Seq: [566217] [ INFO] [1452419480.329119721]: Imu gyro Seq: [566218] [ INFO] [1452419480.370062934]: Image 1 at [113966] [ INFO] [1452419480.370108213]: Image 2 at [113711] [ INFO] [1452419480.422391429]: Image 1 at [113967] [ INFO] [1452419480.422424172]: Image 2 at [113712] [ INFO] [1452419480.428996515]: Imu gyro Seq: [566219] [ INFO] [1452419480.429091046]: Imu gyro Seq: [566220] [ INFO] [1452419480.429198228]: Imu gyro Seq: [566221] [ INFO] [1452419480.429713945]: Imu gyro Seq: [566222] [ INFO] [1452419480.429800366]: Imu gyro Seq: [566223] [ INFO] [1452419480.429864396]: Imu gyro Seq: [566224] [ INFO] [1452419480.429953678]: Imu gyro Seq: [566225] [ INFO] [1452419480.430326191]: Imu gyro Seq: [566226] [ INFO] [1452419480.430437508]: Imu gyro Seq: [566227] [ INFO] [1452419480.430511820]: Imu gyro Seq: [566228] [ INFO] [1452419480.472830708]: Image 1 at [113968] [ INFO] [1452419480.472861238]: Image 2 at [113713] [ INFO] [1452419480.519742858]: Image 1 at [113969] [ INFO] [1452419480.519771315]: Image 2 at [113714] I am very puzzled with this output ! Since frequency of IMU messages are 5 times higher that image, why I have only 10 message between 4 images ? Moreover, why I obtained two consecutive image messages ? Any help would be greatly appreciated. Thx in adavance

RGBDSLAM indigo

$
0
0
Hello, Thanks to Felix Endres for his great package. I use RGBDSLAM on ROS indigo (Ubuntu 14.04) with freenect driver. I see errors messages : "Using Standard kinect /openni_camera -> /openni_rgb_optical_frame as transformation (This message is throttled to 1 per 5 seconds)". May be a problem with freenect (instead of openni ?). Thanks for reply

ROS Stage Indigo Turtlebot

$
0
0
After install https://github.com/turtlebot/turtlebot_simulator.git rosdep install --from-paths src --ignore-src --rosdistro indigo -y -rw i launch it roslaunch turtlebot_stage turtlebot_in_stage.launch and now i see (in RVIZ) the map changing the hight (oscillating in z) how to stop it?

How to use camera calibration with ubuntu 14.04?

$
0
0
I use ubuntu 14.04 and ROS Indigo. I try to run lsd_slam using image list. It requires a calibration file. So, I try to create a calibration file using `rosrun camera_calibration cameracalibrator.py --size 8x6 --square 0.108 image:=/my_camera/image camera:=/my_camera` command in ubuntu terminal. It throws an error : File "/opt/ros/indigo/lib/camera_calibration/cameracalibrator.py", line 47, in import cv2 ImportError: libopencv_nonfree.so.2.4: cannot open shared object file: No such file or directory How can I solve it?

How to use Eigen with tf2?

$
0
0
As tf is deprecated, I've started learning how to use tf2. Unfortunately the documentation and the tutorials are not complete, as the old tf tutorial where. In particular there's no explanation on how to publish in the most effective way an Eigen transformation throught tf. The only way I've managed to solve the problem, was writing a boilerplate code, filling a message manually. This happens as there's no function, as far as I can see, in the tf2_eigen package to convert an Eigen affine3D transformation into a geometry_message. There seemes to be no documentation for tf2_eigen package. If I'm wrong, can you please point me where I can find the documentation? And, by the way, the "external conversion" interface (that seemes to be complete only for kdl) is very strange, I would expect a templated broadcaster, in wich i could send an eigen transform like this: broadcaster.sendTransform(eigenTransform, parent_frame, child_frame, timestamp);

EKF rejects timestamp more than the cache length earlier than newest transform cache

$
0
0
Hi, Having a [px4flow](http://wiki.ros.org/px4flow_node) optical flow sensor, I want to convert its [opt_flow_rad](https://github.com/cehberlin/px-ros-pkg/blob/master/px_comm/msg/OpticalFlowRad.msg) message into a TwistWithCovarianceStamped, which I can use in my [EKF localization node](http://wiki.ros.org/robot_localization#ekf_localization_node). However, the ekf node doesn't accept my twists. It warns (I configured my ros log to show nodes instead of time): > [ WARN] [/ekf_localization_node]:> WARNING: failed to transform from> /px4flow->base_link for twist0 message> received at 3370.342710000. The> timestamp on the message is more than> the cache length earlier than the> newest data in the transform cache. The message conversion (optflow_odometry) works like this: #include #include #include ros::Publisher twist_publisher; void flow_callback (const px_comm::OpticalFlowRad::ConstPtr& opt_flow) { // Don't publish garbage data if(opt_flow->quality == 0){ return; } geometry_msgs::TwistWithCovarianceStamped twist; twist.header = opt_flow->header; // translation from optical flow, in m/s twist.twist.twist.linear.x = (opt_flow->integrated_x/opt_flow->integration_time_us)/opt_flow->distance; twist.twist.twist.linear.y = (opt_flow->integrated_y/opt_flow->integration_time_us)/opt_flow->distance; twist.twist.twist.linear.z = 0; // rotation from integrated gyro, in rad/s twist.twist.twist.angular.x = opt_flow->integrated_xgyro/opt_flow->integration_time_us; twist.twist.twist.angular.y = opt_flow->integrated_ygyro/opt_flow->integration_time_us; twist.twist.twist.angular.z = opt_flow->integrated_zgyro/opt_flow->integration_time_us; // Populate covariance matrix with uncertainty values twist.twist.covariance.assign(0.0); // We say that generally, our data is uncorrelated to each other // However, we have uncertainties for x, y, z, rotation about X axis, rotation about Y axis, rotation about Z axis double uncertainty = pow(10, -1.0 * opt_flow->quality / (255.0/6.0)); for (int i=0; i<36; i+=7) twist.twist.covariance[i] = uncertainty; twist_publisher.publish(twist); } int main(int argc, char** argv) { ros::init(argc, argv, "optflow_odometry"); ros::NodeHandle n; ros::Subscriber flow_subscriber = n.subscribe("/px4flow/opt_flow_rad", 100, flow_callback); twist_publisher = n.advertise("visual_odom", 50); ros::spin(); return 0; } My launchfile looks like this: [false, false, false, # x, y, z, false, false, false, # roll, pitch, yaw, true, true, false, # vx, vy, vz, ---> vx, vy from optical flow false, false, true, # vroll, vpitch, vyaw, ---> use px4flow gyro false, false, false] # ax, ay, az Lastly, here are my TF Tree and Node Graph: ![image description](http://i.imgur.com/yZKIfSL.png) ![image description](http://i.imgur.com/2dtcdx8.png) What do I have to change to get this working? Cheers Laurenz

Unable to run hokuyo_node for Hokuyo URG-04LX

$
0
0
Hi all, I'm working on Surface Reconstruction from point cloud data and since in my lab there's an Hokuyo URG-04LX laser range finder, I would like to use it for building my data set. In order to get it working I followed this tutorial: http://wiki.ros.org/hokuyo_node/Tutorials/UsingTheHokuyoNode In particular, I installed the ros node by running: federico@HP-Compaq-8200:~$ sudo apt-get install ros-indigo-hokuyo-node then, when I connect the laser to the PC, it gets associated to /dev/ttyUSB0 so I set the permissions for this port: federico@HP-Compaq-8200:~$ ls -l /dev/ttyUSB0 crw-rw-rw- 1 root dialout 188, 0 gen 12 15:47 /dev/ttyUSB0 after this, I set the parameters for hokuyo_node: federico@HP-Compaq-8200:~$ rosparam get /hokuyo_node/calibrate_time false federico@HP-Compaq-8200:~$ rosparam get /hokuyo_node/port /dev/ttyUSB0 as explained in the tutorial, but when I run the ROS node it gives me this error: federico@HP-Compaq-8200:~$ rosrun hokuyo_node hokuyo_node [ERROR] [1452610493.392974859]: Exception thrown while opening Hokuyo. timeout reached (in hokuyo::laser::laserReadline) You may find further details at http://www.ros.org/wiki/hokuyo_node/Troubleshooting I really have no idea of what could cause this problem, so any help is greatly appreciated!!! Thanks.

cob_camera_sensors launch file missing

$
0
0
I am buildind the system under indigo and check out the indigo branch. However their are no launch files for the running "roslaunch cob_camera_sensors" only a python script file exists.

How to install ROS indigo in Ubuntu 14.04.3 LTS Desktop 64-bit?

$
0
0
I am having problems with installation of Indigo in UBUNTU 14.04.3 LTS Desktop 64 Bit. I followed the installation instructions provided on ROS website. But following problems are occuring. 1. At step 1.3 when i run following in terminal: sudo apt-key adv --keyserver hkp://pool.sks-keyservers.net --recv-key 0xB01FA116 following msg is displayed: Executing: gpg --ignore-time-conflict --no-options --no-default-keyring --homedir /tmp/tmp.AyKV0NvoaE --no-auto-check-trustdb --trust-model always --keyring /etc/apt/trusted.gpg --primary-keyring /etc/apt/trusted.gpg --keyserver hkp://pool.sks-keyservers.net --recv-key 0xB01FA116 gpg: requesting key B01FA116 from hkp server pool.sks-keyservers.net ?: pool.sks-keyservers.net: Host not found gpgkeys: HTTP fetch error 7: couldn't connect: Connection timed out gpg: no valid OpenPGP data found. gpg: Total number processed: 0

How to use lsd_slam with my own bag file?

$
0
0
I try to use lsd_slam with my data. lsd_slam works with sample datas (bag files taken from lsd_slam web page) perfectly. I want to use it with my data. So, I create a .bag file for monocular camera using [this code.](http://lars.mec.ua.pt/public/LAR%20Projects/Perception/2014_RicardoMorais/Ferramentas/Create_bag_from_frame_sequence.py) When I run lsd_slam, I cannot see any cloud data on viewer window or any image on depth window. How can I use my bag file with lsd_slam? I use ubuntu 14.04 and ros indigo.

Unmet Dependencies Installing ROS Indigo with Ubuntu MATE on Raspberry PI 2

$
0
0
Hi I'm trying to install ROS Indigo on my Raspberry PI 2 using Ubuntu MATE 15.04, through the following instructions: http://wiki.ros.org/indigo/Installation/UbuntuARM However once I got up to installing the ROS communication packages: sudo apt-get install ros-indigo-ros-base I ran the line and it came up with an error: The following packages have unmet dependencies: Depends: ros-indigo-actionlib but it is not going to be installed Depends: ros-indigo-bond-core but it is not going to be installed Depends: ros-indigo-class-loader but it is not going to be installed Depends: ros-indigo-dynamic-reconfigure but it is not going to be installed Depends: ros-indigo-nodelet-core but it is not going to be installed Depends: ros-indigo-pluginlib but it is not going to be installed Depends: ros-indigo-ros-core but it is not going to be installed E: Unable to correct problems, you have held broken packages. I tried installing each package manually but the first one resulted in another set of dependency errors which highlighted both libboost-system1.54.0 and libboost-thread1.54.0 package dependencies as well as other ros-indigo dependencies. If anyone can provide any help it would be much appreciated!! Thanks!

Integer overflow in differential_drive wheel encoders?

$
0
0
Hi, I'm reading a sensored brushless motor's [tri-phase hall encoders](https://engineering.purdue.edu/~ee323/index.php?p=lab7a) in an effort to get odometry on my robot. I get six increments for one motor turn. The motor runs at something like 17000rpm at max speed. If I track the encoders with an std_msgs/Int16 message, as expected from the [differential_drive](http://wiki.ros.org/differential_drive) package, I will get an integer overflow after only about 300 ms... I'll be using [rosserial_arduino](http://wiki.ros.org/rosserial_arduino) on an [Arduino Micro](https://www.arduino.cc/en/Main/ArduinoBoardMicro) with interrupt driven software. Is there an alternative package I could use? Maybe something that tracks the relative change of the encoder counter instead of its absolute value? Cheers Laurenz

Problem installing any package

$
0
0
Hello! I am a newbie to ROS. Please bear with me. Edit 1: I am unable to install any package now. I tried installing Turtlebot Simulator and I am getting the same error. I think there is some problem with ROS itself. I am unable to install jackal simulator from clearpathrobotics. I get the following error - E: Unable to locate package ros-indigo-jackal-simulator E: Unable to locate package ros-indigo-jackal-desktop I am not sure why this is happening as I have ROS Indigo installed and running Ubuntu 14.04.3 LTS. I tried the installation after sudo-apt-get-update, and still I get the same error. Can anyone please tell why I am unable to install? Thank you.

Install Indigo on ubuntu 15.04 [vivid]

$
0
0
I am trying to install ROS Indigo on Ubuntu 15.04 from source. After trying to install dependencies in the catkin workspace I'm getting the following error message: ERROR: the following packages/stacks could not have their rosdep keys resolved to system dependencies: gazebo_ros: No definition of [gazebo] for OS version [vivid] gazebo_plugins: No definition of [gazebo] for OS version [vivid] I have tried working through the answer in [this previously asked question](http://answers.ros.org/question/196076/building-indigo-on-1410/). But, unfortunately the same error message persists when trying to install dependencies.
Viewing all 2203 articles
Browse latest View live


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