I want to publish a ultrasonic distance from arduino.The ultra sonic sensor is acting as a radar with the help of a servo motor.But i getting some out of sync messages when i echoed to the topic range data.The code is given below.can any one help to correct this issue.
code:
#include
#include
#include
#include .
ros::NodeHandle nh;
// Defines Tirg and Echo pins of the Ultrasonic Sensor
const int trigPin = 2;
const int echoPin = 4;
int i=0;
double r =0;
double d;
int j;
// Variables for the duration and the distance
double duration;
double distance;
sensor_msgs::Range range_msg;
Servo myServo;
ros::Publisher pub_range( "range_data", &range_msg);
char frameid[] = "range_data";// Creates a servo object for controlling the servo motor
void setup() {
Serial.begin(57600);
nh.initNode();
nh.advertise(pub_range);
range_msg.radiation_type = sensor_msgs::Range::ULTRASOUND;
range_msg.header.frame_id = frameid;
range_msg.field_of_view = 0.8;
range_msg.min_range = 0.0;
range_msg.max_range = 400;
pinMode(trigPin, OUTPUT); // Sets the trigPin as an Output
pinMode(echoPin, INPUT); // Sets the echoPin as an Input
//Serial.begin(9600);
myServo.attach(8); // Defines on which pin is the servo motor attached
}
double getRange_Ultrasound(){
// rotates the servo motor from 15 to 165 degrees
digitalWrite(trigPin, LOW);
delayMicroseconds(2);
// Sets the trigPin on HIGH state for 10 micro seconds
digitalWrite(trigPin, HIGH);
delayMicroseconds(10);
digitalWrite(trigPin, LOW);
duration = pulseIn(echoPin, HIGH); // Reads the echoPin, returns the sound wave travel time in microseconds
distance= (duration*343)/20000;
if (distance>500)
{
distance=400;
}
Serial.print(distance); // Sends the distance value into the Serial Port
Serial.println();
return distance;
delay(50);
}
// Function for calculating the distance measured by the Ultrasonic sensor
double range_time;
void loop() {
/* The following trigPin/echoPin cycle is used to determine the
distance of the nearest object by bouncing soundwaves off of it. */
//if ( millis() >= range_time ){
for( i=0;i<=180;i++){
j=i-1;
myServo.write(i);
//delay(5);
range_msg.range = getRange_Ultrasound();
if (range_msg.range<90)
{
myServo.detach();
// delay(10);
i=j;
}
else
{
myServo.attach(8);
}
range_msg.header.stamp = nh.now();
pub_range.publish(&range_msg);
//distance = calculateDistancf e();// Calls a function for calculating the distance measured by the Ultrasonic sensor for each degree
//Serial.print(i); // Sends the current degree into the Serial Port
//Serial.print(","); // Sends addition character right next to the previous value needed later in the Processing IDE for indexing
//Serial.print(distance); // Sends the distance value into the Serial Port
//Serial.println();
//return (distance);
//Serial.print("."); // Sends addition character right next to the previous value needed later in the Processing IDE for indexing
}
// Repeats the previous lines from 165 to 15 degrees
for(i=180;i>=0;i--){
j=i+1;
myServo.write(i);
range_msg.range = getRange_Ultrasound();
if (range_msg.range<90)
{
myServo.detach();
// delay(10);
i=j;
}
else
{
myServo.attach(8);
}
range_msg.header.stamp = nh.now();
pub_range.publish(&range_msg);
//range_msg.header.stamp = nh.now();
//pub_range.publish(&range_msg);
// delay(5);
//distance = calculateDistance();
//Serial.print(i);
//Serial.print(",");
// Serial.print(distance);
// Serial.println();
// return distance;
//Serial.print(".");
}
if ( millis() >= range_time ){
range_time =millis() + 50;
}
nh.spinOnce();
delay(200);
}
I wrote a node in ros to subscribe to this topic and perform a path planning operation on abb 2400 in rviz.But while running this node, after a few second i got segmentation fault core dumped message .How to resolve this issue
The code is:
#include
#include
#include "sensor_msgs/Range.h"
#include "std_msgs/Bool.h"
//#include
#include
#include
#include
#include
#include
#include
//#include
//ros::NodeHandle n;
//#include
↧
publishing issue
↧
Moveit Virtual Box crashes
Hey all,
I installed Ubuntu 14.04 and ROS Indigo on my Virtual Box. After starting the Moveit Setup Assistant and launching an URDF File, the Assistant crashes.
I installed the Pr2 Demo Package and tried
roslaunch pr2_moveit_config demo.launch
but RVIZ crashes again with the error Code:
[rviz_muhi_VirtualBox_2662_3043522441594486229-6] process has died [pid 2723, exit code -11, cmd /opt/ros/indigo/lib/rviz/rviz -d /opt/ros/indigo/share/pr2_moveit_config/launch/moveit.rviz __name:=rviz_muhi_VirtualBox_2662_3043522441594486229 __log:=/home/muhi/.ros/log/f849d4d6-b7e0-11e6-a223-08002778ad04/rviz_muhi_VirtualBox_2662_3043522441594486229-6.log].
Do you have any ideas how i can fix this problem?
Thanks and greetings
muhi
↧
↧
error install indigo ROS on debian wheezy
rosdep install --from-paths src --ignore-src --rosdistro indigo -y -r --os=debian:wheezy
Reading package lists... Done
Building dependency tree
Reading state information... Done
Package libfltk-dev is a virtual package provided by:
libfltk1.3-dev 1.3.0-8
libfltk1.1-dev 1.1.10-14
You should explicitly select one to install.
E: Package 'libfltk-dev' has no installation candidate
ERROR: the following rosdeps failed to install
apt: command [sudo apt-get install -y rosdep] failed
apt: command [sudo apt-get install -y libcollada-dom2.4-dp-dev] failed
apt: command [sudo apt-get install -y liblz4-dev] failed
apt: command [sudo apt-get install -y libfltk-dev] failed
apt: Failed to detect successful installation of [libcollada-dom2.4-dp-dev]
apt: Failed to detect successful installation of [liblz4-dev]
apt: Failed to detect successful installation of [rosdep]
apt: Failed to detect successful installation of [libjpeg-dev]
apt: Failed to detect successful installation of [libfltk-dev]
how can i solve this?
----
UPDATE
I have install the libcollada-dom2.4-dp-dev
rosdep install --from-paths src --ignore-src --rosdistro indigo -y -r --os=debian:wheezy
E: Package 'libfltk-dev' has no installation candidate
ERROR: the following rosdeps failed to install
apt: command [sudo apt-get install -y rosdep] failed
apt: command [sudo apt-get install -y libcollada-dom2.4-dp-dev] failed
apt: command [sudo apt-get install -y liblz4-dev] failed
apt: command [sudo apt-get install -y libfltk-dev] failed
apt: Failed to detect successful installation of [libcollada-dom2.4-dp-dev]
apt: Failed to detect successful installation of [liblz4-dev]
apt: Failed to detect successful installation of [rosdep]
apt: Failed to detect successful installation of [libjpeg-dev]
apt: Failed to detect successful installation of [libfltk-dev]
↧
arduino communication error
i want to rotate a servo motor from 0 to 180 and back continues fashion.At the same time during each 1degree rotation i want to publish an ultrasonic range topic.But when i call serial communication node it displays communication error messages.
↧
can't launch node of type
I am learning a ROS tutorial(Learning ROS for Robotics Programming). In chapter3_tutorials, i run fellow command:
roslaunch chapter3_tutorials example.launch
I got fellow results:
ERROR: cannot launch node of type [chapter3_tutorials/example6]: can't locate node [example6] in package [chapter3_tutorials]
My computer: Ubtuntu 14.04 indigo
Thanks
↧
↧
TF (nan value) error in revolute joints (in RViz)
hi . this is my URDF file . when i load this file in Rviz i have error :
[ERROR] [1481984390.816723728]: Ignoring transform for child_frame_id "link_U42_1" from authority "unknown_publisher" because of a nan value in the transform (-nan -nan -nan) (-nan -nan -nan -nan)
why i have this error ??!! please help me !
my URDF :
↧
Error: 'std_srvs::Empty' is not a namespace
Hey everyone,
I'm currently working through "A Gentle Introduction to ROS" and in the chapter about services the following example is shown:
bool toggleForward(std_srvs::Empty::Request &request, std_srvs::Empty::Response &response){...}
Now I don't want to write the std_srvs::Empty:: all the time and I tried the following:
using std_srvs::Empty::Request;
using std_srvs::Empty::Response;
bool toggleForward(Request &request, Response &response){...}
But now I'm getting the following errors:
error: ‘std_srvs::Empty’ is not a namespace
using std_srvs::Empty::Request;
^
error: ‘std_srvs::Empty’ is not a namespace
using std_srvs::Empty::Response;
^
error: ‘Request’ was not declared in this scope
bool toggleForward(Request &request, Response &response)
^
error: ‘request’ was not declared in this scope
bool toggleForward(Request &request, Response &response)
^
error: ‘Response’ was not declared in this scope
bool toggleForward(Request &request, Response &response)
^
error: ‘response’ was not declared in this scope
bool toggleForward(Request &request, Response &response)
^
I don't understand what's happening here. For example, the following works:
using std::cout;
What is the difference between those two?
↧
Import error: no module named Num.msg
Hi,
I want to use my own msg, and try this:
from Num.msg import *
and get the import error. Num.msg is in /msg/ and is found by "rosmsg show". When I don't import, codeline "a = Num()" gets error "Global name 'Num' is not defined". What do I miss?
Thanks,
hvn
↧
Tutorial question 'Using rosmsg' error
Hello,
I have been going through the tutorials for the first time, but got stuck on the 'Using rosmsg' section. The command is : `rosmsg show beginner_tutorials/Num`, and the error is
Unable to load msg [beginner_tutorials/Num]: Cannot locate message [Num]: unknown package [beginner_tutorials] on search path [ ...
I tried re-making the package and carefully reviewed the instructions. I haven't had any other error until now. Some further information:
- the command: `rossrv show beginner_tutorials/AddTwoInts` gives a similar error.
- I am sightly confused over the code section that says:
> Also make sure you export the message runtime dependency.> catkin_package(
...
CATKIN_DEPENDS message_runtime ...
...)
Am I supposed to just uncomment this line only? I notice in the `CMakeLists.txt` there are a lot of other 'instructions', I have been ignoring them I assume this is correct?
-I am running Ubuntu 16.04 on VirtualBox, I haven't had any issues with it.
The forum won't let me upload files yet. Thanks for your help.
Perigalacticon
↧
↧
rosdep initialization error
I have installed Ubuntu 12.10 a day back. And I'm trying to install ROS. I have installed ros-groovy-destop-full. When I try to initialise rosdep, I get error.>sudo rosdep init>ERROR: cannot download default sources list from:
...
Website may be down.
But when I copy the address and paste into web browser, the links works. I am running behind proxy (with username/password), so it may be problem of proxy. But I have put proxy details in /etc/apt/apt.conf and apt-get is working fine behind proxy. How do I resolve this issue?
↧
fatal error: beginner_tutorials/AddTwoInts.h: No such file or directory , #include "beginner_tutorials/AddTwoInts.h" Please help me to solve this as I have spent nearly 4 days to get it done
/home/mayankfirst/catkin_ws/src/beginner_tutorials/src/add_two_ints_client.cpp:2:43: fatal error: beginner_tutorials/AddTwoInts.h: No such file or directory
#include "beginner_tutorials/AddTwoInts.h"
^
compilation terminated.
/home/mayankfirst/catkin_ws/src/beginner_tutorials/src/add_two_ints_server.cpp:2:43: fatal error: beginner_tutorials/AddTwoInts.h: No such file or directory
#include "beginner_tutorials/AddTwoInts.h"
^
compilation terminated.
make[2]: *** [beginner_tutorials/CMakeFiles/add_two_ints_client.dir/src/add_two_ints_client.cpp.o] Error 1
make[2]: Leaving directory `/home/mayankfirst/catkin_ws/build'
make[1]: *** [beginner_tutorials/CMakeFiles/add_two_ints_client.dir/all] Error 2
make[1]: *** Waiting for unfinished jobs....
make[2]: *** [beginner_tutorials/CMakeFiles/add_two_ints_server.dir/src/add_two_ints_server.cpp.o] Error 1
make[2]: Leaving directory `/home/mayankfirst/catkin_ws/build'
make[1]: *** [beginner_tutorials/CMakeFiles/add_two_ints_server.dir/all] Error 2
make[1]: Leaving directory `/home/mayankfirst/catkin_ws/build'
make: *** [all] Error 2
Invoking "make -j4 -l4" failed
#############################################################################################
CMAKE list
cmake_minimum_required(VERSION 2.8.3)
project(beginner_tutorials)
## Find catkin macros and libraries
## if COMPONENTS list like find_package(catkin REQUIRED COMPONENTS xyz)
## is used, also find other catkin packages
find_package(catkin REQUIRED COMPONENTS
roscpp
rospy
std_msgs
genmsg
)
## System dependencies are found with CMake's conventions
# find_package(Boost REQUIRED COMPONENTS system)
## Uncomment this if the package has a setup.py. This macro ensures
## modules and global scripts declared therein get installed
## See http://ros.org/doc/api/catkin/html/user_guide/setup_dot_py.html
# catkin_python_setup()
################################################
## Declare ROS messages, services and actions ##
################################################
## To declare and build messages, services or actions from within this
## package, follow these steps:
## * Let MSG_DEP_SET be the set of packages whose message types you use in
## your messages/services/actions (e.g. std_msgs, actionlib_msgs, ...).
## * In the file package.xml:
## * add a build_depend and a run_depend tag for each package in MSG_DEP_SET
## * If MSG_DEP_SET isn't empty the following dependencies might have been
## pulled in transitively but can be declared for certainty nonetheless:
## * add a build_depend tag for "message_generation"
## * add a run_depend tag for "message_runtime"
## * In this file (CMakeLists.txt):
## * add "message_generation" and every package in MSG_DEP_SET to
## find_package(catkin REQUIRED COMPONENTS ...)
## * add "message_runtime" and every package in MSG_DEP_SET to
## catkin_package(CATKIN_DEPENDS ...)
## * uncomment the add_*_files sections below as needed
## and list every .msg/.srv/.action file to be processed
## * uncomment the generate_messages entry below
## * add every package in MSG_DEP_SET to generate_messages(DEPENDENCIES ...)
## Generate messages in the 'msg' folder
# add_message_files(
# FILES
# Message1.msg
# Message2.msg
# )
## Generate services in the 'srv' folder
add_message_files(DIRECTORY msg FILES Num.msg)
add_service_files(DIRECTORY srv FILES AddTwoInts.srv)
## Generate actions in the 'action' folder
# add_action_files(
# FILES
# Action1.action
# Action2.action
# )
## Generate added messages and services with any dependencies listed here
generate_messages(DEPENDENCIES std_msgs)
###################################
## catkin specific configuration ##
###################################
## The catkin_package macro generates cmake config files for your package
## Declare things to be passed to dependent projects
## INCLUDE_DIRS: uncomment this if you package contains header files
## LIBRARIES: libraries you create in this project that dependent projects also need
## CATKIN_DEPENDS: catkin_packages dependent projects also need
## DEPENDS: system dependencies of this project that dependent projects also need
catkin_package(CATKIN_DEPENDS roscpp rospy std_msgs genmsg)
# INCLUDE_DIRS include
# LIBRARIES beginner_tutorials
# CATKIN_DEPENDS roscpp rospy std_msgs
# DEPENDS system_lib
#)
###########
## Build ##
###########
## Specify additional locations of header files
## Your package locations should be listed before other locations
# include_directories(include)
#include_directories(
# ${catkin_INCLUDE_DIRS}
#)
## Declare a cpp library
# add_library(beginner_tutorials
# src/${PROJECT_NAME}/beginner_tutorials.cpp
# )
## Declare a cpp executable
# add_executable(beginner_tutorials_node src/beginner_tutorials_node.cpp)
## Add cmake target dependencies of the executable/library
## as an example, message headers may need to be generated before nodes
# add_dependencies(beginner_tutorials_node beginner_tutorials_generate_messages_cpp)
## Specify libraries to link a library or executable target against
# target_link_libraries(beginner_tutorials_node
# ${catkin_LIBRARIES}
# )
#############
## Install ##
#############
# all install targets should use catkin DESTINATION variables
# See http://ros.org/doc/api/catkin/html/adv_user_guide/variables.html
## Mark executable scripts (Python etc.) for installation
## in contrast to setup.py, you can choose the destination
# install(PROGRAMS
# scripts/my_python_script
# DESTINATION ${CATKIN_PACKAGE_BIN_DESTINATION}
# )
## Mark executables and/or libraries for installation
# install(TARGETS beginner_tutorials beginner_tutorials_node
# ARCHIVE DESTINATION ${CATKIN_PACKAGE_LIB_DESTINATION}
# LIBRARY DESTINATION ${CATKIN_PACKAGE_LIB_DESTINATION}
# RUNTIME DESTINATION ${CATKIN_PACKAGE_BIN_DESTINATION}
# )
## Mark cpp header files for installation
# install(DIRECTORY include/${PROJECT_NAME}/
# DESTINATION ${CATKIN_PACKAGE_INCLUDE_DESTINATION}
# FILES_MATCHING PATTERN "*.h"
# PATTERN ".svn" EXCLUDE
# )
## Mark other files for installation (e.g. launch and bag files, etc.)
# install(FILES
# # myfile1
# # myfile2
# DESTINATION ${CATKIN_PACKAGE_SHARE_DESTINATION}
# )
#############
## Testing ##
#############
## Add gtest based cpp test target and link libraries
# catkin_add_gtest(${PROJECT_NAME}-test test/test_beginner_tutorials.cpp)
# if(TARGET ${PROJECT_NAME}-test)
# target_link_libraries(${PROJECT_NAME}-test ${PROJECT_NAME})
# endif()
## Add folders to be run by python nosetests
# catkin_add_nosetests(test)
include_directories(include ${catkin_INCLUDE_DIRS})
add_executable(talker src/talker.cpp)
target_link_libraries(talker ${catkin_LIBRARIES})
add_dependencies(talker beginner_tutorials_generate_messages_cpp)
add_executable(listener src/listener.cpp)
target_link_libraries(listener ${catkin_LIBRARIES})
add_dependencies(listener beginner_tutorials_generate_messages_cpp)
add_executable(add_two_ints_server src/add_two_ints_server.cpp)
target_link_libraries(add_two_ints_server ${catkin_LIBRARIES})
add_dependencies(add_two_ints_server beginner_tutorials_gencpp)
add_executable(add_two_ints_client src/add_two_ints_client.cpp)
target_link_libraries(add_two_ints_client ${catkin_LIBRARIES})
add_dependencies(add_two_ints_client beginner_tutorials_gencpp)
**********************************************************************************************************************************
After running rossrv show beginner_tutorials/AddTwoInts I get the following
mayankfirst@mayankfirst-Aspire-V5-571:~/catkin_ws/beginner_tutorials$ rossrv show beginner_tutorials/AddTwoInts
Unknown srv type [beginner_tutorials/AddTwoInts]: Cannot locate message [AddTwoInts]: unknown package [beginner_tutorials] on search path [{'rosconsole': ['/opt/ros/indigo/share/rosconsole/srv'], 'hector_quadrotor_pose_estimation': ['/opt/ros/indigo/share/hector_quadrotor_pose_estimation/srv'], 'catkin': ['/opt/ros/indigo/share/catkin/srv'], 'qt_dotgraph': ['/opt/ros/indigo/share/qt_dotgraph/srv'], 'image_view': ['/opt/ros/indigo/share/image_view/srv'], 'hector_gazebo_worlds': ['/opt/ros/indigo/share/hector_gazebo_worlds/srv'], 'urdf': ['/opt/ros/indigo/share/urdf/srv'], 'rosgraph': ['/opt/ros/indigo/share/rosgraph/srv'], 'rqt_py_console': ['/opt/ros/indigo/share/rqt_py_console/srv'], 'nodelet_topic_tools': ['/opt/ros/indigo/share/nodelet_topic_tools/srv'], 'rqt_graph': ['/opt/ros/indigo/share/rqt_graph/srv'], 'nodelet_tutorial_math': ['/opt/ros/indigo/share/nodelet_tutorial_math/srv'], 'qt_gui': ['/opt/ros/indigo/share/qt_gui/srv'], 'filters': ['/opt/ros/indigo/share/filters/srv'], 'hector_quadrotor_controller_gazebo': ['/opt/ros/indigo/share/hector_quadrotor_controller_gazebo/srv'], 'hector_map_tools': ['/opt/ros/indigo/share/hector_map_tools/srv'], 'controller_manager_tests': ['/opt/ros/indigo/share/controller_manager_tests/srv'], 'pointcloud_to_laserscan': ['/opt/ros/indigo/share/pointcloud_to_laserscan/srv'], 'smclib': ['/opt/ros/indigo/share/smclib/srv'], 'roslib': ['/opt/ros/indigo/share/roslib/srv'], 'roscpp_serialization': ['/opt/ros/indigo/share/roscpp_serialization/srv'], 'diagnostic_msgs': ['/opt/ros/indigo/share/diagnostic_msgs/srv'], 'rosbuild': ['/opt/ros/indigo/share/rosbuild/srv'], 'rosclean': ['/opt/ros/indigo/share/rosclean/srv'], 'ps3joy': ['/opt/ros/indigo/share/ps3joy/srv'], 'tf': ['/opt/ros/indigo/share/tf/srv'], 'rqt_publisher': ['/opt/ros/indigo/share/rqt_publisher/srv'], 'roswtf': ['/opt/ros/indigo/share/roswtf/srv'], 'hector_uav_msgs': ['/opt/ros/indigo/share/hector_uav_msgs/srv'], 'smach_ros': ['/opt/ros/indigo/share/smach_ros/srv'], 'genlisp': ['/opt/ros/indigo/share/genlisp/srv'], 'shape_msgs': ['/opt/ros/indigo/share/shape_msgs/srv'], 'trajectory_msgs': ['/opt/ros/indigo/share/trajectory_msgs/srv'], 'hector_pose_estimation_core': ['/opt/ros/indigo/share/hector_pose_estimation_core/srv'], 'diagnostic_aggregator': ['/opt/ros/indigo/share/diagnostic_aggregator/srv'], 'robot_state_publisher': ['/opt/ros/indigo/share/robot_state_publisher/srv'], 'smach_msgs': ['/opt/ros/indigo/share/smach_msgs/srv'], 'resource_retriever': ['/opt/ros/indigo/share/resource_retriever/srv'], 'rqt_topic': ['/opt/ros/indigo/share/rqt_topic/srv'], 'smach': ['/opt/ros/indigo/share/smach/srv'], 'rqt_action': ['/opt/ros/indigo/share/rqt_action/srv'], 'control_toolbox': ['/opt/ros/indigo/share/control_toolbox/srv'], 'rqt_top': ['/opt/ros/indigo/share/rqt_top/srv'], 'random_numbers': ['/opt/ros/indigo/share/random_numbers/srv'], 'rqt_rviz': ['/opt/ros/indigo/share/rqt_rviz/srv'], 'rosgraph_msgs': ['/opt/ros/indigo/share/rosgraph_msgs/srv'], 'rosboost_cfg': ['/opt/ros/indigo/share/rosboost_cfg/srv'], 'genmsg': ['/opt/ros/indigo/share/genmsg/srv'], 'xacro': ['/opt/ros/indigo/share/xacro/srv'], 'turtle_tf2': ['/opt/ros/indigo/share/turtle_tf2/srv'], 'rqt_robot_dashboard': ['/opt/ros/indigo/share/rqt_robot_dashboard/srv'], 'pluginlib': ['/opt/ros/indigo/share/pluginlib/srv'], 'rqt_msg': ['/opt/ros/indigo/share/rqt_msg/srv'], 'rqt_service_caller': ['/opt/ros/indigo/share/rqt_service_caller/srv'], 'xmlrpcpp': ['/opt/ros/indigo/share/xmlrpcpp/srv'], 'rqt_logger_level': ['/opt/ros/indigo/share/rqt_logger_level/srv'], 'rosmaster': ['/opt/ros/indigo/share/rosmaster/srv'], 'rosnode': ['/opt/ros/indigo/share/rosnode/srv'], 'rqt_pose_view': ['/opt/ros/indigo/share/rqt_pose_view/srv'], 'hector_quadrotor_description': ['/opt/ros/indigo/share/hector_quadrotor_description/srv'], 'bond': ['/opt/ros/indigo/share/bond/srv'], 'self_test': ['/opt/ros/indigo/share/self_test/srv'], 'pr2_description': ['/opt/ros/indigo/share/pr2_description/srv'], 'hector_imu_attitude_to_tf': ['/opt/ros/indigo/share/hector_imu_attitude_to_tf/srv'], 'rospack': ['/opt/ros/indigo/share/rospack/srv'], 'hector_nav_msgs': ['/opt/ros/indigo/share/hector_nav_msgs/srv'], 'hector_gazebo_plugins': ['/opt/ros/indigo/share/hector_gazebo_plugins/srv'], 'actionlib_msgs': ['/opt/ros/indigo/share/actionlib_msgs/srv'], 'image_rotate': ['/opt/ros/indigo/share/image_rotate/srv'], 'hector_quadrotor_teleop': ['/opt/ros/indigo/share/hector_quadrotor_teleop/srv'], 'rqt_image_view': ['/opt/ros/indigo/share/rqt_image_view/srv'], 'hector_geotiff': ['/opt/ros/indigo/share/hector_geotiff/srv'], 'polled_camera': ['/opt/ros/indigo/share/polled_camera/srv'], 'rqt_console': ['/opt/ros/indigo/share/rqt_console/srv'], 'joint_state_publisher': ['/opt/ros/indigo/share/joint_state_publisher/srv'], 'pr2_position_scripts': ['/opt/ros/indigo/share/pr2_position_scripts/srv'], 'hector_pose_estimation': ['/opt/ros/indigo/share/hector_pose_estimation/srv'], 'depth_image_proc': ['/opt/ros/indigo/share/depth_image_proc/srv'], 'tf2_msgs': ['/opt/ros/indigo/share/tf2_msgs/srv'], 'message_to_tf': ['/opt/ros/indigo/share/message_to_tf/srv'], 'laser_geometry': ['/opt/ros/indigo/share/laser_geometry/srv'], 'rviz': ['/opt/ros/indigo/share/rviz/srv'], 'gencpp': ['/opt/ros/indigo/share/gencpp/srv'], 'rqt_gui_cpp': ['/opt/ros/indigo/share/rqt_gui_cpp/srv'], 'rqt_bag': ['/opt/ros/indigo/share/rqt_bag/srv'], 'rqt_gui': ['/opt/ros/indigo/share/rqt_gui/srv'], 'hector_compressed_map_transport': ['/opt/ros/indigo/share/hector_compressed_map_transport/srv'], 'qt_gui_py_common': ['/opt/ros/indigo/share/qt_gui_py_common/srv'], 'eigen_conversions': ['/opt/ros/indigo/share/eigen_conversions/srv'], 'roscpp_traits': ['/opt/ros/indigo/share/roscpp_traits/srv'], 'driver_base': ['/opt/ros/indigo/share/driver_base/srv'], 'rosout': ['/opt/ros/indigo/share/rosout/srv'], 'diagnostic_common_diagnostics': ['/opt/ros/indigo/share/diagnostic_common_diagnostics/srv'], 'rostopic': ['/opt/ros/indigo/share/rostopic/srv'], 'visualization_msgs': ['/opt/ros/indigo/share/visualization_msgs/srv'], 'message_generation': ['/opt/ros/indigo/share/message_generation/srv'], 'pr2_tuck_arms_action': ['/opt/ros/indigo/share/pr2_tuck_arms_action/srv'], 'camera_calibration': ['/opt/ros/indigo/share/camera_calibration/srv'], 'rqt_runtime_monitor': ['/opt/ros/indigo/share/rqt_runtime_monitor/srv'], 'node_example': ['/home/mayankfirst/node_example/srv'], 'pr2_mechanism_diagnostics': ['/opt/ros/indigo/share/pr2_mechanism_diagnostics/srv'], 'collada_parser': ['/opt/ros/indigo/share/collada_parser/srv'], 'gazebo_msgs': ['/opt/ros/indigo/share/gazebo_msgs/srv'], 'joy': ['/opt/ros/indigo/share/joy/srv'], 'rostime': ['/opt/ros/indigo/share/rostime/srv'], 'urdf_tutorial': ['/opt/ros/indigo/share/urdf_tutorial/srv'], 'kdl_conversions': ['/opt/ros/indigo/share/kdl_conversions/srv'], 'rqt_nav_view': ['/opt/ros/indigo/share/rqt_nav_view/srv'], 'roslint': ['/opt/ros/indigo/share/roslint/srv'], 'rosservice': ['/opt/ros/indigo/share/rosservice/srv'], 'rospy': ['/opt/ros/indigo/share/rospy/srv'], 'rosunit': ['/opt/ros/indigo/share/rosunit/srv'], 'hector_marker_drawing': ['/opt/ros/indigo/share/hector_marker_drawing/srv'], 'roscpp_tutorials': ['/opt/ros/indigo/share/roscpp_tutorials/srv'], 'gmapping': ['/opt/ros/indigo/share/gmapping/srv'], 'turtle_actionlib': ['/opt/ros/indigo/share/turtle_actionlib/srv'], 'python_orocos_kdl': ['/opt/ros/indigo/share/python_orocos_kdl/srv'], 'pr2_controllers_msgs': ['/opt/ros/indigo/share/pr2_controllers_msgs/srv'], 'geographic_msgs': ['/opt/ros/indigo/share/geographic_msgs/srv'], 'visualization_marker_tutorials': ['/opt/ros/indigo/share/visualization_marker_tutorials/srv'], 'tf2_bullet': ['/opt/ros/indigo/share/tf2_bullet/srv'], 'rosconsole_bridge': ['/opt/ros/indigo/share/rosconsole_bridge/srv'], 'pluginlib_tutorials': ['/opt/ros/indigo/share/pluginlib_tutorials/srv'], 'camera_info_manager': ['/opt/ros/indigo/share/camera_info_manager/srv'], 'camera_calibration_parsers': ['/opt/ros/indigo/share/camera_calibration_parsers/srv'], 'hector_sensors_description': ['/opt/ros/indigo/share/hector_sensors_description/srv'], 'roslz4': ['/opt/ros/indigo/share/roslz4/srv'], 'rqt_dep': ['/opt/ros/indigo/share/rqt_dep/srv'], 'rosmsg': ['/opt/ros/indigo/share/rosmsg/srv'], 'actionlib_tutorials': ['/opt/ros/indigo/share/actionlib_tutorials/srv'], 'turtlesim': ['/opt/ros/indigo/share/turtlesim/srv'], 'rqt_robot_monitor': ['/opt/ros/indigo/share/rqt_robot_monitor/srv'], 'gazebo_plugins': ['/opt/ros/indigo/share/gazebo_plugins/srv'], 'rosparam': ['/opt/ros/indigo/share/rosparam/srv'], 'controller_interface': ['/opt/ros/indigo/share/controller_interface/srv'], 'diagnostic_analysis': ['/opt/ros/indigo/share/diagnostic_analysis/srv'], 'stereo_msgs': ['/opt/ros/indigo/share/stereo_msgs/srv'], 'pr2_mechanism_msgs': ['/opt/ros/indigo/share/pr2_mechanism_msgs/srv'], 'pcl_msgs': ['/opt/ros/indigo/share/pcl_msgs/srv'], 'interactive_markers': ['/opt/ros/indigo/share/interactive_markers/srv'], 'object_recognition_msgs': ['/opt/ros/indigo/share/object_recognition_msgs/srv'], 'diagnostic_updater': ['/opt/ros/indigo/share/diagnostic_updater/srv'], 'laser_assembler': ['/opt/ros/indigo/share/laser_assembler/srv'], 'pcl_conversions': ['/opt/ros/indigo/share/pcl_conversions/srv'], 'app_manager': ['/opt/ros/indigo/share/app_manager/srv'], 'rviz_python_tutorial': ['/opt/ros/indigo/share/rviz_python_tutorial/srv'], 'tf2': ['/opt/ros/indigo/share/tf2/srv'], 'hector_quadrotor_gazebo_plugins': ['/opt/ros/indigo/share/hector_quadrotor_gazebo_plugins/srv'], 'rqt_gui_py': ['/opt/ros/indigo/share/rqt_gui_py/srv'], 'rosbash': ['/opt/ros/indigo/share/rosbash/srv'], 'rqt_reconfigure': ['/opt/ros/indigo/share/rqt_reconfigure/srv'], 'pr2_controller_interface': ['/opt/ros/indigo/share/pr2_controller_interface/srv'], 'rqt_bag_plugins': ['/opt/ros/indigo/share/rqt_bag_plugins/srv'], 'hector_geotiff_plugins': ['/opt/ros/indigo/share/hector_geotiff_plugins/srv'], 'hector_trajectory_server': ['/opt/ros/indigo/share/hector_trajectory_server/srv'], 'rqt_plot': ['/opt/ros/indigo/share/rqt_plot/srv'], 'topic_tools': ['/opt/ros/indigo/share/topic_tools/srv'], 'rostest': ['/opt/ros/indigo/share/rostest/srv'], 'control_msgs': ['/opt/ros/indigo/share/control_msgs/srv'], 'hector_sensors_gazebo': ['/opt/ros/indigo/share/hector_sensors_gazebo/srv'], 'interactive_marker_tutorials': ['/opt/ros/indigo/share/interactive_marker_tutorials/srv'], 'stage': ['/opt/ros/indigo/share/stage/srv'], 'nodelet': ['/opt/ros/indigo/share/nodelet/srv'], 'transmission_interface': ['/opt/ros/indigo/share/transmission_interface/srv'], 'stage_ros': ['/opt/ros/indigo/share/stage_ros/srv'], 'pr2_msgs': ['/opt/ros/indigo/share/pr2_msgs/srv'], 'rqt_robot_steering': ['/opt/ros/indigo/share/rqt_robot_steering/srv'], 'roslaunch': ['/opt/ros/indigo/share/roslaunch/srv'], 'hardware_interface': ['/opt/ros/indigo/share/hardware_interface/srv'], 'tf2_geometry_msgs': ['/opt/ros/indigo/share/tf2_geometry_msgs/srv'], 'compressed_image_transport': ['/opt/ros/indigo/share/compressed_image_transport/srv'], 'controller_manager_msgs': ['/opt/ros/indigo/share/controller_manager_msgs/srv'], 'rqt_shell': ['/opt/ros/indigo/share/rqt_shell/srv'], 'std_msgs': ['/opt/ros/indigo/share/std_msgs/srv'], 'realtime_tools': ['/opt/ros/indigo/share/realtime_tools/srv'], 'image_transport': ['/opt/ros/indigo/share/image_transport/srv'], 'rqt_launch': ['/opt/ros/indigo/share/rqt_launch/srv'], 'pr2_teleop_general': ['/opt/ros/indigo/share/pr2_teleop_general/srv'], 'angles': ['/opt/ros/indigo/share/angles/srv'], 'cv_bridge': ['/opt/ros/indigo/share/cv_bridge/srv'], 'gazebo_ros': ['/opt/ros/indigo/share/gazebo_ros/srv'], 'rosbag_storage': ['/opt/ros/indigo/share/rosbag_storage/srv'], 'bondcpp': ['/opt/ros/indigo/share/bondcpp/srv'], 'roslang': ['/opt/ros/indigo/share/roslang/srv'], 'std_srvs': ['/opt/ros/indigo/share/std_srvs/srv'], 'geometric_shapes': ['/opt/ros/indigo/share/geometric_shapes/srv'], 'willow_maps': ['/opt/ros/indigo/share/willow_maps/srv'], 'joint_limits_interface': ['/opt/ros/indigo/share/joint_limits_interface/srv'], 'mk': ['/opt/ros/indigo/share/mk/srv'], 'cpp_common': ['/opt/ros/indigo/share/cpp_common/srv'], 'octomap': ['/opt/ros/indigo/share/octomap/srv'], 'stereo_image_proc': ['/opt/ros/indigo/share/stereo_image_proc/srv'], 'bondpy': ['/opt/ros/indigo/share/bondpy/srv'], 'collada_urdf': ['/opt/ros/indigo/share/collada_urdf/srv'], 'pr2_controller_manager': ['/opt/ros/indigo/share/pr2_controller_manager/srv'], 'tf2_kdl': ['/opt/ros/indigo/share/tf2_kdl/srv'], 'rqt_web': ['/opt/ros/indigo/share/rqt_web/srv'], 'class_loader': ['/opt/ros/indigo/share/class_loader/srv'], 'tf2_py': ['/opt/ros/indigo/share/tf2_py/srv'], 'genpy': ['/opt/ros/indigo/share/genpy/srv'], 'kdl_parser': ['/opt/ros/indigo/share/kdl_parser/srv'], 'hector_quadrotor_gazebo': ['/opt/ros/indigo/share/hector_quadrotor_gazebo/srv'], 'cmake_modules': ['/opt/ros/indigo/share/cmake_modules/srv'], 'uuid_msgs': ['/opt/ros/indigo/share/uuid_msgs/srv'], 'pr2_tuckarm': ['/opt/ros/indigo/share/pr2_tuckarm/srv'], 'pcl_ros': ['/opt/ros/indigo/share/pcl_ros/srv'], 'nav_msgs': ['/opt/ros/indigo/share/nav_msgs/srv'], 'rosmake': ['/opt/ros/indigo/share/rosmake/srv'], 'rqt_srv': ['/opt/ros/indigo/share/rqt_srv/srv'], 'roscpp': ['/opt/ros/indigo/share/roscpp/srv'], 'rqt_moveit': ['/opt/ros/indigo/share/rqt_moveit/srv'], 'theora_image_transport': ['/opt/ros/indigo/share/theora_image_transport/srv'], 'rqt_py_common': ['/opt/ros/indigo/share/rqt_py_common/srv'], 'rviz_plugin_tutorials': ['/opt/ros/indigo/share/rviz_plugin_tutorials/srv'], 'actionlib': ['/opt/ros/indigo/share/actionlib/srv'], 'hector_slam_launch': ['/opt/ros/indigo/share/hector_slam_launch/srv'], 'qt_gui_cpp': ['/opt/ros/indigo/share/qt_gui_cpp/srv'], 'eigen_stl_containers': ['/opt/ros/indigo/share/eigen_stl_containers/srv'], 'tf2_ros': ['/opt/ros/indigo/share/tf2_ros/srv'], 'librviz_tutorial': ['/opt/ros/indigo/share/librviz_tutorial/srv'], 'moveit_msgs': ['/opt/ros/indigo/share/moveit_msgs/srv'], 'roslisp': ['/opt/ros/indigo/share/roslisp/srv'], 'image_geometry': ['/opt/ros/indigo/share/image_geometry/srv'], 'message_runtime': ['/opt/ros/indigo/share/message_runtime/srv'], 'message_filters': ['/opt/ros/indigo/share/message_filters/srv'], 'python_qt_binding': ['/opt/ros/indigo/share/python_qt_binding/srv'], 'sensor_msgs': ['/opt/ros/indigo/share/sensor_msgs/srv'], 'hector_map_server': ['/opt/ros/indigo/share/hector_map_server/srv'], 'pr2_common_action_msgs': ['/opt/ros/indigo/share/pr2_common_action_msgs/srv'], 'roscreate': ['/opt/ros/indigo/share/roscreate/srv'], 'rospy_tutorials': ['/opt/ros/indigo/share/rospy_tutorials/srv'], 'hector_quadrotor_demo': ['/opt/ros/indigo/share/hector_quadrotor_demo/srv'], 'hector_quadrotor_model': ['/opt/ros/indigo/share/hector_quadrotor_model/srv'], 'laser_filters': ['/opt/ros/indigo/share/laser_filters/srv'], 'image_proc': ['/opt/ros/indigo/share/image_proc/srv'], 'octomap_msgs': ['/opt/ros/indigo/share/octomap_msgs/srv'], 'map_msgs': ['/opt/ros/indigo/share/map_msgs/srv'], 'dynamic_reconfigure': ['/opt/ros/indigo/share/dynamic_reconfigure/srv'], 'compressed_depth_image_transport': ['/opt/ros/indigo/share/compressed_depth_image_transport/srv'], 'rqt_tf_tree': ['/opt/ros/indigo/share/rqt_tf_tree/srv'], 'gazebo_ros_control': ['/opt/ros/indigo/share/gazebo_ros_control/srv'], 'turtle_tf': ['/opt/ros/indigo/share/turtle_tf/srv'], 'controller_manager': ['/opt/ros/indigo/share/controller_manager/srv'], 'pr2_hardware_interface': ['/opt/ros/indigo/share/pr2_hardware_interface/srv'], 'pr2_app_manager': ['/opt/ros/indigo/share/pr2_app_manager/srv'], 'openslam_gmapping': ['/opt/ros/indigo/share/openslam_gmapping/srv'], 'tf2_sensor_msgs': ['/opt/ros/indigo/share/tf2_sensor_msgs/srv'], 'hector_quadrotor_controller': ['/opt/ros/indigo/share/hector_quadrotor_controller/srv'], 'media_export': ['/opt/ros/indigo/share/media_export/srv'], 'geometry_msgs': ['/opt/ros/indigo/share/geometry_msgs/srv'], 'urdf_parser_plugin': ['/opt/ros/indigo/share/urdf_parser_plugin/srv'], 'tf2_tools': ['/opt/ros/indigo/share/tf2_tools/srv'], 'tf_conversions': ['/opt/ros/indigo/share/tf_conversions/srv'], 'orocos_kdl': ['/opt/ros/indigo/share/orocos_kdl/srv'], 'rosbag': ['/opt/ros/indigo/share/rosbag/srv'], 'rosbag_migration_rule': ['/opt/ros/indigo/share/rosbag_migration_rule/srv'], 'hector_mapping': ['/opt/ros/indigo/share/hector_mapping/srv'], 'pr2_mechanism_model': ['/opt/ros/indigo/share/pr2_mechanism_model/srv']}]
↧
Frame error: ARV_BUFFER_STATUS_TIMEOUT
Hello, I'm trying to run the camera node with a Matrix-Vision mvBlueCOUGAR-X, but I keep getting the following error: "Frame error: ARV_BUFFER_STATUS_TIMEOUT" as in the attached log. How can I solve it?
Thanks in advance,
Tomer
user@linuxpc:~/$ rosrun camera_aravis camnode
[ INFO] [1484842693.733610130]: Attached cameras:
[ INFO] [1484842695.328079715]: # Interfaces: 2
[ INFO] [1484842695.328172958]: # Devices: 1
[ INFO] [1484842695.328220525]: Device0: MATRIX VISION GmbH-GX014939
[ INFO] [1484842695.330113018]: Opening: (any)
[ INFO] [1484842695.739390709]: Opened: MATRIX VISION GmbH-GX014939
[ INFO] [1484842695.877577190]: Camera does not support FocusPos.
[ INFO] [1484842697.911977015]: Using Camera Configuration:
[ INFO] [1484842697.912065196]: ---------------------------
[ INFO] [1484842697.914429950]: Vendor name = MATRIX VISION GmbH
[ INFO] [1484842697.916508969]: Model name = mvBlueCOUGAR-X104iC
[ INFO] [1484842697.918602011]: Device id = GX014939
[ INFO] [1484842697.918681433]: Sensor width = 2064
[ INFO] [1484842697.918722750]: Sensor height = 1544
[ INFO] [1484842697.918761037]: ROI x,y,w,h = 0, 0, 2064, 1544
[ INFO] [1484842697.918797775]: Pixel format = bayerrg8
[ INFO] [1484842697.918832389]: BytesPerPixel = 1
[ INFO] [1484842697.920953447]: Acquisition Mode = Continuous
[ INFO] [1484842697.927478129]: Trigger Mode = Off
[ INFO] [1484842697.934081683]: Trigger Source = Line4
[ INFO] [1484842697.934183419]: Can set FrameRate: True
[ INFO] [1484842697.938519719]: AcquisitionFrameRate = 100 hz
[ INFO] [1484842697.938600795]: Can set Exposure: False
[ INFO] [1484842697.938640374]: Can set Gain: True
[ INFO] [1484842697.938673377]: Can set GainAuto: True
[ INFO] [1484842697.938729814]: Gain = 1.000000 % in range [0.000000,48.000000]
[ INFO] [1484842697.938774321]: Can set FocusPos: False
[ INFO] [1484842697.940829962]: Network mtu = 576
[ INFO] [1484842697.941009596]: ---------------------------
[ WARN] [1484842698.633371690]: Frame error: ARV_BUFFER_STATUS_TIMEOUT
[ WARN] [1484842698.633423970]: Frame error: ARV_BUFFER_STATUS_TIMEOUT
[ WARN] [1484842698.633472453]: Frame error: ARV_BUFFER_STATUS_TIMEOUT
↧
ERROR : cannot identify
Hello.
I input 'roslaunch elp_stereo_camera elp_stereo_camera.launch'
and I got an error as below.
ubuntu@ubuntu:~$ roslaunch elp_stereo_camera elp_stereo_camera.launch
... logging to /home/ubuntu/.ros/log/7b619c30-e2fe-11e6-9f1e-0022cffa2d4b/roslaunch-ubuntu-4255.log
Checking log directory for disk usage. This may take awhile.
Press Ctrl-C to interrupt
Done checking log file disk usage. Usage is <1GB.
started roslaunch server http://ubuntu:41191/
SUMMARY
========
PARAMETERS
* /elp/left/camera_frame_id: elp_left_optical_...
* /elp/left/camera_info_url: package://elp_ste...
* /elp/left/camera_name: elp_left
* /elp/left/framerate: 15
* /elp/left/image_height: 720
* /elp/left/image_width: 1280
* /elp/left/pixel_format: mjpeg
* /elp/left/video_device: /dev/elp_left
* /elp/right/camera_frame_id: elp_right_optical...
* /elp/right/camera_info_url: package://elp_ste...
* /elp/right/camera_name: elp_right
* /elp/right/framerate: 15
* /elp/right/image_height: 720
* /elp/right/image_width: 1280
* /elp/right/pixel_format: mjpeg
* /elp/right/video_device: /dev/elp_right
* /rosdistro: indigo
* /rosversion: 1.11.20
NODES
/elp/
left (usb_cam/usb_cam_node)
right (usb_cam/usb_cam_node)
ROS_MASTER_URI=http://localhost:11311
core service [/rosout] found
process[elp/left-1]: started with pid [4273]
process[elp/right-2]: started with pid [4274]
[ERROR] [1485349340.027221093]: Cannot identify '/dev/elp_left': 2, No such file or directory
[elp/left-1] process has died [pid 4273, exit code 1, cmd /opt/ros/indigo/lib/usb_cam/usb_cam_node __name:=left __log:=/home/ubuntu/.ros/log/7b619c30-e2fe-11e6-9f1e-0022cffa2d4b/elp-left-1.log].
log file: /home/ubuntu/.ros/log/7b619c30-e2fe-11e6-9f1e-0022cffa2d4b/elp-left-1*.log
[elp/left-1] restarting process
Please help me..
↧
↧
After creating the tutorial package beginner_tutorials, the package cannot be found later
I am going through the beginner tutorials and I just created the package beginner_tutorials in the last tutorial, but now when I use roscd I get an error message that the package cannot be found. This is the link to the current tutorial that I am working on: http://wiki.ros.org/ROS/Tutorials/CreatingMsgAndSrv
↧
Connecting a motor controller to ROS
I have installed a driver to connect ROS with the AX2550 motor controller ( https://github.com/wjwwood/ax2550 ).
After connecting the motor controller and enabling permissions, I get this error.
rosrun ax2550 ax2550_node
(info): AX2550 connecting to port /dev/ttyUSB0
(error): Failed to connect to the AX2550: x{o??
[(info): Will try to reconnect to the AX2550 in 5 seconds.
I get this error regardless of what device is connected to the USB port.
↧
rosdep update: "No address associated with hostname"
I have a Intel RealSense robotic development kit. I installed Ubuntu 16.04.
$ which rosdep
/usr/bin/rosdep
$ rosdep --version
0.11.5
$ apt-cache policy python-rosdep
python-rosdep:
Installed: 0.11.5-1
Candidate: 0.11.5-1
Version table:
*** 0.11.5-1 500
500 http://packages.ros.org/ros/ubuntu xenial/main amd64 Packages
500 http://packages.ros.org/ros/ubuntu xenial/main i386 Packages
100 /var/lib/dpkg/status
0.11.4-2 500
500 http://us.archive.ubuntu.com/ubuntu xenial/universe amd64 Packages
500 http://us.archive.ubuntu.com/ubuntu xenial/universe i386 Packages
so version is not the problem. I'm able to ping raw.githubusercontent.com and get results
$ ping raw.githubusercontent.comPING raw.githubusercontent.com (151.101.48.133) 56(84) bytes of data.
64 bytes from raw.githubusercontent.com (151.101.48.133): icmp_seq=1 ttl=56 time=74.5 ms
64 bytes from raw.githubusercontent.com (151.101.48.133): icmp_seq=2 ttl=56 time=80.8 ms
64 bytes from raw.githubusercontent.com (151.101.48.133): icmp_seq=3 ttl=56 time=24.8 ms
64 bytes from raw.githubusercontent.com (151.101.48.133): icmp_seq=4 ttl=56 time=21.9 ms
^C
--- raw.githubusercontent.com ping statistics ---
4 packets transmitted, 4 received, 0% packet loss, time 3004ms
rtt min/avg/max/mdev = 21.915/50.552/80.889/27.279 ms
However, when I get to installing rosdep, I get this:
$ sudo apt -y install ros-kinetic-desktop-full python-rosinstall ros-kinetic-realsense-camera
[sudo] password for <>:
Reading package lists... Done
Building dependency tree
Reading state information... Done
python-rosinstall is already the newest version (0.7.8-1).
ros-kinetic-desktop-full is already the newest version (1.3.0-0xenial-20161211-213832-0800).
ros-kinetic-realsense-camera is already the newest version (1.6.1-0xenial-20161204-170602-0800).
0 upgraded, 0 newly installed, 0 to remove and 0 not upgraded.
$ sudo rosdep init
Wrote /etc/ros/rosdep/sources.list.d/20-default.list
Recommended: please run
rosdep update
$ rosdep update
reading in sources list data from /etc/ros/rosdep/sources.list.d
ERROR: unable to process source [https://raw.githubusercontent.com/ros/rosdistro/master/rosdep/osx-homebrew.yaml]:
(https://raw.githubusercontent.com/ros/rosdistro/master/rosdep/osx-homebrew.yaml)
ERROR: unable to process source [https://raw.githubusercontent.com/ros/rosdistro/master/rosdep/base.yaml]:
(https://raw.githubusercontent.com/ros/rosdistro/master/rosdep/base.yaml)
ERROR: unable to process source [https://raw.githubusercontent.com/ros/rosdistro/master/rosdep/python.yaml]:
(https://raw.githubusercontent.com/ros/rosdistro/master/rosdep/python.yaml)
ERROR: unable to process source [https://raw.githubusercontent.com/ros/rosdistro/master/rosdep/ruby.yaml]:
(https://raw.githubusercontent.com/ros/rosdistro/master/rosdep/ruby.yaml)
ERROR: unable to process source [https://raw.githubusercontent.com/ros/rosdistro/master/releases/fuerte.yaml]:
Failed to download target platform data for gbpdistro:
Query rosdistro index https://raw.githubusercontent.com/ros/rosdistro/master/index.yaml
ERROR: error loading sources list:
(https://raw.githubusercontent.com/ros/rosdistro/master/index.yaml)>
I have no proxy on my Internet connection, either.
↧
launch file foreign_relay error
I am trying to run a node for foreign relay to a remote computer turtlebot but it gives me this error.
[FATAL] [1486425646.037670123]: Couldn't parse the foreign master URI [http:] into a host:port pair.
[generic_msg_foreign_relay-1] process has died [pid 25027, exit code 1, cmd /opt/ros/groovy/stacks/multimaster_experimental/foreign_relay/bin/foreign_relay adv http: //192.168.1.17:11311 /leader/base_link /leader/base_link __name:=generic_msg_foreign_relay __log:=/home/turtlebot/.ros/log/4accea04-ecc0-11e6-856c-48d2246be9cd/generic_msg_foreign_relay-1.log].
log file: /home/turtlebot/.ros/log/4accea04-ecc0-11e6-856c-48d2246be9cd/generic_msg_foreign_relay-1*.log
this is my launch file:
↧
↧
Docker ROS "unable to communicate with master!"
Hi, I have ros indigo running through docker and when i try to run rostopic list on a new terminal with roscore open in another, I get "ERROR: Unable to communicate with master!" I don't really have experience with any of this but both of these terminals are on the same laptop so I'm unsure as to what the problem could be or what to do,
↧
Problems with roslaunch
Hey.
Robot: UR3
Polyscope: 3.3.3.292
when typing:
roslaunch ur_modern_driver ur3_bringup.launch robot_ip:[The robots IP]
I am getting:
ERROR: cannot launch node of type [ur_modern_driver/ur_driver]: can't locate node [ur_driver] in package [ur_modern_driver]
↧
cmake error suitesparseconfig.cmake
hi, i've got an error when i compiled `mcptam`.
After `catkin_make`, then i had message like this
CMake Error at CMakeLists.txt:15 (find_package):
By not providing "FindSUITESPARSE.cmake" in CMAKE_MODULE_PATH this project
has asked CMake to find a package configuration file provided by
"SUITESPARSE", but CMake did not find one.
Could not find a package configuration file provided by "SUITESPARSE" with
any of the following names:
SUITESPARSEConfig.cmake
suitesparse-config.cmake
Add the installation prefix of "SUITESPARSE" to CMAKE_PREFIX_PATH or set
"SUITESPARSE_DIR" to a directory containing one of the above files. If
"SUITESPARSE" provides a separate development package or SDK, be sure it
has been installed.
please help me guys. :)
↧