ros

ROS, opencv3 and CMake - unable to remove the library

守給你的承諾、 提交于 2019-12-08 05:22:53
问题 Working environment: Kubuntu 14.04 LTS 64bit ROS Indigo (up-to-date, full desktop install) OpenCV 2.4.8 For some unknown reason I decided to install the ros-indigo-opencv3 package which I regretted almost immediately due to the fact I also have the default version that comes with Ubuntu 14.04 - OpenCV 2.4.8. At first I noticed that QtCreator was warning me of possible incompatibility between 2.4.8 and 3.0.0 when I was building my CMake project (you can see the CMakeLists.txt at the end of

Removing points from a pcl::PointCloud<pcl::PointXYZRGB>

丶灬走出姿态 提交于 2019-12-08 04:28:18
问题 I'm new in PCL. I'm using the PCL library and I'm looking for a way to extract points from a point cloud or copying particular points to a new one. I want to verify for each point if it respects a condition and I want to obtain a point cloud with only the good points.Thank you! 回答1: Use the ExtractIndices class: add your points to be removed to a PointIndices variable pass these Indices to the ExtractIndices run filter() method "negatively" to get the original cloud minus your points example:

Drone's motion is unstable with ROS topics

那年仲夏 提交于 2019-12-08 03:32:57
问题 Drone's motion is not stable with rostopics...what can I do ? import rospy import time #import library untuk mengirim command dan menerima data navigasi dari quadcopter from geometry_msgs.msg import Twist from std_msgs.msg import String from std_msgs.msg import Empty from ardrone_autonomy.msg import Navdata #import class status untuk menentukan status ddari quadcopter from drone_status import DroneStatus COMMAND_PERIOD = 1000 class AutonomousFlight(): def __init__(self): self.status = ""

ROS Kinetic Code API

痴心易碎 提交于 2019-12-07 21:26:59
ROS Kinetic Code API Move Group Interface MoveGroupInterface class - the main C++ interface to the move_group_node . MoveGroupInterface is the successor to the MoveGroup class from previous releases, which is now deprecated . PlanningSceneInterface class - a C++ interface to the planning scene MoveIt! commander - documentation for the MoveIt! commander. MoveIt! ROS This API is meant for advanced developers. Most users should use the Move Group interface (above). Planning - The planning components in MoveIt! ROS, especially the planning scene, kinematics and monitors Move Group - The move_group

Cmake not detecting boost-python when installing ROS

孤者浪人 提交于 2019-12-07 19:53:30
问题 I have been trying to install ROS on my Mac and have gotten around the errors with different libraries depending on different versions of boost. However, it seems that one library is not even detecting boost-python. Here is the error I get: CMake Error at /usr/local/share/cmake-3.12/Modules/FindBoost.cmake:2048 (message): Unable to find the requested Boost libraries. Boost version: 1.67.0 Boost include path: /usr/local/include Could not find the following static Boost libraries: boost_python

Solving a difficult compilation issue

六月ゝ 毕业季﹏ 提交于 2019-12-07 18:33:41
问题 Good day, First up, I have a mac running Mavericks, and I am attempting to build PCL (Point Cloud Library) as part of ROS. This is the command that fails: cd /Users/X/ros_catkin_ws/build_isolated/pcl_ros && /Users/X/ros_catkin_ws/install_isolated/env.sh cmake -vd /Users/X/ros_catkin_ws/src/perception_pcl/pcl_ros -DCATKIN_DEVEL_PREFIX=/Users/X/ros_catkin_ws/devel_isolated/pcl_ros -DCMAKE_INSTALL_PREFIX=/Users/X/ros_catkin_ws/install_isolated -DCMAKE_BUILD_TYPE=Release With: CMake Error at /usr

ros中move_group的参数动态设置

倾然丶 夕夏残阳落幕 提交于 2019-12-07 12:28:02
1、写一个配置文件 cfg/ElfinBasicAPIDynamicReconfigure.cfg #!/usr/bin/env python PACKAGE = "elfin_basic_api" from dynamic_reconfigure.parameter_generator_catkin import * gen = ParameterGenerator() gen.add("velocity_scaling", double_t, 0, "the max velocity scaling", 0.4, 0.01, 1.0) exit(gen.generate(PACKAGE, PACKAGE, "ElfinBasicAPIDynamicReconfigure")) 2、cmake自动产生 ElfinBasicAPIDynamicReconfigureConfig.h头文件 find_package(catkin REQUIRED COMPONENTS dynamic_reconfigure ) generate_dynamic_reconfigure_options( cfg/ElfinBasicAPIDynamicReconfigure.cfg ) 3、使用dynamic_reconfigure::Server #include <elfin_basic_api

How to read live output from subprocess python 2.7 and Apache

房东的猫 提交于 2019-12-07 11:55:07
问题 I have an Apache web server and I made a python script to run a command. Command that I'm running is launching a ROS launch file, that is working indefinitely. I would like to read output from the subprocess live and display it in the page. With my code so far I could only manage to make output to be printed after I terminate the process. I've tried all kinds of solutions from the web but none of them seem to work command = "roslaunch package test.launch" proc = subprocess.Popen( command,

How to view GUI apps from inside a docker container

痴心易碎 提交于 2019-12-07 10:31:23
问题 When I try to run a GUI, like xclock for example I get the error: Error: Can't open display: I'm trying to use Docker to run a ROS container, and I need to see the GUI applications that run inside of it. I did this once just using a Vagrant VM and was able to use X11 to get it done. So far I've tried putting way #1 and #2 into a docker file based on the info here: http://wiki.ros.org/docker/Tutorials/GUI Then I tried copying most of the dockerfile here: https://hub.docker.com/r/mjenz/ros

Installing ROS Melodic on Ubuntu 18.10

亡梦爱人 提交于 2019-12-07 05:59:19
问题 I can't be the only person interested in this combination of Cosmic (with Wayland) and Melodic. I'll be up-front: I seem to have successfully managed this on my XPS 13 (9370), or at least the install script [eventually] completed successfully. However, there's a really hacky workaround. I'll gladly vote up replies of others who attempt an installation, regardless of outcome. Basically, I ran the instructions on http://wiki.ros.org/Installation/Source for a "desktop" install, and here's how I