ros_comm icon indicating copy to clipboard operation
ros_comm copied to clipboard

ROS communications-related packages, including core client libraries (roscpp, rospy, roslisp) and graph introspection tools (rostopic, rosnode, rosservice, rosparam).

Results 200 ros_comm issues
Sort by recently updated
recently updated
newest added

test.py ``` import rospy print("initializing node") rospy.init_node( 'listener' , anonymous = True ) print("done") ``` Expected behaviour: init ros node and print "Done". Current behaviour: `python3.11 test.py` is stucked in...

`rostest.rosrun` seems to provide a code coverage tool that can be called from the `sysargs==--cov`. However this functionality it is not documented and it is not clear how to use...

enhancement

[ros_comm/tools/rosbag/src/recorder.cpp](https://github.com/ros/ros_comm/blob/noetic-devel/tools/rosbag/src/recorder.cpp) has a bug that makes it vulnerable to generating lots of empty bag files if there is a time jump between "`start_time_`" and "`t`"(current time). We are running recorder.cpp...

Hi, I'm using the C++ rosbag API, and want to delete a single message from a bag. For this, I was thinking of opening the bag in `Read` mode, opening...

Hi @jacobperron, @mjcarroll, @sloretz, you are listed as maintainer for this central package. I know, you are focussing on ROS2 development, but could you please review some of the open...

# Summary Exception occurs after `rospy.wait_for_message()` call returns value (invoked in HTTP request handler). # Setup information ROS version: melodic OS version: Ubuntu 18.04 Python version: python3.6 # More details...

bug

Subscribers and services are limited to 1000000000-byte messages, even though messages up to 4294967295 bytes are possible. Such large messages are useful for sending large data structures like voxel grids...

enhancement

rostopic pub time and header substitution does not work with yaml file messages. For example: ``` rostopic pub -s -r 10 /test sensor_msgs/Temperature -f msg.yaml ``` with ```msg.yaml``` as ```...

related ros forum topic: https://answers.ros.org/question/251206/ros-log-named-and-stderr/ The `is_child_mode()` is only used for disabling creating a stderr logfile on local machine. I assume the mechanism is designed that local error messages are...

I know that 'serialize' and 'deserialize' will be used when publish and subscribe messages. What's the difference between 'serialize' and 'serialize_numpy' method?