Quantcast
Channel: ROS Answers: Open Source Q&A Forum - RSS feed

How to call a global planner from within a custom planner?

## Problem (TL;DR) ## I am trying to write a custom global planner that can alternate between the another global planner (here `navfn`), and a custom algorithm of my own. The errors I am getting...

View Article


How to compile a non-native Navigation Stack with your workspace?

## Problem (TL;DR) ## I am running ROS Indigo on Ubuntu 14.04. For historical reasons I had to install PCL 1.8 and remove PCL 1.7. I now need to write a custom global planner, and it seems that I need...

View Article


"no map received" in RVIZ, how to create map? I only got real time info in rviz

I'd like to create 2D or 3D map in RVIZ using Kinect v1. I have Kinect v1 connect to Raspberry Pi2 (ubuntu 14.04, ROS indigo). And Ubuntu 14.04 local machine. ROS_XXXs are all set correctly. On...

View Article

Why my publisher node stops when subscriber node start?

Hi all, I currently working on creating a GPR system based on Walabot sensor. The data that I want to publish is the raw signal from Walabot which consist of two-row array of amplitude and timeaxis...

View Article

Python script for controlling the AR Drone doesn't work

I have written a simple python script to takeoff the drone. #! /usr/bin/env python import rospy from std_msgs.msg import Empty rospy.init_node('cipek') empty = Empty() takeoff =...

View Article


How can we actually use Float32MultiArray to publish 2D array using Python?

Hi, I am frustrated trying to understand the concept of **Float32MultiArray**. I have been reading the documentations from [Float32MultiArray...

View Article

Extremely large network traffic using RosLibJs - possible solutions

Hello! I am using RosLibJs for a web GUI that shows robot data like position, battery status, map etc. Unfortunately, it uses a **lot** of network traffic (around 20 GBytes per day!). I am thinking...

View Article

Error when running python script with ProcessBuilder()-...

I want to run a python script with ProcessBuilder(). This is my code: new ProcessBuilder().inheritIO().command("/usr/bin/python", System.getProperty("user.dir")+"/WebRoot/result.py").start(); And this...

View Article


Scripts don't see ROS if executed by ProcessBuilder()

I want to execute a script with a `ProcessBuilder()`. My code is: new ProcessBuilder().inheritIO().command("/bin/bash", "-c", "./deploy.sh").start(); In the bash script I have: #!/bin/bash rosrun...

View Article


Cannot install baxter simulator in ROS Indigo

I am trying to install Baxter simulator so that I may use it with Moveit without connecting to a real Baxter robot. I have followed the following tutorial: link:[Baxter...

View Article

Do we have a ROS package for Kinect for XBOX One camera Sensor?

I have a microsoft Kinect XBOX ONE camera. Its model number is 1595. I tried using http://wiki.ros.org/openni_camera and followed the below link to install the driver for the sensor...

View Article

How to use Baxter in simulation with Rviz and moveit?

I have come across the following tutorials of Baxter. [Baxter Simulator](http://sdk.rethinkrobotics.com/wiki/Simulator_Installation) [Baxter with...

View Article

Callback for a Ardrone Navdata Subscriber doesn't work

I want to track the state of the AR Drone. For that, I have created a Subscriber, but for some reason, it doesn't go into my callback function. This is my code: #include "ros/ros.h" #include...

View Article


Planner is not working for Baxter simulator in Rviz and with Moveit

I installed Baxter and Moveit simulator to work with Baxter as said [here](http://answers.ros.org/question/325925/how-to-use-baxter-in-simulation-with-rviz-and-moveit/). However, I am having an issue,...

View Article

Multi map or multi floor navigation with a mobile robot.

I'm trying one of my ideas of using a mobile differential drive mobile robot for multi floor navigation. Firstly i'm trying to have a multi-map navigation approach, so that different maps are loaded...

View Article


ros::spinOnce() blocks publisher

I am working on controlling the AR Drone with c++ script. I added the subscriber for checking the state of the drone. However, it runs once, when the `spinOnce()` is called and then it doesn't update...

View Article

Running OpenCV code- error: ‘DescriptorMatcher’ was not declared in this scope

I have installed the OpenCV on my machine along with the `opencv_bridge`. I am trying to use this script in my ROS package: https://github.com/spillai/recognition-utils/blob/master/FLAIR/flair.hpp The...

View Article


rosdep permissions while ssh'ed

I am sshing into the Baxter computer, and need PCL in order to run a package. Everything says to use rosdep to install pcl, but since this is the first time, `sudo rosdep init` has to be run first, but...

View Article

How to move a drone by a given distance using ardrone_autonomy

I am working on a script for controlling a drone with `ardrone_autonomy` package, and I want to create a code for moving it by a given distance. Right now I implemented code base on these tutorials:...

View Article

Getting error of 'undefined reference to' while doing 'catkin_make' with...

Dump or the error: [ 51%] Built target grasp_execution_msgs_generate_messages_lisp [ 51%] [ 51%] [ 51%] Built target arm_components_name_manager Built target final_project_generate_messages_lisp Built...

View Article

How to create colored objects in moveit or Rviz in robot's frame

I have been making collision objects just to use them as regular grasping object in moveit, I keep a distance between the robot's gripper and the object so that I can plan the gripper. This is the code...

View Article


I'm trying to develop an RVIZ plugin and I've error like this one presented...

Link to question:...

View Article


Connect to robots from ROS Docker Container

Hi, Thanks in advance to anyone that may help me with this. I was working on my mac to set up a ROS Docker container that can connect to my robot under the same local network. However, it seems like...

View Article

Error in Rviz: Rviz loads a non-existent map.

Hello. Lately I was trying to create a SLAM (2D) map of a room using a **Summit_X** mobile robot having a **Hokuyo utm-30lx** laser range finder (LIDAR). Rviz clearly shows the map building process...

View Article

libjsk_recognition_utils.so to ‘pcl::search::KdTree::KdTree(bool)’ undefined...

Hi, My system is: ubuntu14.04, indigo, autoware-1.9.1, pcl-1.7, gcc-4.8.5, g++-4.8.5, kernel: 4.4.0-146-generic. Following autoware install wiki, when build with `AUTOWARE_COMPILE_WITH_CUDA=1...

View Article


Opening and closing the gripper in python

I found [this](http://docs.ros.org/kinetic/api/moveit_tutorials/html/doc/pick_place/pick_place_tutorial.html) code in C++, I need a python equivalent.

View Article

grid_dim_ from height map parameters

Hi! I'm trying to use the heightmap to detect obstacles, but I cant manage to set the grid_dim to a number higher than 500, and this limits the distance max within which I could detect an obstacle from...

View Article

Gmapping with V-REP

Hello, I'm doing a course project whose goal is to build a SLAM simulation with ROS and V-REP. I'm new to ROS and V-REP and I'd like some help from you guys. Here is what I did: 1. I created a scene...

View Article

Creating Second Workspace

I have a workspace called "catkin_ws" in my home directory. I built the workspace with the command `catkin_make` and I added two extra lines to .bashrc file: `source /opt/ros/indigo/setup.bash`...

View Article



Object reference not set to an instance of an object

Hi, Could someone please help me with the following question. Idk what I'm missing here, but no fixes discussed on previous posts seem to work for me....

View Article