Questions tagged [ros-kinetic]
3588 questions
1
vote
2 answers
Serialize ROS message and pass it
Hi all.
I want to build my own ROS-like msg transferring through zmq (for practice).
My problem is that I need to create and pub a msg object in python and transfer it to a sub receiving and desalinize it in c++.
My problem is that I can't manage…
dforer
0
votes
1 answer
Why is my robot not moving although I published in the correct topic?
class MoveTurtlebot {
private:
ros::Publisher pub;
ros::NodeHandle nhMove;
public:
MoveTurtlebot() {
pub = nhMove.advertise("/cmd/vel", 1);
};
void laser_callback(const sensor_msgs::LaserScanConstPtr &msg) {
…
KhalidOwlWalid
0
votes
1 answer
get initial pose of turtle in turtlesim?
I am trying to write a c++ program which sets the robot to a set orientation in the turtlesim. In order to calculate how much the turtle has to rotate I need the initial pose of the turtle but my code isn't able to get the initial value of theta,…
Victor_Kash
0
votes
1 answer
unable to locate package problem on ubuntu 16
Hello, I am struggling to solve this problem I am having and I would appreciate it if someone could help. During the read me installation file when it says to input 'sudo apt-get install ros-kinetic-desktop-full' it comes up with Unable to locate…
jaaz.gd
0
votes
1 answer
Is it possible to modify a specification of the real Hokuyo Lidar, not the vitual?
Hello, I'm ROS-kinetic user of Ubuntu 16.04.
As far as my knowledge, my Hokuyo lidar UBG-04LX-F01 has 240 degrees of the detection range.
But I just checked the real range through
$ rostopic echo /scan
and it returns 1.57079637051 as the…
kane_choigo
0
votes
1 answer
custom global planner with multiple cpp and h files
Hi
I have created a custom planner following this tutorial:
http://wiki.ros.org/navigation/Tutorials/Writing%20A%20Global%20Path%20Planner%20As%20Plugin%20in%20ROS
I created the files:
GA_global_planner.cpp and GA_global_planner.h
Also, I needed…
Eman.m
0
votes
1 answer
Calling constructor of custom global planner
Hi
I have created a custom global planner based on Genetic Algorithm.
I followed this tutorial:
http://wiki.ros.org/navigation/Tutorials/Writing%20A%20Global%20Path%20Planner%20As%20Plugin%20in%20ROS
In the…
Eman.m
0
votes
1 answer
Ros topic echo doesn't show on multi-computer setting
I followed the tutorial on http://wiki.ros.org/ROS/Tutorials/MultipleMachines.
I tried setting up 3 computer running ROS. Let's call them RobotComputer, MasterComputer, NodeComputer.
MasterComputer can see topics of RobotComputer, and command sent…
Vic
0
votes
1 answer
How to connect an Intel RealSense camera to a raspberry pi 4 with ROS Kinetic?
Hi all,
I'm working on a robotics-related project and I want to connect an Intel RealSense d435 camera to a raspberry pi 4 with ROS Kinetic.
Any links on how to do that?
Originally posted by Beedz98 on ROS Answers with karma: 1 on 2021-05-22
Post…
Beedz98
0
votes
1 answer
part of the node's code is not executed
Hi
I implemented a node to create a costmap2dROS from map server. Then use this costmap2dROS object to initialize NavfnROS object. I want to measure the run time of makePlan.
The code for creating costmap2dROS from map server works perfectly as I…
Eman.m
0
votes
1 answer
map.yaml resolution parameter
Hi all, I want to know what is the resolution parameter in map.yaml file. I read the documentation and it just says that "it is the resolution of the map, meters/pixels". I don't really understand what it means. What happens if I change the…
Chan
0
votes
1 answer
using multiple robots with the same roscore on multiple machines
Hi,
I have 2 robots with the same code. They are running on multiple machines(each robot on one machine).
I have one node that needs to sync the data between them.
The question is, how I change the topics on the launch so that each robot will work…
os
0
votes
1 answer
roslaunch file contains multiple nodes named [/robot_state_publisher]
straight dump of the error:
'roslaunch file contains multiple nodes named [/robot_state_publisher]. Please check all 'name' attributes to make sure they are unique. Also check that $(anon id) use different ids. The traceback for the…
Kothandaraman Kannadasan
0
votes
1 answer
autoware open planner
I have only one point cloud map in autoware,Can I do global path planning by using op_global_planner.I don't want to use waypoint_maker
Originally posted by liuliuliu on ROS Answers with karma: 5 on 2021-02-24
Post score: 0
liuliuliu
0
votes
1 answer
SummitXLPose has no attribute '_request_class'
I am following a tutorial from theConstructSim in which I am trying to create a service which when called will write the current coordinate position of the robot to a file.
However, the rospy.service function call is immediately triggering the…
sisko